#include <front_joints_node.h>
Public Member Functions | |
front_joints () | |
void | joints (const dynamixel_msgs::MotorStateList::ConstPtr &state) |
Private Attributes | |
ros::Subscriber | creative_sub |
std::map< int, std::string > | front_servos |
ros::Publisher | joint_states_pub |
ros::NodeHandle | node |
Definition at line 23 of file front_joints_node.h.
Definition at line 6 of file front_joint_node.cpp.
void front_joints::joints | ( | const dynamixel_msgs::MotorStateList::ConstPtr & | state | ) |
Definition at line 33 of file front_joint_node.cpp.
ros::Subscriber front_joints::creative_sub [private] |
Definition at line 39 of file front_joints_node.h.
std::map<int,std::string> front_joints::front_servos [private] |
Definition at line 43 of file front_joints_node.h.
ros::Publisher front_joints::joint_states_pub [private] |
Definition at line 40 of file front_joints_node.h.
ros::NodeHandle front_joints::node [private] |
Definition at line 36 of file front_joints_node.h.