#include <ROSInterface.h>
Public Member Functions | |
void | createPublisher (ros::NodeHandle &nh) |
GPSSensorToROS (GPSSensor *sensor, std::string topic, int rate) | |
void | publish () |
~GPSSensorToROS () | |
Private Attributes | |
GPSSensor * | sensor_ |
Definition at line 313 of file ROSInterface.h.
GPSSensorToROS::GPSSensorToROS | ( | GPSSensor * | sensor, |
std::string | topic, | ||
int | rate | ||
) | [inline] |
Definition at line 318 of file ROSInterface.h.
GPSSensorToROS::~GPSSensorToROS | ( | ) | [inline] |
Definition at line 327 of file ROSInterface.h.
void GPSSensorToROS::createPublisher | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 521 of file ROSInterface.cpp.
void GPSSensorToROS::publish | ( | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 527 of file ROSInterface.cpp.
GPSSensor* GPSSensorToROS::sensor_ [private] |
Definition at line 315 of file ROSInterface.h.