00001 00014 #ifndef BACK_JOINTS_NODE_H_ 00015 #define BACK_JOINTS_NODE_H_ 00016 00017 #include <ros/ros.h> 00018 #include <sensor_msgs/JointState.h> 00019 #include <dynamixel_msgs/MotorStateList.h> 00020 #include <dynamixel_msgs/MotorState.h> 00021 #include <math.h> 00022 00023 class back_joints 00024 { 00025 public: 00026 back_joints(); 00032 void joints(const dynamixel_msgs::MotorStateList::ConstPtr& state); 00033 00034 private: 00035 // main node handle 00036 ros::NodeHandle node; 00037 00038 // the ros subscriber and publisher 00039 ros::Subscriber asus_sub; 00040 ros::Publisher joint_states_pub; 00041 00042 // map to store the ids and the link names of each servo connected 00043 std::map<int, std::string> back_servos; 00044 }; 00045 00046 #endif