|
void | cbDistance (const sensor_msgs::PointCloud::ConstPtr &msg) |
|
void | cbHysteresis (const nav_msgs::OccupancyGrid::ConstPtr &msg) |
|
void | cbMetrics (const neonavigation_metrics_msgs::Metrics::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) |
|
Definition at line 40 of file test_debug_outputs.cpp.
◆ DebugOutputsTest()
DebugOutputsTest::DebugOutputsTest |
( |
| ) |
|
|
inline |
◆ cbDistance()
void DebugOutputsTest::cbDistance |
( |
const sensor_msgs::PointCloud::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ cbHysteresis()
void DebugOutputsTest::cbHysteresis |
( |
const nav_msgs::OccupancyGrid::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ cbMetrics()
void DebugOutputsTest::cbMetrics |
( |
const neonavigation_metrics_msgs::Metrics::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ cbPath()
void DebugOutputsTest::cbPath |
( |
const nav_msgs::Path::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ cbRemembered()
void DebugOutputsTest::cbRemembered |
( |
const nav_msgs::OccupancyGrid::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ cbStatus()
void DebugOutputsTest::cbStatus |
( |
const planner_cspace_msgs::PlannerStatus::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ showMap()
void DebugOutputsTest::showMap |
( |
const nav_msgs::OccupancyGrid::ConstPtr & |
msg | ) |
|
|
inline |
◆ cnt_distance_
int DebugOutputsTest::cnt_distance_ |
|
protected |
◆ cnt_hysteresis_
int DebugOutputsTest::cnt_hysteresis_ |
|
protected |
◆ cnt_path_
int DebugOutputsTest::cnt_path_ |
|
protected |
◆ cnt_planner_ready_
int DebugOutputsTest::cnt_planner_ready_ |
|
protected |
◆ cnt_remembered_
int DebugOutputsTest::cnt_remembered_ |
|
protected |
◆ map_distance_
sensor_msgs::PointCloud::ConstPtr DebugOutputsTest::map_distance_ |
|
protected |
◆ map_hysteresis_
nav_msgs::OccupancyGrid::ConstPtr DebugOutputsTest::map_hysteresis_ |
|
protected |
◆ map_remembered_
nav_msgs::OccupancyGrid::ConstPtr DebugOutputsTest::map_remembered_ |
|
protected |
◆ metrics_
neonavigation_metrics_msgs::Metrics::ConstPtr DebugOutputsTest::metrics_ |
|
protected |
◆ nh_
◆ path_
nav_msgs::Path::ConstPtr DebugOutputsTest::path_ |
|
protected |
◆ sub_distance_
◆ sub_hysteresis_
◆ sub_metrics_
◆ sub_path_
◆ sub_remembered_
◆ sub_status_
The documentation for this class was generated from the following file: