Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
DebugOutputsTest Class Reference
Inheritance diagram for DebugOutputsTest:
Inheritance graph
[legend]

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_
 

Detailed Description

Definition at line 39 of file test_debug_outputs.cpp.

Constructor & Destructor Documentation

DebugOutputsTest::DebugOutputsTest ( )
inline

Definition at line 42 of file test_debug_outputs.cpp.

Member Function Documentation

void DebugOutputsTest::cbDistance ( const sensor_msgs::PointCloud::ConstPtr &  msg)
inlineprotected

Definition at line 112 of file test_debug_outputs.cpp.

void DebugOutputsTest::cbHysteresis ( const nav_msgs::OccupancyGrid::ConstPtr &  msg)
inlineprotected

Definition at line 102 of file test_debug_outputs.cpp.

void DebugOutputsTest::cbPath ( const nav_msgs::Path::ConstPtr &  msg)
inlineprotected

Definition at line 123 of file test_debug_outputs.cpp.

void DebugOutputsTest::cbRemembered ( const nav_msgs::OccupancyGrid::ConstPtr &  msg)
inlineprotected

Definition at line 107 of file test_debug_outputs.cpp.

void DebugOutputsTest::cbStatus ( const planner_cspace_msgs::PlannerStatus::ConstPtr &  msg)
inlineprotected

Definition at line 117 of file test_debug_outputs.cpp.

void DebugOutputsTest::showMap ( const nav_msgs::OccupancyGrid::ConstPtr &  msg)
inline

Definition at line 79 of file test_debug_outputs.cpp.

Member Data Documentation

int DebugOutputsTest::cnt_distance_
protected

Definition at line 146 of file test_debug_outputs.cpp.

int DebugOutputsTest::cnt_hysteresis_
protected

Definition at line 144 of file test_debug_outputs.cpp.

int DebugOutputsTest::cnt_path_
protected

Definition at line 143 of file test_debug_outputs.cpp.

int DebugOutputsTest::cnt_planner_ready_
protected

Definition at line 142 of file test_debug_outputs.cpp.

int DebugOutputsTest::cnt_remembered_
protected

Definition at line 145 of file test_debug_outputs.cpp.

sensor_msgs::PointCloud::ConstPtr DebugOutputsTest::map_distance_
protected

Definition at line 135 of file test_debug_outputs.cpp.

nav_msgs::OccupancyGrid::ConstPtr DebugOutputsTest::map_hysteresis_
protected

Definition at line 133 of file test_debug_outputs.cpp.

nav_msgs::OccupancyGrid::ConstPtr DebugOutputsTest::map_remembered_
protected

Definition at line 134 of file test_debug_outputs.cpp.

ros::NodeHandle DebugOutputsTest::nh_
protected

Definition at line 132 of file test_debug_outputs.cpp.

nav_msgs::Path::ConstPtr DebugOutputsTest::path_
protected

Definition at line 136 of file test_debug_outputs.cpp.

ros::Subscriber DebugOutputsTest::sub_distance_
protected

Definition at line 141 of file test_debug_outputs.cpp.

ros::Subscriber DebugOutputsTest::sub_hysteresis_
protected

Definition at line 139 of file test_debug_outputs.cpp.

ros::Subscriber DebugOutputsTest::sub_path_
protected

Definition at line 138 of file test_debug_outputs.cpp.

ros::Subscriber DebugOutputsTest::sub_remembered_
protected

Definition at line 140 of file test_debug_outputs.cpp.

ros::Subscriber DebugOutputsTest::sub_status_
protected

Definition at line 137 of file test_debug_outputs.cpp.


The documentation for this class was generated from the following file:


planner_cspace
Author(s): Atsushi Watanabe
autogenerated on Wed May 12 2021 02:20:43