#include <goal_passer.h>
Public Member Functions | |
GoalPasser () | |
void | initialize (std::string name, costmap_2d::Costmap2DROS *costmap_ros) |
bool | makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan) |
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 () |
Additional Inherited Members | |
Protected Member Functions inherited from nav_core::BaseGlobalPlanner | |
BaseGlobalPlanner () | |
Definition at line 44 of file goal_passer.h.
|
inline |
Definition at line 46 of file goal_passer.h.
|
inlinevirtual |
Implements nav_core::BaseGlobalPlanner.
Definition at line 47 of file goal_passer.h.
|
virtual |
Implements nav_core::BaseGlobalPlanner.
Definition at line 44 of file goal_passer.cpp.