We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent f020478 commit 8f7b6ceCopy full SHA for 8f7b6ce
nav2_mppi_controller/include/nav2_mppi_controller/tools/utils.hpp
@@ -698,7 +698,7 @@ inline unsigned int removePosesAfterFirstInversion(nav_msgs::msg::Path & path)
698
inline size_t findClosestPathPt(const std::vector<float> & vec, float dist, size_t init = 0)
699
{
700
auto iter = std::lower_bound(vec.begin() + init, vec.end(), dist);
701
- if (iter == vec.begin()) {
+ if (iter == vec.begin() + init) {
702
return 0;
703
}
704
if (dist - *(iter - 1) < *iter - dist) {
0 commit comments