#include <ROSInterface.h>
Public Member Functions | |
void | createPublisher (ros::NodeHandle &nh) |
void | publish () |
WorldToROSTF (osg::Group *rootNode, std::vector< boost::shared_ptr< SimulatedIAUV > > iauvFile, std::vector< osg::ref_ptr< osg::Node > > objects, std::string worldRootName, unsigned int enableObjects, int rate) | |
~WorldToROSTF () | |
Private Attributes | |
unsigned int | enableObjects_ |
std::vector< boost::shared_ptr < SimulatedIAUV > > | iauvFile_ |
std::vector< osg::ref_ptr < osg::Node > > | objects_ |
std::vector< boost::shared_ptr < robot_state_publisher::RobotStatePublisher > > | robot_pubs_ |
osg::Group * | rootNode_ |
boost::shared_ptr < tf::TransformBroadcaster > | tfpub_ |
std::vector< osg::ref_ptr < osg::MatrixTransform > > | transforms_ |
std::string | worldRootName_ |
Definition at line 279 of file ROSInterface.h.
WorldToROSTF::WorldToROSTF | ( | osg::Group * | rootNode, |
std::vector< boost::shared_ptr< SimulatedIAUV > > | iauvFile, | ||
std::vector< osg::ref_ptr< osg::Node > > | objects, | ||
std::string | worldRootName, | ||
unsigned int | enableObjects, | ||
int | rate | ||
) |
Definition at line 971 of file ROSInterface.cpp.
Definition at line 1175 of file ROSInterface.cpp.
void WorldToROSTF::createPublisher | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 1010 of file ROSInterface.cpp.
void WorldToROSTF::publish | ( | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 1015 of file ROSInterface.cpp.
unsigned int WorldToROSTF::enableObjects_ [private] |
Definition at line 287 of file ROSInterface.h.
std::vector< boost::shared_ptr<SimulatedIAUV> > WorldToROSTF::iauvFile_ [private] |
Definition at line 284 of file ROSInterface.h.
std::vector<osg::ref_ptr<osg::Node> > WorldToROSTF::objects_ [private] |
Definition at line 285 of file ROSInterface.h.
std::vector< boost::shared_ptr<robot_state_publisher::RobotStatePublisher> > WorldToROSTF::robot_pubs_ [private] |
Definition at line 282 of file ROSInterface.h.
osg::Group* WorldToROSTF::rootNode_ [private] |
Definition at line 288 of file ROSInterface.h.
boost::shared_ptr<tf::TransformBroadcaster> WorldToROSTF::tfpub_ [private] |
Definition at line 283 of file ROSInterface.h.
std::vector< osg::ref_ptr<osg::MatrixTransform> > WorldToROSTF::transforms_ [private] |
Definition at line 281 of file ROSInterface.h.
std::string WorldToROSTF::worldRootName_ [private] |
Definition at line 286 of file ROSInterface.h.