#include <gazebo_ros_sonar.h>
|
| virtual void | Load (sensors::SensorPtr _sensor, sdf::ElementPtr _sdf) |
| |
| virtual void | Reset () |
| |
| virtual void | Update () |
| |
Definition at line 46 of file gazebo_ros_sonar.h.
| gazebo::GazeboRosSonar::GazeboRosSonar |
( |
| ) |
|
| gazebo::GazeboRosSonar::~GazeboRosSonar |
( |
| ) |
|
|
virtual |
| void gazebo::GazeboRosSonar::Load |
( |
sensors::SensorPtr |
_sensor, |
|
|
sdf::ElementPtr |
_sdf |
|
) |
| |
|
protectedvirtual |
| void gazebo::GazeboRosSonar::Reset |
( |
| ) |
|
|
protectedvirtual |
| void gazebo::GazeboRosSonar::Update |
( |
| ) |
|
|
protectedvirtual |
| boost::shared_ptr<dynamic_reconfigure::Server<SensorModelConfig> > gazebo::GazeboRosSonar::dynamic_reconfigure_server_ |
|
private |
| std::string gazebo::GazeboRosSonar::frame_id_ |
|
private |
| std::string gazebo::GazeboRosSonar::namespace_ |
|
private |
| sensor_msgs::Range gazebo::GazeboRosSonar::range_ |
|
private |
| sensors::RaySensorPtr gazebo::GazeboRosSonar::sensor_ |
|
private |
| std::string gazebo::GazeboRosSonar::topic_ |
|
private |
| physics::WorldPtr gazebo::GazeboRosSonar::world |
|
private |
The documentation for this class was generated from the following files: