#include <ROSInterface.h>

Public Member Functions | |
| virtual void | createSubscriber (ros::NodeHandle &nh) |
| virtual void | processData (const sensor_msgs::JointState::ConstPtr &js) |
| ROSJointStateToArm (std::string topic, boost::shared_ptr< SimulatedIAUV > arm) | |
| ~ROSJointStateToArm () | |
Private Attributes | |
| boost::shared_ptr< SimulatedIAUV > | arm |
Definition at line 209 of file ROSInterface.h.
| ROSJointStateToArm::ROSJointStateToArm | ( | std::string | topic, |
| boost::shared_ptr< SimulatedIAUV > | arm | ||
| ) |
Definition at line 287 of file ROSInterface.cpp.
Definition at line 318 of file ROSInterface.cpp.
| void ROSJointStateToArm::createSubscriber | ( | ros::NodeHandle & | nh | ) | [virtual] |
Implements ROSSubscriberInterface.
Definition at line 293 of file ROSInterface.cpp.
| void ROSJointStateToArm::processData | ( | const sensor_msgs::JointState::ConstPtr & | js | ) | [virtual] |
Definition at line 299 of file ROSInterface.cpp.
boost::shared_ptr<SimulatedIAUV> ROSJointStateToArm::arm [private] |
Definition at line 211 of file ROSInterface.h.