#include <JointStatePublisher.hpp>
Public Member Functions | |
bool | configureHook () |
JointStatePublisher (const std::string &name) | |
void | updateHook () |
~JointStatePublisher () | |
Protected Attributes | |
RTT::Property< std::vector < std::string > > | joint_names_prop |
RTT::OutputPort < sensor_msgs::JointState > | joint_state_port_ |
RTT::InputPort< std::vector < double > > | msr_jnt_pos_port_ |
Private Attributes | |
std::vector< double > | jnt_pos_ |
sensor_msgs::JointState | joint_state_ |
std::vector< std::string > | names_ |
unsigned int | number_of_joints_ |
Definition at line 43 of file JointStatePublisher.hpp.
JointStatePublisher::JointStatePublisher | ( | const std::string & | name | ) |
Definition at line 39 of file JointStatePublisher.cpp.
Definition at line 50 of file JointStatePublisher.cpp.
bool JointStatePublisher::configureHook | ( | ) | [virtual] |
Reimplemented from RTT::base::TaskCore.
Definition at line 54 of file JointStatePublisher.cpp.
void JointStatePublisher::updateHook | ( | ) | [virtual] |
Reimplemented from RTT::base::TaskCore.
Definition at line 72 of file JointStatePublisher.cpp.
std::vector<double> JointStatePublisher::jnt_pos_ [private] |
Definition at line 58 of file JointStatePublisher.hpp.
RTT::Property<std::vector<std::string> > JointStatePublisher::joint_names_prop [protected] |
Definition at line 55 of file JointStatePublisher.hpp.
sensor_msgs::JointState JointStatePublisher::joint_state_ [private] |
Definition at line 57 of file JointStatePublisher.hpp.
RTT::OutputPort<sensor_msgs::JointState> JointStatePublisher::joint_state_port_ [protected] |
Definition at line 53 of file JointStatePublisher.hpp.
RTT::InputPort<std::vector<double> > JointStatePublisher::msr_jnt_pos_port_ [protected] |
Definition at line 52 of file JointStatePublisher.hpp.
std::vector<std::string> JointStatePublisher::names_ [private] |
Definition at line 60 of file JointStatePublisher.hpp.
unsigned int JointStatePublisher::number_of_joints_ [private] |
Definition at line 59 of file JointStatePublisher.hpp.