Public Member Functions | |
| void | scan_cb (const sensor_msgs::LaserScan::ConstPtr &msg) |
| getting range messages from your system and output fields of choice | |
| TestNode () | |
| Constructor. | |
| ~TestNode () | |
| Destructor. | |
Public Attributes | |
| string | input_scan_topic_ |
| ros::NodeHandle | nh_ |
| ros::Subscriber | scan_ |
| int | scan_id_ |
Definition at line 55 of file test_scan.cpp.
| TestNode::TestNode | ( | ) | [inline] |
Constructor.
Definition at line 69 of file test_scan.cpp.
| TestNode::~TestNode | ( | ) | [inline] |
Destructor.
Definition at line 78 of file test_scan.cpp.
| void TestNode::scan_cb | ( | const sensor_msgs::LaserScan::ConstPtr & | msg | ) | [inline] |
getting range messages from your system and output fields of choice
| msg | input laser scan |
Definition at line 86 of file test_scan.cpp.
| string TestNode::input_scan_topic_ |
Definition at line 62 of file test_scan.cpp.
Definition at line 58 of file test_scan.cpp.
Definition at line 60 of file test_scan.cpp.
Definition at line 63 of file test_scan.cpp.