MagnetometerROSPlugin
class gazebo::MagnetometerROSPlugin¶
class gazebo::MagnetometerROSPlugin : public gazebo::ROSBaseModelPlugin
Summary¶
| Members | Descriptions |
|---|---|
publicMagnetometerROSPlugin() |
Class constructor. |
public virtual~MagnetometerROSPlugin() |
Class destructor. |
public virtual voidLoad(physics::ModelPtr _model,sdf::ElementPtr _sdf) |
Load the plugin. |
protectedMagnetometerParametersparameters |
Magnetometer configuration parameters: |
protected ignition::math::Vector3dmagneticFieldWorld |
Reference magnetic field in world frame: |
protected ignition::math::Vector3dturnOnBias |
Constant turn-on bias [muT]. |
protected ignition::math::Vector3dmeasMagneticField |
Last measurement of magnetic field. |
protected sensor_msgs::MagneticFieldrosMsg |
ROS message. |
protected virtual boolOnUpdate(const common::UpdateInfo & _info) |
Update sensor measurement. |
Members¶
publicMagnetometerROSPlugin()¶
Class constructor.
public virtual~MagnetometerROSPlugin()¶
Class destructor.
public virtual voidLoad(physics::ModelPtr _model,sdf::ElementPtr _sdf)¶
Load the plugin.
protectedMagnetometerParametersparameters¶
Magnetometer configuration parameters:
protected ignition::math::Vector3dmagneticFieldWorld¶
Reference magnetic field in world frame:
protected ignition::math::Vector3dturnOnBias¶
Constant turn-on bias [muT].
protected ignition::math::Vector3dmeasMagneticField¶
Last measurement of magnetic field.
protected sensor_msgs::MagneticFieldrosMsg¶
ROS message.
protected virtual boolOnUpdate(const common::UpdateInfo & _info)¶
Update sensor measurement.