hebiros_publishers.h
Go to the documentation of this file.
1 #ifndef HEBIROS_PUBLISHERS_H
2 #define HEBIROS_PUBLISHERS_H
3 
4 #include "ros/ros.h"
5 #include "sensor_msgs/JointState.h"
6 
7 #include "hebiros/FeedbackMsg.h"
8 
9 
11 
12  public:
13 
14  static std::map<std::string, ros::Publisher> publishers;
15 
16  void registerGroupPublishers(std::string group_name);
17  void feedback(hebiros::FeedbackMsg feedback_msg, std::string group_name);
18  void feedbackJointState(sensor_msgs::JointState joint_state_msg, std::string group_name);
19  void feedbackJointStateUrdf(sensor_msgs::JointState joint_state_msg, std::string group_name);
20  void commandJointState(sensor_msgs::JointState joint_state_msg, std::string group_name);
21 
22 };
23 
24 #endif
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)


hebiros
Author(s): Xavier Artache , Matthew Tesch
autogenerated on Thu Sep 3 2020 04:08:14