Deprecated List
Member BiQuad< T >::BiQuad () GAZEBO_DEPRECATED(8.0)
See ignition::math::BiQuad
Member BiQuad< T >::BiQuad (double _fc, double _fs) GAZEBO_DEPRECATED(8.0)
See ignition::math::BiQuad
Member BoxShape::GetSize () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Size() const
Member BoxShape::SetSize (const math::Vector3 &_size) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object
Member BulletMesh::Init (const common::SubMesh *_subMesh, BulletCollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member BulletMesh::Init (const common::Mesh *_mesh, BulletCollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member BulletTypes::ConvertPose (const btTransform &_bt) GAZEBO_DEPRECATED(8.0)
See ConvertPoseIgn
Member BulletTypes::ConvertPose (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See function which accepts ignition math.
Member BulletTypes::ConvertVector3 (const btVector3 &_bt) GAZEBO_DEPRECATED(8.0)
See ConvertVector3Ign
Member BulletTypes::ConvertVector3 (const math::Vector3 &_vec) GAZEBO_DEPRECATED(8.0)
See function which accepts ignition math.
Member BulletTypes::ConvertVector4 (const btVector4 &_bt) GAZEBO_DEPRECATED(8.0)
Use ConvertVector4dIgn instead.
Member BulletTypes::ConvertVector4 (const math::Vector4 &_vec) GAZEBO_DEPRECATED(8.0)
Use ConvertVector4dIgn instead
Member Camera::DisconnectNewImageFrame (event::ConnectionPtr &_c) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Camera::SetWorldPose (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See function that accepts an ignition::math parameter.
Member Camera::VFOV () const
See function that returns an ignition::math object.
See Also
VFOV
Member CameraSensor::ImageWidth () const
See ImageWidth()
Member Collision::GetRelativeAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularAccel() const
Member Collision::GetRelativeAngularVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularVel() const
Member Collision::GetRelativeLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearAccel() const
Member Collision::GetRelativeLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearVel() const
Member Collision::GetWorldAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularAccel() const
Member Collision::GetWorldAngularVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularVel() const
Member Collision::GetWorldLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearAccel() const
Member Collision::GetWorldLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearVel() const
Member Collision::GetWorldPose () const GAZEBO_DEPRECATED(8.0)
See const ignition::math::Pose3d &WorldPose() const
Member Collision::SetScale (const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member CollisionState::GetPose () const GAZEBO_DEPRECATED(8.0)
See function that returns ign-math.
Member Color::GetAsYUV () const GAZEBO_DEPRECATED(8.0)
See YUV() function that returns an ignition::math::Vector3d object.
Member COMVisual::GetInertiaPose () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d InertiaPose() const
Member Connection::DisconnectShutdown (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Connection::GetId () const GAZEBO_DEPRECATED(8.0)
See const Id() const;
Member Conversions::Convert (const math::Vector3 &_v) GAZEBO_DEPRECATED(8.0)
See Convert(const ignition::math::Vector3d &)
Parameters
[in]_vGazebo vector
Returns
Ogre vector
Member Conversions::Convert (const Ogre::Vector3 &_v) GAZEBO_DEPRECATED(8.0)
See ConvertIgn()
Parameters
[in]_vOgre vector
Returns
Gazebo vector
Member Conversions::Convert (const math::Quaternion &_v) GAZEBO_DEPRECATED(8.0)
See Convert(const ignition::math::Quaterniond &)
Parameters
[in]_vGazebo quaternion
Returns
Ogre quaternion
Member Conversions::Convert (const Ogre::Quaternion &_v) GAZEBO_DEPRECATED(8.0)
See ConvertIgn()
Parameters
[in]_vOgre quaternion
Returns
Gazebo quaternion
Member DARTCollision::GetDARTCollisionShape () const GAZEBO_DEPRECATED(8.0)
See dart::dynamics::ShapePtr DARTCollisionShape()
Member DARTCollision::SetDARTCollisionShape (dart::dynamics::Shape *_shape, const bool _placeable=true) GAZEBO_DEPRECATED(8.0)
See version that accepts dart::dynamics::ShapePtr
Member DARTCylinderShape::DARTCylinderShape (CollisionPtr _parent) GAZEBO_DEPRECATED(8.0)
See version that accepts DARTCollisionPtr.
Member DARTHeightmapShape::DARTHeightmapShape (CollisionPtr _parent) GAZEBO_DEPRECATED(8.0)
See version that accepts DARTCollisionPtr
Member DARTLink::GetDARTWorld (void) const GAZEBO_DEPRECATED(8.0)
See dart::simulation::WorldPtr DARTWorld(void) const
Member DARTMesh::Init (const common::SubMesh *_subMesh, DARTCollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member DARTMesh::Init (const common::Mesh *_mesh, DARTCollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member DARTMeshShape::DARTMeshShape (CollisionPtr _parent) GAZEBO_DEPRECATED(8.0)
See version that accepts DARTCollisionPtr
Member DARTModel::GetDARTSkeleton () GAZEBO_DEPRECATED(8.0)
See dart::dynamics::SkeletonPtr DARTSkeleton()
Member DARTModel::GetDARTWorld (void) const GAZEBO_DEPRECATED(8.0)
See dart::simulation::WorldPtr DARTWorld(void) const
Member DARTMultiRayShape::DARTMultiRayShape (CollisionPtr _parent) GAZEBO_DEPRECATED(8.0)
See version that accepts DARTCollisionPtr
Member DARTPhysics::GetDARTWorld () const GAZEBO_DEPRECATED(8.0)
See dart::simulation::WorldPtr DARTWorld()
Member DARTPlaneShape::DARTPlaneShape (CollisionPtr _parent) GAZEBO_DEPRECATED(8.0)
See version that accepts DARTCollisionPtr
Member DepthCamera::DisconnectNewDepthFrame (event::ConnectionPtr &_c) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member DepthCamera::DisconnectNewRGBPointCloud (event::ConnectionPtr &_c) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Distortion::Distort (const math::Vector2d &_in, const math::Vector2d &_center, double _k1, double _k2, double _k3, double _p1, double _p2) GAZEBO_DEPRECATED(8.0)
See version that accepts and returns ignition math objects.
Member Distortion::GetCenter () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector2d Center() const.
Member Distortion::GetK1 () const GAZEBO_DEPRECATED(8.0)
See double K1() const
Member Distortion::GetK2 () const GAZEBO_DEPRECATED(8.0)
See double K2() const
Member Distortion::GetK3 () const GAZEBO_DEPRECATED(8.0)
See double K3() const
Member Distortion::GetP1 () const GAZEBO_DEPRECATED(8.0)
See double P1() const
Member Distortion::GetP2 () const GAZEBO_DEPRECATED(8.0)
See double P2() const
Member Entity::GetBoundingBox () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Box BoundingBox() const
Member Entity::GetCollisionBoundingBox () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Box CollisionBoundingBox() const
Member Entity::GetDirtyPose () const GAZEBO_DEPRECATED(8.0)
See const ignition::math::Pose3d GetDirtyPose() const
Member Entity::GetInitialRelativePose () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d InitialRelativePose() const
Member Entity::GetRelativeAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularAccel() const
Member Entity::GetRelativeAngularVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularVel() const
Member Entity::GetRelativeLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearAccel() const
Member Entity::GetRelativeLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearVel() const
Member Entity::GetRelativePose () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d RelativePose() const
Member Entity::GetWorldAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularAccel() const
Member Entity::GetWorldAngularVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularVel() const
Member Entity::GetWorldLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearAccel() const
Member Entity::GetWorldLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearVel() const
Member Entity::GetWorldPose () const GAZEBO_DEPRECATED(8.0)
See const ignition::math::Pose3d &WorldPose() const
Member Entity::SetInitialRelativePose (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math object.
Member Entity::SetRelativePose (const math::Pose &_pose, bool _notify=true, bool _publish=true) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object
Member Entity::SetWorldPose (const math::Pose &_pose, bool _notify=true, bool _publish=true) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Entity::SetWorldTwist (const math::Vector3 &_linear, const math::Vector3 &_angular, bool _updateChildren=true) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math objects.
Member Event::Disconnect (ConnectionPtr _c) GAZEBO_DEPRECATED(8.0)=0
Use event::~Connection to disconnect
Member Event::GetSignaled () const GAZEBO_DEPRECATED(8.0)
See bool Signaled() const;
Member Events::DisconnectAddBuildingLevel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectAddEntity (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectAlignMode (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectBeforePhysicsUpdate (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectBuildingNameChanged (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectChangeBuildingEditorZoom (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectChangeBuildingLevel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectColorSelected (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectCreateBuildingEditorItem (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectCreateEntity (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectCreateEntity (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectCreateScene (event::ConnectionPtr _connection) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectCreateSensor (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectDeleteBuildingLevel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectDeleteEntity (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectDiagTimerStart (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectDiagTimerStop (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectEditModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectExitBuildingEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectExitModelEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectFinishBuildingModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectFinishModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectFollow (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectFPS (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectFullScreen (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectInputStepSize (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectJointChanged (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectJointInserted (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectJointNameChanged (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectJointRemoved (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectKeyPress (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectLeftPaneVisibility (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectLightUpdate (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectLinkInserted (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectLinkRemoved (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectMainWindowReady (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectManipMode (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectModelChanged (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectModelNameChanged (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectModelPluginInserted (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectModelPluginRemoved (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectModelPropertiesChanged (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectModelUpdate (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectMoveEntity (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectMoveMode (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectNestedModelInserted (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectNestedModelRemoved (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectNewBuildingEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectNewBuildingModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectNewLayer (event::ConnectionPtr _connection) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectNewModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectNewModelEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectOpenJointInspector (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectOpenLinkInspector (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectOpenModelPluginInspector (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectOrbit (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectPause (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectPostRender (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectPreRender (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRemoveScene (event::ConnectionPtr _connection) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRemoveSensor (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRender (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestJointInsertion (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestJointRemoval (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestLinkInsertion (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestLinkMove (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestLinkRemoval (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestModelPluginInsertion (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestModelPluginRemoval (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestNestedModelInsertion (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestNestedModelMove (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectRequestNestedModelRemoval (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSaveAsBuildingEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSaveAsModelEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSaveBuildingEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSaveBuildingModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSaveModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSaveModelEditor (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectScaleEntity (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSetSelectedEntity (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSetSelectedEntity (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSetSelectedJoint (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSetSelectedModelPlugin (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectShowElements (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectShowFloorplan (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectShowJointContextMenu (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectShowLinkContextMenu (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectShowModelPluginContextMenu (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectShowToolbars (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectSigInt (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectStep (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectStop (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectTextureSelected (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectTimeReset (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectToggleEditMode (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectToggleLayer (event::ConnectionPtr _connection) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectTriggerShowElements (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectTriggerShowFloorplan (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectUpdateLevelWidget (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectWindowMode (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectWorldCreated (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectWorldReset (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectWorldUpdateBegin (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Events::DisconnectWorldUpdateEnd (ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member EventT< T >::Disconnect (ConnectionPtr _c) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Class Filter< T >
See ignition::math::Filter
Member ForceTorqueSensor::ConnectUpdate (std::function< void(msgs::WrenchStamped)> _subscriber)
See ConnectUpdate that accepts a std::function parameter.
Member ForceTorqueSensor::DisconnectUpdate (event::ConnectionPtr &_conn) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member gazebo::math::GAZEBO_DEPRECATED (8.0) MAX_D

See ignition::math::clamp

See ignition::math::isnan

See ignition::math::isnan

See ignition::math::fixnan

See ignition::math::fixnan

See ignition::math::mean

See ignition::math::variance

See ignition::math::max

See ignition::math::min

See ignition::math::equal

Member GpuLaser::DisconnectNewLaserFrame (event::ConnectionPtr &_c) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member GpuRaySensor::ConnectNewLaserFrame (std::function< void(const float *, unsigned int, unsigned int, unsigned int, const std::string &)> _subscriber)
See ConnectNewLaserFrame that accepts a std::function.
Member GpuRaySensor::DisconnectNewLaserFrame (event::ConnectionPtr &_conn) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Grid::GetCellCount () const GAZEBO_DEPRECATED(8.0)
See CellCount()
Member Grid::GetCellLength () const GAZEBO_DEPRECATED(8.0)
See CellLength()
Member Grid::GetColor () const GAZEBO_DEPRECATED(8.0)
See Color()
Member Grid::GetHeight () const GAZEBO_DEPRECATED(8.0)
See Height()
Member Grid::GetLineWidth () const GAZEBO_DEPRECATED(8.0)
See LineWidth()
Member Grid::GetSceneNode () GAZEBO_DEPRECATED(8.0)
See GridVisual()
Member Gripper::GetName () const GAZEBO_DEPRECATED(8.0)
See std::string Name() const;
Member HeightmapShape::GetPos () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Pos() const
Member HeightmapShape::GetSize () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Size() const
Member HeightmapShape::GetVertexCount () const GAZEBO_DEPRECATED(8.0)
Use function that returns ignition math.
Member ImuSensor::SetWorldToReferencePose (const ignition::math::Pose3d &_pose=ignition::math::Pose3d()) GAZEBO_DEPRECATED(8.0)
See SetWorldToReferenceOrientation(Quaterniond)
Member Inertial::GetCoG () const GAZEBO_DEPRECATED(8.0)
See CoG() const
Member Inertial::GetInertial (const math::Pose &_frameOffset) const GAZEBO_DEPRECATED(8.0)
See operator()(const ignition::math::Pose3d &) const
Member Inertial::GetIXX () const GAZEBO_DEPRECATED(8.0)
See IXX() const
Member Inertial::GetIXY () const GAZEBO_DEPRECATED(8.0)
See IXY() const
Member Inertial::GetIXZ () const GAZEBO_DEPRECATED(8.0)
See IXZ() const
Member Inertial::GetIYY () const GAZEBO_DEPRECATED(8.0)
See IYY() const
Member Inertial::GetIYZ () const GAZEBO_DEPRECATED(8.0)
See IYZ() const
Member Inertial::GetIZZ () const GAZEBO_DEPRECATED(8.0)
See IZZ() const
Member Inertial::GetMass () const GAZEBO_DEPRECATED(8.0)
See Mass() const
Member Inertial::GetMOI (const math::Pose &_pose) const GAZEBO_DEPRECATED(8.0)
See MOI(const ignition::math::Pose3d &) const
Member Inertial::GetMOI () const GAZEBO_DEPRECATED(8.0)
See MOI() const
Member Inertial::GetPose () const GAZEBO_DEPRECATED(8.0)
See Pose() const
Member Inertial::GetPrincipalMoments () const GAZEBO_DEPRECATED(8.0)
See PrincipalMoments() const
Member Inertial::GetProductsofInertia () const GAZEBO_DEPRECATED(8.0)
See ProductsOfInertia() const
Member Inertial::operator() (const ignition::math::Pose3d &_frameOffset) const
See operator()(const ignition::math::Pose3d &) const
Member Inertial::operator() (const ignition::math::Vector3d &_frameOffset) const
See operator()(const ignition::math::Pose3d &) const
Member Inertial::Rotate (const math::Quaternion &_rot) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition::math parameters.
Member Inertial::SetCoG (const math::Pose &_c) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition::math parameters.
Member Inertial::SetCoG (const math::Vector3 &_center) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition::math parameters.
Member Inertial::SetMOI (const math::Matrix3 &_moi) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math parameters
Member Joint::ComputeChildLinkPose (unsigned int _index, double _position) GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::DisconnectJointUpdate (event::ConnectionPtr &_conn) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Joint::GetAnchor (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetAnchorErrorPose () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetAngle (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See Position(), which returns a double.
Member Joint::GetAngleCount () const GAZEBO_DEPRECATED(8.0)
See DOF()
Member Joint::GetAngleImpl (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See PositionImpl, which takes double.
Member Joint::GetAxisFrame (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetAxisFrameOffset (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetGlobalAxis (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See GlobalAxis()
Member Joint::GetHighStop (unsigned int _index) GAZEBO_DEPRECATED(8.0)
See UpperLimit, which returns double.
Member Joint::GetInertiaRatio (const math::Vector3 &_axis) const GAZEBO_DEPRECATED(8.0)
See function that takes ignition math.
Member Joint::GetInitialAnchorPose () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetLinkForce (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetLinkTorque (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetLocalAxis (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See LocalAxis()
Member Joint::GetLowerLimit (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See LowerLimit, which returns double.
Member Joint::GetLowStop (unsigned int _index) GAZEBO_DEPRECATED(8.0)
See LowerLimit, which returns double.
Member Joint::GetParentWorldPose () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::GetUpperLimit (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See UpperLimit, which returns double.
Member Joint::GetWorldPose () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member Joint::Load (LinkPtr _parent, LinkPtr _child, const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See function that takes ignition math.
Member Joint::SetAnchor (unsigned int _index, const math::Vector3 &_anchor) GAZEBO_DEPRECATED(8.0)
See function that takes ignition math.
Member Joint::SetAxis (unsigned int _index, const math::Vector3 &_axis) GAZEBO_DEPRECATED(8.0)
See function that takes ignition math.
Member Joint::SetHighStop (unsigned int _index, const math::Angle &_angle) GAZEBO_DEPRECATED(8.0)
See SetUpperLimit, which takes double.
Member Joint::SetLowerLimit (unsigned int _index, math::Angle _limit) GAZEBO_DEPRECATED(8.0)
See SetLowerLimit which takes double.
Member Joint::SetLowStop (unsigned int _index, const math::Angle &_angle) GAZEBO_DEPRECATED(8.0)
See SetLowerLimit, which takes double.
Member Joint::SetUpperLimit (unsigned int _index, math::Angle _limit) GAZEBO_DEPRECATED(8.0)
See SetUpperLimit which takes double.
Member JointState::GetAngle (unsigned int _axis) const GAZEBO_DEPRECATED(8.0)
See Position()
Member JointState::GetAngles () const GAZEBO_DEPRECATED(8.0)
See Positions()
Member JointVisual::CreateAxis (const math::Vector3 &_axis, bool _useParentFrame, msgs::Joint::Type _type) GAZEBO_DEPRECATED(8.0)
See function that takes a ignition::math::Vector3d object
Member JointVisual::UpdateAxis (ArrowVisualPtr _arrowVisual, const math::Vector3 &_axis, bool _useParentFrame, msgs::Joint::Type _type) GAZEBO_DEPRECATED(8.0)
See function that takes ignition::math
Member Kmeans::Kmeans (const std::vector< Vector3 > &_obs) GAZEBO_DEPRECATED(8.0)
See ignition::math::Kmeans
Member Link::AddForce (const math::Vector3 &_force) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::AddForceAtRelativePosition (const math::Vector3 &_force, const math::Vector3 &_relPos) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::AddForceAtWorldPosition (const math::Vector3 &_force, const math::Vector3 &_pos) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::AddLinkForce (const math::Vector3 &_force, const math::Vector3 &_offset=math::Vector3::Zero) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::AddRelativeForce (const math::Vector3 &_force) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::AddRelativeTorque (const math::Vector3 &_torque) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::AddTorque (const math::Vector3 &_torque) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::AttachStaticModel (ModelPtr &_model, const math::Pose &_offset) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::DisconnectEnabled (event::ConnectionPtr &_conn) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Link::GetRelativeAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularAccel() const
Member Link::GetRelativeAngularVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularVel() const
Member Link::GetRelativeForce () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeForce() const
Member Link::GetRelativeLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearAccel() const
Member Link::GetRelativeLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearVel() const
Member Link::GetRelativeTorque () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeTorque() const
Member Link::GetWorldAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularAccel() const
Member Link::GetWorldAngularMomentum () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularMomentum() const
Member Link::GetWorldCoGLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldCoGLinearVel() const
Member Link::GetWorldCoGPose () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d WorldCoGPose() const
Member Link::GetWorldForce () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldForce() const
Member Link::GetWorldInertialPose () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d WorldInertialPose() const
Member Link::GetWorldInertiaMatrix () const GAZEBO_DEPRECATED(8.0)
See WorldInertiaMatrix() that uses ignition
Member Link::GetWorldLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearAccel() const
Member Link::GetWorldLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearVel() const
Member Link::GetWorldLinearVel (const math::Vector3 &_offset) const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d GetWorldLinearVel( const ignition::math::Vector3d &_offset) const
Member Link::GetWorldLinearVel (const math::Vector3 &_offset, const math::Quaternion &_q) const GAZEBO_DEPRECATED(8.0)
See
Member Link::GetWorldTorque () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldTorque() const
Member Link::MoveFrame (const math::Pose &_worldReferenceFrameSrc, const math::Pose &_worldReferenceFrameDst) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math objects.
Member Link::RelativeForce () const
See
Member Link::SetAngularAccel (const math::Vector3 &_accel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::SetAngularVel (const math::Vector3 &_vel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::SetForce (const math::Vector3 &_force) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::SetLinearAccel (const math::Vector3 &_accel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::SetLinearVel (const math::Vector3 &_vel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Link::SetScale (const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See SetScale(const ignition::math::Vector3d &_scale)
Member Link::SetTorque (const math::Vector3 &_torque) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member LinkState::GetAcceleration () const GAZEBO_DEPRECATED(8.0)
See function that returns ign-math.
Member LinkState::GetPose () const GAZEBO_DEPRECATED(8.0)
See function that returns ign-math.
Member LinkState::GetVelocity () const GAZEBO_DEPRECATED(8.0)
See function that returns ign-math.
Member LinkState::GetWrench () const GAZEBO_DEPRECATED(8.0)
See function that returns ign-math.
Member MapShape::GetScale () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Scale() const
Member Matrix4::Matrix4 () GAZEBO_DEPRECATED(8.0)
See ignition::math::Matrix4
Member Matrix4::Matrix4 (const Matrix4 &_m) GAZEBO_DEPRECATED(8.0)
See ignition::math::Matrix4
Member Matrix4::Matrix4 (const ignition::math::Matrix4d &_m) GAZEBO_DEPRECATED(8.0)
See ignition::math::Matrix4
Member Matrix4::Matrix4 (double _v00, double _v01, double _v02, double _v03, double _v10, double _v11, double _v12, double _v13, double _v20, double _v21, double _v22, double _v23, double _v30, double _v31, double _v32, double _v33) GAZEBO_DEPRECATED(8.0)
See ignition::math::Matrix4
Member MeshShape::GetSize () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Size() const
Member Model::AttachStaticModel (ModelPtr &_model, math::Pose _offset) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Model::GetBoundingBox () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Box BoundingBox() const
Member Model::GetRelativeAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularAccel() const
Member Model::GetRelativeAngularVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeAngularVel() const
Member Model::GetRelativeLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearAccel() const
Member Model::GetRelativeLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d RelativeLinearVel() const
Member Model::GetWorldAngularAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularAccel() const
Member Model::GetWorldAngularVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldAngularVel() const
Member Model::GetWorldLinearAccel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearAccel() const
Member Model::GetWorldLinearVel () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d WorldLinearVel() const
Member Model::SetAngularAccel (const math::Vector3 &_vel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Model::SetAngularVel (const math::Vector3 &_vel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Model::SetLinearAccel (const math::Vector3 &_vel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Model::SetLinearVel (const math::Vector3 &_vel) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Model::SetLinkWorldPose (const math::Pose &_pose, const LinkPtr &_link) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member Model::SetLinkWorldPose (const math::Pose &_pose, std::string _linkName) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math object.
Member ModelManipulator::GetMouseMoveDistance (rendering::CameraPtr _camera, const math::Vector2i &_start, const math::Vector2i &_end, const math::Pose &_pose, const math::Vector3 &_axis, bool _local) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelManipulator::GetMousePositionOnPlane (rendering::CameraPtr _camera, const common::MouseEvent &_event) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelManipulator::RotateEntity (rendering::VisualPtr &_vis, const math::Vector3 &_axis, bool _local=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelManipulator::ScaleEntity (rendering::VisualPtr &_vis, const math::Vector3 &_axis, bool _local=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelManipulator::SnapPoint (const math::Vector3 &_point, double _interval=1.0, double _sensitivity=0.4) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelManipulator::TranslateEntity (rendering::VisualPtr &_vis, const math::Vector3 &_axis, bool _local=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelSnap::GetSnapTransform (const std::vector< math::Vector3 > &_triangleSrc, const std::vector< math::Vector3 > &_triangleDest, const math::Pose &_poseSrc, math::Vector3 &_trans, math::Quaternion &_rot) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelSnap::Snap (const std::vector< math::Vector3 > &_triangleSrc, const std::vector< math::Vector3 > &_triangleDest, rendering::VisualPtr _visualSrc) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters.
Member ModelState::GetPose () const GAZEBO_DEPRECATED(8.0)
See function that returns ign-math.
Member MovableText::AABB ()
See ignition::math::Box AABB();
Member MovableText::GetAABB () GAZEBO_DEPRECATED(8.0)
See ignition::math::Box AABB();
Member MultiRayShape::AddRay (const math::Vector3 &_start, const math::Vector3 &_end) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math objects.
Member MultiRayShape::DisconnectNewLaserScans (event::ConnectionPtr &_conn) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member MultiRayShape::GetMaxAngle () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member MultiRayShape::GetMinAngle () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member MultiRayShape::GetVerticalMaxAngle () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member MultiRayShape::GetVerticalMinAngle () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition math.
Member ODEMesh::Init (const common::Mesh *_mesh, ODECollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member ODEMesh::Init (const common::SubMesh *_subMesh, ODECollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member OnePole< T >::OnePole () GAZEBO_DEPRECATED(8.0)
See ignition::math::OnePole
Member OnePole< T >::OnePole (double _fc, double _fs) GAZEBO_DEPRECATED(8.0)
See ignition::math::OnePole
Member OrbitViewController::GetFocalPoint () const GAZEBO_DEPRECATED(8.0)
See version that returns an ignition vector3d object.
Member OrbitViewController::Init (const math::Vector3 &_focalPoint, const double _yaw=0, const double _pitch=0) GAZEBO_DEPRECATED(8.0)
See version that uses an ignition vector3d object.
Member OrbitViewController::SetFocalPoint (const math::Vector3 &_fp) GAZEBO_DEPRECATED(8.0)
See version that uses an ignition vector3d object.
Member OrbitViewController::TranslateGlobal (const math::Vector3 &_vec) GAZEBO_DEPRECATED(8.0)
See version that uses an ignition vector3d object.
Member OrbitViewController::TranslateLocal (const math::Vector3 &_vec) GAZEBO_DEPRECATED(8.0)
See version that uses an ignition vector3d object.
Member OrthoViewController::Init (const math::Vector3 &_focalPoint, const double _yaw=0, const double _pitch=0) GAZEBO_DEPRECATED(8.0)
See version that uses an ignition vector3d object.
Member PhysicsEngine::GetGravity () const GAZEBO_DEPRECATED(8.0)
See World::Gravity() const
Returns
The gravity vector.
Member PhysicsEngine::MagneticField () const GAZEBO_DEPRECATED(8.0)
See World::MagneticField() const
Returns
The magnetic field vector.
Member PhysicsEngine::SetGravity (const gazebo::math::Vector3 &_gravity) GAZEBO_DEPRECATED(8.0)
See function that accepts an ignition math object.
Member Plane::Plane (const Vector3 &_normal, double _offset=0.0) GAZEBO_DEPRECATED(8.0)
See ignition::math::Plane
Member Plane::Plane (const ignition::math::Planed &_plane) GAZEBO_DEPRECATED(8.0)
See ignition::math::Plane
Member Plane::Plane () GAZEBO_DEPRECATED(8.0)
See ignition::math::Plane
Member Plane::Plane (const Vector3 &_normal, const Vector2d &_size, double _offset) GAZEBO_DEPRECATED(8.0)
See ignition::math::Plane
Member PlaneShape::GetNormal () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Normal() const;
Member PlaneShape::GetSize () const GAZEBO_DEPRECATED(8.0)
Use function which returns ignition math.
Member PlaneShape::SetAltitude (const math::Vector3 &_pos) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member PlaneShape::SetNormal (const math::Vector3 &_norm) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member PlaneShape::SetSize (const math::Vector2d &_size) GAZEBO_DEPRECATED(8.0)
Use function which accepts ignition math.
Member Projector::Load (const std::string &_name, const math::Pose &_pose=math::Pose(0, 0, 0, 0, 0, 0), const std::string &_textureName="", double _nearClip=0.25, double _farClip=15.0, double _fov=IGN_PI *0.25) GAZEBO_DEPRECATED(8.0)
See version that uses a ignition::math Pose3d objects.
Member Rand::GetDblNormal (double _mean=0, double _sigma=1) GAZEBO_DEPRECATED(8.0)
See ignition::math::Rand::DblNormal
Member Rand::GetDblUniform (double _min=0, double _max=1) GAZEBO_DEPRECATED(8.0)
See ignition::math::Rand::DblUniform
Member Rand::GetIntNormal (int _mean, int _sigma) GAZEBO_DEPRECATED(8.0)
See ignition::math::Rand::IntNormal
Member Rand::GetIntUniform (int _min, int _max) GAZEBO_DEPRECATED(8.0)
See ignition::math::Rand::IntUniform
Member Rand::GetSeed () GAZEBO_DEPRECATED(8.0)
See unsigned int ignition::math::Rand::Seed()
Member Rand::SetSeed (uint32_t _seed) GAZEBO_DEPRECATED(8.0)
See void ignition::math::Rand::Seed(unsigned int)
Member RayShape::GetGlobalPoints (math::Vector3 &_posA, math::Vector3 &_posB) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math objects.
Member RayShape::GetRelativePoints (math::Vector3 &_posA, math::Vector3 &_posB) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math objects.
Member RayShape::SetPoints (const math::Vector3 &_posStart, const math::Vector3 &_posEnd) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math objects.
Member Region::Contains (const math::Vector3 &_p) const GAZEBO_DEPRECATED(8.0)
See function that accepts an ignition::math object
Member Road::GetPoints () const GAZEBO_DEPRECATED(8.0)
See Points()
Member RotationSpline::AddPoint (const Quaternion &_p) GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::Clear () GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::GetNumPoints () const GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::GetPoint (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::Interpolate (unsigned int _fromIndex, double _t, bool _useShortestPath=true) GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::Interpolate (double _t, bool _useShortestPath=true) GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::RecalcTangents () GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::RotationSpline () GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::SetAutoCalculate (bool _autoCalc) GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::UpdatePoint (unsigned int _index, const Quaternion &_value) GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member RotationSpline::~RotationSpline () GAZEBO_DEPRECATED(8.0)
See ignition::math::RotationSpline
Member Sensor::DisconnectUpdated (event::ConnectionPtr &_c) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Sensor::LastMeasurementTime () const
See LastMeasurementTime() function.
Member ServerFixture::GetEntityPose (const std::string &_name) GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d EntityPose( const std::string &_name)
Member ServerFixture::SpawnBox (const std::string &_name, const math::Vector3 &_size, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnCamera (const std::string &_modelName, const std::string &_cameraName, const math::Vector3 &_pos, const math::Vector3 &_rpy, unsigned int _width=320, unsigned int _height=240, double _rate=25, const std::string &_noiseType="", double _noiseMean=0.0, double _noiseStdDev=0.0, bool _distortion=false, double _distortionK1=0.0, double _distortionK2=0.0, double _distortionK3=0.0, double _distortionP1=0.0, double _distortionP2=0.0, double _cx=0.5, double _cy=0.5) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnCylinder (const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnEmptyLink (const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnGpuRaySensor (const std::string &_modelName, const std::string &_raySensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, double _hMinAngle=-2.0, double _hMaxAngle=2.0, double _minRange=0.08, double _maxRange=10, double _rangeResolution=0.01, unsigned int _samples=640, const std::string &_noiseType="", double _noiseMean=0.0, double _noiseStdDev=0.0) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnImuSensor (const std::string &_modelName, const std::string &_imuSensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, const std::string &_noiseType="", double _rateNoiseMean=0.0, double _rateNoiseStdDev=0.0, double _rateBiasMean=0.0, double _rateBiasStdDev=0.0, double _accelNoiseMean=0.0, double _accelNoiseStdDev=0.0, double _accelBiasMean=0.0, double _accelBiasStdDev=0.0) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnLight (const std::string &_name, const std::string &_type, const math::Vector3 &_pos, const math::Vector3 &_rpy, const common::Color &_diffuse=common::Color::White, const common::Color &_specular=common::Color::White, const math::Vector3 &_direction=-math::Vector3::UnitZ, double _attenuationRange=20, double _attenuationConstant=0.5, double _attenuationLinear=0.01, double _attenuationQuadratic=0.001, double _spotInnerAngle=0, double _spotOuterAngle=0, double _spotFallOff=0, bool _castShadows=true) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnRaySensor (const std::string &_modelName, const std::string &_raySensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, double _hMinAngle=-2.0, double _hMaxAngle=2.0, double _vMinAngle=-1.0, double _vMaxAngle=1.0, double _minRange=0.08, double _maxRange=10, double _rangeResolution=0.01, unsigned int _samples=640, unsigned int _vSamples=1, double _hResolution=1.0, double _vResolution=1.0, const std::string &_noiseType="", double _noiseMean=0.0, double _noiseStdDev=0.0) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnSphere (const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, const math::Vector3 &_cog, double _radius, bool _wait=true, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnSphere (const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _wait=true, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnTrimesh (const std::string &_name, const std::string &_modelPath, const math::Vector3 &_scale, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnUnitContactSensor (const std::string &_name, const std::string &_sensorName, const std::string &_collisionType, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnUnitImuSensor (const std::string &_name, const std::string &_sensorName, const std::string &_collisionType, const std::string &_topic, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnWirelessReceiverSensor (const std::string &_name, const std::string &_sensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, double _minFreq, double _maxFreq, double _power, double _gain, double _sensitivity, bool _visualize=true) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member ServerFixture::SpawnWirelessTransmitterSensor (const std::string &_name, const std::string &_sensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, const std::string &_essid, double _freq, double _power, double _gain, bool _visualize=true) GAZEBO_DEPRECATED(8.0)
See function that accepts ignition::math parameters
Member Shape::GetScale () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Scale() const
Member SignalStatistic::SignalStatistic (const SignalStatistic &_ss) GAZEBO_DEPRECATED(8.0)
See ignition::math::SignalStatistic
Member SignalStatistic::SignalStatistic () GAZEBO_DEPRECATED(8.0)
See ignition::math::SignalStatistic
Member SignalStats::SignalStats () GAZEBO_DEPRECATED(8.0)
See ignition::math::SignalStats
Member SignalStats::SignalStats (const SignalStats &_ss) GAZEBO_DEPRECATED(8.0)
See ignition::math::SignalStats
Member SimbodyMesh::Init (const common::SubMesh *_subMesh, SimbodyCollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member SimbodyMesh::Init (const common::Mesh *_mesh, SimbodyCollisionPtr _collision, const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member SimbodyPhysics::Pose2Transform (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member SimbodyPhysics::QuadToQuad (const math::Quaternion &_q) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member SimbodyPhysics::QuadToQuad (const SimTK::Quaternion &_q) GAZEBO_DEPRECATED(8.0)
See QuadToQuadIgn
Member SimbodyPhysics::Transform2Pose (const SimTK::Transform &_xAB) GAZEBO_DEPRECATED(8.0)
See Transform2PoseIgn
Member SimbodyPhysics::Vec3ToVector3 (const SimTK::Vec3 &_v) GAZEBO_DEPRECATED(8.0)
See Vec3ToVector3Ign
Member SimbodyPhysics::Vector3ToVec3 (const math::Vector3 &_v) GAZEBO_DEPRECATED(8.0)
See function which accepts an ignition math object.
Member SimEventConnector::DisconnectSpawnModel (event::ConnectionPtr _subscriber) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member SonarSensor::DisconnectUpdate (event::ConnectionPtr &_conn) GAZEBO_DEPRECATED(8.0)
Use event::~Connection to disconnect
Member Spline::AddPoint (const Vector3 &_pt) GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::Clear () GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::GetPoint (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::GetPointCount () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::GetTangent (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::GetTension () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::Interpolate (double _t) const GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::Interpolate (unsigned int _fromIndex, double _t) const GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::RecalcTangents () GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::SetAutoCalculate (bool _autoCalc) GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::SetTension (double _t) GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::Spline () GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::UpdatePoint (unsigned int _index, const Vector3 &_value) GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member Spline::~Spline () GAZEBO_DEPRECATED(8.0)
See ignition::math::Spline
Member SystemPaths::GetDefaultTestPath () GAZEBO_DEPRECATED(8.0)
See std::string DefaultTestPath() const
Member SystemPaths::GetTmpInstancePath () GAZEBO_DEPRECATED(8.0)
See const std::string &TmpInstancePath() const
Member SystemPaths::GetTmpPath () GAZEBO_DEPRECATED(8.0)
See const std::string &TmpPath() const
Member UserCamera::DefaultPose () const GAZEBO_DEPRECATED(8.0)
See InitialPose
Member UserCamera::GetVisual (const math::Vector2i &_mousePos) const GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math::Vector2i object
Member UserCamera::GetVisual (const math::Vector2i &_mousePos, std::string &_mod) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math::Vector2i object
Member UserCamera::SetDefaultPose (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See SetInitialPose
Member UserCamera::SetFocalPoint (const math::Vector3 &_pt) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition::math::Vector3 object
Member UserCamera::SetViewController (const std::string &_type, const math::Vector3 &_pos) GAZEBO_DEPRECATED(8.0)
See function that uses ignition::math::Vector3d
Member UserCamera::SetWorldPose (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See verison that accepts an ignition::math::Pose3d object.
Member Vector3Stats::Vector3Stats () GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3Stats
Member ViewController::Init (const math::Vector3 &_focalPoint, const double _yaw=0, const double _pitch=0) GAZEBO_DEPRECATED(8.0)
See function that uses ignition::math
Member Visual::GetBoundingBox () const GAZEBO_DEPRECATED(8.0)
See version the returns an ignition math object.
Member Visual::GetName () const GAZEBO_DEPRECATED(8.0)
See std::string Name() const
Member Visual::GetPose () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d Pose() const;
Member Visual::GetPosition () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Vector3d Position() const
Member Visual::GetRotation () const GAZEBO_DEPRECATED(8.0)
ignition::math::Quaterniond Rotation() const
Member Visual::GetScale () GAZEBO_DEPRECATED(8.0)
See version that return an ignition math object.
Member Visual::GetWorldPose () const GAZEBO_DEPRECATED(8.0)
See ignition::math::Pose3d WorldPose() const.
Member Visual::MoveToPosition (const math::Pose &_pose, double _time) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Visual::MoveToPositions (const std::vector< math::Pose > &_pts, double _time, std::function< void()> _onComplete=nullptr) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Visual::Pose () const
See ignition::math::Pose3d Pose() const;
Member Visual::SetPose (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Visual::SetPosition (const math::Vector3 &_pos) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math parameters
Member Visual::SetRotation (const math::Quaternion &_rot) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Visual::SetScale (const math::Vector3 &_scale) GAZEBO_DEPRECATED(8.0)
See version that accepts ignition math parameters.
Member Visual::SetWorldPose (const math::Pose &_pose) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Visual::SetWorldPosition (const math::Vector3 &_pos) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member Visual::SetWorldRotation (const math::Quaternion &_rot) GAZEBO_DEPRECATED(8.0)
See version that accepts an ignition math object.
Member WireBox::GetBox () const GAZEBO_DEPRECATED(8.0)
See function that returns ignition::math
Member WireBox::GetVisible () const GAZEBO_DEPRECATED(8.0)
See Visible()
Member WireBox::Init (const math::Box &_box) GAZEBO_DEPRECATED(8.0)
See function that takes ignition::math
Member WireBox::WireBox (VisualPtr _parent, const math::Box &_box) GAZEBO_DEPRECATED(8.0)
See function that takes ignition::math
Member World::EnablePhysicsEngine (const bool _enable) GAZEBO_DEPRECATED(8.0)
See void SetPhysicsEngineEnabled(const bool _enable)
Member World::GetByName (const std::string &_name) GAZEBO_DEPRECATED(8.0)
See BasePtr BaseByName(const std::string &_name) const;
Member World::GetEnablePhysicsEngine () GAZEBO_DEPRECATED(8.0)
See bool PhysicsEnabled() const;
Member World::GetEntity (const std::string &_name) GAZEBO_DEPRECATED(8.0)
See EntityPtr EntityByName(const std::string &_name)
Member World::GetEntityBelowPoint (const math::Vector3 &_pt) GAZEBO_DEPRECATED(8.0)
See EntityPtr EntityBelowPoint( const ignition::math::Vector3d &_pt)
Member World::GetIterations () const GAZEBO_DEPRECATED(8.0)
see uint32_t Iterations() const;
Member World::GetModel (unsigned int _index) const GAZEBO_DEPRECATED(8.0)
See ModelPtr ModelByIndex(const unsigned int _index) const
Member World::GetModel (const std::string &_name) GAZEBO_DEPRECATED(8.0)
See ModelPtr ModelByName(const std::string &_name)
Member World::GetModelBelowPoint (const math::Vector3 &_pt) GAZEBO_DEPRECATED(8.0)
See ModelPtr ModelBelowPoint( const ignition::math::Vector3d &_pt)
Member World::GetModelCount () const GAZEBO_DEPRECATED(8.0)
See unsigned int ModelCount() const
Member World::GetModels () const GAZEBO_DEPRECATED(8.0)
See Model_V Models() const
Member World::GetName () const GAZEBO_DEPRECATED(8.0)
See std::string Name() const;
Member World::GetPauseTime () const GAZEBO_DEPRECATED(8.0)
See common::Time PauseTime() const
Member World::GetPhysicsEngine () const GAZEBO_DEPRECATED(8.0)
See PhysicsEnginePtr Physics() const;
Member World::GetPresetManager () const GAZEBO_DEPRECATED(8.0)
See PresetManagerPtr PresetMgr() const
Member World::GetRealTime () const GAZEBO_DEPRECATED(8.0)
See common::Time RealTime() const
Member World::GetRunning () const GAZEBO_DEPRECATED(8.0)
See bool Running() const
Member World::GetSceneMsg () const GAZEBO_DEPRECATED(8.0)
See msgs::Scene SceneMsg() const
Member World::GetSetWorldPoseMutex () const GAZEBO_DEPRECATED(8.0)
See std::mutex &WorldPoseMutex() const;
Member World::GetSimTime () const GAZEBO_DEPRECATED(8.0)
See common::Time SimTime() const
Member World::GetSphericalCoordinates () const GAZEBO_DEPRECATED(8.0)
See common::SphericalCoordinatesPtr SphericalCoords()
Member World::GetStartTime () const GAZEBO_DEPRECATED(8.0)
See common::Time StartTime() const
Member World::Light (const std::string &_name) GAZEBO_DEPRECATED(8.0)
See LightPtr LightByName(const std::string &_name) const