Deprecated List
Member gazebo::common::Color::GetAsHSV () const GAZEBO_DEPRECATED(6.0)
See HSV() function that returns an ignition::math::Vector3d object.
Member gazebo::common::Color::GetAsYUV () const
See YUV() function that returns an ignition::math::Vector3d object.
Member gazebo::common::Dem::FillHeightMap (int _subSampling, unsigned int _vertSize, const math::Vector3 &_size, const math::Vector3 &_scale, bool _flipY, std::vector< float > &_heights) GAZEBO_DEPRECATED(6.0)
See FillHeightMap() function that accepts ignition::math objects.
Member gazebo::common::Dem::GetGeoReferenceOrigin (math::Angle &_latitude, math::Angle &_longitude) GAZEBO_DEPRECATED(6.0)
See GetGeoReferenceOrigin() that accepts ignition::math::Angle objects.
Member gazebo::common::GTSMeshUtils::DelaunayTriangulation (const std::vector< math::Vector2d > &_vertices, const std::vector< math::Vector2i > &_edges, SubMesh *_submesh) GAZEBO_DEPRECATED(6.0)
See DelaunayTriangulation function that accepts ignition::math objects.
Member gazebo::common::HeightmapData::FillHeightMap (int _subSampling, unsigned int _vertSize, const math::Vector3 &_size, const math::Vector3 &_scale, bool _flipY, std::vector< float > &_heights) GAZEBO_DEPRECATED(6.0)=0
See FillHeightMap() that accepts ignition::math::Vector3d objects.
Member gazebo::common::Mesh::Center (const math::Vector3 &_center=math::Vector3::Zero) GAZEBO_DEPRECATED(6.0)
See Center function that accepts ignition::math::Vector3
Member gazebo::common::Mesh::GenSphericalTexCoord (const math::Vector3 &_center) GAZEBO_DEPRECATED(6.0)
See GenSphericalTexCoord that accepts ignition::math::Vector3d.
Member gazebo::common::Mesh::GetAABB (math::Vector3 &_center, math::Vector3 &_min_xyz, math::Vector3 &_max_xyz) const GAZEBO_DEPRECATED(6.0)
See GetAABB function that accepts ignition::math::Vector3d
Member gazebo::common::Mesh::GetMax () const GAZEBO_DEPRECATED(6.0)
See Max function that returns ignition::math::Vector3d
Member gazebo::common::Mesh::GetMin () const GAZEBO_DEPRECATED(6.0)
See Min function that returns ignition::math::Vector3d
Member gazebo::common::Mesh::SetScale (const math::Vector3 &_factor) GAZEBO_DEPRECATED(6.0)
See SetScale function that accepts ignition::math::Vector3d
Member gazebo::common::Mesh::Translate (const math::Vector3 &_vec) GAZEBO_DEPRECATED(6.0)
See Translate function that accepts ignition::math::Vector3d.
Member gazebo::common::MeshCSG::CreateBoolean (const Mesh *_m1, const Mesh *_m2, const int _operation, const math::Pose &_offset=math::Pose::Zero) GAZEBO_DEPRECATED(6.0)
See CreateBoolean function that accepts ignition math objects
Member gazebo::common::MeshManager::CreateBox (const std::string &_name, const math::Vector3 &_sides, const math::Vector2d &_uvCoords) GAZEBO_DEPRECATED(6.0)
See CreateBox function that accepts ignition::math::Vector3d and ignition::math::Vector2d.
Member gazebo::common::MeshManager::CreateExtrudedPolyline (const std::string &_name, const std::vector< std::vector< math::Vector2d > > &_vertices, double _height) GAZEBO_DEPRECATED(6.0)
See CreateExtrudedPolyline that accepts ignition::math::Vector2d.
Member gazebo::common::MeshManager::CreatePlane (const std::string &_name, const math::Plane &_plane, const math::Vector2d &_segments, const math::Vector2d &_uvTile) GAZEBO_DEPRECATED(6.0)
See CreatePlane function that accepts ignition::math objects.
Member gazebo::common::MeshManager::CreatePlane (const std::string &_name, const math::Vector3 &_normal, double _d, const math::Vector2d &_size, const math::Vector2d &_segments, const math::Vector2d &_uvTile) GAZEBO_DEPRECATED(6.0)
See CreatePlane function that accepts ignition::math objects.
Member gazebo::common::MeshManager::GenSphericalTexCoord (const Mesh *_mesh, math::Vector3 _center) GAZEBO_DEPRECATED(6.0)
See GenSphericalTexCoord function that accepts ignition::math::Vector3d.
Member gazebo::common::MeshManager::GetMeshAABB (const Mesh *_mesh, math::Vector3 &_center, math::Vector3 &_minXYZ, math::Vector3 &_maxXYZ) GAZEBO_DEPRECATED(6.0)
See GetMeshAABB that accepts ignition::math::Vector3d.
Member gazebo::common::NodeAnimation::AddKeyFrame (const double _time, const math::Pose &_pose) GAZEBO_DEPRECATED(6.0)
See AddKeyFrame function that accepts ignition::math::Pose3d
Member gazebo::common::NodeAnimation::AddKeyFrame (const double _time, const math::Matrix4 &_trans) GAZEBO_DEPRECATED(6.0)
See AddKeyFrame function accepts ignition::math::Matrix4d.
Member gazebo::common::NodeAnimation::GetFrameAt (double _time, bool _loop=true) const GAZEBO_DEPRECATED(6.0)
See FrameAt function that return ignition::math::Matrix4d.
Member gazebo::common::NodeAnimation::GetKeyFrame (const unsigned int _i, double &_time, math::Matrix4 &_trans) const GAZEBO_DEPRECATED(6.0)
See GetKeyFrame function that accepts ignition::math::Matrix4d.
Member gazebo::common::NodeAnimation::GetKeyFrame (const unsigned int _i) const GAZEBO_DEPRECATED(6.0)
See KeyFrame function that return ignition::math::Matrix4d.
Member gazebo::common::NodeTransform::Get () GAZEBO_DEPRECATED(6.0)
See GetTransform function that returns ignition::math::Matrix4d.
Member gazebo::common::NodeTransform::NodeTransform (math::Matrix4 _mat, std::string _sid="_default_", TransformType _type=MATRIX) GAZEBO_DEPRECATED(6.0)
See NodeTransform constructor that accepts ignition::math::Matrix4d.
Member gazebo::common::NodeTransform::operator* (math::Matrix4 _m) GAZEBO_DEPRECATED(6.0)
See operator* that accepts ignition::math::Matrix4d.
Member gazebo::common::NodeTransform::Set (math::Matrix4 _mat) GAZEBO_DEPRECATED(6.0)
See Set function that accepts ignition::math::Matrix4d.
Member gazebo::common::NodeTransform::SetSourceValues (math::Matrix4 _mat) GAZEBO_DEPRECATED(6.0)
See SetSourceValues function that accepts ignition::math::Matrix4d.
Member gazebo::common::NodeTransform::SetSourceValues (math::Vector3 _vec) GAZEBO_DEPRECATED(6.0)
See SetSourceValues function that accepts ignition::math::Vector3d.
Member gazebo::common::NodeTransform::SetSourceValues (math::Vector3 _axis, double _angle) GAZEBO_DEPRECATED(6.0)
See SetSourceValues function that accepts ignition::math::Vector3d.
Member gazebo::common::PoseKeyFrame::GetRotation () const GAZEBO_DEPRECATED(6.0)
See Rotation function that returns ignition::math
Member gazebo::common::PoseKeyFrame::GetTranslation () const GAZEBO_DEPRECATED(6.0)
See Translation function that returns igntion::math
Member gazebo::common::PoseKeyFrame::SetRotation (const math::Quaternion &_rot) GAZEBO_DEPRECATED(6.0)
See Rotation function that accepts ignition::math
Member gazebo::common::PoseKeyFrame::SetTranslation (const math::Vector3 &_trans) GAZEBO_DEPRECATED(6.0)
See Translation function that accepts ignition::math
Member gazebo::common::Skeleton::GetBindShapeTransform () GAZEBO_DEPRECATED(6.0)
See BindShapeTransform that return ignition::math::Matrix4d.
Member gazebo::common::Skeleton::SetBindShapeTransform (math::Matrix4 _trans) GAZEBO_DEPRECATED(6.0)
See SetBindShapeTransform that accepts ignition::math::Matrix4d
Member gazebo::common::SkeletonAnimation::AddKeyFrame (const std::string &_node, const double _time, const math::Matrix4 &_mat) GAZEBO_DEPRECATED(6.0)
See AddKeyFrame function that accepts ignition::math::Matrix4d.
Member gazebo::common::SkeletonAnimation::AddKeyFrame (const std::string &_node, const double _time, const math::Pose &_pose) GAZEBO_DEPRECATED(6.0)
See AddKeyFrame function that accepts ignition::math::Pose3d.
Member gazebo::common::SkeletonAnimation::GetNodePoseAt (const std::string &_node, const double _time, const bool _loop=true) GAZEBO_DEPRECATED(6.0)
See NodePoseAt function that return ignition::math::Matrix4d.
Member gazebo::common::SkeletonAnimation::GetPoseAt (const double _time, const bool _loop=true) const GAZEBO_DEPRECATED(6.0)
See PoseAt function that returns ignition::math::Matrix4d.
Member gazebo::common::SkeletonAnimation::GetPoseAtX (const double _x, const std::string &_node, const bool _loop=true) const GAZEBO_DEPRECATED(6.0)
See PoseAtX function that returns ignition::math::Matrix4d.
Member gazebo::common::SkeletonNode::GetInverseBindTransform () GAZEBO_DEPRECATED(6.0)
See InverseBindTransform function that returns ignition::math::Matrix4d.
Member gazebo::common::SkeletonNode::GetModelTransform () GAZEBO_DEPRECATED(6.0)
See ModelTransform function that returns ignition::math::Matrix4d.
Member gazebo::common::SkeletonNode::GetTransform () GAZEBO_DEPRECATED(6.0)
See Transform function that return ignition::math::Matrix4d.
Member gazebo::common::SkeletonNode::SetInitialTransform (math::Matrix4 _tras) GAZEBO_DEPRECATED(6.0)
See SetInitialTransform that accepts ignition::math::Matrix4d.
Member gazebo::common::SkeletonNode::SetInverseBindTransform (math::Matrix4 _invBM) GAZEBO_DEPRECATED(6.0)
See SetInverseBindTransform that accepts ignition::math::Matrix4d.
Member gazebo::common::SkeletonNode::SetModelTransform (math::Matrix4 _trans, bool _updateChildren=true) GAZEBO_DEPRECATED(6.0)
See SetModelTransform that accepts ignition::math::Matrix4d.
Member gazebo::common::SkeletonNode::SetTransform (math::Matrix4 _trans, bool _updateChildren=true) GAZEBO_DEPRECATED(6.0)
See SetTransform function that accepts ignition::math::Matrix4d.
Member gazebo::common::SphericalCoordinates::Distance (const math::Angle &_latA, const math::Angle &_lonA, const math::Angle &_latB, const math::Angle &_lonB) GAZEBO_DEPRECATED(6.0)
See Distance() function that accepts ignition::math::Angle objects.
Member gazebo::common::SphericalCoordinates::GetHeadingOffset () const GAZEBO_DEPRECATED(6.0)
See HeadingOffset() function that returns an ignition::math::Angle object.
Member gazebo::common::SphericalCoordinates::GetLatitudeReference () const GAZEBO_DEPRECATED(6.0)
See LatitudeReference function that returns an ignition::math::Angle object.
Member gazebo::common::SphericalCoordinates::GetLongitudeReference () const GAZEBO_DEPRECATED(6.0)
See LongitudeReference function that returns an ignition::math::Angle object.
Member gazebo::common::SphericalCoordinates::GlobalFromLocal (const math::Vector3 &_xyz) const GAZEBO_DEPRECATED(6.0)
See GlobalFromLocal function that use ignition::math::Vector3d objects.
Member gazebo::common::SphericalCoordinates::SetHeadingOffset (const math::Angle &_angle) GAZEBO_DEPRECATED(6.0)
See SetHeadingOffset function that accepts an ignition::math::Angle object.
Member gazebo::common::SphericalCoordinates::SetLatitudeReference (const math::Angle &_angle) GAZEBO_DEPRECATED(6.0)
See SetLatitudeReference function that accepts an ignition::math::Angle object.
Member gazebo::common::SphericalCoordinates::SetLongitudeReference (const math::Angle &_angle) GAZEBO_DEPRECATED(6.0)
See SetLongitudeReference function that accepts an ignition::math::Angle object.
Member gazebo::common::SphericalCoordinates::SphericalCoordinates (const SurfaceType _type, const math::Angle &_latitude, const math::Angle &_longitude, double _elevation, const math::Angle &_heading) GAZEBO_DEPRECATED(6.0)
See SphericalCoordinates constructor that accepts ignition::math::Angle objects.
Member gazebo::common::SphericalCoordinates::SphericalFromLocal (const math::Vector3 &_xyz) const GAZEBO_DEPRECATED(6.0)
See SphericalFromLocal function that use ignition::math::Vector3d objects.
Member gazebo::common::SubMesh::AddNormal (const math::Vector3 &_n) GAZEBO_DEPRECATED(6.0)
See AddNormal function that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::AddVertex (const math::Vector3 &_v) GAZEBO_DEPRECATED(6.0)
See AddVertex function that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::Center (const math::Vector3 &_center=math::Vector3::Zero) GAZEBO_DEPRECATED(6.0)
See Center function that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::CopyNormals (const std::vector< math::Vector3 > &_norms) GAZEBO_DEPRECATED(6.0)
See CopyNormals that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::CopyVertices (const std::vector< math::Vector3 > &_verts) GAZEBO_DEPRECATED(6.0)
See CopyVertices that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::GenSphericalTexCoord (const math::Vector3 &_center) GAZEBO_DEPRECATED(6.0)
See GenSphericalTexCoord that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::GetMax () const GAZEBO_DEPRECATED(6.0)
See Max function that returns ignition::math::Vector3d.
Member gazebo::common::SubMesh::GetMin () const GAZEBO_DEPRECATED(6.0)
See Min function that returns ignition::math::Vector3d.
Member gazebo::common::SubMesh::GetNormal (unsigned int _i) const GAZEBO_DEPRECATED(6.0)
See Normal function that return ignition::math::Vector3d.
Member gazebo::common::SubMesh::GetTexCoord (unsigned int _i) const GAZEBO_DEPRECATED(6.0)
See TexCoord function that return ignition::math::Vector2d.
Member gazebo::common::SubMesh::GetVertex (unsigned int _i) const GAZEBO_DEPRECATED(6.0)
See Vertex function that return an ignition::math::Vector3d.
Member gazebo::common::SubMesh::GetVertexIndex (const math::Vector3 &_v) const GAZEBO_DEPRECATED(6.0)
See GetVertexIndex function that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::HasVertex (const math::Vector3 &_v) const GAZEBO_DEPRECATED(6.0)
See HasVertex function that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::SetNormal (unsigned int _i, const math::Vector3 &_n) GAZEBO_DEPRECATED(6.0)
See SetNormal function that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::SetScale (const math::Vector3 &_factor) GAZEBO_DEPRECATED(6.0)
See SetScale function accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::SetTexCoord (unsigned int _i, const math::Vector2d &_t) GAZEBO_DEPRECATED(6.0)
See SetTexCoord function that accepts ignition::math::Vector2d.
Member gazebo::common::SubMesh::SetVertex (unsigned int _i, const math::Vector3 &_v) GAZEBO_DEPRECATED(6.0)
See SetVertex function that accepts ignition::math::Vector3d.
Member gazebo::common::SubMesh::Translate (const math::Vector3 &_vec) GAZEBO_DEPRECATED(6.0)
See Translate function that accepts ignition::math::Vector3d.
Member gazebo::common::SVGLoader::PathsToClosedPolylines (const std::vector< common::SVGPath > &_paths, double _tol, std::vector< std::vector< math::Vector2d > > &_closedPolys, std::vector< std::vector< math::Vector2d > > &_openPolys) GAZEBO_DEPRECATED(6.0)
See PathsToClosedPolylines that accepts ignition::math objects
Member gazebo::msgs::AddBoxLink (msgs::Model &_model, const double _mass, const math::Vector3 &_size) GAZEBO_DEPRECATED(6.0)
See AddBoxLink() function that accepts an ignition::math::Vector3d object.
Member gazebo::msgs::Convert (const math::Plane &_p) GAZEBO_DEPRECATED(6.0)
See function that accepts an ignition::math object.
Member gazebo::msgs::Convert (const msgs::Quaternion &_q) GAZEBO_DEPRECATED(6.0)
See ConvertIgn() function that returns an ignition::math object.
Member gazebo::msgs::Convert (const math::Vector3 &_v) GAZEBO_DEPRECATED(6.0)
See function that accepts an ignition::math object.
Member gazebo::msgs::Convert (const math::Pose &_p) GAZEBO_DEPRECATED(6.0)
See function that accepts an ignition::math object.
Member gazebo::msgs::Convert (const msgs::Vector2d &_v) GAZEBO_DEPRECATED(6.0)
See ConvertIgn() function that returns an ignition::math object.
Member gazebo::msgs::Convert (const msgs::Pose &_p) GAZEBO_DEPRECATED(6.0)
See ConvertIgn() function that returns an ignition::math object.
Member gazebo::msgs::Convert (const math::Vector2d &_v) GAZEBO_DEPRECATED(6.0)
See function that accepts an ignition::math object.
Member gazebo::msgs::Convert (const math::Quaternion &_q) GAZEBO_DEPRECATED(6.0)
See function that accepts an ignition::math object.
Member gazebo::msgs::Convert (const msgs::Vector3d &_v) GAZEBO_DEPRECATED(6.0)
See ConvertIgn() function that returns an ignition::math object.
Member gazebo::msgs::Convert (const msgs::PlaneGeom &_p) GAZEBO_DEPRECATED(6.0)
See ConvertIgn() function that returns an ignition::math object.
Member gazebo::msgs::Set (msgs::PlaneGeom *_p, const math::Plane &_v) GAZEBO_DEPRECATED(6.0)
See Set() function that accepts an ignition::math::Planed object.
Member gazebo::msgs::Set (msgs::Vector3d *_pt, const math::Vector3 &_v) GAZEBO_DEPRECATED(6.0)
See Set() function that accepts an ignition::math::Vector3d object.
Member gazebo::msgs::Set (msgs::Vector2d *_pt, const math::Vector2d &_v) GAZEBO_DEPRECATED(6.0)
See Set() function that accepts an ignition::math::Vector2d object.
Member gazebo::msgs::Set (msgs::Pose *_p, const math::Pose &_v) GAZEBO_DEPRECATED(6.0)
See Set() function that accepts an ignition::math::Pose3d object.
Member gazebo::msgs::Set (msgs::Quaternion *_q, const math::Quaternion &_v) GAZEBO_DEPRECATED(6.0)
See Set() function that accepts an ignition::math::Quaterniond object.
Member gazebo::physics::PolylineShape::GetVertices () const GAZEBO_DEPRECATED(6.0)
See Vertices function that returns an array of ignition::math::Vector2d objects.
Member gazebo::sensors::ForceTorqueSensor::GetForce () const GAZEBO_DEPRECATED(6.0)
See Force() function that returns an ignition::math::Vector3d object.
Member gazebo::sensors::ForceTorqueSensor::GetTorque () const GAZEBO_DEPRECATED(6.0)
See Torque() function that returns an ignition::math::Vector3d object.
Member gazebo::sensors::GpsSensor::GetLatitude () const GAZEBO_DEPRECATED(6.0)
See Latitude() function that return an ignition::math::Angle object.
Member gazebo::sensors::GpsSensor::GetLongitude () const GAZEBO_DEPRECATED(6.0)
See Longitude() function that return an ignition::math::Angle object.
Member gazebo::sensors::GpuRaySensor::GetAngleMax () const GAZEBO_DEPRECATED(6.0)
See AngleMax() function that returns an ignition::math::Angle object.
Member gazebo::sensors::GpuRaySensor::GetAngleMin () const GAZEBO_DEPRECATED(6.0)
See AngleMin() function that returns an ignition::math::Angle object.
Member gazebo::sensors::GpuRaySensor::GetVerticalAngleMax () const GAZEBO_DEPRECATED(6.0)
See VerticalAngleMax() function that returns an ignition::math::Angle object.
Member gazebo::sensors::GpuRaySensor::GetVerticalAngleMin () const GAZEBO_DEPRECATED(6.0)
See VerticalAngleMin() function that returns an ignition::math::Angle object.
Member gazebo::sensors::ImuSensor::GetAngularVelocity () const GAZEBO_DEPRECATED(6.0)
See AngularVelocity() function that returns an ignition::math::Vector3d object.
Member gazebo::sensors::ImuSensor::GetLinearAcceleration () const GAZEBO_DEPRECATED(6.0)
See LinearVelocity() function that returns an ignition::math::Vector3d object.
Member gazebo::sensors::ImuSensor::GetOrientation () const GAZEBO_DEPRECATED(6.0)
See Orientation() function that returns an ignition::math::Quaterniond object.
Member gazebo::sensors::RaySensor::GetAngleMax () const GAZEBO_DEPRECATED(6.0)
See AngleMax() function that returns an ignition::math::Angle object.
Member gazebo::sensors::RaySensor::GetAngleMin () const GAZEBO_DEPRECATED(6.0)
See AngleMin() function that returns an ignition::math::Angle object.
Member gazebo::sensors::RaySensor::GetVerticalAngleMax () const GAZEBO_DEPRECATED(6.0)
See VerticalAngleMax() function that returns an ignition::math::Angle object.
Member gazebo::sensors::RaySensor::GetVerticalAngleMin () const GAZEBO_DEPRECATED(6.0)
See VerticalAngleMin() function that returns an ignition::math::Angle object.
Member gazebo::sensors::RFIDTag::GetTagPose () const GAZEBO_DEPRECATED(6.0)
See TagPose() function that returns an ignition::math::Pose3d object.
Member gazebo::sensors::Sensor::GetPose () const GAZEBO_DEPRECATED(6.0)
See Pose() function that returns an ignition::math::Pose3d object.
Member gazebo::sensors::WirelessTransmitter::GetSignalStrength (const math::Pose &_receiver, const double _rxGain) GAZEBO_DEPRECATED(6.0)
See SignalStrength() function that accepts an ignition::math::Pose3d object.
Member gazebo::util::OpenALSink::SetPose (const math::Pose &_pose) GAZEBO_DEPRECATED(6.0)
See SetPose function that accepts an ignition::math::Pose3d object.
Member gazebo::util::OpenALSink::SetVelocity (const math::Vector3 &_vel) GAZEBO_DEPRECATED(6.0)
See SetVelocity function that accepts an ignition::math::Vector3d object.
Member gazebo::util::OpenALSource::SetPose (const math::Pose &_pose) GAZEBO_DEPRECATED(6.0)
See SetPose function that accepts an ignition::math::Pose3d object.
Member gazebo::util::OpenALSource::SetVelocity (const math::Vector3 &_vel) GAZEBO_DEPRECATED(6.0)
See SetVelocity function that accepts an ignition::math::Vector3d object.