41 #ifndef MBF_COSTMAP_NAV__WRAPPER_GLOBAL_PLANNER_H_    42 #define MBF_COSTMAP_NAV__WRAPPER_GLOBAL_PLANNER_H_    69       virtual uint32_t 
makePlan(
const geometry_msgs::PoseStamped &
start, 
const geometry_msgs::PoseStamped &
goal,
    70                                 double tolerance, std::vector<geometry_msgs::PoseStamped> &plan, 
double &cost,
    71                                 std::string &message);
 
virtual bool cancel()
Requests the planner to cancel, e.g. if it takes too much time. 
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)
Given a goal pose in the world, compute a plan. 
virtual void initialize(std::string name, costmap_2d::Costmap2DROS *costmap_ros)
Initialization function for the CostmapPlanner. 
WrapperGlobalPlanner(boost::shared_ptr< nav_core::BaseGlobalPlanner > plugin)
Public constructor used for handling a nav_core-based plugin. 
boost::shared_ptr< nav_core::BaseGlobalPlanner > nav_core_plugin_
virtual ~WrapperGlobalPlanner()
Virtual destructor for the interface.