Go to the documentation of this file.
17 #ifndef GAZEBO_ROS_IMU_SENSOR_H
18 #define GAZEBO_ROS_IMU_SENSOR_H
20 #include <gazebo/common/Plugin.hh>
21 #include <gazebo/common/UpdateInfo.hh>
22 #include <ignition/math/Vector3.hh>
23 #include <ignition/math/Pose3.hh>
25 #include <sensor_msgs/Imu.h>
52 virtual void Load(sensors::SensorPtr sensor_, sdf::ElementPtr sdf_);
56 virtual void UpdateChild(
const gazebo::common::UpdateInfo &);
104 #endif //GAZEBO_ROS_IMU_SENSOR_H
bool LoadParameters()
Load the parameters from the sdf file.
common::Time last_time
last time on which the data was published.
sensor_msgs::Imu imu_msg
Ros IMU message.
Gazebo Ros imu sensor plugin.
virtual void Load(sensors::SensorPtr sensor_, sdf::ElementPtr sdf_)
Load the sensor.
virtual ~GazeboRosImuSensor()
Destructor.
ignition::math::Quaterniond orientation
Orientation data from the sensor.
std::string body_name
Name of the link of the IMU.
gazebo::event::ConnectionPtr connection
Pointer to the update event connection.
ignition::math::Pose3d offset
Offset parameter, position part is unused.
std::string topic_name
The data is published on the topic named: /robot_namespace/topic_name.
sdf::ElementPtr sdf
Pointer to the sdf config file.
double update_rate
Sensor update rate.
ros::Publisher imu_data_publisher
Ros Publisher for imu data.
GazeboRosImuSensor()
Constructor.
ignition::math::Vector3d accelerometer_data
Linear acceleration data from the sensor.
ignition::math::Vector3d gyroscope_data
Angular velocity data from the sensor.
sensors::ImuSensor * sensor
Pointer to the sensor.
std::string robot_namespace
The data is published on the topic named: /robot_namespace/topic_name.
ros::NodeHandle * node
Ros NodeHandle pointer.
double GuassianKernel(double mu, double sigma)
Gaussian noise generator.
double gaussian_noise
Gaussian noise.
virtual void UpdateChild(const gazebo::common::UpdateInfo &)
Update the sensor.
gazebo_plugins
Author(s): John Hsu
autogenerated on Thu Sep 5 2024 02:49:55