#include <hector_exploration_base_global_planner_plugin.h>
Public Member Functions | |
HectorExplorationBaseGlobalPlannerPlugin () | |
virtual void | initialize (std::string name, costmap_2d::Costmap2DROS *costmap_ros) |
virtual bool | makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan) |
virtual | ~HectorExplorationBaseGlobalPlannerPlugin () |
Public Member Functions inherited from nav_core::BaseGlobalPlanner | |
virtual bool | makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan, double &cost) |
virtual | ~BaseGlobalPlanner () |
Protected Attributes | |
HectorExplorationPlanner * | exploration_planner |
Additional Inherited Members | |
Protected Member Functions inherited from nav_core::BaseGlobalPlanner | |
BaseGlobalPlanner () | |
Definition at line 41 of file hector_exploration_base_global_planner_plugin.h.
HectorExplorationBaseGlobalPlannerPlugin::HectorExplorationBaseGlobalPlannerPlugin | ( | ) |
Definition at line 36 of file hector_exploration_base_global_planner_plugin.cpp.
|
virtual |
Definition at line 41 of file hector_exploration_base_global_planner_plugin.cpp.
|
virtual |
Implements nav_core::BaseGlobalPlanner.
Definition at line 52 of file hector_exploration_base_global_planner_plugin.cpp.
|
virtual |
Implements nav_core::BaseGlobalPlanner.
Definition at line 46 of file hector_exploration_base_global_planner_plugin.cpp.
|
protected |
Definition at line 53 of file hector_exploration_base_global_planner_plugin.h.