#include <R2RosTreeFk.hpp>
Public Member Functions | |
void | jointStatesCallback (const sensor_msgs::JointState &msg) |
R2RosTreeFk (std::string urdf) | |
void | setup (std::string inputJointStatesName, std::string outputPoseStatesName) |
virtual | ~R2RosTreeFk () |
Private Attributes | |
ros::Subscriber | jointStatesIn |
ros::Publisher | poseStatesOut |
nasa_r2_common_msgs::PoseState | poseStatesOutMsg |
RosMsgTreeFk | treeFk |
Definition at line 7 of file R2RosTreeFk.hpp.
R2RosTreeFk::R2RosTreeFk | ( | std::string | urdf | ) |
Definition at line 3 of file R2RosTreeFk.cpp.
virtual R2RosTreeFk::~R2RosTreeFk | ( | ) | [inline, virtual] |
Definition at line 11 of file R2RosTreeFk.hpp.
void R2RosTreeFk::jointStatesCallback | ( | const sensor_msgs::JointState & | msg | ) |
Definition at line 15 of file R2RosTreeFk.cpp.
void R2RosTreeFk::setup | ( | std::string | inputJointStatesName, |
std::string | outputPoseStatesName | ||
) |
Publishers and subscribers
Definition at line 8 of file R2RosTreeFk.cpp.
ros::Subscriber R2RosTreeFk::jointStatesIn [private] |
Definition at line 17 of file R2RosTreeFk.hpp.
ros::Publisher R2RosTreeFk::poseStatesOut [private] |
Definition at line 16 of file R2RosTreeFk.hpp.
Definition at line 19 of file R2RosTreeFk.hpp.
RosMsgTreeFk R2RosTreeFk::treeFk [private] |
Definition at line 21 of file R2RosTreeFk.hpp.