Public Member Functions | |
DebugOutputsTest () | |
void | showMap (const nav_msgs::OccupancyGrid::ConstPtr &msg) |
Protected Member Functions | |
void | cbDistance (const sensor_msgs::PointCloud::ConstPtr &msg) |
void | cbHysteresis (const nav_msgs::OccupancyGrid::ConstPtr &msg) |
void | cbPath (const nav_msgs::Path::ConstPtr &msg) |
void | cbRemembered (const nav_msgs::OccupancyGrid::ConstPtr &msg) |
void | cbStatus (const planner_cspace_msgs::PlannerStatus::ConstPtr &msg) |
Protected Attributes | |
int | cnt_distance_ |
int | cnt_hysteresis_ |
int | cnt_path_ |
int | cnt_planner_ready_ |
int | cnt_remembered_ |
sensor_msgs::PointCloud::ConstPtr | map_distance_ |
nav_msgs::OccupancyGrid::ConstPtr | map_hysteresis_ |
nav_msgs::OccupancyGrid::ConstPtr | map_remembered_ |
ros::NodeHandle | nh_ |
nav_msgs::Path::ConstPtr | path_ |
ros::Subscriber | sub_distance_ |
ros::Subscriber | sub_hysteresis_ |
ros::Subscriber | sub_path_ |
ros::Subscriber | sub_remembered_ |
ros::Subscriber | sub_status_ |
Definition at line 39 of file test_debug_outputs.cpp.
|
inline |
Definition at line 42 of file test_debug_outputs.cpp.
|
inlineprotected |
Definition at line 112 of file test_debug_outputs.cpp.
|
inlineprotected |
Definition at line 102 of file test_debug_outputs.cpp.
|
inlineprotected |
Definition at line 123 of file test_debug_outputs.cpp.
|
inlineprotected |
Definition at line 107 of file test_debug_outputs.cpp.
|
inlineprotected |
Definition at line 117 of file test_debug_outputs.cpp.
|
inline |
Definition at line 79 of file test_debug_outputs.cpp.
|
protected |
Definition at line 146 of file test_debug_outputs.cpp.
|
protected |
Definition at line 144 of file test_debug_outputs.cpp.
|
protected |
Definition at line 143 of file test_debug_outputs.cpp.
|
protected |
Definition at line 142 of file test_debug_outputs.cpp.
|
protected |
Definition at line 145 of file test_debug_outputs.cpp.
|
protected |
Definition at line 135 of file test_debug_outputs.cpp.
|
protected |
Definition at line 133 of file test_debug_outputs.cpp.
|
protected |
Definition at line 134 of file test_debug_outputs.cpp.
|
protected |
Definition at line 132 of file test_debug_outputs.cpp.
|
protected |
Definition at line 136 of file test_debug_outputs.cpp.
|
protected |
Definition at line 141 of file test_debug_outputs.cpp.
|
protected |
Definition at line 139 of file test_debug_outputs.cpp.
|
protected |
Definition at line 138 of file test_debug_outputs.cpp.
|
protected |
Definition at line 140 of file test_debug_outputs.cpp.
|
protected |
Definition at line 137 of file test_debug_outputs.cpp.