#include <ROSInterface.h>

Public Member Functions | |
| void | createPublisher (ros::NodeHandle &nh) |
| void | publish () |
| RangeSensorToROSRange (VirtualRangeSensor *rangesensor, std::string topic, int rate) | |
| ~RangeSensorToROSRange () | |
Private Attributes | |
| VirtualRangeSensor * | rs |
Definition at line 415 of file ROSInterface.h.
| RangeSensorToROSRange::RangeSensorToROSRange | ( | VirtualRangeSensor * | rangesensor, |
| std::string | topic, | ||
| int | rate | ||
| ) |
Definition at line 819 of file ROSInterface.cpp.
Definition at line 846 of file ROSInterface.cpp.
| void RangeSensorToROSRange::createPublisher | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 824 of file ROSInterface.cpp.
| void RangeSensorToROSRange::publish | ( | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 830 of file ROSInterface.cpp.
VirtualRangeSensor* RangeSensorToROSRange::rs [private] |
Definition at line 417 of file ROSInterface.h.