19 #ifndef BASE_MODULE_H_ 20 #define BASE_MODULE_H_ 24 #include <std_msgs/Empty.h> 25 #include <std_msgs/String.h> 26 #include <std_msgs/Int32.h> 27 #include <sensor_msgs/JointState.h> 28 #include <boost/thread.hpp> 30 #include "rh_p12_rn_base_module_msgs/GetItemValue.h" 31 #include "robotis_controller_msgs/SyncWriteItem.h" 68 void setPosition(
const robotis_controller_msgs::SyncWriteItem::ConstPtr &msg);
72 rh_p12_rn_base_module_msgs::GetItemValue::Response &res);
75 void process(std::map<std::string, robotis_framework::Dynamixel *> dxls, std::map<std::string, double> sensors);
ros::Publisher present_current_pub_
void setPosition(const robotis_controller_msgs::SyncWriteItem::ConstPtr &msg)
boost::thread queue_thread_
ros::Publisher present_position_pub_
void process(std::map< std::string, robotis_framework::Dynamixel * > dxls, std::map< std::string, double > sensors)
robotis_framework::Robot * robot_
void initialize(const int control_cycle_msec, robotis_framework::Robot *robot)
bool getItemValueCallback(rh_p12_rn_base_module_msgs::GetItemValue::Request &req, rh_p12_rn_base_module_msgs::GetItemValue::Response &res)