16 #ifndef __GPS_SENSOR_ROS_PLUGIN_HH__ 17 #define __GPS_SENSOR_ROS_PLUGIN_HH__ 19 #include <gazebo/gazebo.hh> 20 #include <gazebo/sensors/sensors.hh> 21 #include <sensor_msgs/NavSatFix.h> 36 public:
virtual void Load(sensors::SensorPtr _parent,
37 sdf::ElementPtr _sdf);
50 #endif // __GPS_SENSOR_ROS_PLUGIN_HH__ GPSROSPlugin()
Class constructor.
bool OnUpdateGPS()
Update GPS ROS message.
virtual ~GPSROSPlugin()
Class destructor.
sensors::GpsSensorPtr gazeboGPSSensor
Pointer to the parent sensor.
virtual void Load(sensors::SensorPtr _parent, sdf::ElementPtr _sdf)
Load module and read parameters from SDF.
sensor_msgs::NavSatFix gpsMessage
Output GPS ROS message.