GPSROSPlugin.hh
Go to the documentation of this file.
1 // Copyright (c) 2016 The UUV Simulator Authors.
2 // All rights reserved.
3 //
4 // Licensed under the Apache License, Version 2.0 (the "License");
5 // you may not use this file except in compliance with the License.
6 // You may obtain a copy of the License at
7 //
8 // http://www.apache.org/licenses/LICENSE-2.0
9 //
10 // Unless required by applicable law or agreed to in writing, software
11 // distributed under the License is distributed on an "AS IS" BASIS,
12 // WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
13 // See the License for the specific language governing permissions and
14 // limitations under the License.
15 
16 #ifndef __GPS_SENSOR_ROS_PLUGIN_HH__
17 #define __GPS_SENSOR_ROS_PLUGIN_HH__
18 
19 #include <gazebo/gazebo.hh>
20 #include <gazebo/sensors/sensors.hh>
21 #include <sensor_msgs/NavSatFix.h>
23 #include <ros/ros.h>
24 
25 namespace gazebo
26 {
28  {
30  public: GPSROSPlugin();
31 
33  public: virtual ~GPSROSPlugin();
34 
36  public: virtual void Load(sensors::SensorPtr _parent,
37  sdf::ElementPtr _sdf);
38 
40  public: bool OnUpdateGPS();
41 
43  protected: sensors::GpsSensorPtr gazeboGPSSensor;
44 
46  protected: sensor_msgs::NavSatFix gpsMessage;
47  };
48 }
49 
50 #endif // __GPS_SENSOR_ROS_PLUGIN_HH__
GPSROSPlugin()
Class constructor.
Definition: GPSROSPlugin.cc:21
bool OnUpdateGPS()
Update GPS ROS message.
Definition: GPSROSPlugin.cc:68
virtual ~GPSROSPlugin()
Class destructor.
Definition: GPSROSPlugin.cc:25
sensors::GpsSensorPtr gazeboGPSSensor
Pointer to the parent sensor.
Definition: GPSROSPlugin.hh:43
virtual void Load(sensors::SensorPtr _parent, sdf::ElementPtr _sdf)
Load module and read parameters from SDF.
Definition: GPSROSPlugin.cc:29
sensor_msgs::NavSatFix gpsMessage
Output GPS ROS message.
Definition: GPSROSPlugin.hh:46


uuv_sensor_ros_plugins
Author(s): Musa Morena Marcusso Manhaes , Sebastian Scherer , Luiz Ricardo Douat
autogenerated on Thu Jun 18 2020 03:28:33