43 #include <boost/shared_ptr.hpp> 44 #include <boost/thread.hpp> 49 #include <std_msgs/Bool.h> 52 #include <gazebo/gazebo.hh> 53 #include <gazebo/physics/physics.hh> 54 #include <gazebo/common/common.hh> 71 virtual void Load(gazebo::physics::ModelPtr parent, sdf::ElementPtr sdf);
80 std::string
getURDF(std::string param_name)
const;
86 void eStopCB(
const std_msgs::BoolConstPtr& e_stop_active);
virtual ~GazeboRosControlPlugin()
boost::thread deferred_load_thread_
ros::NodeHandle model_nh_
boost::shared_ptr< controller_manager::ControllerManager > controller_manager_
std::string getURDF(std::string param_name) const
gazebo::event::ConnectionPtr update_connection_
ros::Subscriber e_stop_sub_
gazebo::physics::ModelPtr parent_model_
ros::Time last_update_sim_time_ros_
boost::shared_ptr< gazebo_ros_control::RobotHWSim > robot_hw_sim_
bool parseTransmissionsFromURDF(const std::string &urdf_string)
ros::Time last_write_sim_time_ros_
std::vector< transmission_interface::TransmissionInfo > transmissions_
ros::Duration control_period_
void eStopCB(const std_msgs::BoolConstPtr &e_stop_active)
std::string robot_namespace_
std::string robot_description_
void load_robot_hw_sim_srv()
std::string robot_hw_sim_type_str_
boost::shared_ptr< pluginlib::ClassLoader< gazebo_ros_control::RobotHWSim > > robot_hw_sim_loader_
Plugin template for hardware interfaces for ros_control and Gazebo.
virtual void Load(gazebo::physics::ModelPtr parent, sdf::ElementPtr sdf)