Namespaces | |
namespace | gazebo::msgs |
Messages namespace. | |
Classes | |
class | GazeboGenerator |
Google protobuf message generator for gazebo::msgs. More... | |
class | MsgFactory |
A factory that generates protobuf message based on a string type. More... | |
Macros | |
#define | GZ_REGISTER_STATIC_MSG(_msgtype, _classname) |
Static message registration macro. | |
Functions | |
GAZEBO_VISIBLE void | AddBoxLink (msgs::Model &_model, const double _mass, const ignition::math::Vector3d &_size) |
Add a simple box link to a Model message. | |
GAZEBO_VISIBLE void | AddCylinderLink (msgs::Model &_model, const double _mass, const double _radius, const double _length) |
Add a simple cylinder link to a Model message. | |
GAZEBO_VISIBLE void | AddLinkGeom (Model &_msg, const Geometry &_geom) |
Add a link with a collision and visual of specified geometry to a model message. | |
GAZEBO_VISIBLE void | AddSphereLink (msgs::Model &_model, const double _mass, const double _radius) |
Add a simple sphere link to a Model message. | |
GAZEBO_VISIBLE msgs::Axis | AxisFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Axis from an axis SDF element. | |
GAZEBO_VISIBLE msgs::CameraSensor | CameraSensorFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::CameraSensor from a camera sensor SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | CameraSensorToSDF (const msgs::CameraSensor &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::CameraSensor. | |
GAZEBO_VISIBLE msgs::Collision | CollisionFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Collision from a collision SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | CollisionToSDF (const msgs::Collision &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Collision. | |
GAZEBO_VISIBLE msgs::ContactSensor | ContactSensorFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::ContactSensor from a contact sensor SDF element. | |
GAZEBO_VISIBLE msgs::Time | Convert (const common::Time &_t) |
Convert a common::Time to a msgs::Time. | |
GAZEBO_VISIBLE msgs::Color | Convert (const ignition::math::Color &_c) |
Convert an ignition::math::Color to a msgs::Color. | |
GAZEBO_VISIBLE msgs::Inertial | Convert (const ignition::math::Inertiald &_i) |
Convert an ignition::math::Inertiald to a msgs::Inertial. | |
GAZEBO_VISIBLE msgs::Inertial | Convert (const ignition::math::MassMatrix3d &_m) |
Convert an ignition::math::MassMatrix3d to a msgs::Inertial. | |
GAZEBO_VISIBLE msgs::PlaneGeom | Convert (const ignition::math::Planed &_p) |
Convert a ignition::math::Planed to a msgs::PlaneGeom. | |
GAZEBO_VISIBLE msgs::Pose | Convert (const ignition::math::Pose3d &_p) |
Convert a ignition::math::Pose to a msgs::Pose. | |
GAZEBO_VISIBLE msgs::Quaternion | Convert (const ignition::math::Quaterniond &_q) |
Convert a ignition::math::Quaterniond to a msgs::Quaternion. | |
GAZEBO_VISIBLE msgs::Vector2d | Convert (const ignition::math::Vector2d &_v) |
Convert a ignition::math::Vector2d to a msgs::Vector2d. | |
GAZEBO_VISIBLE msgs::Vector3d | Convert (const ignition::math::Vector3d &_v) |
Convert a ignition::math::Vector3 to a msgs::Vector3d. | |
GAZEBO_VISIBLE ignition::math::Color | Convert (const msgs::Color &_c) |
Convert a msgs::Color to a ignition::math::Color. | |
GAZEBO_VISIBLE ignition::math::Inertiald | Convert (const msgs::Inertial &_i) |
Convert a msgs::Inertial to an ignition::math::Inertiald. | |
GAZEBO_VISIBLE common::Time | Convert (const msgs::Time &_t) |
Convert a msgs::Time to a common::Time. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const bool _b) |
Convert a bool to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const char *_s) |
Convert a string literal to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const common::Time &_t) |
Convert a common::Time to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const double _v) |
Convert a double to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const ignition::math::Color &_c) |
Convert an ignition::math::Color to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const ignition::math::Pose3d &_p) |
Convert an ignition::math::Pose3d to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const ignition::math::Quaterniond &_q) |
Convert an ignition::math::Quaterniond to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const ignition::math::Vector3d &_v) |
Convert an ignition::math::Vector3d to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const int _i) |
Convert an int to a msgs::Any. | |
GAZEBO_VISIBLE msgs::Any | ConvertAny (const std::string &_s) |
Convert a std::string to a msgs::Any. | |
GAZEBO_VISIBLE std::string | ConvertGeometryType (const msgs::Geometry::Type _type) |
Convert a msgs::Geometry::Type to a string. | |
GAZEBO_VISIBLE msgs::Geometry::Type | ConvertGeometryType (const std::string &_str) |
Convert a string to a msgs::Geometry::Type enum. | |
GAZEBO_VISIBLE ignition::math::Planed | ConvertIgn (const msgs::PlaneGeom &_p) |
Convert a msgs::PlaneGeom to an ignition::math::Planed. | |
GAZEBO_VISIBLE ignition::math::Pose3d | ConvertIgn (const msgs::Pose &_p) |
Convert a msgs::Pose to an ignition::math::Pose. | |
GAZEBO_VISIBLE ignition::math::Quaterniond | ConvertIgn (const msgs::Quaternion &_q) |
Convert a msgs::Quaternion to an ignition::math::Quaternion. | |
GAZEBO_VISIBLE ignition::math::Vector2d | ConvertIgn (const msgs::Vector2d &_v) |
Convert a msgs::Vector2d to an ignition::math::Vector2d. | |
GAZEBO_VISIBLE ignition::math::Vector3d | ConvertIgn (const msgs::Vector3d &_v) |
Convert a msgs::Vector3d to an ignition::math::Vector. | |
GAZEBO_VISIBLE msgs::Color | ConvertIgnMsg (const ignition::msgs::Color &_msg) |
Convert ignition::msgs::Color to gazebo::msgs::Color. | |
GAZEBO_VISIBLE msgs::Material | ConvertIgnMsg (const ignition::msgs::Material &_msg) |
Convert ignition::msgs::Material to gazebo::msgs::Material. | |
GAZEBO_VISIBLE msgs::Material::Script | ConvertIgnMsg (const ignition::msgs::Material::Script &_script) |
Convert ignition::msgs::Material::Script to gazebo::msgs::Material::Script. | |
GAZEBO_VISIBLE msgs::Material::ShaderType | ConvertIgnMsg (const ignition::msgs::Material::ShaderType &_type) |
Convert ignition::msgs::Material::ShaderType to gazebo::msgs::Material::ShaderType. | |
GAZEBO_VISIBLE ignition::msgs::Color | ConvertIgnMsg (const msgs::Color &_msg) |
Convert gazebo::msgs::Color to ignition::msgs::Color. | |
GAZEBO_VISIBLE ignition::msgs::Material | ConvertIgnMsg (const msgs::Material &_msg) |
Convert gazebo::msgs::Material to ignition::msgs::Material. | |
GAZEBO_VISIBLE ignition::msgs::Material::Script | ConvertIgnMsg (const msgs::Material::Script &_script) |
Convert gazebo::msgs::Material::Script to ignition::msgs::Material::Script. | |
GAZEBO_VISIBLE ignition::msgs::Material::ShaderType | ConvertIgnMsg (const msgs::Material::ShaderType &_type) |
Convert gazebo::msgs::Material::ShaderType to ignition::msgs::Material::ShaderType. | |
GAZEBO_VISIBLE std::string | ConvertJointType (const msgs::Joint::Type &_type) |
Convert a msgs::Joint::Type to a string. | |
GAZEBO_VISIBLE msgs::Joint::Type | ConvertJointType (const std::string &_str) |
Convert a string to a msgs::Joint::Type enum. | |
GAZEBO_VISIBLE std::string | ConvertShaderType (const msgs::Material::ShaderType &_type) |
Convert a msgs::ShaderType to a string. | |
GAZEBO_VISIBLE msgs::Material::ShaderType | ConvertShaderType (const std::string &_str) |
Convert a string to a msgs::Material::ShaderType enum. | |
GAZEBO_VISIBLE msgs::Request * | CreateRequest (const std::string &_request, const std::string &_data="") |
Create a request message. | |
GAZEBO_VISIBLE msgs::Fog | FogFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Fog from a fog SDF element. | |
GAZEBO_VISIBLE msgs::Friction | FrictionFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Friction from a friction SDF element. | |
GAZEBO_VISIBLE msgs::Geometry | GeometryFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Geometry from a geometry SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | GeometryToSDF (const msgs::Geometry &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Geometry If _sdf is supplied and the _msg has non-empty repeated elements, any existing sdf elements will be removed from _sdf prior to adding the new elements from _msg. | |
GAZEBO_VISIBLE msgs::Header * | GetHeader (google::protobuf::Message &_message) |
Get the header from a protobuf message. | |
GAZEBO_VISIBLE msgs::GPSSensor | GPSSensorFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::GPSSensor from a gps sensor SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | GPSSensorToSDF (const msgs::GPSSensor &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::GPSSensor. | |
GAZEBO_VISIBLE msgs::GUI | GUIFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::GUI from a GUI SDF element. | |
GAZEBO_VISIBLE msgs::IMUSensor | IMUSensorFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::IMUSensor from an imu sensor SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | IMUSensorToSDF (const msgs::IMUSensor &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::IMUSensor. | |
GAZEBO_VISIBLE sdf::ElementPtr | InertialToSDF (const msgs::Inertial &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Inertial. | |
GAZEBO_VISIBLE void | Init (google::protobuf::Message &_message, const std::string &_id="") |
Initialize a message. | |
GAZEBO_VISIBLE msgs::Joint | JointFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Joint from a joint SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | JointToSDF (const msgs::Joint &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from msgs::Joint. | |
GAZEBO_VISIBLE msgs::Light | LightFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Light from a light SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | LightToSDF (const msgs::Light &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Light. | |
GAZEBO_VISIBLE sdf::ElementPtr | LinkToSDF (const msgs::Link &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Link. | |
GAZEBO_VISIBLE msgs::LogicalCameraSensor | LogicalCameraSensorFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::LogicalCameraSensor from a logical camera sensor. | |
GAZEBO_VISIBLE sdf::ElementPtr | LogicalCameraSensorToSDF (const msgs::LogicalCameraSensor &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::LogicalCameraSensor. | |
GAZEBO_VISIBLE sdf::ElementPtr | MaterialToSDF (const msgs::Material &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Material If _sdf is supplied and _msg has script uri's the <uri> elements will be removed from _sdf. | |
GAZEBO_VISIBLE msgs::MeshGeom | MeshFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::MeshGeom from a mesh SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | MeshToSDF (const msgs::MeshGeom &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Mesh. | |
GAZEBO_VISIBLE sdf::ElementPtr | ModelToSDF (const msgs::Model &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from msgs::Model. | |
GAZEBO_VISIBLE msgs::Plugin | PluginFromSDF (const sdf::ElementPtr _sdf) |
Create a msgs::Plugin from a plugin SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | PluginToSDF (const msgs::Plugin &_plugin, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Plugin. | |
GAZEBO_VISIBLE msgs::RaySensor | RaySensorFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::RaySensor from a ray sensor SDF element. | |
GAZEBO_VISIBLE msgs::Scene | SceneFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Scene from a scene SDF element. | |
GAZEBO_VISIBLE msgs::Sensor | SensorFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Sensor from a sensor SDF element. | |
GAZEBO_VISIBLE msgs::SensorNoise | SensorNoiseFromSDF (sdf::ElementPtr _elem) |
Create a msgs::SensorNoise from a sensor noise SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | SensorNoiseToSDF (const msgs::SensorNoise &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::SensorNoise. | |
GAZEBO_VISIBLE void | Set (common::Image &_img, const msgs::Image &_msg) |
Convert a msgs::Image to a common::Image. | |
GAZEBO_VISIBLE void | Set (msgs::Color *_c, const ignition::math::Color &_v) |
Set a msgs::Color from an ignition::math::Color. | |
GAZEBO_VISIBLE void | Set (msgs::Image *_msg, const common::Image &_i) |
Set a msgs::Image from a common::Image. | |
GAZEBO_VISIBLE void | Set (msgs::Inertial *_i, const ignition::math::Inertiald &_m) |
Set a msgs::Inertial from an ignition::math::Inertiald. | |
GAZEBO_VISIBLE void | Set (msgs::Inertial *_i, const ignition::math::MassMatrix3d &_m) |
Set a msgs::Inertial from an ignition::math::MassMatrix3d. | |
GAZEBO_VISIBLE void | Set (msgs::PlaneGeom *_p, const ignition::math::Planed &_v) |
Set a msgs::Plane from an ignition::math::Planed. | |
GAZEBO_VISIBLE void | Set (msgs::Pose *_p, const ignition::math::Pose3d &_v) |
Set a msgs::Pose from an ignition::math::Pose3d. | |
GAZEBO_VISIBLE void | Set (msgs::Quaternion *_q, const ignition::math::Quaterniond &_v) |
Set a msgs::Quaternion from an ignition::math::Quaterniond. | |
GAZEBO_VISIBLE void | Set (msgs::SphericalCoordinates *_s, const common::SphericalCoordinates &_v) |
Set a msgs::SphericalCoordinates from a common::SphericalCoordinates object. | |
GAZEBO_VISIBLE void | Set (msgs::Time *_t, const common::Time &_v) |
Set a msgs::Time from a common::Time. | |
GAZEBO_VISIBLE void | Set (msgs::Vector2d *_pt, const ignition::math::Vector2d &_v) |
Set a msgs::Vector2d from an ignition::math::Vector2d. | |
GAZEBO_VISIBLE void | Set (msgs::Vector3d *_pt, const ignition::math::Vector3d &_v) |
Set a msgs::Vector3d from an ignition::math::Vector3d. | |
GAZEBO_VISIBLE void | Stamp (msgs::Header *_header) |
Time stamp a header. | |
GAZEBO_VISIBLE void | Stamp (msgs::Time *_time) |
Set the time in a time message. | |
GAZEBO_VISIBLE msgs::Surface | SurfaceFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Surface from a surface SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | SurfaceToSDF (const msgs::Surface &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Surface. | |
GAZEBO_VISIBLE msgs::TrackVisual | TrackVisualFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::TrackVisual from a track visual SDF element. | |
GAZEBO_VISIBLE msgs::Visual | VisualFromSDF (sdf::ElementPtr _sdf) |
Create a msgs::Visual from a visual SDF element. | |
GAZEBO_VISIBLE sdf::ElementPtr | VisualToSDF (const msgs::Visual &_msg, sdf::ElementPtr _sdf=sdf::ElementPtr()) |
Create or update an SDF element from a msgs::Visual. | |
All messages and helper functions
#define GZ_REGISTER_STATIC_MSG | ( | _msgtype, | |
_classname ) |
Static message registration macro.
Use this macro to register messages.
[in] | _msgtype | Message type name. |
[in] | _classname | Class name for message. |
GAZEBO_VISIBLE void AddBoxLink | ( | msgs::Model & | _model, |
const double | _mass, | ||
const ignition::math::Vector3d & | _size ) |
Add a simple box link to a Model message.
The size and mass of the box are specified, and a single collision is added, along with an inertial block corresponding to a box of uniform density.
[out] | _model | The msgs::Model to which the link is added. |
[in] | _mass | Mass of the box. |
[in] | _size | Size of the box. |
GAZEBO_VISIBLE void AddCylinderLink | ( | msgs::Model & | _model, |
const double | _mass, | ||
const double | _radius, | ||
const double | _length ) |
Add a simple cylinder link to a Model message.
The radius, length, and mass of the cylinder are specified, and a single collision is added, along with an inertial block corresponding to a cylinder of uniform density with an axis of symmetry along the Z axis.
[out] | _model | The msgs::Model to which the link is added. |
[in] | _mass | Mass of the cylinder. |
[in] | _radius | Radius of the cylinder. |
[in] | _length | Length of the cylinder. |
GAZEBO_VISIBLE void AddLinkGeom | ( | Model & | _msg, |
const Geometry & | _geom ) |
Add a link with a collision and visual of specified geometry to a model message.
It does not set any inertial values.
[out] | _model | The msgs::Model object to receive a new link. |
[in] | _geom | Geometry to be added to collision and visual. |
GAZEBO_VISIBLE void AddSphereLink | ( | msgs::Model & | _model, |
const double | _mass, | ||
const double | _radius ) |
Add a simple sphere link to a Model message.
The size and mass of the sphere are specified, and a single collision is added, along with an inertial block corresponding to a sphere of uniform density.
[out] | _model | The msgs::Model to which the link is added. |
[in] | _mass | Mass of the sphere. |
[in] | _radius | Radius of the sphere. |
GAZEBO_VISIBLE msgs::Axis AxisFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Axis from an axis SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE msgs::CameraSensor CameraSensorFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::CameraSensor from a camera sensor SDF element.
[in] | _sdf | The camera sensor sdf element |
GAZEBO_VISIBLE sdf::ElementPtr CameraSensorToSDF | ( | const msgs::CameraSensor & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::CameraSensor.
[in] | _msg | CameraSensor messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::Collision CollisionFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Collision from a collision SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr CollisionToSDF | ( | const msgs::Collision & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Collision.
[in] | _msg | Collision messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::ContactSensor ContactSensorFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::ContactSensor from a contact sensor SDF element.
[in] | _sdf | The contact sensor sdf element |
GAZEBO_VISIBLE msgs::Time Convert | ( | const common::Time & | _t | ) |
Convert a common::Time to a msgs::Time.
[in] | _t | The time to convert |
GAZEBO_VISIBLE msgs::Color Convert | ( | const ignition::math::Color & | _c | ) |
Convert an ignition::math::Color to a msgs::Color.
[in] | _c | The color to convert |
GAZEBO_VISIBLE msgs::Inertial Convert | ( | const ignition::math::Inertiald & | _i | ) |
Convert an ignition::math::Inertiald to a msgs::Inertial.
[in] | _i | The Inertiald to convert |
GAZEBO_VISIBLE msgs::Inertial Convert | ( | const ignition::math::MassMatrix3d & | _m | ) |
Convert an ignition::math::MassMatrix3d to a msgs::Inertial.
[in] | _m | The MassMatrix3d to convert |
GAZEBO_VISIBLE msgs::PlaneGeom Convert | ( | const ignition::math::Planed & | _p | ) |
Convert a ignition::math::Planed to a msgs::PlaneGeom.
[in] | _p | The plane to convert |
GAZEBO_VISIBLE msgs::Pose Convert | ( | const ignition::math::Pose3d & | _p | ) |
Convert a ignition::math::Pose to a msgs::Pose.
[in] | _p | The pose to convert |
GAZEBO_VISIBLE msgs::Quaternion Convert | ( | const ignition::math::Quaterniond & | _q | ) |
Convert a ignition::math::Quaterniond to a msgs::Quaternion.
[in] | _q | The quaternion to convert |
GAZEBO_VISIBLE msgs::Vector2d Convert | ( | const ignition::math::Vector2d & | _v | ) |
Convert a ignition::math::Vector2d to a msgs::Vector2d.
[in] | _v | The vector to convert |
GAZEBO_VISIBLE msgs::Vector3d Convert | ( | const ignition::math::Vector3d & | _v | ) |
Convert a ignition::math::Vector3 to a msgs::Vector3d.
[in] | _v | The vector to convert |
GAZEBO_VISIBLE ignition::math::Color Convert | ( | const msgs::Color & | _c | ) |
Convert a msgs::Color to a ignition::math::Color.
[in] | _c | The color to convert |
GAZEBO_VISIBLE ignition::math::Inertiald Convert | ( | const msgs::Inertial & | _i | ) |
Convert a msgs::Inertial to an ignition::math::Inertiald.
[in] | _i | The inertial to convert |
GAZEBO_VISIBLE common::Time Convert | ( | const msgs::Time & | _t | ) |
Convert a msgs::Time to a common::Time.
[in] | _t | The time to convert |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const bool | _b | ) |
Convert a bool to a msgs::Any.
[in] | _b | The bool to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const char * | _s | ) |
Convert a string literal to a msgs::Any.
[in] | _s | The string to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const common::Time & | _t | ) |
Convert a common::Time to a msgs::Any.
[in] | _t | The time to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const double | _v | ) |
Convert a double to a msgs::Any.
[in] | _v | The double to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const ignition::math::Color & | _c | ) |
Convert an ignition::math::Color to a msgs::Any.
[in] | _c | The color to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const ignition::math::Pose3d & | _p | ) |
Convert an ignition::math::Pose3d to a msgs::Any.
[in] | _p | The pose to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const ignition::math::Quaterniond & | _q | ) |
Convert an ignition::math::Quaterniond to a msgs::Any.
[in] | _q | The quaternion to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const ignition::math::Vector3d & | _v | ) |
Convert an ignition::math::Vector3d to a msgs::Any.
[in] | _v | The vector to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const int | _i | ) |
Convert an int to a msgs::Any.
[in] | _i | The int to convert. |
GAZEBO_VISIBLE msgs::Any ConvertAny | ( | const std::string & | _s | ) |
Convert a std::string to a msgs::Any.
[in] | _s | The string to convert. |
GAZEBO_VISIBLE std::string ConvertGeometryType | ( | const msgs::Geometry::Type | _type | ) |
Convert a msgs::Geometry::Type to a string.
[in] | _type | A msgs::Geometry::Type enum. |
GAZEBO_VISIBLE msgs::Geometry::Type ConvertGeometryType | ( | const std::string & | _str | ) |
Convert a string to a msgs::Geometry::Type enum.
[in] | _str | Geometry type string. |
GAZEBO_VISIBLE ignition::math::Planed ConvertIgn | ( | const msgs::PlaneGeom & | _p | ) |
Convert a msgs::PlaneGeom to an ignition::math::Planed.
[in] | _p | The plane to convert |
GAZEBO_VISIBLE ignition::math::Pose3d ConvertIgn | ( | const msgs::Pose & | _p | ) |
Convert a msgs::Pose to an ignition::math::Pose.
[in] | _p | The pose to convert |
GAZEBO_VISIBLE ignition::math::Quaterniond ConvertIgn | ( | const msgs::Quaternion & | _q | ) |
Convert a msgs::Quaternion to an ignition::math::Quaternion.
[in] | _q | The quaternion to convert |
GAZEBO_VISIBLE ignition::math::Vector2d ConvertIgn | ( | const msgs::Vector2d & | _v | ) |
Convert a msgs::Vector2d to an ignition::math::Vector2d.
[in] | _v | The vector2 to convert |
GAZEBO_VISIBLE ignition::math::Vector3d ConvertIgn | ( | const msgs::Vector3d & | _v | ) |
Convert a msgs::Vector3d to an ignition::math::Vector.
[in] | _v | The plane to convert |
GAZEBO_VISIBLE msgs::Color ConvertIgnMsg | ( | const ignition::msgs::Color & | _msg | ) |
Convert ignition::msgs::Color to gazebo::msgs::Color.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE msgs::Material ConvertIgnMsg | ( | const ignition::msgs::Material & | _msg | ) |
Convert ignition::msgs::Material to gazebo::msgs::Material.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE msgs::Material::Script ConvertIgnMsg | ( | const ignition::msgs::Material::Script & | _script | ) |
Convert ignition::msgs::Material::Script to gazebo::msgs::Material::Script.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE msgs::Material::ShaderType ConvertIgnMsg | ( | const ignition::msgs::Material::ShaderType & | _type | ) |
Convert ignition::msgs::Material::ShaderType to gazebo::msgs::Material::ShaderType.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE ignition::msgs::Color ConvertIgnMsg | ( | const msgs::Color & | _msg | ) |
Convert gazebo::msgs::Color to ignition::msgs::Color.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE ignition::msgs::Material ConvertIgnMsg | ( | const msgs::Material & | _msg | ) |
Convert gazebo::msgs::Material to ignition::msgs::Material.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE ignition::msgs::Material::Script ConvertIgnMsg | ( | const msgs::Material::Script & | _script | ) |
Convert gazebo::msgs::Material::Script to ignition::msgs::Material::Script.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE ignition::msgs::Material::ShaderType ConvertIgnMsg | ( | const msgs::Material::ShaderType & | _type | ) |
Convert gazebo::msgs::Material::ShaderType to ignition::msgs::Material::ShaderType.
[in] | _msg | The message to convert |
GAZEBO_VISIBLE std::string ConvertJointType | ( | const msgs::Joint::Type & | _type | ) |
Convert a msgs::Joint::Type to a string.
[in] | _type | A msgs::Joint::Type enum. |
GAZEBO_VISIBLE msgs::Joint::Type ConvertJointType | ( | const std::string & | _str | ) |
Convert a string to a msgs::Joint::Type enum.
[in] | _str | Joint type string. |
GAZEBO_VISIBLE std::string ConvertShaderType | ( | const msgs::Material::ShaderType & | _type | ) |
Convert a msgs::ShaderType to a string.
[in] | _type | A msgs::ShaderType enum. |
GAZEBO_VISIBLE msgs::Material::ShaderType ConvertShaderType | ( | const std::string & | _str | ) |
Convert a string to a msgs::Material::ShaderType enum.
[in] | _str | Shader type string. |
GAZEBO_VISIBLE msgs::Request * CreateRequest | ( | const std::string & | _request, |
const std::string & | _data = "" ) |
Create a request message.
[in] | _request | Request string |
[in] | _data | Optional data string |
GAZEBO_VISIBLE msgs::Fog FogFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Fog from a fog SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE msgs::Friction FrictionFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Friction from a friction SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE msgs::Geometry GeometryFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Geometry from a geometry SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr GeometryToSDF | ( | const msgs::Geometry & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Geometry If _sdf is supplied and the _msg has non-empty repeated elements, any existing sdf elements will be removed from _sdf prior to adding the new elements from _msg.
[in] | _msg | Geometry messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::Header * GetHeader | ( | google::protobuf::Message & | _message | ) |
Get the header from a protobuf message.
[in] | _message | A google protobuf message |
GAZEBO_VISIBLE msgs::GPSSensor GPSSensorFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::GPSSensor from a gps sensor SDF element.
[in] | _sdf | The GPS sensor sdf element |
GAZEBO_VISIBLE sdf::ElementPtr GPSSensorToSDF | ( | const msgs::GPSSensor & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::GPSSensor.
[in] | _msg | GPSSensor messsage |
[in] | _sdf | If supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::GUI GUIFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::GUI from a GUI SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE msgs::IMUSensor IMUSensorFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::IMUSensor from an imu sensor SDF element.
[in] | _sdf | The IMU sensor sdf element |
GAZEBO_VISIBLE sdf::ElementPtr IMUSensorToSDF | ( | const msgs::IMUSensor & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::IMUSensor.
[in] | _msg | IMUSensor messsage |
[in] | _sdf | If supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE sdf::ElementPtr InertialToSDF | ( | const msgs::Inertial & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Inertial.
[in] | _msg | Inertial messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE void Init | ( | google::protobuf::Message & | _message, |
const std::string & | _id = "" ) |
Initialize a message.
[in] | _message | Message to initialize |
[in] | _id | Optional string id |
GAZEBO_VISIBLE msgs::Joint JointFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Joint from a joint SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr JointToSDF | ( | const msgs::Joint & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from msgs::Joint.
[in] | _msg | The msgs::Joint object. |
[in] | _sdf | if supplied, performs an update from _sdf instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::Light LightFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Light from a light SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr LightToSDF | ( | const msgs::Light & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Light.
[in] | _msg | Light messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE sdf::ElementPtr LinkToSDF | ( | const msgs::Link & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Link.
If _sdf is supplied and _msg has any collisions or visuals, the <collision> and <visual> elements will be removed from _sdf.
[in] | _msg | Link messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::LogicalCameraSensor LogicalCameraSensorFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::LogicalCameraSensor from a logical camera sensor.
SDF element
[in] | _sdf | The logical camera sensor sdf element |
GAZEBO_VISIBLE sdf::ElementPtr LogicalCameraSensorToSDF | ( | const msgs::LogicalCameraSensor & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::LogicalCameraSensor.
[in] | _msg | LogicalCameraSensor messsage |
[in] | _sdf | If supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE sdf::ElementPtr MaterialToSDF | ( | const msgs::Material & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Material If _sdf is supplied and _msg has script uri's the <uri> elements will be removed from _sdf.
[in] | _msg | Material messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::MeshGeom MeshFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::MeshGeom from a mesh SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr MeshToSDF | ( | const msgs::MeshGeom & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Mesh.
[in] | _msg | Mesh messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE sdf::ElementPtr ModelToSDF | ( | const msgs::Model & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from msgs::Model.
If _sdf is supplied and _msg has any links or joints, the <link> and <joint> elements will be removed from _sdf.
[in] | _msg | The msgs::Model object. |
[in] | _sdf | if supplied, performs an update from _sdf instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::Plugin PluginFromSDF | ( | const sdf::ElementPtr | _sdf | ) |
Create a msgs::Plugin from a plugin SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr PluginToSDF | ( | const msgs::Plugin & | _plugin, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Plugin.
[in] | _msg | Plugin messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::RaySensor RaySensorFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::RaySensor from a ray sensor SDF element.
[in] | _sdf | The ray sensor sdf element |
GAZEBO_VISIBLE msgs::Scene SceneFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Scene from a scene SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE msgs::Sensor SensorFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Sensor from a sensor SDF element.
[in] | _sdf | The sensor sdf element |
GAZEBO_VISIBLE msgs::SensorNoise SensorNoiseFromSDF | ( | sdf::ElementPtr | _elem | ) |
Create a msgs::SensorNoise from a sensor noise SDF element.
[in] | _sdf | The sensor noise sdf element |
GAZEBO_VISIBLE sdf::ElementPtr SensorNoiseToSDF | ( | const msgs::SensorNoise & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::SensorNoise.
[in] | _msg | SensorNoise messsage |
[in] | _sdf | If supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE void Set | ( | common::Image & | _img, |
const msgs::Image & | _msg ) |
Convert a msgs::Image to a common::Image.
[out] | _img | The common::Image container |
[in] | _msg | The Image message to convert |
GAZEBO_VISIBLE void Set | ( | msgs::Color * | _c, |
const ignition::math::Color & | _v ) |
Set a msgs::Color from an ignition::math::Color.
[out] | _p | A msgs::Color pointer |
[in] | _v | An ignition::math::Color reference |
GAZEBO_VISIBLE void Set | ( | msgs::Image * | _msg, |
const common::Image & | _i ) |
Set a msgs::Image from a common::Image.
[out] | _msg | A msgs::Image pointer |
[in] | _i | A common::Image reference |
GAZEBO_VISIBLE void Set | ( | msgs::Inertial * | _i, |
const ignition::math::Inertiald & | _m ) |
Set a msgs::Inertial from an ignition::math::Inertiald.
[out] | _i | A msgs::Inertial pointer |
[in] | _m | An ignition::math::Inertiald reference |
GAZEBO_VISIBLE void Set | ( | msgs::Inertial * | _i, |
const ignition::math::MassMatrix3d & | _m ) |
Set a msgs::Inertial from an ignition::math::MassMatrix3d.
[out] | _i | A msgs::Inertial pointer |
[in] | _m | An ignition::math::MassMatrix3d reference |
GAZEBO_VISIBLE void Set | ( | msgs::PlaneGeom * | _p, |
const ignition::math::Planed & | _v ) |
Set a msgs::Plane from an ignition::math::Planed.
[out] | _p | A msgs::Plane pointer |
[in] | _v | An ignition::math::Planed reference |
GAZEBO_VISIBLE void Set | ( | msgs::Pose * | _p, |
const ignition::math::Pose3d & | _v ) |
Set a msgs::Pose from an ignition::math::Pose3d.
[out] | _p | A msgs::Pose pointer |
[in] | _v | An ignition::math::Pose3d reference |
GAZEBO_VISIBLE void Set | ( | msgs::Quaternion * | _q, |
const ignition::math::Quaterniond & | _v ) |
Set a msgs::Quaternion from an ignition::math::Quaterniond.
[out] | _q | A msgs::Quaternion pointer |
[in] | _v | An ignition::math::Quaterniond reference |
GAZEBO_VISIBLE void Set | ( | msgs::SphericalCoordinates * | _s, |
const common::SphericalCoordinates & | _v ) |
Set a msgs::SphericalCoordinates from a common::SphericalCoordinates object.
[out] | _p | A msgs::SphericalCoordinates pointer. |
[in] | _v | A common::SphericalCoordinates reference |
GAZEBO_VISIBLE void Set | ( | msgs::Time * | _t, |
const common::Time & | _v ) |
Set a msgs::Time from a common::Time.
[out] | _p | A msgs::Time pointer |
[in] | _v | A common::Time reference |
GAZEBO_VISIBLE void Set | ( | msgs::Vector2d * | _pt, |
const ignition::math::Vector2d & | _v ) |
Set a msgs::Vector2d from an ignition::math::Vector2d.
[out] | _pt | A msgs::Vector2d pointer |
[in] | _v | An ignition::math::Vector2d reference |
GAZEBO_VISIBLE void Set | ( | msgs::Vector3d * | _pt, |
const ignition::math::Vector3d & | _v ) |
Set a msgs::Vector3d from an ignition::math::Vector3d.
[out] | _pt | A msgs::Vector3d pointer |
[in] | _v | An ignition::math::Vector3d reference |
GAZEBO_VISIBLE void Stamp | ( | msgs::Header * | _header | ) |
Time stamp a header.
[in] | _header | Header to stamp |
GAZEBO_VISIBLE void Stamp | ( | msgs::Time * | _time | ) |
Set the time in a time message.
[in] | _time | A Time message |
GAZEBO_VISIBLE msgs::Surface SurfaceFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Surface from a surface SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr SurfaceToSDF | ( | const msgs::Surface & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Surface.
[in] | _msg | Surface messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |
GAZEBO_VISIBLE msgs::TrackVisual TrackVisualFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::TrackVisual from a track visual SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE msgs::Visual VisualFromSDF | ( | sdf::ElementPtr | _sdf | ) |
Create a msgs::Visual from a visual SDF element.
[in] | _sdf | The sdf element |
GAZEBO_VISIBLE sdf::ElementPtr VisualToSDF | ( | const msgs::Visual & | _msg, |
sdf::ElementPtr | _sdf = sdf::ElementPtr() ) |
Create or update an SDF element from a msgs::Visual.
[in] | _msg | Visual messsage |
[in] | _sdf | if supplied, performs an update from _msg instead of creating a new sdf element. |