Go to the documentation of this file.
37 #ifndef CARROT_PLANNER_H_
38 #define CARROT_PLANNER_H_
44 #include <geometry_msgs/PoseStamped.h>
87 const geometry_msgs::PoseStamped& goal, std::vector<geometry_msgs::PoseStamped>& plan);
102 double footprintCost(
double x_i,
double y_i,
double theta_i);
void initialize(std::string name, costmap_2d::Costmap2DROS *costmap_ros)
Initialization function for the CarrotPlanner.
costmap_2d::Costmap2D * costmap_
base_local_planner::WorldModel * world_model_
The world model that the controller will use.
costmap_2d::Costmap2DROS * costmap_ros_
double footprintCost(double x_i, double y_i, double theta_i)
Checks the legality of the robot footprint at a position and orientation using the world model.
bool makePlan(const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan)
Given a goal pose in the world, compute a plan.
double min_dist_from_robot_
Provides a simple global planner that will compute a valid goal point for the local planner by walkin...
~CarrotPlanner()
Destructor.
CarrotPlanner()
Constructor for the CarrotPlanner.
carrot_planner
Author(s): Eitan Marder-Eppstein, Sachin Chitta, contradict@gmail.com
autogenerated on Mon Mar 6 2023 03:50:28