This is the complete list of members for ODEJoint, including all inherited members.
ACTOR enum value | Base | |
AddChild(BasePtr _child) | Base | |
AddType(EntityType _type) | Base | |
anchorLink | Joint | protected |
anchorPos | Joint | protected |
anchorPose | Joint | protected |
applyDamping | Joint | protected |
ApplyExplicitStiffnessDamping() | ODEJoint | |
ApplyImplicitStiffnessDamping() | ODEJoint | |
ApplyStiffnessDamping() | ODEJoint | virtual |
AreConnected(LinkPtr _one, LinkPtr _two) const | ODEJoint | virtual |
Attach(LinkPtr _parent, LinkPtr _child) | ODEJoint | virtual |
Attribute enum name | Joint | |
axisParentModelFrame | Joint | protected |
BALL_JOINT enum value | Base | |
BASE enum value | Base | |
Base(BasePtr _parent) | Base | explicit |
BOX_SHAPE enum value | Base | |
CacheForceTorque() | ODEJoint | virtual |
CFM enum value | Joint | |
CFMMode enum name | ODEJoint | |
CheckAndTruncateForce(unsigned int _index, double _effort) | Joint | |
childLink | Joint | protected |
children | Base | protected |
COLLISION enum value | Base | |
ComputeChildLinkPose(unsigned int _index, double _position) | Joint | protected |
ComputeScopedName() | Base | protected |
ConnectJointUpdate(T _subscriber) | Joint | inline |
CYLINDER_SHAPE enum value | Base | |
DAMPING_ACTIVE enum value | ODEJoint | |
Detach() | ODEJoint | virtual |
DisconnectJointUpdate(event::ConnectionPtr &_conn) | Joint | inline |
dissipationCoefficient | Joint | protected |
effortLimit | Joint | protected |
ENTITY enum value | Base | |
EntityType enum name | Base | |
ERP enum value | Joint | |
FillMsg(msgs::Joint &_msg) | Joint | virtual |
FindAllConnectedLinks(const LinkPtr &_originalParentLink, Link_V &_connectedLinks) | Joint | protected |
Fini() | ODEJoint | virtual |
FIXED_JOINT enum value | Base | |
FMAX enum value | Joint | |
FUDGE_FACTOR enum value | Joint | |
GEARBOX_JOINT enum value | Base | |
GetAnchor(unsigned int _index) const =0 | Joint | pure virtual |
GetAnchorErrorPose() const | Joint | |
GetAngle(unsigned int _index) const | Joint | |
GetAngleCount() const =0 | Joint | pure virtual |
GetAngleImpl(unsigned int _index) const =0 | Joint | protectedpure virtual |
GetAxisFrame(unsigned int _index) const | Joint | |
GetAxisFrameOffset(unsigned int _index) const | Joint | |
GetByName(const std::string &_name) | Base | |
GetCFM() | ODEJoint | |
GetChild() const | Joint | |
gazebo::physics::Base::GetChild(unsigned int _i) const | Base | |
gazebo::physics::Base::GetChild(const std::string &_name) | Base | |
GetChildCount() const | Base | |
GetDamping(unsigned int _index) | Joint | |
GetEffortLimit(unsigned int _index) | Joint | virtual |
GetERP() | ODEJoint | |
GetFeedback() | ODEJoint | |
GetForce(unsigned int _index) | ODEJoint | virtual |
GetForceTorque(unsigned int _index) | ODEJoint | virtual |
GetGlobalAxis(unsigned int _index) const =0 | Joint | pure virtual |
GetHighStop(unsigned int _index) | ODEJoint | virtual |
GetId() const | Base | |
GetInertiaRatio(const unsigned int _index) const | Joint | |
GetInertiaRatio(const math::Vector3 &_axis) const | Joint | |
GetInitialAnchorPose() const | Joint | |
GetJointLink(unsigned int _index) const | ODEJoint | virtual |
GetLinkForce(unsigned int _index) const | ODEJoint | virtual |
GetLinkTorque(unsigned int _index) const | ODEJoint | virtual |
GetLocalAxis(unsigned int _index) const | Joint | |
GetLowerLimit(unsigned int _index) const | Joint | |
GetLowStop(unsigned int _index) | ODEJoint | virtual |
GetMsgType() const | Joint | |
GetName() const | Base | |
GetParam(unsigned int _parameter) const | ODEJoint | virtual |
GetParam(const std::string &_key, unsigned int _index) | ODEJoint | virtual |
GetParent() const | Joint | |
GetParentId() const | Base | |
GetParentWorldPose() const | Joint | |
GetSaveable() const | Base | |
GetScopedName(bool _prependWorldName=false) const | Base | |
GetSDF() | Base | virtual |
GetSpringReferencePosition(unsigned int _index) const | Joint | |
GetStiffness(unsigned int _index) | Joint | |
GetStopCFM() | ODEJoint | inline |
GetStopDissipation(unsigned int _index) const | Joint | |
GetStopERP() | ODEJoint | inline |
GetStopStiffness(unsigned int _index) const | Joint | |
GetType() const | Base | |
GetUpperLimit(unsigned int _index) const | Joint | |
GetVelocity(unsigned int _index) const =0 | Joint | pure virtual |
GetVelocityLimit(unsigned int _index) | Joint | virtual |
GetWorld() const | Base | |
GetWorldEnergyPotentialSpring(unsigned int _index) const | Joint | |
GetWorldPose() const | Joint | |
HasType(const EntityType &_t) const | Base | |
HEIGHTMAP_SHAPE enum value | Base | |
HI_STOP enum value | Joint | |
HINGE2_JOINT enum value | Base | |
HINGE_JOINT enum value | Base | |
Init() | Joint | virtual |
IsSelected() const | Base | |
JOINT enum value | Base | |
Joint(BasePtr _parent) | Joint | explicit |
JOINT_LIMIT enum value | ODEJoint | |
jointId | ODEJoint | protected |
LIGHT enum value | Base | |
LINK enum value | Base | |
LO_STOP enum value | Joint | |
Load(sdf::ElementPtr _sdf) | ODEJoint | virtual |
gazebo::physics::Joint::Load(LinkPtr _parent, LinkPtr _child, const math::Pose &_pose) | Joint | |
lowerLimit | Joint | protected |
MAP_SHAPE enum value | Base | |
MESH_SHAPE enum value | Base | |
MODEL enum value | Base | |
model | Joint | protected |
MULTIRAY_SHAPE enum value | Base | |
NONE enum value | ODEJoint | |
ODEJoint(BasePtr _parent) | ODEJoint | |
operator==(const Base &_ent) const | Base | |
parent | Base | protected |
parentAnchorPose | Joint | protected |
parentLink | Joint | protected |
PLANE_SHAPE enum value | Base | |
POLYLINE_SHAPE enum value | Base | |
Print(const std::string &_prefix) | Base | |
provideFeedback | Joint | protected |
RAY_SHAPE enum value | Base | |
RemoveChild(unsigned int _id) | Base | virtual |
RemoveChild(const std::string &_name) | Base | |
RemoveChild(physics::BasePtr _child) | Base | |
RemoveChildren() | Base | |
Reset() | ODEJoint | virtual |
gazebo::physics::Base::Reset(Base::EntityType _resetType) | Base | virtual |
SCREW_JOINT enum value | Base | |
sdf | Base | protected |
SENSOR_COLLISION enum value | Base | |
SetAnchor(unsigned int _index, const math::Vector3 &_anchor)=0 | Joint | pure virtual |
SetAxis(unsigned int _index, const math::Vector3 &_axis) | ODEJoint | virtual |
SetCFM(double _cfm) | ODEJoint | |
SetDamping(unsigned int _index, double _damping) | ODEJoint | virtual |
SetEffortLimit(unsigned int _index, double _effort) | Joint | virtual |
SetERP(double _erp) | ODEJoint | |
SetForce(unsigned int _index, double _force) | ODEJoint | virtual |
SetForceImpl(unsigned int _index, double _force)=0 | ODEJoint | protectedpure virtual |
SetHighStop(unsigned int _index, const math::Angle &_angle) | ODEJoint | virtual |
SetLowerLimit(unsigned int _index, math::Angle _limit) | Joint | |
SetLowStop(unsigned int _index, const math::Angle &_angle) | ODEJoint | virtual |
SetModel(ModelPtr _model) | Joint | |
SetName(const std::string &_name) | Base | virtual |
SetParam(unsigned int _parameter, double _value) | ODEJoint | virtual |
SetParam(const std::string &_key, unsigned int _index, const boost::any &_value) | ODEJoint | virtual |
SetParent(BasePtr _parent) | Base | |
SetPosition(unsigned int _index, double _position) | ODEJoint | virtual |
SetPositionMaximal(unsigned int _index, double _position) | Joint | protected |
SetProvideFeedback(bool _enable) | ODEJoint | virtual |
SetSaveable(bool _v) | Base | |
SetSelected(bool _show) | Base | virtual |
SetState(const JointState &_state) | Joint | |
SetStiffness(unsigned int _index, const double _stiffness) | ODEJoint | virtual |
SetStiffnessDamping(unsigned int _index, double _stiffness, double _damping, double _reference=0) | ODEJoint | virtual |
SetStopDissipation(unsigned int _index, double _dissipation) | Joint | |
SetStopStiffness(unsigned int _index, double _stiffness) | Joint | |
SetUpperLimit(unsigned int _index, math::Angle _limit) | Joint | |
SetVelocity(unsigned int _index, double _vel)=0 | Joint | pure virtual |
SetVelocityLimit(unsigned int _index, double _velocity) | Joint | virtual |
SetVelocityMaximal(unsigned int _index, double _velocity) | Joint | protected |
SetWorld(const WorldPtr &_newWorld) | Base | |
SHAPE enum value | Base | |
SLIDER_JOINT enum value | Base | |
SPHERE_SHAPE enum value | Base | |
springReferencePosition | Joint | protected |
stiffnessCoefficient | Joint | protected |
STOP_CFM enum value | Joint | |
STOP_ERP enum value | Joint | |
SUSPENSION_CFM enum value | Joint | |
SUSPENSION_ERP enum value | Joint | |
UNIVERSAL_JOINT enum value | Base | |
Update() | Joint | virtual |
UpdateParameters(sdf::ElementPtr _sdf) | Joint | virtual |
upperLimit | Joint | protected |
UseImplicitSpringDamper(const bool _implicit) | ODEJoint | |
UsesImplicitSpringDamper() | ODEJoint | |
VEL enum value | Joint | |
velocityLimit | Joint | protected |
VISUAL enum value | Base | |
world | Base | protected |
wrench | Joint | protected |
~Base() | Base | virtual |
~Joint() | Joint | virtual |
~ODEJoint() | ODEJoint | virtual |