| b2Body class | b2World | [friend] |
| b2ContactManager class | b2World | [friend] |
| b2Controller class | b2World | [friend] |
| b2Fixture class | b2World | [friend] |
| b2World(const b2Vec2 &gravity) | b2World | |
| ClearForces() | b2World | |
| CreateBody(const b2BodyDef *def) | b2World | |
| CreateJoint(const b2JointDef *def) | b2World | |
| DestroyBody(b2Body *body) | b2World | |
| DestroyJoint(b2Joint *joint) | b2World | |
| DrawDebugData() | b2World | |
| DrawJoint(b2Joint *joint) | b2World | [private] |
| DrawShape(b2Fixture *shape, const b2Transform &xf, const b2Color &color) | b2World | [private] |
| Dump() | b2World | |
| e_clearForces enum value | b2World | [private] |
| e_locked enum value | b2World | [private] |
| e_newFixture enum value | b2World | [private] |
| g_debugDraw | b2World | [private] |
| GetAllowSleeping() const | b2World | [inline] |
| GetAutoClearForces() const | b2World | [inline] |
| GetBodyCount() const | b2World | [inline] |
| GetBodyList() | b2World | [inline] |
| GetBodyList() const | b2World | [inline] |
| GetContactCount() const | b2World | [inline] |
| GetContactList() | b2World | [inline] |
| GetContactList() const | b2World | [inline] |
| GetContactManager() const | b2World | [inline] |
| GetContinuousPhysics() const | b2World | [inline] |
| GetGravity() const | b2World | [inline] |
| GetJointCount() const | b2World | [inline] |
| GetJointList() | b2World | [inline] |
| GetJointList() const | b2World | [inline] |
| GetProfile() const | b2World | [inline] |
| GetProxyCount() const | b2World | |
| GetSubStepping() const | b2World | [inline] |
| GetTreeBalance() const | b2World | |
| GetTreeHeight() const | b2World | |
| GetTreeQuality() const | b2World | |
| GetWarmStarting() const | b2World | [inline] |
| IsLocked() const | b2World | [inline] |
| m_allowSleep | b2World | [private] |
| m_blockAllocator | b2World | [private] |
| m_bodyCount | b2World | [private] |
| m_bodyList | b2World | [private] |
| m_contactManager | b2World | [private] |
| m_continuousPhysics | b2World | [private] |
| m_destructionListener | b2World | [private] |
| m_flags | b2World | [private] |
| m_gravity | b2World | [private] |
| m_inv_dt0 | b2World | [private] |
| m_jointCount | b2World | [private] |
| m_jointList | b2World | [private] |
| m_profile | b2World | [private] |
| m_stackAllocator | b2World | [private] |
| m_stepComplete | b2World | [private] |
| m_subStepping | b2World | [private] |
| m_warmStarting | b2World | [private] |
| QueryAABB(b2QueryCallback *callback, const b2AABB &aabb) const | b2World | |
| RayCast(b2RayCastCallback *callback, const b2Vec2 &point1, const b2Vec2 &point2) const | b2World | |
| SetAllowSleeping(bool flag) | b2World | |
| SetAutoClearForces(bool flag) | b2World | [inline] |
| SetContactFilter(b2ContactFilter *filter) | b2World | |
| SetContactListener(b2ContactListener *listener) | b2World | |
| SetContinuousPhysics(bool flag) | b2World | [inline] |
| SetDebugDraw(b2Draw *debugDraw) | b2World | |
| SetDestructionListener(b2DestructionListener *listener) | b2World | |
| SetGravity(const b2Vec2 &gravity) | b2World | [inline] |
| SetSubStepping(bool flag) | b2World | [inline] |
| SetWarmStarting(bool flag) | b2World | [inline] |
| ShiftOrigin(const b2Vec2 &newOrigin) | b2World | |
| Solve(const b2TimeStep &step) | b2World | [private] |
| SolveTOI(const b2TimeStep &step) | b2World | [private] |
| Step(float32 timeStep, int32 velocityIterations, int32 positionIterations) | b2World | |
| ~b2World() | b2World |