1 #ifndef HEBIROS_PUBLISHERS_H 2 #define HEBIROS_PUBLISHERS_H 5 #include "sensor_msgs/JointState.h" 7 #include "hebiros/FeedbackMsg.h" 17 void feedback(hebiros::FeedbackMsg feedback_msg, std::string group_name);
18 void feedbackJointState(sensor_msgs::JointState joint_state_msg, std::string group_name);
20 void commandJointState(sensor_msgs::JointState joint_state_msg, std::string group_name);
void commandJointState(sensor_msgs::JointState joint_state_msg, std::string group_name)
void feedbackJointState(sensor_msgs::JointState joint_state_msg, std::string group_name)
static std::map< std::string, ros::Publisher > publishers
void registerGroupPublishers(std::string group_name)
void feedbackJointStateUrdf(sensor_msgs::JointState joint_state_msg, std::string group_name)
void feedback(hebiros::FeedbackMsg feedback_msg, std::string group_name)