Public Member Functions | |
void | callback_0 (const micros_mars_task_alloc::PathConstPtr &msg) |
void | callback_1 (const std_msgs::BoolConstPtr &msg) |
virtual void | onInit () |
Pathplan () | |
~Pathplan () | |
Private Attributes | |
ros::NodeHandle | nh_ |
ros::Publisher | pub_ |
bool | start_pathplan_ |
ros::Subscriber | sub_0_ |
ros::Subscriber | sub_1_ |
Definition at line 18 of file pathplan.cpp.
micros_mars_task_alloc::Pathplan::Pathplan | ( | ) | [inline] |
Definition at line 21 of file pathplan.cpp.
micros_mars_task_alloc::Pathplan::~Pathplan | ( | ) | [inline] |
Definition at line 22 of file pathplan.cpp.
void micros_mars_task_alloc::Pathplan::callback_0 | ( | const micros_mars_task_alloc::PathConstPtr & | msg | ) |
Definition at line 44 of file pathplan.cpp.
void micros_mars_task_alloc::Pathplan::callback_1 | ( | const std_msgs::BoolConstPtr & | msg | ) |
Definition at line 56 of file pathplan.cpp.
void micros_mars_task_alloc::Pathplan::onInit | ( | ) | [virtual] |
Implements nodelet::Nodelet.
Definition at line 36 of file pathplan.cpp.
Reimplemented from nodelet::Nodelet.
Definition at line 29 of file pathplan.cpp.
Definition at line 32 of file pathplan.cpp.
bool micros_mars_task_alloc::Pathplan::start_pathplan_ [private] |
Definition at line 33 of file pathplan.cpp.
Definition at line 30 of file pathplan.cpp.
Definition at line 31 of file pathplan.cpp.