#include <BulletPhysics.h>
Classes | |
| class | TickCallbackManager |
Public Types | |
| enum | collisionShapeType_t { SHAPE_BOX, SHAPE_SPHERE, SHAPE_TRIMESH, SHAPE_COMPOUND_TRIMESH, SHAPE_COMPOUND_BOX, SHAPE_COMPOUND_CYLINDER } |
Public Member Functions | |
| btRigidBody * | addObject (osg::MatrixTransform *root, osg::Node *node, CollisionDataType *data, boost::shared_ptr< PhysicProperties > pp, osg::Node *colShape=NULL) |
| BulletPhysics (PhysicsConfig physicsConfig, osgOcean::OceanTechnique *oceanSurf) | |
| btRigidBody * | copyObject (btRigidBody *copied) |
| btPersistentManifold * | getCollision (int i) |
| int | getNumCollisions () |
| void | printManifolds () |
| void | setGravity (btVector3 g) |
| void | stepSimulation (btScalar timeStep, int maxSubSteps, btScalar fixedTimeStep) |
| ~BulletPhysics () | |
Public Attributes | |
| TickCallbackManager * | callbackManager |
| btDiscreteDynamicsWorld * | dynamicsWorld |
| int | physicsStep |
Private Member Functions | |
| void | cleanManifolds () |
| btCollisionShape * | GetCSFromOSG (osg::Node *node, collisionShapeType_t ctype) |
Private Attributes | |
| btDefaultCollisionConfiguration * | collisionConfiguration |
| btCollisionDispatcher * | dispatcher |
| btBroadphaseInterface * | inter |
| osgOcean::OceanTechnique * | oceanSurface |
| btConstraintSolver * | solver |
Definition at line 75 of file BulletPhysics.h.
| SHAPE_BOX | |
| SHAPE_SPHERE | |
| SHAPE_TRIMESH | |
| SHAPE_COMPOUND_TRIMESH | |
| SHAPE_COMPOUND_BOX | |
| SHAPE_COMPOUND_CYLINDER |
Definition at line 79 of file BulletPhysics.h.
| BulletPhysics::BulletPhysics | ( | PhysicsConfig | physicsConfig, |
| osgOcean::OceanTechnique * | oceanSurf | ||
| ) |
Definition at line 183 of file BulletPhysics.cpp.
| BulletPhysics::~BulletPhysics | ( | ) | [inline] |
Definition at line 106 of file BulletPhysics.h.
| btRigidBody * BulletPhysics::addObject | ( | osg::MatrixTransform * | root, |
| osg::Node * | node, | ||
| CollisionDataType * | data, | ||
| boost::shared_ptr< PhysicProperties > | pp, | ||
| osg::Node * | colShape = NULL |
||
| ) |
Definition at line 317 of file BulletPhysics.cpp.
| void BulletPhysics::cleanManifolds | ( | ) | [private] |
Definition at line 448 of file BulletPhysics.cpp.
| btRigidBody * BulletPhysics::copyObject | ( | btRigidBody * | copied | ) |
Definition at line 50 of file BulletPhysics.cpp.
| btPersistentManifold * BulletPhysics::getCollision | ( | int | i | ) |
Definition at line 443 of file BulletPhysics.cpp.
| btCollisionShape * BulletPhysics::GetCSFromOSG | ( | osg::Node * | node, |
| collisionShapeType_t | ctype | ||
| ) | [private] |
Definition at line 297 of file BulletPhysics.cpp.
| int BulletPhysics::getNumCollisions | ( | ) |
Definition at line 438 of file BulletPhysics.cpp.
| void BulletPhysics::printManifolds | ( | ) |
Definition at line 143 of file BulletPhysics.cpp.
| void BulletPhysics::setGravity | ( | btVector3 | g | ) | [inline] |
Definition at line 89 of file BulletPhysics.h.
| void BulletPhysics::stepSimulation | ( | btScalar | timeStep, |
| int | maxSubSteps = 1, |
||
| btScalar | fixedTimeStep = btScalar(1.) / btScalar(60.) |
||
| ) |
Definition at line 131 of file BulletPhysics.cpp.
Definition at line 138 of file BulletPhysics.h.
btDefaultCollisionConfiguration* BulletPhysics::collisionConfiguration [private] |
Definition at line 141 of file BulletPhysics.h.
btCollisionDispatcher* BulletPhysics::dispatcher [private] |
Definition at line 142 of file BulletPhysics.h.
| btDiscreteDynamicsWorld* BulletPhysics::dynamicsWorld |
Definition at line 84 of file BulletPhysics.h.
btBroadphaseInterface* BulletPhysics::inter [private] |
Definition at line 144 of file BulletPhysics.h.
osgOcean::OceanTechnique* BulletPhysics::oceanSurface [private] |
Definition at line 146 of file BulletPhysics.h.
Definition at line 102 of file BulletPhysics.h.
btConstraintSolver* BulletPhysics::solver [private] |
Definition at line 143 of file BulletPhysics.h.