43 const geometry_msgs::Pose2D& goal,
44 const nav_2d_msgs::Path2D& global_plan)
48 unsigned int local_goal_x, local_goal_y;
56 queue_->enqueueCell(local_goal_x, local_goal_y);
68 bool started_path =
false;
71 for (
unsigned int i = 0; i < adjusted_global_plan.poses.size(); ++i)
73 double g_x = adjusted_global_plan.poses[i].x;
74 double g_y = adjusted_global_plan.poses[i].y;
75 unsigned int map_x, map_y;
83 else if (started_path)
97 ROS_ERROR_NAMED(
"GoalDistCritic",
"None of the points of the global plan were in the local costmap.");