#include <hebiros_subscribers_gazebo.h>
Public Member Functions | |
void | command (const boost::shared_ptr< hebiros::CommandMsg const > data, std::string group_name) |
void | feedback (const boost::shared_ptr< hebiros::FeedbackMsg const > data, std::string group_name) |
void | jointCommand (const boost::shared_ptr< sensor_msgs::JointState const > data, std::string group_name) |
void | registerGroupSubscribers (std::string group_name) |
Additional Inherited Members | |
Static Public Member Functions inherited from HebirosSubscribers | |
static bool | jointFound (std::string group_name, std::string joint_name) |
static void | jointNotFound (std::string joint_name) |
Static Public Attributes inherited from HebirosSubscribers | |
static std::map< std::string, ros::Subscriber > | subscribers |
Definition at line 11 of file hebiros_subscribers_gazebo.h.
void HebirosSubscribersGazebo::command | ( | const boost::shared_ptr< hebiros::CommandMsg const > | data, |
std::string | group_name | ||
) |
Definition at line 25 of file hebiros_subscribers_gazebo.cpp.
void HebirosSubscribersGazebo::feedback | ( | const boost::shared_ptr< hebiros::FeedbackMsg const > | data, |
std::string | group_name | ||
) |
Definition at line 43 of file hebiros_subscribers_gazebo.cpp.
void HebirosSubscribersGazebo::jointCommand | ( | const boost::shared_ptr< sensor_msgs::JointState const > | data, |
std::string | group_name | ||
) |
Definition at line 31 of file hebiros_subscribers_gazebo.cpp.
|
virtual |
Reimplemented from HebirosSubscribers.
Definition at line 8 of file hebiros_subscribers_gazebo.cpp.