#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) |
Definition at line 44 of file goal_passer.h.
| goal_passer::GoalPasser::GoalPasser | ( | ) | [inline] |
Definition at line 46 of file goal_passer.h.
| void goal_passer::GoalPasser::initialize | ( | std::string | name, |
| costmap_2d::Costmap2DROS * | costmap_ros | ||
| ) | [inline, virtual] |
Implements nav_core::BaseGlobalPlanner.
Definition at line 47 of file goal_passer.h.
| bool goal_passer::GoalPasser::makePlan | ( | const geometry_msgs::PoseStamped & | start, |
| const geometry_msgs::PoseStamped & | goal, | ||
| std::vector< geometry_msgs::PoseStamped > & | plan | ||
| ) | [virtual] |
Implements nav_core::BaseGlobalPlanner.
Definition at line 44 of file goal_passer.cpp.