#include <ROSInterface.h>
Public Member Functions | |
void | createPublisher (ros::NodeHandle &nh) |
MultibeamSensorToROS (MultibeamSensor *multibeamSensor, std::string topic, int rate) | |
void | publish () |
~MultibeamSensorToROS () | |
Private Attributes | |
MultibeamSensor * | MB |
Definition at line 395 of file ROSInterface.h.
MultibeamSensorToROS::MultibeamSensorToROS | ( | MultibeamSensor * | multibeamSensor, |
std::string | topic, | ||
int | rate | ||
) |
Definition at line 782 of file ROSInterface.cpp.
Definition at line 839 of file ROSInterface.cpp.
void MultibeamSensorToROS::createPublisher | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 787 of file ROSInterface.cpp.
void MultibeamSensorToROS::publish | ( | ) | [virtual] |
MultibeamSensor* MultibeamSensorToROS::MB [private] |
Definition at line 397 of file ROSInterface.h.