3 #include <gazebo/common/common.hh> 4 #include <gazebo/gazebo.hh> 5 #include <gazebo/physics/physics.hh> 6 #include <gazebo/transport/transport.hh> 7 #include <gazebo/msgs/msgs.hh> 10 #include "sensor_msgs/JointState.h" 11 #include "std_srvs/Empty.h" 13 #include "hebiros/FeedbackMsg.h" 14 #include "hebiros/CommandMsg.h" 15 #include "hebiros/AddGroupFromNamesSrv.h" 16 #include "hebiros/SetCommandLifetimeSrv.h" 17 #include "hebiros/SetFeedbackFrequencySrv.h" 31 void Load(physics::ModelPtr _model, sdf::ElementPtr _sdf);
32 void OnUpdate(
const common::UpdateInfo & _info);
42 std::shared_ptr<ros::NodeHandle>
n;
47 void AddJointToGroup(std::shared_ptr<HebirosGazeboGroup> hebiros_group, std::string joint_name);
48 void UpdateGroup(std::shared_ptr<HebirosGazeboGroup> hebiros_group,
const ros::Duration& iteration_time);
50 bool SrvAddGroup(AddGroupFromNamesSrv::Request &req, AddGroupFromNamesSrv::Response &res);
ros::ServiceServer add_group_srv
event::ConnectionPtr update_connection
std::string robot_namespace
std::map< std::string, std::shared_ptr< HebirosGazeboGroup > > hebiros_groups
ros::Subscriber command_sub
ros::ServiceServer acknowledge_srv
std::map< std::string, std::shared_ptr< HebirosGazeboJoint > > hebiros_joints
std::shared_ptr< ros::NodeHandle > n