#include <action_test_base.h>
Public Member Functions | |
ActionTestBase () | |
void | SetUp () |
~ActionTestBase () | |
Protected Types | |
using | ActionClient = actionlib::SimpleActionClient< ACTION > |
using | ActionClientPtr = std::shared_ptr< ActionClient > |
Protected Member Functions | |
void | cbStatus (const planner_cspace_msgs::PlannerStatus::ConstPtr &msg) |
std::string | statusString () const |
Protected Attributes | |
bool | map_ready_ |
ActionClientPtr | move_base_ |
ros::NodeHandle | node_ |
planner_cspace_msgs::PlannerStatus::ConstPtr | planner_status_ |
ros::Subscriber | sub_status_ |
tf2_ros::Buffer | tfbuf_ |
tf2_ros::TransformListener | tfl_ |
Definition at line 51 of file action_test_base.h.
|
protected |
Definition at line 105 of file action_test_base.h.
|
protected |
Definition at line 106 of file action_test_base.h.
|
inline |
Definition at line 54 of file action_test_base.h.
|
inline |
Definition at line 100 of file action_test_base.h.
|
inlineprotected |
Definition at line 108 of file action_test_base.h.
|
inline |
Definition at line 62 of file action_test_base.h.
|
inlineprotected |
Definition at line 113 of file action_test_base.h.
|
protected |
Definition at line 129 of file action_test_base.h.
|
protected |
Definition at line 125 of file action_test_base.h.
|
protected |
Definition at line 123 of file action_test_base.h.
|
protected |
Definition at line 126 of file action_test_base.h.
|
protected |
Definition at line 124 of file action_test_base.h.
|
protected |
Definition at line 127 of file action_test_base.h.
|
protected |
Definition at line 128 of file action_test_base.h.