#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) |
Private Attributes | |
| costmap_2d::Costmap2DROS * | costmap_ros_ |
| geometry_msgs::PoseStamped | last_goal_ |
Definition at line 41 of file goal_passer.h.
| goal_passer::GoalPasser::GoalPasser | ( | ) | [inline] |
Definition at line 42 of file goal_passer.h.
| void goal_passer::GoalPasser::initialize | ( | std::string | name, | |
| costmap_2d::Costmap2DROS * | costmap_ros | |||
| ) |
Definition at line 40 of file goal_passer.cpp.
| bool goal_passer::GoalPasser::makePlan | ( | const geometry_msgs::PoseStamped & | start, | |
| const geometry_msgs::PoseStamped & | goal, | |||
| std::vector< geometry_msgs::PoseStamped > & | plan | |||
| ) |
Definition at line 45 of file goal_passer.cpp.
costmap_2d::Costmap2DROS* goal_passer::GoalPasser::costmap_ros_ [private] |
Definition at line 47 of file goal_passer.h.
geometry_msgs::PoseStamped goal_passer::GoalPasser::last_goal_ [private] |
Definition at line 48 of file goal_passer.h.