#include <ROSInterface.h>

Public Member Functions | |
| virtual void | createSubscriber (ros::NodeHandle &nh) |
| virtual void | processData (const geometry_msgs::TwistStamped::ConstPtr &odom) |
| ROSTwistToPAT (osg::Group *rootNode, std::string topic, std::string vehicleName) | |
| ~ROSTwistToPAT () | |
Private Attributes | |
| ros::WallTime | last |
| int | started |
| osg::ref_ptr < osg::MatrixTransform > | transform |
Definition at line 131 of file ROSInterface.h.
| ROSTwistToPAT::ROSTwistToPAT | ( | osg::Group * | rootNode, |
| std::string | topic, | ||
| std::string | vehicleName | ||
| ) |
Definition at line 131 of file ROSInterface.cpp.
Definition at line 190 of file ROSInterface.cpp.
| void ROSTwistToPAT::createSubscriber | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSSubscriberInterface.
Definition at line 148 of file ROSInterface.cpp.
| void ROSTwistToPAT::processData | ( | const geometry_msgs::TwistStamped::ConstPtr & | odom | ) | [virtual] |
Definition at line 154 of file ROSInterface.cpp.
ros::WallTime ROSTwistToPAT::last [private] |
Definition at line 134 of file ROSInterface.h.
int ROSTwistToPAT::started [private] |
Definition at line 135 of file ROSInterface.h.
osg::ref_ptr<osg::MatrixTransform> ROSTwistToPAT::transform [private] |
Definition at line 133 of file ROSInterface.h.