Link Member List

This is the complete list of members for Link, including all inherited members.

ACTOR enum valueBase
AddChild(BasePtr _child)Base
AddChildJoint(JointPtr _joint)Link
AddForce(const math::Vector3 &_force)=0Linkpure virtual
AddForceAtRelativePosition(const math::Vector3 &_force, const math::Vector3 &_relPos)=0Linkpure virtual
AddForceAtWorldPosition(const math::Vector3 &_force, const math::Vector3 &_pos)=0Linkpure virtual
AddLinkForce(const math::Vector3 &_force, const math::Vector3 &_offset=math::Vector3::Zero)=0Linkpure virtual
AddParentJoint(JointPtr _joint)Link
AddRelativeForce(const math::Vector3 &_force)=0Linkpure virtual
AddRelativeTorque(const math::Vector3 &_torque)=0Linkpure virtual
AddTorque(const math::Vector3 &_torque)=0Linkpure virtual
AddType(EntityType _type)Base
angularAccelLinkprotected
animationEntityprotected
animationConnectionEntityprotected
animationStartPoseEntityprotected
attachedModelsOffsetLinkprotected
AttachStaticModel(ModelPtr &_model, const math::Pose &_offset)Link
BALL_JOINT enum valueBase
BASE enum valueBase
Base(BasePtr _parent)Baseexplicit
Battery(const std::string &_name) constLink
Battery(const size_t _index) constLink
BatteryCount() constLink
BOX_SHAPE enum valueBase
cgVisualsLinkprotected
childrenBaseprotected
COLLISION enum valueBase
ComputeScopedName()Baseprotected
ConnectEnabled(T _subscriber)Linkinline
connectionsEntityprotected
CYLINDER_SHAPE enum valueBase
DetachAllStaticModels()Link
DetachStaticModel(const std::string &_modelName)Link
dirtyPoseEntityprotected
DisconnectEnabled(event::ConnectionPtr &_conn)Linkinline
Entity(BasePtr _parent)Entityexplicit
ENTITY enum valueBase
EntityType enum nameBase
FillMsg(msgs::Link &_msg)Link
FindAllConnectedLinksHelper(const LinkPtr &_originalParentLink, Link_V &_connectedLinks, bool _fistLink=false)Link
Fini()Linkvirtual
FIXED_JOINT enum valueBase
GEARBOX_JOINT enum valueBase
GetAngularDamping() constLink
GetBoundingBox() constLinkvirtual
GetByName(const std::string &_name)Base
GetChild(unsigned int _i) constBase
GetChild(const std::string &_name)Base
GetChildCollision(const std::string &_name)Entity
GetChildCount() constBase
GetChildJoints() constLink
GetChildJointsLinks() constLink
GetChildLink(const std::string &_name)Entity
GetCollision(const std::string &_name)Link
GetCollision(unsigned int _index) constLink
GetCollisionBoundingBox() constEntity
GetCollisions() constLink
GetDirtyPose() constEntity
GetEnabled() const =0Linkpure virtual
GetGravityMode() const =0Linkpure virtual
GetId() constBase
GetInertial() constLinkinline
GetInitialRelativePose() constEntity
GetKinematic() constLinkinlinevirtual
GetLinearDamping() constLink
GetModel() constLink
GetName() constBase
GetNearestEntityBelow(double &_distBelow, std::string &_entityName)Entity
GetParent() constBase
GetParentId() constBase
GetParentJoints() constLink
GetParentJointsLinks() constLink
GetParentModel()Entity
GetRelativeAngularAccel() constLinkvirtual
GetRelativeAngularVel() constLinkvirtual
GetRelativeForce() constLink
GetRelativeLinearAccel() constLinkvirtual
GetRelativeLinearVel() constLinkvirtual
GetRelativePose() constEntity
GetRelativeTorque() constLink
GetSaveable() constBase
GetScopedName(bool _prependWorldName=false) constBase
GetSDF()Basevirtual
GetSelfCollide() constLink
GetSensorCount() constLink
GetSensorName(unsigned int _index) constLink
GetType() constBase
GetVisualMessage(const std::string &_name) constLink
GetWorld() constBase
GetWorldAngularAccel() constLinkvirtual
GetWorldAngularMomentum() constLink
GetWorldAngularVel() constEntityinlinevirtual
GetWorldCoGLinearVel() const =0Linkpure virtual
GetWorldCoGPose() constLink
GetWorldEnergy() constLink
GetWorldEnergyKinetic() constLink
GetWorldEnergyPotential() constLink
GetWorldForce() const =0Linkpure virtual
GetWorldInertialPose() constLink
GetWorldInertiaMatrix() constLink
GetWorldLinearAccel() constLinkvirtual
GetWorldLinearVel() constLinkinlinevirtual
GetWorldLinearVel(const math::Vector3 &_offset) const =0Linkpure virtual
GetWorldLinearVel(const math::Vector3 &_offset, const math::Quaternion &_q) const =0Linkpure virtual
GetWorldPose() constEntityinlinevirtual
GetWorldTorque() const =0Linkpure virtual
HasType(const EntityType &_t) constBase
HEIGHTMAP_SHAPE enum valueBase
HINGE2_JOINT enum valueBase
HINGE_JOINT enum valueBase
inertialLinkprotected
Init()Linkvirtual
initializedLinkprotected
IsCanonicalLink() constEntityinline
IsSelected() constBase
IsStatic() constEntity
JOINT enum valueBase
LIGHT enum valueBase
linearAccelLinkprotected
Link(EntityPtr _parent)Linkexplicit
LINK enum valueBase
Load(sdf::ElementPtr _sdf)Linkvirtual
MAP_SHAPE enum valueBase
MESH_SHAPE enum valueBase
MODEL enum valueBase
MoveFrame(const math::Pose &_worldReferenceFrameSrc, const math::Pose &_worldReferenceFrameDst)Link
MULTIRAY_SHAPE enum valueBase
nodeEntityprotected
OnPoseChange()Linkvirtual
operator==(const Base &_ent) constBase
parentBaseprotected
parentEntityEntityprotected
PlaceOnEntity(const std::string &_entityName)Entity
PlaceOnNearestEntityBelow()Entity
PLANE_SHAPE enum valueBase
POLYLINE_SHAPE enum valueBase
prevAnimationTimeEntityprotected
Print(const std::string &_prefix)Base
ProcessMsg(const msgs::Link &_msg)Link
RAY_SHAPE enum valueBase
RemoveChild(EntityPtr _child)Linkvirtual
gazebo::physics::Entity::RemoveChild(unsigned int _id)Basevirtual
gazebo::physics::Entity::RemoveChild(const std::string &_name)Base
gazebo::physics::Entity::RemoveChild(physics::BasePtr _child)Base
RemoveChildJoint(const std::string &_jointName)Link
RemoveChildren()Base
RemoveCollision(const std::string &_name)Link
RemoveParentJoint(const std::string &_jointName)Link
requestPubEntityprotected
Reset()Linkvirtual
gazebo::physics::Base::Reset(Base::EntityType _resetType)Basevirtual
ResetPhysicsStates()Link
scaleEntityprotected
SCREW_JOINT enum valueBase
sdfBaseprotected
SENSOR_COLLISION enum valueBase
SetAngularAccel(const math::Vector3 &_accel)Link
SetAngularDamping(double _damping)=0Linkpure virtual
SetAngularVel(const math::Vector3 &_vel)=0Linkpure virtual
SetAnimation(const common::PoseAnimationPtr &_anim, boost::function< void()> _onComplete)Entity
SetAnimation(common::PoseAnimationPtr _anim)Entity
SetAutoDisable(bool _disable)=0Linkpure virtual
SetCanonicalLink(bool _value)Entity
SetCollideMode(const std::string &_mode)Link
SetEnabled(bool _enable) const =0Linkpure virtual
SetForce(const math::Vector3 &_force)=0Linkpure virtual
SetGravityMode(bool _mode)=0Linkpure virtual
SetInertial(const InertialPtr &_inertial)Link
SetInitialRelativePose(const math::Pose &_pose)Entity
SetKinematic(const bool &_kinematic)Linkvirtual
SetLaserRetro(float _retro)Link
SetLinearAccel(const math::Vector3 &_accel)Link
SetLinearDamping(double _damping)=0Linkpure virtual
SetLinearVel(const math::Vector3 &_vel)=0Linkpure virtual
SetLinkStatic(bool _static)=0Linkpure virtual
SetName(const std::string &_name)Entityvirtual
SetParent(BasePtr _parent)Base
SetPublishData(bool _enable)Link
SetRelativePose(const math::Pose &_pose, bool _notify=true, bool _publish=true)Entity
SetSaveable(bool _v)Base
SetScale(const math::Vector3 &_scale)Link
SetSelected(bool _set)Linkvirtual
SetSelfCollide(bool _collide)=0Linkpure virtual
SetState(const LinkState &_state)Link
SetStatic(const bool &_static)Entity
SetTorque(const math::Vector3 &_torque)=0Linkpure virtual
SetVisualPose(const uint32_t _id, const ignition::math::Pose3d &_pose)Link
SetWorld(const WorldPtr &_newWorld)Base
SetWorldPose(const math::Pose &_pose, bool _notify=true, bool _publish=true)Entity
SetWorldTwist(const math::Vector3 &_linear, const math::Vector3 &_angular, bool _updateChildren=true)Entity
SHAPE enum valueBase
SLIDER_JOINT enum valueBase
SPHERE_SHAPE enum valueBase
StopAnimation()Entityvirtual
UNIVERSAL_JOINT enum valueBase
Update(const common::UpdateInfo &_info)Link
gazebo::physics::Entity::Update()Baseinlinevirtual
UpdateMass()Linkinlinevirtual
UpdateParameters(sdf::ElementPtr _sdf)Linkvirtual
UpdateSurface()Linkinlinevirtual
visPubEntityprotected
VISUAL enum valueBase
VisualId(const std::string &_visName, uint32_t &_visualId) constLink
visualMsgEntityprotected
VisualPose(const uint32_t _id, ignition::math::Pose3d &_pose) constLink
visualsLinkprotected
Visuals_M typedefLinkprotected
worldBaseprotected
worldPoseEntitymutableprotected
~Base()Basevirtual
~Entity()Entityvirtual
~Link()Linkvirtual