#include <ROSInterface.h>
Public Member Functions | |
void | createPublisher (ros::NodeHandle &nh) |
PATToROSOdom (osg::Group *rootNode, std::string vehicleName, std::string topic, int rate) | |
void | publish () |
~PATToROSOdom () | |
Private Attributes | |
osg::ref_ptr < osg::MatrixTransform > | transform |
Definition at line 252 of file ROSInterface.h.
PATToROSOdom::PATToROSOdom | ( | osg::Group * | rootNode, |
std::string | vehicleName, | ||
std::string | topic, | ||
int | rate | ||
) |
Definition at line 392 of file ROSInterface.cpp.
Definition at line 451 of file ROSInterface.cpp.
void PATToROSOdom::createPublisher | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 409 of file ROSInterface.cpp.
void PATToROSOdom::publish | ( | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 415 of file ROSInterface.cpp.
osg::ref_ptr<osg::MatrixTransform> PATToROSOdom::transform [private] |
Definition at line 254 of file ROSInterface.h.