MagnetometerROSPlugin
class gazebo::MagnetometerROSPlugin
¶
class gazebo::MagnetometerROSPlugin : public gazebo::ROSBaseModelPlugin
Summary¶
Members | Descriptions |
---|---|
public MagnetometerROSPlugin () |
Class constructor. |
public virtual ~MagnetometerROSPlugin () |
Class destructor. |
public virtual void Load (physics::ModelPtr _model,sdf::ElementPtr _sdf) |
Load the plugin. |
protected MagnetometerParameters
parameters |
Magnetometer configuration parameters: |
protected ignition::math::Vector3d magneticFieldWorld |
Reference magnetic field in world frame: |
protected ignition::math::Vector3d turnOnBias |
Constant turn-on bias [muT]. |
protected ignition::math::Vector3d measMagneticField |
Last measurement of magnetic field. |
protected sensor_msgs::MagneticField rosMsg |
ROS message. |
protected virtual bool OnUpdate (const common::UpdateInfo & _info) |
Update sensor measurement. |
Members¶
public
MagnetometerROSPlugin
()
¶
Class constructor.
public virtual
~MagnetometerROSPlugin
()
¶
Class destructor.
public virtual void
Load
(physics::ModelPtr _model,sdf::ElementPtr _sdf)
¶
Load the plugin.
protected
MagnetometerParameters
parameters
¶
Magnetometer configuration parameters:
protected ignition::math::Vector3d
magneticFieldWorld
¶
Reference magnetic field in world frame:
protected ignition::math::Vector3d
turnOnBias
¶
Constant turn-on bias [muT].
protected ignition::math::Vector3d
measMagneticField
¶
Last measurement of magnetic field.
protected sensor_msgs::MagneticField
rosMsg
¶
ROS message.
protected virtual bool
OnUpdate
(const common::UpdateInfo & _info)
¶
Update sensor measurement.