Go to the documentation of this file.
41 #ifndef MBF_COSTMAP_NAV__COSTMAP_PLANNER_EXECUTION_H_
42 #define MBF_COSTMAP_NAV__COSTMAP_PLANNER_EXECUTION_H_
47 #include "mbf_costmap_nav/MoveBaseFlexConfig.h"
73 const MoveBaseFlexConfig& config);
100 mbf_abstract_nav::MoveBaseFlexConfig
toAbstract(
const MoveBaseFlexConfig &config);
114 const geometry_msgs::PoseStamped &
start,
115 const geometry_msgs::PoseStamped &goal,
117 std::vector<geometry_msgs::PoseStamped> &plan,
119 std::string &message);
The CostmapPlannerExecution binds a global costmap to the AbstractPlannerExecution and uses the nav_c...
virtual uint32_t makePlan(const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, double tolerance, std::vector< geometry_msgs::PoseStamped > &plan, double &cost, std::string &message)
Calls the planner plugin to make a plan from the start pose to the goal pose with the given tolerance...
void postRun()
Implementation-specific cleanup function, called right after execution. This method overrides abstrac...
std::string planner_name_
Name of the planner assigned by the class loader.
virtual ~CostmapPlannerExecution()
Destructor.
void preRun()
Implementation-specific setup function, called right before execution. This method overrides abstract...
bool lock_costmap_
Whether to lock costmap before calling the planner (see issue #4 for details)
const CostmapWrapper::Ptr & costmap_ptr_
Shared pointer to the global planner costmap.
CostmapPlannerExecution(const std::string &planner_name, const mbf_costmap_core::CostmapPlanner::Ptr &planner_ptr, const TFPtr &tf_listener_ptr, const CostmapWrapper::Ptr &costmap_ptr, const MoveBaseFlexConfig &config)
Constructor.
mbf_abstract_nav::MoveBaseFlexConfig toAbstract(const MoveBaseFlexConfig &config)
mbf_costmap_nav
Author(s): Sebastian Pütz
autogenerated on Wed Mar 2 2022 00:33:55