This is the complete list of members for
b2WheelJoint, including all inherited members.
b2Body class | b2Joint | [friend] |
b2GearJoint class | b2Joint | [friend] |
b2Island class | b2Joint | [friend] |
b2Joint class | b2WheelJoint | [friend] |
b2Joint::b2Joint(const b2JointDef *def) | b2Joint | [protected] |
b2WheelJoint(const b2WheelJointDef *def) | b2WheelJoint | [protected] |
b2World class | b2Joint | [friend] |
Create(const b2JointDef *def, b2BlockAllocator *allocator) | b2Joint | [protected, static] |
Destroy(b2Joint *joint, b2BlockAllocator *allocator) | b2Joint | [protected, static] |
Dump() | b2WheelJoint | [virtual] |
EnableMotor(bool flag) | b2WheelJoint | |
GetAnchorA() const | b2WheelJoint | [virtual] |
GetAnchorB() const | b2WheelJoint | [virtual] |
GetBodyA() | b2Joint | [inline] |
GetBodyB() | b2Joint | [inline] |
GetCollideConnected() const | b2Joint | [inline] |
GetJointSpeed() const | b2WheelJoint | |
GetJointTranslation() const | b2WheelJoint | |
GetLocalAnchorA() const | b2WheelJoint | [inline] |
GetLocalAnchorB() const | b2WheelJoint | [inline] |
GetLocalAxisA() const | b2WheelJoint | [inline] |
GetMaxMotorTorque() const | b2WheelJoint | [inline] |
GetMotorSpeed() const | b2WheelJoint | [inline] |
GetMotorTorque(float32 inv_dt) const | b2WheelJoint | |
GetNext() | b2Joint | [inline] |
GetNext() const | b2Joint | [inline] |
GetReactionForce(float32 inv_dt) const | b2WheelJoint | [virtual] |
GetReactionTorque(float32 inv_dt) const | b2WheelJoint | [virtual] |
GetSpringDampingRatio() const | b2WheelJoint | [inline] |
GetSpringFrequencyHz() const | b2WheelJoint | [inline] |
GetType() const | b2Joint | [inline] |
GetUserData() const | b2Joint | [inline] |
InitVelocityConstraints(const b2SolverData &data) | b2WheelJoint | [protected, virtual] |
IsActive() const | b2Joint | |
IsMotorEnabled() const | b2WheelJoint | |
m_ax | b2WheelJoint | [protected] |
m_ay | b2WheelJoint | [protected] |
m_bias | b2WheelJoint | [protected] |
m_bodyA | b2Joint | [protected] |
m_bodyB | b2Joint | [protected] |
m_collideConnected | b2Joint | [protected] |
m_dampingRatio | b2WheelJoint | [protected] |
m_edgeA | b2Joint | [protected] |
m_edgeB | b2Joint | [protected] |
m_enableMotor | b2WheelJoint | [protected] |
m_frequencyHz | b2WheelJoint | [protected] |
m_gamma | b2WheelJoint | [protected] |
m_impulse | b2WheelJoint | [protected] |
m_index | b2Joint | [protected] |
m_indexA | b2WheelJoint | [protected] |
m_indexB | b2WheelJoint | [protected] |
m_invIA | b2WheelJoint | [protected] |
m_invIB | b2WheelJoint | [protected] |
m_invMassA | b2WheelJoint | [protected] |
m_invMassB | b2WheelJoint | [protected] |
m_islandFlag | b2Joint | [protected] |
m_localAnchorA | b2WheelJoint | [protected] |
m_localAnchorB | b2WheelJoint | [protected] |
m_localCenterA | b2WheelJoint | [protected] |
m_localCenterB | b2WheelJoint | [protected] |
m_localXAxisA | b2WheelJoint | [protected] |
m_localYAxisA | b2WheelJoint | [protected] |
m_mass | b2WheelJoint | [protected] |
m_maxMotorTorque | b2WheelJoint | [protected] |
m_motorImpulse | b2WheelJoint | [protected] |
m_motorMass | b2WheelJoint | [protected] |
m_motorSpeed | b2WheelJoint | [protected] |
m_next | b2Joint | [protected] |
m_prev | b2Joint | [protected] |
m_sAx | b2WheelJoint | [protected] |
m_sAy | b2WheelJoint | [protected] |
m_sBx | b2WheelJoint | [protected] |
m_sBy | b2WheelJoint | [protected] |
m_springImpulse | b2WheelJoint | [protected] |
m_springMass | b2WheelJoint | [protected] |
m_type | b2Joint | [protected] |
m_userData | b2Joint | [protected] |
SetMaxMotorTorque(float32 torque) | b2WheelJoint | |
SetMotorSpeed(float32 speed) | b2WheelJoint | |
SetSpringDampingRatio(float32 ratio) | b2WheelJoint | [inline] |
SetSpringFrequencyHz(float32 hz) | b2WheelJoint | [inline] |
SetUserData(void *data) | b2Joint | [inline] |
ShiftOrigin(const b2Vec2 &newOrigin) | b2Joint | [inline, virtual] |
SolvePositionConstraints(const b2SolverData &data) | b2WheelJoint | [protected, virtual] |
SolveVelocityConstraints(const b2SolverData &data) | b2WheelJoint | [protected, virtual] |
~b2Joint() | b2Joint | [inline, protected, virtual] |