gjkepa2_impl | |
MinkowskiDiff | |
GJK | |
eStatus | |
sSimplex | |
sSV | |
EPA | |
eStatus | |
sFace | |
sHorizon | |
sList | |
Vectormath | |
Aos | |
Vector3 | |
Vector4 | |
Point3 | |
Quat | |
Matrix3 | |
Matrix4 | |
Transform3 | |
boolInVec | |
floatInVec | |
_cl_image_format | |
addr64 | This file provides some platform/compiler checks for common definitions |
Box | The Box is an internal class used by the boxBoxDistance calculation |
BoxPoint | Internally used class to contain feature information for boxBoxDistance calculation |
BroadphaseAabbTester | |
BroadphaseRayTester | |
bt32BitAxisSweep3 | The bt32BitAxisSweep3 allows higher precision quantization and more objects compared to the btAxisSweep3 sweep and prune |
bt3DGrid3F1U | |
bt3DGridBroadphaseParams | |
BT_BOX_BOX_TRANSFORM_CACHE | Class for transforming a model1 to the space of model0 |
BT_QUANTIZED_BVH_NODE | BtQuantizedBvhNode is a compressed aabb node, 16 bytes |
btAABB | Axis aligned box |
btActionInterface | Basic interface to allow actions such as vehicles and characters to be updated inside a btDynamicsWorld |
btActivatingCollisionAlgorithm | This class is not enabled yet (work-in-progress) to more aggressively activate objects |
btAlignedAllocator | The btAlignedAllocator is a portable class for aligned memory allocations |
rebind | |
btAlignedObjectArray | The btAlignedObjectArray template class uses a subset of the stl::vector interface for its methods It is developed to replace stl::vector to avoid portability issues, including STL alignment issues to add SIMD/SSE data |
less | |
btAngleCompareFunc | |
btAngularLimit | |
btAxisSweep3 | The btAxisSweep3 is an efficient implementation of the 3d axis sweep and prune broadphase |
btAxisSweep3Internal | The internal templace class btAxisSweep3Internal implements the sweep and prune broadphase |
Edge | |
Handle | |
btBarrier | |
btBlock | Internal structure for the btStackAlloc memory allocator |
btBox2dBox2dCollisionAlgorithm | Box-box collision detection |
CreateFunc | |
btBox2dShape | The btBox2dShape is a box primitive around the origin, its sides axis aligned with length specified by half extents, in local shape coordinates. When used as part of a btCollisionObject or btRigidBody it will be an oriented box in world space |
btBoxBoxCollisionAlgorithm | Box-box collision detection |
CreateFunc | |
btBoxBoxDetector | BtBoxBoxDetector wraps the ODE box-box collision detector re-distributed under the Zlib license with permission from Russell L |
btBoxShape | The btBoxShape is a box primitive around the origin, its sides axis aligned with length specified by half extents, in local shape coordinates. When used as part of a btCollisionObject or btRigidBody it will be an oriented box in world space |
btBridgedManifoldResult | |
btBroadphaseAabbCallback | |
btBroadphaseInterface | Interface to detect aabb-overlapping object pairs |
btBroadphasePair | Pair of aabb-overlapping objects |
btBroadphasePairSortPredicate | |
btBroadphaseProxy | The btBroadphaseProxy is the main class that can be used with the Bullet broadphases |
btBroadphaseRayCallback | |
btBU_Simplex1to4 | The btBU_Simplex1to4 implements tetrahedron, triangle, line, vertex collision shapes. In most cases it is better to use btConvexHullShape instead |
btBvhSubtreeInfo | BtBvhSubtreeInfo provides info to gather a subtree of limited size |
btBvhSubtreeInfoData | |
btBvhTree | Basic Box tree structure |
btBvhTriangleMeshShape | The btBvhTriangleMeshShape is a static-triangle mesh shape, it can only be used for fixed/non-moving objects |
btCapsuleShape | The btCapsuleShape represents a capsule around the Y axis, there is also the btCapsuleShapeX aligned around the X axis and btCapsuleShapeZ around the Z axis |
btCapsuleShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btCapsuleShapeX | BtCapsuleShapeX represents a capsule around the Z axis the total height is height+2*radius, so the height is just the height between the center of each 'sphere' of the capsule caps |
btCapsuleShapeZ | BtCapsuleShapeZ represents a capsule around the Z axis the total height is height+2*radius, so the height is just the height between the center of each 'sphere' of the capsule caps |
btCharacterControllerInterface | |
btCharIndexTripletData | |
btChunk | |
btClock | The btClock is a portable basic clock that measures accurate time in seconds, use for profiling |
btClockData | |
btClosestNotMeConvexResultCallback | |
btCollisionAlgorithm | BtCollisionAlgorithm is an collision interface that is compatible with the Broadphase and btDispatcher |
btCollisionAlgorithmConstructionInfo | |
btCollisionAlgorithmCreateFunc | Used by the btCollisionDispatcher to register and create instances for btCollisionAlgorithm |
btCollisionConfiguration | BtCollisionConfiguration allows to configure Bullet collision detection stack allocator size, default collision algorithms and persistent manifold pool size |
btCollisionDispatcher | BtCollisionDispatcher supports algorithms that handle ConvexConvex and ConvexConcave collision pairs |
btCollisionObject | BtCollisionObject can be used to manage collision detection objects |
btCollisionObjectDoubleData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btCollisionObjectFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btCollisionObjectWrapper | |
btCollisionPairCallback | Interface for iterating all overlapping collision pairs, no matter how those pairs are stored (array, set, map etc) this is useful for the collision dispatcher |
btCollisionShape | Interface for collision shapes that can be shared among btCollisionObjects |
btCollisionShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btCollisionWorld | CollisionWorld is interface and container for the collision detection |
AllHitsRayResultCallback | |
ClosestConvexResultCallback | |
ClosestRayResultCallback | |
ContactResultCallback | ContactResultCallback is used to report contact points |
ConvexResultCallback | RayResultCallback is used to report new raycast results |
LocalConvexResult | |
LocalRayResult | |
LocalShapeInfo | LocalShapeInfo gives extra information for complex shapes Currently, only btTriangleMeshShape is available, so it just contains triangleIndex and subpart |
RayResultCallback | RayResultCallback is used to report new raycast results |
btCompoundCollisionAlgorithm | BtCompoundCollisionAlgorithm supports collision between CompoundCollisionShapes and other collision shapes |
CreateFunc | |
SwappedCreateFunc | |
btCompoundCompoundCollisionAlgorithm | BtCompoundCompoundCollisionAlgorithm supports collision between two btCompoundCollisionShape shapes |
CreateFunc | |
SwappedCreateFunc | |
btCompoundCompoundLeafCallback | |
btCompoundLeafCallback | |
btCompoundShape | The btCompoundShape allows to store multiple other btCollisionShapes This allows for moving concave collision objects |
btCompoundShapeChild | |
btCompoundShapeChildData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btCompoundShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btConcaveShape | Interface for non-moving (static) concave shapes |
btConeShape | The btConeShape implements a cone shape primitive, centered around the origin and aligned with the Y axis. The btConeShapeX is aligned around the X axis and btConeShapeZ around the Z axis |
btConeShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btConeShapeX | BtConeShape implements a Cone shape, around the X axis |
btConeShapeZ | BtConeShapeZ implements a Cone shape, around the Z axis |
btConeTwistConstraint | BtConeTwistConstraint can be used to simulate ragdoll joints (upper arm, leg etc) |
btConeTwistConstraintData | This structure is not used, except for loading pre-2.82 .bullet files |
btConeTwistConstraintDoubleData | |
btConnectivityProcessor | |
btConstraintRow | |
btConstraintSetting | |
btConstraintSolver | |
btConstraintSolverIO | |
btContactArray | |
btContactConstraint | BtContactConstraint can be automatically created to solve contact constraints using the unified btTypedConstraint interface |
btContactSolverInfo | |
btContactSolverInfoData | |
btContactSolverInfoDoubleData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btContactSolverInfoFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btContinuousConvexCollision | BtContinuousConvexCollision implements angular and linear time of impact for convex objects |
btConvex2dConvex2dAlgorithm | The convex2dConvex2dAlgorithm collision algorithm support 2d collision detection for btConvex2dShape Currently it requires the btMinkowskiPenetrationDepthSolver, it has support for 2d penetration depth computation |
CreateFunc | |
btConvex2dShape | The btConvex2dShape allows to use arbitrary convex shapes as 2d convex shapes, with the Z component assumed to be 0 |
btConvexCast | BtConvexCast is an interface for Casting |
CastResult | RayResult stores the closest result alternatively, add a callback method to decide about closest/all results |
btConvexConcaveCollisionAlgorithm | BtConvexConcaveCollisionAlgorithm supports collision between convex shapes and (concave) trianges meshes |
CreateFunc | |
SwappedCreateFunc | |
btConvexConvexAlgorithm | Enabling USE_SEPDISTANCE_UTIL2 requires 100% reliable distance computation |
CreateFunc | |
btConvexHullComputer | Convex hull implementation based on Preparata and Hong See http://code.google.com/p/bullet/issues/detail?id=275 Ole Kniemeyer, MAXON Computer GmbH |
Edge | |
btConvexHullInternal | |
DMul | |
Edge | |
Face | |
Int128 | |
IntermediateHull | |
Point32 | |
Point64 | |
PointR128 | |
Pool | |
PoolArray | |
Rational128 | |
Rational64 | |
Vertex | |
btConvexHullShape | The btConvexHullShape implements an implicit convex hull of an array of vertices |
btConvexHullShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btConvexInternalAabbCachingShape | BtConvexInternalAabbCachingShape adds local aabb caching for convex shapes, to avoid expensive bounding box calculations |
btConvexInternalShape | The btConvexInternalShape is an internal base class, shared by most convex shape implementations |
btConvexInternalShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btConvexPenetrationDepthSolver | ConvexPenetrationDepthSolver provides an interface for penetration depth calculation |
btConvexPlaneCollisionAlgorithm | BtSphereBoxCollisionAlgorithm provides sphere-box collision detection |
CreateFunc | |
btConvexPointCloudShape | The btConvexPointCloudShape implements an implicit convex hull of an array of vertices |
btConvexPolyhedron | |
btConvexSeparatingDistanceUtil | The btConvexSeparatingDistanceUtil can help speed up convex collision detection by conservatively updating a cached separating distance/vector instead of re-calculating the closest distance |
btConvexShape | The btConvexShape is an abstract shape interface, implemented by all convex shapes such as btBoxShape, btConvexHullShape etc |
btConvexTriangleCallback | For each triangle in the concave mesh that overlaps with the AABB of a convex (m_convexProxy), processTriangle is called |
btConvexTriangleMeshShape | The btConvexTriangleMeshShape is a convex hull of a triangle mesh, but the performance is not as good as btConvexHullShape |
btCPUVertexBufferDescriptor | |
btCriticalSection | |
btCylinderShape | Implements a cylinder shape primitive, centered around the origin. Its central axis aligned with the Y axis. btCylinderShapeX is aligned with the X axis and btCylinderShapeZ around the Z axis |
btCylinderShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btCylinderShapeX | |
btCylinderShapeZ | |
btDantzigScratchMemory | |
btDantzigSolver | Original version written by Erwin Coumans, October 2013 |
btDbvt | Implements a fast dynamic bounding volume tree based on axis aligned bounding boxes (aabb tree) |
IClone | |
ICollide | |
IWriter | |
sStkCLN | |
sStkNN | |
sStkNP | |
sStkNPS | |
btDbvtAabbMm | |
btDbvtBroadphase | The btDbvtBroadphase implements a broadphase using two dynamic AABB bounding volume hierarchies/trees (see btDbvt) |
btDbvtNode | |
btDbvtNodeEnumerator | |
btDbvtProxy | |
btDbvtTreeCollider | |
btDefaultCollisionConfiguration | BtCollisionConfiguration allows to configure Bullet collision detection stack allocator, pool memory allocators |
btDefaultCollisionConstructionInfo | |
btDefaultMotionState | The btDefaultMotionState provides a common implementation to synchronize world transforms with offsets |
btDefaultSerializer | The btDefaultSerializer is the main Bullet serialization class |
btDefaultSoftBodySolver | |
btDefaultVehicleRaycaster | |
btDiscreteCollisionDetectorInterface | This interface is made to be used by an iterative approach to do TimeOfImpact calculations This interface allows to query for closest points and penetration depth between two (convex) objects the closest point is on the second object (B), and the normal points from the surface on B towards A |
ClosestPointInput | |
Result | |
btDiscreteDynamicsWorld | BtDiscreteDynamicsWorld provides discrete rigid body simulation those classes replace the obsolete CcdPhysicsEnvironment/CcdPhysicsController |
btDispatcher | The btDispatcher interface class can be used in combination with broadphase to dispatch calculations for overlapping pairs |
btDispatcherInfo | |
btDummyBarrier | |
btDummyCriticalSection | |
btDX11Buffer | DX11 Buffer that tracks a host buffer on use to ensure size-correctness |
btDX11SIMDAwareSoftBodySolver | |
SolvePositionsFromLinksKernelCB | |
btDX11SoftBodySolver | |
AddVelocityCB | |
ApplyForcesCB | |
btAcceleratedSoftBodyInterface | SoftBody class to maintain information about a soft body instance within a solver |
CollisionObjectIndices | |
CollisionShapeDescription | Entry in the collision shape array |
ComputeBoundsCB | |
IntegrateCB | |
PrepareLinksCB | |
SolveCollisionsAndUpdateVelocitiesCB | |
SolvePositionsFromLinksKernelCB | |
UIntVector3 | |
UpdatePositionsFromVelocitiesCB | |
UpdateSoftBodiesCB | |
UpdateVelocitiesFromPositionsWithoutVelocitiesCB | |
UpdateVelocitiesFromPositionsWithVelocitiesCB | |
VSolveLinksCB | |
btDX11VertexBufferDescriptor | |
btDynamicsWorld | The btDynamicsWorld is the interface class for several dynamics implementation, basic, discrete, parallel, and continuous etc |
btDynamicsWorldDoubleData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btDynamicsWorldFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btEigen | |
btElement | |
btEmptyAlgorithm | EmptyAlgorithm is a stub for unsupported collision pairs |
CreateFunc | |
btEmptyShape | The btEmptyShape is a collision shape without actual collision detection shape, so most users should ignore this class |
btFace | |
btFixedConstraint | |
btGearConstraint | The btGeatConstraint will couple the angular velocity for two bodies around given local axis and ratio |
btGearConstraintDoubleData | |
btGearConstraintFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btGEN_Link | |
btGEN_List | |
btGeneric6DofConstraint | BtGeneric6DofConstraint between two rigidbodies each with a pivotpoint that descibes the axis location in local space |
btGeneric6DofConstraintData | |
btGeneric6DofConstraintDoubleData2 | |
btGeneric6DofSpringConstraint | Generic 6 DOF constraint that allows to set spring motors to any translational and rotational DOF |
btGeneric6DofSpringConstraintData | |
btGeneric6DofSpringConstraintDoubleData2 | |
btGenericMemoryPool | Generic Pool class |
btGenericPoolAllocator | Generic Allocator with pools |
btGeometryUtil | The btGeometryUtil helper class provides a few methods to convert between plane equations and vertices |
btGhostObject | The btGhostObject can keep track of all objects that are overlapping By default, this overlap is based on the AABB This is useful for creating a character controller, collision sensors/triggers, explosions etc |
btGhostPairCallback | The btGhostPairCallback interfaces and forwards adding and removal of overlapping pairs from the btBroadphaseInterface to btGhostObject |
btGImpactBvh | Structure for containing Boxes |
btGImpactCollisionAlgorithm | Collision Algorithm for GImpact Shapes |
CreateFunc | |
btGImpactCompoundShape | BtGImpactCompoundShape allows to handle multiple btCollisionShape objects at once |
CompoundPrimitiveManager | Compound primitive manager |
btGImpactMeshShape | This class manages a mesh supplied by the btStridingMeshInterface interface |
btGImpactMeshShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btGImpactMeshShapePart | This class manages a sub part of a mesh supplied by the btStridingMeshInterface interface |
TrimeshPrimitiveManager | Trimesh primitive manager |
btGImpactQuantizedBvh | Structure for containing Boxes |
btGImpactShapeInterface | Base class for gimpact shapes |
btGImpactTriangleCallback | |
btGjkConvexCast | GjkConvexCast performs a raycast on a convex object using support mapping |
btGjkEpaPenetrationDepthSolver | EpaPenetrationDepthSolver uses the Expanding Polytope Algorithm to calculate the penetration depth between two convex shapes |
btGjkEpaSolver2 | BtGjkEpaSolver contributed under zlib by Nathanael Presson |
sResults | |
btGjkPairDetector | BtGjkPairDetector uses GJK to implement the btDiscreteCollisionDetectorInterface |
btGpu3DGridBroadphase | The btGpu3DGridBroadphase uses GPU-style code compiled for CPU to compute overlapping pairs |
btHashedOverlappingPairCache | Hash-space based Pair Cache, thanks to Erin Catto, Box2D, http://www.box2d.org, and Pierre Terdiman, Codercorner, http://codercorner.com |
btHashedSimplePairCache | |
btHashInt | |
btHashKey | |
btHashKeyPtr | |
btHashMap | The btHashMap template class implements a generic and lightweight hashmap |
btHashPtr | |
btHashString | Very basic hashable string implementation, compatible with btHashMap |
btHeightfieldTerrainShape | BtHeightfieldTerrainShape simulates a 2D heightfield terrain |
btHinge2Constraint | |
btHingeConstraint | Hinge constraint between two rigidbodies each with a pivotpoint that descibes the axis location in local space axis defines the orientation of the hinge axis |
btHingeConstraintDoubleData | This structure is not used, except for loading pre-2.82 .bullet files |
btHingeConstraintDoubleData2 | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btHingeConstraintFloatData | |
btHullTriangle | |
btIDebugDraw | The btIDebugDraw interface class allows hooking up a debug renderer to visually debug simulations |
btIndexedMesh | The btIndexedMesh indexes a single vertex and index array |
btInternalEdge | |
btInternalTriangleIndexCallback | |
btInternalVertexPair | |
btIntIndexData | |
btIntSortPredicate | Original version written by Erwin Coumans, October 2013 |
btJacobianEntry | Jacobian entry is an abstraction that allows to describe constraints it can be used in combination with a constraint solver Can be used to relate the effect of an impulse to the constraint error |
btJointFeedback | |
btJointNode | |
btKinematicCharacterController | BtKinematicCharacterController is an object that supports a sliding motion in a world |
btKinematicClosestNotMeConvexResultCallback | |
btKinematicClosestNotMeRayResultCallback | |
btLCP | |
btManifoldPoint | ManifoldContactPoint collects and maintains persistent contactpoints |
btManifoldResult | BtManifoldResult is a helper class to manage contact results |
btMaterial | This file was created by Alex Silverman |
btMaterialProperties | This file was created by Alex Silverman |
btMatrix3x3 | Implements a 3x3 rotation matrix, to perform linear algebra in combination with btQuaternion, btTransform and btVector3 |
btMatrix3x3DoubleData | For serialization |
btMatrix3x3FloatData | For serialization |
btMatrixX | |
btMeshPartData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btMinkowskiPenetrationDepthSolver | MinkowskiPenetrationDepthSolver implements bruteforce penetration depth estimation |
btMinkowskiSumShape | The btMinkowskiSumShape is only for advanced users. This shape represents implicit based minkowski sum of two convex implicit shapes |
btMLCPSolver | Original version written by Erwin Coumans, October 2013 |
btMLCPSolverInterface | Original version written by Erwin Coumans, October 2013 |
btMotionState | The btMotionState interface class allows the dynamics world to synchronize and interpolate the updated world transforms with graphics For optimizations, potentially only moving objects get synchronized (using setWorldPosition/setWorldOrientation) |
btMultiBody | |
btMultiBodyConstraint | |
btMultiBodyConstraintSolver | |
btMultiBodyDynamicsWorld | The btMultiBodyDynamicsWorld adds Featherstone multi body dynamics to Bullet This implementation is still preliminary/experimental |
btMultiBodyJacobianData | |
btMultiBodyJointLimitConstraint | |
btMultiBodyJointMotor | |
btMultibodyLink | |
btMultiBodyLinkCollider | |
btMultiBodyPoint2Point | This file was written by Erwin Coumans |
btMultiBodySolverConstraint | 1D constraint along a normal axis between bodyA and bodyB. It can be combined to solve contact and friction constraints |
btMultimaterialTriangleMeshShape | This file was created by Alex Silverman |
btMultiSapBroadphase | The btMultiSapBroadphase is a research project, not recommended to use in production |
btBridgeProxy | |
btMultiSapProxy | |
btMultiSapBroadphasePairSortPredicate | |
btMultiSphereShape | The btMultiSphereShape represents the convex hull of a collection of spheres |
btMultiSphereShapeData | |
btNodeOverlapCallback | |
btNullPairCache | BtNullPairCache skips add/removal of overlapping pairs. Userful for benchmarking and unit testing |
btOpenCLAcceleratedSoftBodyInterface | SoftBody class to maintain information about a soft body instance within a solver |
btOpenCLBuffer | |
btOpenCLSoftBodySolver | |
AnchorNodeInfoCL | |
CollisionObjectIndices | |
UIntVector3 | |
btOpenCLSoftBodySolverSIMDAware | |
btOpenGLInteropVertexBufferDescriptor | |
btOptimizedBvh | The btOptimizedBvh extends the btQuantizedBvh to create AABB tree for triangle meshes, through the btStridingMeshInterface |
btOptimizedBvhNode | BtOptimizedBvhNode contains both internal and leaf node information |
btOptimizedBvhNodeDoubleData | |
btOptimizedBvhNodeFloatData | |
btOverlapCallback | |
btOverlapFilterCallback | |
btOverlappingPairCache | The btOverlappingPairCache provides an interface for overlapping pair management (add, remove, storage), used by the btBroadphaseInterface broadphases |
btOverlappingPairCallback | Additional optional broadphase user callback for adding/removing overlapping pairs, similar interface to btOverlappingPairCache |
btPairCachingGhostObject | |
btPairSet | A pairset array |
btParallelConstraintSolver | The btParallelConstraintSolver performs computations on constraint rows in parallel Using the cross-platform threading it supports Windows, Linux, Mac OSX and PlayStation 3 Cell SPUs |
btParallelSolverMemoryCache | |
btPersistentManifold | BtPersistentManifold is a contact point cache, it stays persistent as long as objects are overlapping in the broadphase |
btPersistentManifoldSortPredicate | Function object that routes calls to operator< |
btPerturbedContactResult | |
btPhysicsSdk | |
btPlane | |
btPlaneShape | Class for accessing the plane equation |
btPoint2PointConstraint | Point to point constraint between two rigidbodies each with a pivotpoint that descibes the 'ballsocket' location in local space |
btPoint2PointConstraintDoubleData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 this structure is not used, except for loading pre-2.82 .bullet files do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btPoint2PointConstraintDoubleData2 | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btPoint2PointConstraintFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btPointCollector | |
btPointerUid | |
btPolarDecomposition | This class is used to compute the polar decomposition of a matrix |
btPolyhedralContactClipping | |
btPolyhedralConvexAabbCachingShape | The btPolyhedralConvexAabbCachingShape adds aabb caching to the btPolyhedralConvexShape |
btPolyhedralConvexShape | The btPolyhedralConvexShape is an internal interface class for polyhedral convex shapes |
btPoolAllocator | Allows to efficiently allocate a large pool of objects, instead of dynamically allocating them separately |
btPositionAndRadius | |
btPrimitiveManagerBase | Prototype Base class for primitive classification |
btPrimitiveTriangle | |
btQuadWord | Base class for btVector3 and btQuaternion |
btQuantizedBvh | Stores an AABB tree that can be quickly traversed on CPU and Cell SPU |
btQuantizedBvhDoubleData | |
btQuantizedBvhFloatData | |
btQuantizedBvhNode | BtQuantizedBvhNode is a compressed aabb node, 16 bytes |
btQuantizedBvhNodeData | |
btQuantizedBvhTree | Basic Box tree structure |
btQuaternion | The btQuaternion implements quaternion to perform linear algebra rotations in combination with btMatrix3x3, btVector3 and btTransform |
btRaycastVehicle | RayCast vehicle, very special constraint that turn a rigidbody into a vehicle |
btVehicleTuning | |
btRigidBody | The btRigidBody is the main class for rigid body objects |
btRigidBodyConstructionInfo | The btRigidBodyConstructionInfo structure provides information to create a rigid body |
btRigidBodyDoubleData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btRigidBodyFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btRotationalLimitMotor | Rotation Limit structure for generic joints |
btScaledBvhTriangleMeshShape | The btScaledBvhTriangleMeshShape allows to instance a scaled version of an existing btBvhTriangleMeshShape |
btScaledTriangleCallback | |
btScaledTriangleMeshShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btSequentialImpulseConstraintSolver | The btSequentialImpulseConstraintSolver is a fast SIMD implementation of the Projected Gauss Seidel (iterative LCP) method |
btSerializer | |
btShapeHull | BtShapeHull implemented by John McCutchan |
btShortIntIndexData | |
btShortIntIndexTripletData | |
btSimpleBroadphase | The SimpleBroadphase is just a unit-test for btAxisSweep3, bt32BitAxisSweep3, or btDbvtBroadphase, so use those classes instead |
btSimpleBroadphaseProxy | |
btSimpleDynamicsWorld | The btSimpleDynamicsWorld serves as unit-test and to verify more complicated and optimized dynamics worlds |
btSimplePair | |
btSimulationIslandManager | SimulationIslandManager creates and handles simulation islands, using btUnionFind |
IslandCallback | |
btSingleContactCallback | |
btSingleRayCallback | |
btSingleSweepCallback | |
btSliderConstraint | |
btSliderConstraintData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btSliderConstraintDoubleData | |
btSoftBody | The btSoftBody is an class to simulate cloth and volumetric soft bodies |
AJoint | |
IControl | |
Specs | |
Anchor | |
Body | |
CJoint | |
Cluster | |
Config | |
eAeroModel | EAeroModel |
eFeature | EFeature |
Element | |
ePSolver | EPSolver : positions solvers |
eSolverPresets | ESolverPresets |
eVSolver | EVSolver : velocities solvers |
Face | |
fCollision | FCollision |
Feature | |
fMaterial | FMaterial |
ImplicitFn | |
Impulse | |
Joint | |
eType | |
Specs | |
Link | |
LJoint | |
Specs | |
Material | |
Node | |
Note | |
Pose | |
RayFromToCaster | RayFromToCaster takes a ray from, ray to (instead of direction!) |
RContact | |
SContact | |
sCti | |
sMedium | |
SolverState | |
sRayCast | |
Tetra | |
btSoftBodyCollisionShape | |
btSoftBodyConcaveCollisionAlgorithm | BtSoftBodyConcaveCollisionAlgorithm supports collision between soft body shapes and (concave) trianges meshes |
CreateFunc | |
SwappedCreateFunc | |
btSoftBodyFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btSoftBodyHelpers | |
btSoftBodyJointData | |
btSoftBodyLinkData | |
LinkDescription | Class describing a link for input into the system |
LinkNodePair | Class representing a link as a set of three indices into the vertex array |
btSoftBodyLinkDataDX11 | |
BatchPair | |
btSoftBodyLinkDataDX11SIMDAware | |
BatchPair | |
NumBatchesVerticesPair | |
btSoftBodyLinkDataOpenCL | |
BatchPair | |
btSoftBodyLinkDataOpenCLSIMDAware | |
BatchPair | |
NumBatchesVerticesPair | |
btSoftBodyRigidBodyCollisionConfiguration | BtSoftBodyRigidBodyCollisionConfiguration add softbody interaction on top of btDefaultCollisionConfiguration |
btSoftBodySolver | |
btSoftBodySolverOutput | Class to manage movement of data from a solver to a given target |
btSoftBodySolverOutputCLtoCPU | Class to manage movement of data from a solver to a given target |
btSoftBodySolverOutputCLtoGL | Class to manage movement of data from a solver to a given target |
btSoftBodySolverOutputDXtoCPU | Class to manage movement of data from a solver to a given target |
btSoftBodySolverOutputDXtoDX | Class to manage movement of data from a solver to a given target |
OutputToVertexArrayCB | |
btSoftBodyTriangleCallback | For each triangle in the concave mesh that overlaps with the AABB of a soft body (m_softBody), processTriangle is called |
btSoftBodyTriangleData | |
TriangleDescription | |
TriangleNodeSet | Class representing a triangle as a set of three indices into the vertex array |
btSoftBodyTriangleDataDX11 | |
BatchPair | |
btSoftBodyTriangleDataOpenCL | |
btSomePair | Start and length values for computation batches over link data |
btSoftBodyVertexData | Wrapper for vertex data information |
VertexDescription | Class describing a vertex for input into the system |
btSoftBodyVertexDataDX11 | |
btSoftBodyVertexDataOpenCL | |
btSoftBodyWorldInfo | |
btSoftClusterCollisionShape | |
btSoftColliders | |
ClusterBase | |
CollideCL_RS | |
CollideCL_SS | |
CollideSDF_RS | |
CollideVF_SS | |
btSoftRigidCollisionAlgorithm | BtSoftRigidCollisionAlgorithm provides collision detection between btSoftBody and btRigidBody |
CreateFunc | |
btSoftRigidDynamicsWorld | |
btSoftSingleRayCallback | |
btSoftSoftCollisionAlgorithm | Collision detection between two btSoftBody shapes |
CreateFunc | |
btSolve2LinearConstraint | Constraint class used for lateral tyre friction |
btSolveProjectedGaussSeidel | Original version written by Erwin Coumans, October 2013 |
btSolverBody | The btSolverBody is an internal datastructure for the constraint solver. Only necessary data is packed to increase cache coherence/performance |
btSolverConstraint | 1D constraint along a normal axis between bodyA and bodyB. It can be combined to solve contact and friction constraints |
btSortConstraintOnIslandPredicate | |
btSortConstraintOnIslandPredicate2 | |
btSortedOverlappingPairCache | BtSortedOverlappingPairCache maintains the objects with overlapping AABB Typically managed by the Broadphase, Axis3Sweep or btSimpleBroadphase |
btSortMultiBodyConstraintOnIslandPredicate | |
btSparseSdf | |
Cell | |
IntFrac | |
btSphereBoxCollisionAlgorithm | BtSphereBoxCollisionAlgorithm provides sphere-box collision detection |
CreateFunc | |
btSphereShape | The btSphereShape implements an implicit sphere, centered around a local origin with radius |
btSphereSphereCollisionAlgorithm | BtSphereSphereCollisionAlgorithm provides sphere-sphere collision detection |
CreateFunc | |
btSphereTriangleCollisionAlgorithm | BtSphereSphereCollisionAlgorithm provides sphere-sphere collision detection |
CreateFunc | |
btSpinlock | |
btSpuCollisionPairCallback | Interface for iterating all overlapping collision pairs, no matter how those pairs are stored (array, set, map etc) this is useful for the collision dispatcher |
btStackAlloc | The StackAlloc class provides some fast stack-based memory allocator (LIFO last-in first-out) |
btStaticPlaneShape | The btStaticPlaneShape simulates an infinite non-moving (static) collision plane |
btStaticPlaneShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btStorageResult | |
btStridingMeshInterface | The btStridingMeshInterface is the interface class for high performance generic access to triangle meshes, used in combination with btBvhTriangleMeshShape and some other collision shapes |
btStridingMeshInterfaceData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btSubSimplexClosestResult | |
btSubsimplexConvexCast | BtSubsimplexConvexCast implements Gino van den Bergens' paper "Ray Casting against bteral Convex Objects with Application to Continuous Collision Detection" GJK based Ray Cast, optimized version Objects should not start in overlap, otherwise results are not defined |
btSymMatrix | BtSoftBody implementation by Nathanael Presson |
btTetrahedronShapeEx | Helper class for tetrahedrons |
btThreadSupportInterface | |
btTransform | Supports rigid transforms with only translation and rotation and no scaling/shear |
btTransformDoubleData | |
btTransformFloatData | For serialization |
btTransformUtil | Utils related to temporal transforms |
btTranslationalLimitMotor | |
btTriangle | |
btTriangleBuffer | The btTriangleBuffer callback can be useful to collect and store overlapping triangles between AABB and concave objects that support 'processAllTriangles' Example usage of this class: btTriangleBuffer triBuf; concaveShape->processAllTriangles(&triBuf,aabbMin, aabbMax); for (int i=0;i<triBuf.getNumTriangles();i++) { const btTriangle& tri = triBuf.getTriangle(i); //do something useful here with the triangle } |
btTriangleCallback | The btTriangleCallback provides a callback for each overlapping triangle when calling processAllTriangles |
btTriangleConvexcastCallback | |
btTriangleIndexVertexArray | The btTriangleIndexVertexArray allows to access multiple triangle meshes, by indexing into existing triangle/index arrays |
btTriangleIndexVertexMaterialArray | Teh btTriangleIndexVertexMaterialArray is built on TriangleIndexVertexArray The addition of a material array allows for the utilization of the partID and triangleIndex that are returned in the ContactAddedCallback |
btTriangleInfo | The btTriangleInfo structure stores information to adjust collision normals to avoid collisions against internal edges it can be generated using |
btTriangleInfoData | Those fields have to be float and not btScalar for the serialization to work properly |
btTriangleInfoMap | The btTriangleInfoMap stores edge angle information for some triangles. You can compute this information yourself or using btGenerateInternalEdgeInfo |
btTriangleInfoMapData | |
btTriangleMesh | Convenience class derived from btTriangleIndexVertexArray, that provides storage for a concave triangle mesh |
btTriangleMeshShape | The btTriangleMeshShape is an internal concave triangle mesh interface. Don't use this class directly, use btBvhTriangleMeshShape instead |
btTriangleMeshShapeData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btTriangleRaycastCallback | |
btTriangleShape | |
btTriangleShapeEx | Helper class for colliding Bullet Triangle Shapes |
btTriIndex | |
btTypedConstraint | TypedConstraint is the baseclass for Bullet constraints and vehicles |
btConstraintInfo1 | |
btConstraintInfo2 | |
btTypedConstraintData | This structure is not used, except for loading pre-2.82 .bullet files |
btTypedConstraintDoubleData | |
btTypedConstraintFloatData | Do not change those serialization structures, it requires an updated sBulletDNAstr/sBulletDNAstr64 |
btTypedObject | Rudimentary class to provide type info |
btUniformScalingShape | The btUniformScalingShape allows to re-use uniform scaled instances of btConvexShape in a memory efficient way |
btUnionFind | UnionFind calculates connected subsets |
btUnionFindElementSortPredicate | |
btUniversalConstraint | Constraint similar to ODE Universal Joint has 2 rotatioonal degrees of freedom, similar to Euler rotations around Z (axis 1) and Y (axis 2) Description from ODE manual : "Given axis 1 on body 1, and axis 2 on body 2 that is perpendicular to axis 1, it keeps them perpendicular |
btUsageBitfield | |
btVector3 | BtVector3 can be used to represent 3D points and vectors |
btVector3DoubleData | |
btVector3FloatData | |
btVector4 | |
btVectorX | |
btVehicleRaycaster | BtVehicleRaycaster is provides interface for between vehicle simulation and raycasting |
btVehicleRaycasterResult | |
btVertexBufferDescriptor | |
btVoronoiSimplexSolver | BtVoronoiSimplexSolver is an implementation of the closest point distance algorithm from a 1-4 points simplex to the origin |
btWheelContactPoint | |
btWheelInfo | BtWheelInfo contains information per wheel about friction and suspension |
RaycastInfo | |
btWheelInfoConstructionInfo | |
btWin32Barrier | |
btWin32CriticalSection | |
bvhMeshShape_LocalStoreMemory | |
CheckOverlapCallback | |
CLFunctions | |
ClipVertex | |
CollisionObjectIndices | |
CollisionShape_LocalStoreMemory | |
CollisionShapeDescription | Entry in the collision shape array |
CollisionTask_LocalStoreMemory | Make sure no destructors are called on this memory |
CompoundShape_LocalStoreMemory | |
CONTACT_KEY_TOKEN | |
CONTACT_KEY_TOKEN_COMP | |
ConvexH | |
HalfEdge | |
Coplanar | |
copy_elements_func | Prototype for copying elements |
CProfileIterator | An iterator to navigate through the tree |
CProfileManager | The Manager for the Profile system |
CProfileNode | A node in the Profile Hierarchy Tree |
CProfileSample | ProfileSampleClass is a simple way to profile a function's scope Use the BT_PROFILE macro at the start of scope to time |
CreateFunc | |
DebugDrawcallback | |
DISTANCE_PLANE_3D_FUNC | This function calcs the distance from a 3D plane |
DoubleBuffer | DoubleBuffer |
DXFunctions | |
KernelDesc | |
EdgeFlag | |
fDrawFlags | |
float3 | |
float4 | |
float8 | |
GIM_AABB | Axis aligned box |
GIM_AABB_DATA | |
gim_array | Very simple array container with fast access and simd memory |
gim_bitset | |
GIM_BOX_BOX_TRANSFORM_CACHE | Class for transforming a model1 to the space of model0 |
GIM_BOX_TREE | Basic Box tree structure |
GIM_BOX_TREE_NODE | Node Structure for trees |
GIM_BOX_TREE_SET | Class for Box Tree Sets |
GIM_BOX_TREE_TEMPLATE_SET | Generic Box Tree Template |
GIM_BVH_DATA | GIM_BVH_DATA is an internal GIMPACT collision structure to contain axis aligned bounding box |
GIM_BVH_DATA_ARRAY | |
GIM_BVH_TREE_NODE | Node Structure for trees |
GIM_BVH_TREE_NODE_ARRAY | |
GIM_CONTACT | The GIM_CONTACT is an internal GIMPACT structure, similar to btManifoldPoint |
gim_contact_array | |
GIM_HASH_NODE_CMP_KEY_MACRO | Macro for comparing the key and the element |
GIM_HASH_NODE_CMP_MACRO | Macro for comparing Hash nodes |
GIM_HASH_NODE_GET_KEY | Macro for getting the key |
gim_hash_table | A compact hash table implementation |
GIM_HASH_TABLE_NODE | |
GIM_PAIR | Overlapping pair |
gim_pair_set | A pairset array |
GIM_PRIMITIVE_MANAGER_PROTOTYPE | Prototype Base class for primitive classification |
GIM_QUANTIZED_BVH_NODE_ARRAY | |
GIM_RSORT_TOKEN | |
GIM_RSORT_TOKEN_COMPARATOR | Prototype for comparators |
GIM_ShapeRetriever | Retrieving shapes shapes |
ChildShapeRetriever | |
TetraShapeRetriever | |
TriangleShapeRetriever | |
GIM_STANDARD_ALLOCATOR | |
GIM_TREE_TREE_COLLIDER | GIM_BOX_SET collision methods |
GIM_TRIANGLE | Class for colliding triangles |
GIM_TRIANGLE_CALCULATION_CACHE | |
GIM_TRIANGLE_CONTACT | Structure for collision |
GIM_TRIANGLE_CONTACT_DATA | Structure for collision |
GrahamVector3 | |
HeapManager | |
HullDesc | |
HullLibrary | Can create a convex hull from a collection of vertices, using the ComputeHull method |
HullResult | |
InplaceSolverIslandCallback | |
int2 | |
int3 | |
int4 | |
integer_comparator | Prototype for comparators |
less_comparator | Macros for sorting |
LocalSupportVertexCallback | It's not nice to have all this virtual function overhead, so perhaps we can also gather the points once but then we are duplicating |
memcopy_elements_func | Prototype for copying elements |
MiniCLKernel | |
MiniCLKernelDesc | |
MiniCLKernelDescEntry | |
MiniCLTask_LocalStoreMemory | |
MiniCLTaskDesc | |
MiniCLTaskScheduler | MiniCLTaskScheduler handles SPU processing of collision pairs |
MultiBodyInplaceSolverIslandCallback | |
MyCallback | |
MyInternalTriangleIndexCallback | |
NodeLinks | |
PfxParallelBatch | |
PfxParallelGroup | |
PfxPostSolverIO | |
PfxSetupContactConstraintsIO | |
PfxSolveConstraintsIO | |
PfxSolverBody | |
PfxSortData16 | |
PHullResult | |
PlaneFlag | |
plRayCastResult | |
pointCmp | |
PosixBarrier | |
PosixCriticalSection | |
PosixThreadSupport | |
btSpuStatus | |
ThreadConstructionInfo | Setup and initialize SPU/CELL/Libspe2 |
QuickSortCompare | |
RemovePairContainingProxy | |
RemovingOverlapCallback | |
SampleTask_LocalStoreMemory | |
SequentialThreadSupport | The SequentialThreadSupport is a portable non-parallel implementation of the btThreadSupportInterface This is useful for debugging and porting SPU Tasks to other platforms |
btSpuStatus | |
SequentialThreadConstructionInfo | |
SoftBodyClusterData | |
SoftBodyConfigData | |
SoftBodyFaceData | |
SoftBodyLinkData | |
SoftBodyMaterialData | |
SoftBodyNodeData | |
SoftBodyPoseData | |
SoftBodyTetraData | |
SoftRigidAnchorData | |
SphereTriangleDetector | Sphere-triangle to match the btDiscreteCollisionDetectorInterface |
SpuClosestPointInput | |
SpuCollisionObjectWrapper | |
SpuCollisionPairInput | |
SpuCollisionTaskProcess | SpuCollisionTaskProcess handles SPU processing of collision pairs |
SpuContactManifoldCollisionAlgorithm | SpuContactManifoldCollisionAlgorithm provides contact manifold and should be processed on SPU |
CreateFunc | |
SpuContactResult | SpuContactResult exports the contact points using double-buffered DMA transfers, only when needed So when an existing contact point is duplicated, no transfer/refresh is performed |
SpuConvexPenetrationDepthSolver | ConvexPenetrationDepthSolver provides an interface for penetration depth calculation |
SpuConvexPolyhedronVertexData | |
SpuGatherAndProcessPairsTaskDesc | Task Description for SPU collision detection |
SpuGatherAndProcessWorkUnitInput | MidphaseWorkUnitInput stores individual primitive versus mesh collision detection input, to be processed by the SPU |
SpuGatheringCollisionDispatcher | SpuGatheringCollisionDispatcher can use SPU to gather and calculate collision detection Time of Impact, Closest Points and Penetration Depth |
SpuMinkowskiPenetrationDepthSolver | MinkowskiPenetrationDepthSolver implements bruteforce penetration depth estimation |
spuNodeCallback | |
SpuSampleTaskDesc | |
SpuSampleTaskProcess | SpuSampleTaskProcess handles SPU processing of collision pairs |
SSEFloat | |
SupportVertexCallback | |
TrbDynBody | |
TrbState | |
uint2 | |
uint3 | |
uint4 | |
uint_key_func | Prototype for getting the integer representation of an object |
VertFlag | |
Win32ThreadSupport | Win32ThreadSupport helps to initialize/shutdown libspe2, start/stop SPU tasks and communication |
btSpuStatus | Placeholder, until libspe2 support is there |
Win32ThreadConstructionInfo | Setup and initialize SPU/CELL/Libspe2 |