29 #ifndef HECTOR_GAZEBO_PLUGINS_GAZEBO_ROS_SONAR_H 30 #define HECTOR_GAZEBO_PLUGINS_GAZEBO_ROS_SONAR_H 32 #include <gazebo/common/Plugin.hh> 37 #include <sensor_msgs/Range.h> 41 #include <dynamic_reconfigure/server.h> 53 virtual void Load(sensors::SensorPtr _sensor, sdf::ElementPtr _sdf);
82 #endif // HECTOR_GAZEBO_PLUGINS_GAZEBO_ROS_SONAR_H sensors::RaySensorPtr sensor_
ros::NodeHandle * node_handle_
virtual void Load(sensors::SensorPtr _sensor, sdf::ElementPtr _sdf)
ros::Publisher publisher_
SensorModel sensor_model_
event::ConnectionPtr updateConnection
virtual ~GazeboRosSonar()
physics::WorldPtr world
The parent World.
sensor_msgs::Range range_
boost::shared_ptr< dynamic_reconfigure::Server< SensorModelConfig > > dynamic_reconfigure_server_