17 #ifndef THORMANG3_GRIPPER_MODULE_H_ 18 #define THORMANG3_GRIPPER_MODULE_H_ 25 #include <std_msgs/Int16.h> 26 #include <std_msgs/Float64.h> 27 #include <std_msgs/String.h> 28 #include <std_msgs/Bool.h> 29 #include <sensor_msgs/JointState.h> 30 #include <boost/thread.hpp> 31 #include <eigen3/Eigen/Eigen> 32 #include <yaml-cpp/yaml.h> 37 #include "robotis_controller_msgs/JointCtrlModule.h" 38 #include "robotis_controller_msgs/StatusMsg.h" 39 #include "robotis_controller_msgs/SyncWriteItem.h" 44 #define NUM_GRIPPER_JOINTS 2 96 void process(std::map<std::string, robotis_framework::Dynamixel *> dxls, std::map<std::string, double> sensors);
double control_cycle_sec_
Eigen::MatrixXd goal_joint_tra_
ros::Publisher movement_done_pub_
std_msgs::String movement_done_msg_
boost::thread * tra_gene_tread_
Eigen::VectorXd present_joint_position_
sensor_msgs::JointState goal_joint_pose_msg_
Eigen::VectorXd present_joint_velocity_
void traGeneProcJointSpace()
ros::Publisher status_msg_pub_
void setModeMsgCallback(const std_msgs::String::ConstPtr &msg)
Eigen::VectorXd goal_joint_position_
ros::Publisher goal_torque_limit_pub_
ros::Publisher set_ctrl_module_pub_
void setJointPoseMsgCallback(const sensor_msgs::JointState::ConstPtr &msg)
void initialize(const int control_cycle_msec, robotis_framework::Robot *robot)
void publishStatusMsg(unsigned int type, std::string msg)
void process(std::map< std::string, robotis_framework::Dynamixel * > dxls, std::map< std::string, double > sensors)
std::map< std::string, int > joint_name_to_id_
boost::thread queue_thread_