#include <ROSInterface.h>
Public Member Functions | |
ArmToROSJointState (SimulatedIAUV *arm, std::string topic, int rate) | |
void | createPublisher (ros::NodeHandle &nh) |
void | publish () |
~ArmToROSJointState () | |
Private Attributes | |
boost::shared_ptr< URDFRobot > | arm |
Definition at line 351 of file ROSInterface.h.
ArmToROSJointState::ArmToROSJointState | ( | SimulatedIAUV * | arm, |
std::string | topic, | ||
int | rate | ||
) |
Definition at line 569 of file ROSInterface.cpp.
Definition at line 600 of file ROSInterface.cpp.
void ArmToROSJointState::createPublisher | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 575 of file ROSInterface.cpp.
void ArmToROSJointState::publish | ( | ) | [virtual] |
Implements ROSPublisherInterface.
Definition at line 581 of file ROSInterface.cpp.
boost::shared_ptr<URDFRobot> ArmToROSJointState::arm [private] |
Definition at line 353 of file ROSInterface.h.