10 subscribers[
"hebiros/"+group_name+
"/command"] =
14 subscribers[
"hebiros/"+group_name+
"/command/joint_state"] =
16 "hebiros/"+group_name+
"/command/joint_state", 100,
19 subscribers[
"hebiros_gazebo_plugin/feedback/"+group_name] =
21 "hebiros_gazebo_plugin/feedback/"+group_name, 100,
26 std::string group_name) {
34 CommandMsg command_msg;
35 command_msg.name = data->name;
36 command_msg.position = data->position;
37 command_msg.velocity = data->velocity;
38 command_msg.effort = data->effort;
44 std::string group_name) {
50 ROS_WARN(
"Improper group type during feedback call");
54 FeedbackMsg feedback_msg = *data;
55 sensor_msgs::JointState joint_state_msg;
57 joint_state_msg.name = feedback_msg.name;
58 joint_state_msg.position = feedback_msg.position;
59 joint_state_msg.velocity = feedback_msg.velocity;
60 joint_state_msg.effort = feedback_msg.effort;
void command(hebiros::CommandMsg command_msg, std::string group_name)
void jointCommand(const boost::shared_ptr< sensor_msgs::JointState const > data, std::string group_name)
static HebirosPublishersGazebo publishers_gazebo
sensor_msgs::JointState joint_state_msg
void command(const boost::shared_ptr< hebiros::CommandMsg const > data, std::string group_name)
static std::shared_ptr< ros::NodeHandle > n_ptr
hebiros::FeedbackMsg feedback_msg
static HebirosGroupRegistry & Instance()
HebirosGroup * getGroup(const std::string &name)
void feedback(const boost::shared_ptr< hebiros::FeedbackMsg const > data, std::string group_name)
void feedbackJointState(sensor_msgs::JointState joint_state_msg, std::string group_name)
void registerGroupSubscribers(std::string group_name)
void feedback(hebiros::FeedbackMsg feedback_msg, std::string group_name)