File tree Expand file tree Collapse file tree 2 files changed +5
-5
lines changed
include/nav2_mppi_controller/tools Expand file tree Collapse file tree 2 files changed +5
-5
lines changed Original file line number Diff line number Diff line change @@ -646,7 +646,7 @@ inline unsigned int removePosesAfterFirstRotation(
646646 // Find first in-place rotation
647647 const unsigned int first_after_rotation = findFirstPathRotation (
648648 cropped_path, translation_threshold, rotation_threshold);
649-
649+
650650 if (first_after_rotation == path.poses .size ()) {
651651 return 0u ; // No rotation found
652652 }
Original file line number Diff line number Diff line change @@ -173,23 +173,23 @@ double PathHandler::getMaxCostmapDist()
173173void PathHandler::setPath (const nav_msgs::msg::Path & plan)
174174{
175175 global_plan_ = plan;
176-
176+
177177 // Start with the full plan and progressively apply restrictions
178178 nav_msgs::msg::Path most_restrictive_plan = global_plan_;
179-
179+
180180 // Check for rotation restrictions first
181181 if (enforce_path_rotation_) {
182182 rotation_locale_ = utils::removePosesAfterFirstRotation (
183183 most_restrictive_plan,
184184 rotation_translation_threshold_,
185185 rotation_rotation_threshold_);
186186 }
187-
187+
188188 // Check for inversion restrictions (may further restrict the path)
189189 if (enforce_path_inversion_) {
190190 inversion_locale_ = utils::removePosesAfterFirstInversion (most_restrictive_plan);
191191 }
192-
192+
193193 // Set the working paths to the most restrictive version
194194 global_plan_up_to_rotation_ = most_restrictive_plan;
195195 global_plan_up_to_inversion_ = most_restrictive_plan;
You can’t perform that action at this time.
0 commit comments