@@ -404,10 +404,10 @@ nav_msgs::msg::Path SmacPlannerHybrid::createPlan(
404404 // Set starting point, in A* bin search coordinates
405405 float mx_start, my_start, mx_goal, my_goal;
406406 if (!costmap->worldToMapContinuous (
407- start.pose .position .x ,
408- start.pose .position .y ,
409- mx_start,
410- my_start))
407+ start.pose .position .x ,
408+ start.pose .position .y ,
409+ mx_start,
410+ my_start))
411411 {
412412 throw nav2_core::StartOutsideMapBounds (
413413 " Start Coordinates of(" + std::to_string (start.pose .position .x ) + " , " +
@@ -428,10 +428,10 @@ nav_msgs::msg::Path SmacPlannerHybrid::createPlan(
428428
429429 // Set goal point, in A* bin search coordinates
430430 if (!costmap->worldToMapContinuous (
431- goal.pose .position .x ,
432- goal.pose .position .y ,
433- mx_goal,
434- my_goal))
431+ goal.pose .position .x ,
432+ goal.pose .position .y ,
433+ mx_goal,
434+ my_goal))
435435 {
436436 throw nav2_core::GoalOutsideMapBounds (
437437 " Goal Coordinates of(" + std::to_string (goal.pose .position .x ) + " , " +
@@ -447,7 +447,8 @@ nav_msgs::msg::Path SmacPlannerHybrid::createPlan(
447447 }
448448 unsigned int goal_orientation_bin_int =
449449 static_cast <unsigned int >(goal_orientation_bin);
450- _a_star->setGoal (mx_goal, my_goal, static_cast <unsigned int >(goal_orientation_bin_int),
450+ _a_star->setGoal (
451+ mx_goal, my_goal, static_cast <unsigned int >(goal_orientation_bin_int),
451452 _goal_heading_mode, _coarse_search_resolution);
452453
453454 // Setup message
@@ -625,7 +626,7 @@ SmacPlannerHybrid::dynamicParametersCallback(std::vector<rclcpp::Parameter> para
625626 for (auto parameter : parameters) {
626627 const auto & param_type = parameter.get_type ();
627628 const auto & param_name = parameter.get_name ();
628- if (param_name.find (_name + " ." ) != 0 && param_name != " resolution" ) {
629+ if (param_name.find (_name + " ." ) != 0 && param_name != " resolution" ) {
629630 continue ;
630631 }
631632 if (param_type == ParameterType::PARAMETER_DOUBLE) {
@@ -756,8 +757,8 @@ SmacPlannerHybrid::dynamicParametersCallback(std::vector<rclcpp::Parameter> para
756757 if (_angle_quantizations % _coarse_search_resolution != 0 ) {
757758 RCLCPP_WARN (
758759 _logger,
759- " coarse iteration should be an increment of the "
760- " number of angular bins configured. Disabling course research!"
760+ " coarse iteration should be an increment of the "
761+ " number of angular bins configured. Disabling course research!"
761762 );
762763 _coarse_search_resolution = 1 ;
763764 }
0 commit comments