#include <ROSInterface.h>
Public Member Functions | |
virtual void | createSubscriber (ros::NodeHandle &nh) |
virtual void | processData (const nav_msgs::Odometry::ConstPtr &odom) |
ROSOdomToPAT (osg::Group *rootNode, std::string topic, std::string vehicleName) | |
~ROSOdomToPAT () | |
Private Attributes | |
ros::WallTime | last |
int | started |
osg::ref_ptr < osg::MatrixTransform > | transform |
Definition at line 116 of file ROSInterface.h.
ROSOdomToPAT::ROSOdomToPAT | ( | osg::Group * | rootNode, |
std::string | topic, | ||
std::string | vehicleName | ||
) |
Definition at line 50 of file ROSInterface.cpp.
Definition at line 127 of file ROSInterface.cpp.
void ROSOdomToPAT::createSubscriber | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSSubscriberInterface.
Definition at line 67 of file ROSInterface.cpp.
void ROSOdomToPAT::processData | ( | const nav_msgs::Odometry::ConstPtr & | odom | ) | [virtual] |
Definition at line 77 of file ROSInterface.cpp.
ros::WallTime ROSOdomToPAT::last [private] |
Definition at line 119 of file ROSInterface.h.
int ROSOdomToPAT::started [private] |
Definition at line 120 of file ROSInterface.h.
osg::ref_ptr<osg::MatrixTransform> ROSOdomToPAT::transform [private] |
Definition at line 118 of file ROSInterface.h.