A B C D E F G H I J K L M N O P Q R S T U V W

A

a - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkNN
 
aabb - Variable in class com.bulletphysics.collision.broadphase.DbvtProxy
 
aabbExpand(Vector3f, Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.AabbUtil2
 
aabbMaxOrg - Variable in class com.bulletphysics.collision.shapes.OptimizedBvhNode
 
aabbMinOrg - Variable in class com.bulletphysics.collision.shapes.OptimizedBvhNode
 
AabbUtil2 - Class in com.bulletphysics.linearmath
Utility functions for axis aligned bounding boxes (AABB).
AabbUtil2() - Constructor for class com.bulletphysics.linearmath.AabbUtil2
 
absolute(Matrix3f) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
accumulatedImpulse - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
accumulatedImpulse - Variable in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
accumulatedTangentImpulse0 - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
accumulatedTangentImpulse1 - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
ActionInterface - Class in com.bulletphysics.dynamics
Basic interface to allow actions such as vehicles and characters to be updated inside a DynamicsWorld.
ActionInterface() - Constructor for class com.bulletphysics.dynamics.ActionInterface
 
activate() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
activate(boolean) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
ACTIVE_TAG - Static variable in class com.bulletphysics.collision.dispatch.CollisionObject
 
add() - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
add(Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
add(Vector3f, Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
add(Vector3f, Vector3f, Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
add(float) - Method in class com.bulletphysics.util.FloatArrayList
 
add(int) - Method in class com.bulletphysics.util.IntArrayList
 
add(T) - Method in class com.bulletphysics.util.ObjectArrayList
 
add(int, T) - Method in class com.bulletphysics.util.ObjectArrayList
 
addAction(ActionInterface) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
addAction(ActionInterface) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
addChildShape(Transform, CollisionShape) - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
addCollisionObject(CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
addCollisionObject(CollisionObject, short, short) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
addConstraint(TypedConstraint, boolean) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
addConstraint(TypedConstraint) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
addConstraint(TypedConstraint, boolean) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
addConstraintRef(TypedConstraint) - Method in class com.bulletphysics.dynamics.RigidBody
 
addContactPoint(Vector3f, Vector3f, float) - Method in class com.bulletphysics.collision.dispatch.ManifoldResult
 
addContactPoint(Vector3f, Vector3f, float) - Method in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.Result
 
addContactPoint(Vector3f, Vector3f, float) - Method in class com.bulletphysics.collision.narrowphase.PointCollector
 
addHandle(Vector3f, Vector3f, Object, short, short, Dispatcher, Object) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
addIndexedMesh(IndexedMesh) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
addIndexedMesh(IndexedMesh, ScalarType) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
additionalAngularDampingFactor - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
additionalAngularDampingThresholdSqr - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
additionalDamping - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
Additional damping can help avoiding lowpass jitter motion, help stability for ragdolls etc.
additionalDampingFactor - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
additionalLinearDampingThresholdSqr - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
addManifoldPoint(ManifoldPoint) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
addOverlappingObjectInternal(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.GhostObject
This method is mainly for expert/internal use only.
addOverlappingObjectInternal(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.PairCachingGhostObject
This method is mainly for expert/internal use only.
addOverlappingPair(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
Add a pair and return the new pair.
addOverlappingPair(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCallback
 
addOverlappingPair(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.GhostPairCallback
 
addPoint(Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
addRigidBody(RigidBody) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
addRigidBody(RigidBody, short, short) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
addRigidBody(RigidBody) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
addRigidBody(RigidBody) - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
addSingleResult(CollisionWorld.LocalConvexResult, boolean) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestConvexResultCallback
 
addSingleResult(CollisionWorld.LocalRayResult, boolean) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestRayResultCallback
 
addSingleResult(CollisionWorld.LocalConvexResult, boolean) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.ConvexResultCallback
 
addSingleResult(CollisionWorld.LocalRayResult, boolean) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
addVehicle(RaycastVehicle) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
addVehicle(RaycastVehicle) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
addVertex(Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
addVertex(Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
addVertex(Vector3f) - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
addWheel(Vector3f, Vector3f, Vector3f, float, float, VehicleTuning, boolean) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
Basically most of the code is general for 2 or 4 wheel vehicles, but some of it needs to be reviewed.
Adiag - Variable in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
aJ - Variable in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
algorithm - Variable in class com.bulletphysics.collision.broadphase.BroadphasePair
 
ALL_FILTER - Static variable in class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
AllLeaves(Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.Dbvt.ICollide
 
allocate(IntArrayList, ObjectArrayList<Dbvt.sStkNPS>, Dbvt.sStkNPS) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
allocate(int) - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
allowedCcdPenetration - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
allowedPenetration - Variable in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
allSolved(ContactSolverInfo, IDebugDraw) - Method in class com.bulletphysics.dynamics.constraintsolver.ConstraintSolver
 
ANGULAR_MOTION_THRESHOLD - Static variable in class com.bulletphysics.linearmath.TransformUtil
 
angularComponentA - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
angularComponentA - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
angularComponentB - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
angularComponentB - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
angularDamping - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
angularFactor - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
angularSleepingThreshold - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
angularVelocity - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
appliedImpulse - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
appliedImpulse - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
total applied impulse during most recent frame
appliedImpulse - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
appliedImpulseLateral1 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
appliedImpulseLateral2 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
appliedPushImpulse - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
applyCentralForce(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
applyCentralImpulse(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
applyDamping(float) - Method in class com.bulletphysics.dynamics.RigidBody
Damps the velocity, using the given linearDamping and angularDamping.
applyEngineForce(float, int) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
applyForce(Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
applyGravity() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
Apply gravity, call this once per timestep.
applyGravity() - Method in class com.bulletphysics.dynamics.RigidBody
 
applyImpulse(Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
applyTorque(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
applyTorqueImpulse(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
applyTransform(Transform) - Method in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
 
applyTransform(Transform) - Method in class com.bulletphysics.extras.gimpact.TriangleShapeEx
 
areVerticesBehindPlane(Vector4f, ObjectArrayList<Vector3f>, float) - Static method in class com.bulletphysics.linearmath.GeometryUtil
 
ArrayPool<T> - Class in com.bulletphysics.util
Object pool for arrays.
ArrayPool(Class) - Constructor for class com.bulletphysics.util.ArrayPool
Creates object pool.
assignInternalNodeFromLeafNode(int, int) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
atan2Fast(float, float) - Static method in class com.bulletphysics.linearmath.ScalarUtil
 
AxisSweep3 - Class in com.bulletphysics.collision.broadphase
AxisSweep3 is an efficient implementation of the 3D axis sweep and prune broadphase.
AxisSweep3(Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.broadphase.AxisSweep3
 
AxisSweep3(Vector3f, Vector3f, int) - Constructor for class com.bulletphysics.collision.broadphase.AxisSweep3
 
AxisSweep3(Vector3f, Vector3f, int, OverlappingPairCache) - Constructor for class com.bulletphysics.collision.broadphase.AxisSweep3
 
AxisSweep3_32 - Class in com.bulletphysics.collision.broadphase
AxisSweep3_32 allows higher precision quantization and more objects compared to the AxisSweep3 sweep and prune.
AxisSweep3_32(Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.broadphase.AxisSweep3_32
 
AxisSweep3_32(Vector3f, Vector3f, int) - Constructor for class com.bulletphysics.collision.broadphase.AxisSweep3_32
 
AxisSweep3_32(Vector3f, Vector3f, int, OverlappingPairCache) - Constructor for class com.bulletphysics.collision.broadphase.AxisSweep3_32
 
AxisSweep3Internal - Class in com.bulletphysics.collision.broadphase
AxisSweep3Internal is an internal base class that implements sweep and prune.

B

b - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkNN
 
backup_closest(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
backup_closest(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
barycentricCoords - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 
basis - Variable in class com.bulletphysics.linearmath.Transform
Rotation matrix of this Transform.
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.ConeShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.CylinderShapeX
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.CylinderShapeZ
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.SphereShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
batchedUnitVectorGetSupportingVertexWithoutMargin(Vector3f[], Vector3f[], int) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
bIsFrontWheel - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
bIsFrontWheel - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
bJ - Variable in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
bounce - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
BoxShape - Class in com.bulletphysics.collision.shapes
BoxShape is a box primitive around the origin, its sides axis aligned with length specified by half extents, in local shape coordinates.
BoxShape(Vector3f) - Constructor for class com.bulletphysics.collision.shapes.BoxShape
 
brake - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
BroadphaseInterface - Class in com.bulletphysics.collision.broadphase
BroadphaseInterface for AABB overlapping object pairs.
BroadphaseInterface() - Constructor for class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
BroadphaseNativeType - Enum in com.bulletphysics.collision.broadphase
Dispatcher uses these types.
BroadphasePair - Class in com.bulletphysics.collision.broadphase
BroadphasePair class contains a pair of AABB-overlapping objects.
BroadphasePair() - Constructor for class com.bulletphysics.collision.broadphase.BroadphasePair
 
BroadphasePair(BroadphaseProxy, BroadphaseProxy) - Constructor for class com.bulletphysics.collision.broadphase.BroadphasePair
 
broadphasePairSortPredicate - Static variable in class com.bulletphysics.collision.broadphase.BroadphasePair
 
BroadphaseProxy - Class in com.bulletphysics.collision.broadphase
BroadphaseProxy is the main class that can be used with the Bullet broadphases.
BroadphaseProxy() - Constructor for class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
BroadphaseProxy(Object, short, short) - Constructor for class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
BroadphaseProxy(Object, short, short, Object) - Constructor for class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
BU_Simplex1to4 - Class in com.bulletphysics.collision.shapes
BU_Simplex1to4 implements feature based and implicit simplex of up to 4 vertices (tetrahedron, triangle, line, vertex).
BU_Simplex1to4() - Constructor for class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
BU_Simplex1to4(Vector3f) - Constructor for class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
BU_Simplex1to4(Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
BU_Simplex1to4(Vector3f, Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
BU_Simplex1to4(Vector3f, Vector3f, Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
build(StridingMeshInterface, boolean, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
buildAndProcessIslands(Dispatcher, ObjectArrayList<CollisionObject>, SimulationIslandManager.IslandCallback) - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
buildHull(float) - Method in class com.bulletphysics.collision.shapes.ShapeHull
 
buildIslands(Dispatcher, ObjectArrayList<CollisionObject>) - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
buildJacobian() - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
buildJacobian() - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
buildJacobian() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
buildJacobian() - Method in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
buildJacobian() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
buildJacobian() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
buildJacobian() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
buildJacobianInt(RigidBody, RigidBody, Transform, Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
buildTriPlane() - Method in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
 
buildTriPlane(Vector4f) - Method in class com.bulletphysics.extras.gimpact.TriangleShapeEx
 
BulletGlobals - Class in com.bulletphysics
Bullet global settings and constants.
BulletGlobals() - Constructor for class com.bulletphysics.BulletGlobals
 
BulletStats - Class in com.bulletphysics
Bullet statistics and profile support.
BulletStats() - Constructor for class com.bulletphysics.BulletStats
 
BvhSubtreeInfo - Class in com.bulletphysics.collision.shapes
BvhSubtreeInfo provides info to gather a subtree of limited size.
BvhSubtreeInfo() - Constructor for class com.bulletphysics.collision.shapes.BvhSubtreeInfo
 
BvhTriangleMeshShape - Class in com.bulletphysics.collision.shapes
BvhTriangleMeshShape is a static-triangle mesh shape with several optimizations, such as bounding volume hierarchy.
BvhTriangleMeshShape() - Constructor for class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
BvhTriangleMeshShape(StridingMeshInterface, boolean) - Constructor for class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
BvhTriangleMeshShape(StridingMeshInterface, boolean, boolean) - Constructor for class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
BvhTriangleMeshShape(StridingMeshInterface, boolean, Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
Optionally pass in a larger bvh aabb, used for quantization.
BvhTriangleMeshShape(StridingMeshInterface, boolean, Vector3f, Vector3f, boolean) - Constructor for class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
Optionally pass in a larger bvh aabb, used for quantization.
ByteBufferVertexData - Class in com.bulletphysics.collision.shapes
 
ByteBufferVertexData() - Constructor for class com.bulletphysics.collision.shapes.ByteBufferVertexData
 

C

cachedBC - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
cachedP1 - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
cachedP2 - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
cachedV - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
cachedValidClosest - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
calcAnchorPos() - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
calcNormal(Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
calcPenDepth(SimplexSolverInterface, ConvexShape, ConvexShape, Transform, Transform, Vector3f, Vector3f, Vector3f, IDebugDraw) - Method in class com.bulletphysics.collision.narrowphase.ConvexPenetrationDepthSolver
 
calcPenDepth(SimplexSolverInterface, ConvexShape, ConvexShape, Transform, Transform, Vector3f, Vector3f, Vector3f, IDebugDraw) - Method in class com.bulletphysics.collision.narrowphase.GjkEpaPenetrationDepthSolver
 
calcTimeOfImpact(Transform, Transform, Transform, Transform, ConvexCast.CastResult) - Method in class com.bulletphysics.collision.narrowphase.ConvexCast
Cast a convex against another convex object.
calcTimeOfImpact(Transform, Transform, Transform, Transform, ConvexCast.CastResult) - Method in class com.bulletphysics.collision.narrowphase.GjkConvexCast
 
calcTimeOfImpact(Transform, Transform, Transform, Transform, ConvexCast.CastResult) - Method in class com.bulletphysics.collision.narrowphase.SubsimplexConvexCast
 
calculateAabbBruteForce(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
calculateDiffAxisAngle(Transform, Transform, Vector3f, float[]) - Static method in class com.bulletphysics.linearmath.TransformUtil
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConeShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.SphereShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
calculateLocalInertia(float, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
calculateOverlappingPairs(Dispatcher) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
calculateOverlappingPairs(Dispatcher) - Method in class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
calculateOverlappingPairs(Dispatcher) - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
calculateOverlappingPairs(Dispatcher) - Method in class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
calculatePrincipalAxisTransform(float[], Transform, Vector3f) - Method in class com.bulletphysics.collision.shapes.CompoundShape
Computes the exact moment of inertia and the transform from the coordinate system defined by the principal axes of the moment of inertia and the center of mass to the current coordinate system.
calculateTemporalAabb(Transform, Vector3f, Vector3f, float, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.EmptyAlgorithm
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm
 
calculateTimeOfImpact(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
calculateTransforms() - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Calcs global transform of the offsets.
calculateTransforms() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
calculateVelocity(Transform, Transform, float, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.TransformUtil
 
canJump() - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
capacity() - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
capacity() - Method in class com.bulletphysics.util.ObjectArrayList
 
CapsuleShape - Class in com.bulletphysics.collision.shapes
CapsuleShape represents a capsule around the Y axis, there is also the CapsuleShapeX aligned around the X axis and CapsuleShapeZ around the Z axis.
CapsuleShape(float, float) - Constructor for class com.bulletphysics.collision.shapes.CapsuleShape
 
CapsuleShapeX - Class in com.bulletphysics.collision.shapes
CapsuleShapeX represents a capsule around the X axis.
CapsuleShapeX(float, float) - Constructor for class com.bulletphysics.collision.shapes.CapsuleShapeX
 
CapsuleShapeZ - Class in com.bulletphysics.collision.shapes
CapsuleShapeZ represents a capsule around the Z axis.
CapsuleShapeZ(float, float) - Constructor for class com.bulletphysics.collision.shapes.CapsuleShapeZ
 
castRay(Vector3f, Vector3f, VehicleRaycasterResult) - Method in class com.bulletphysics.dynamics.vehicle.DefaultVehicleRaycaster
 
castRay(Vector3f, Vector3f, VehicleRaycasterResult) - Method in class com.bulletphysics.dynamics.vehicle.VehicleRaycaster
 
catchDegeneracies - Variable in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
Center(Vector3f) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
centerOfMassOffset - Variable in class com.bulletphysics.linearmath.DefaultMotionState
Center of mass offset transform, used to adjust graphics world transform.
centerOfMassPosition - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
CHARACTER_FILTER - Static variable in class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
CHARACTER_OBJECT - Static variable in class com.bulletphysics.collision.dispatch.CollisionFlags
 
chassisConnectionCS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
chassisConnectionPointCS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
checkCollideWith(CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
checkCollideWithOverride(CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
checkCollideWithOverride(CollisionObject) - Method in class com.bulletphysics.dynamics.RigidBody
 
childMargin - Variable in class com.bulletphysics.collision.shapes.CompoundShapeChild
 
childrenHasTransform() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
childrenHasTransform() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
childrenHasTransform() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
If true, then its children must get transforms.
childs - Variable in class com.bulletphysics.collision.broadphase.Dbvt.Node
 
childShape - Variable in class com.bulletphysics.collision.shapes.CompoundShapeChild
 
childShapeType - Variable in class com.bulletphysics.collision.shapes.CompoundShapeChild
 
Classify(Vector3f, float, int) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
cleanCurrentThread() - Static method in class com.bulletphysics.BulletGlobals
Cleans all current thread specific settings and caches.
cleanCurrentThread() - Static method in class com.bulletphysics.util.ArrayPool
 
cleanCurrentThread() - Static method in class com.bulletphysics.util.ObjectPool
 
cleanOverlappingPair(BroadphasePair, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
cleanOverlappingPair(BroadphasePair, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
cleanProxyFromPairs(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
cleanProxyFromPairs(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
cleanupMemory() - Static method in class com.bulletphysics.linearmath.CProfileManager
 
clear() - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
clear() - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
clear() - Method in class com.bulletphysics.util.IntArrayList
 
clear() - Method in class com.bulletphysics.util.ObjectArrayList
 
clearCache() - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm
 
clearForces() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
clearForces() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
clearForces() - Method in class com.bulletphysics.dynamics.RigidBody
 
clearForces() - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
clearHullFlag(int) - Method in class com.bulletphysics.linearmath.convexhull.HullDesc
 
clearManifold(PersistentManifold) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
clearManifold(PersistentManifold) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
clearManifold() - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
clearUserCache(ManifoldPoint) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
clientInfo - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
clientObject - Variable in class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
clip_triangle(PrimitiveTriangle, ObjectArrayList<Vector3f>) - Method in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
Clips the triangle against this.
clippedInvContactDotSuspension - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
Clock - Class in com.bulletphysics.linearmath
Clock is a portable basic clock that measures accurate time in seconds, use for profiling.
Clock() - Constructor for class com.bulletphysics.linearmath.Clock
Creates a new clock and resets it.
clone(Dbvt) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
clone(Dbvt, Dbvt.IClone) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
CloneLeaf(Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.Dbvt.IClone
 
closest(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
closest(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
Return/calculate the closest vertex.
closestAxis4(Vector4f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
closestHitFraction - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ConvexResultCallback
 
closestHitFraction - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
closestPointOnSimplex - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 
closestPtPointTetrahedron(Vector3f, Vector3f, Vector3f, Vector3f, Vector3f, VoronoiSimplexSolver.SubSimplexClosestResult) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
closestPtPointTriangle(Vector3f, Vector3f, Vector3f, Vector3f, VoronoiSimplexSolver.SubSimplexClosestResult) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
collide(Dispatcher) - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
collide(ConvexShape, Transform, ConvexShape, Transform, float, GjkEpaSolver.Results) - Method in class com.bulletphysics.collision.narrowphase.GjkEpaSolver
 
collideKDOP(Dbvt.Node, Vector3f[], float[], int, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideOCL(Dbvt.Node, Vector3f[], float[], Vector3f, int, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideOCL(Dbvt.Node, Vector3f[], float[], Vector3f, int, Dbvt.ICollide, boolean) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideRAY(Dbvt.Node, Vector3f, Vector3f, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideTT(Dbvt.Node, Dbvt.Node, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideTT(Dbvt.Node, Dbvt.Node, Transform, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideTT(Dbvt.Node, Transform, Dbvt.Node, Transform, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideTU(Dbvt.Node, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
collideTV(Dbvt.Node, DbvtAabbMm, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
CollisionAlgorithm - Class in com.bulletphysics.collision.broadphase
Collision algorithm for handling narrowphase or midphase collision detection between two collision object types.
CollisionAlgorithm() - Constructor for class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
CollisionAlgorithmConstructionInfo - Class in com.bulletphysics.collision.broadphase
Construction information for collision algorithms.
CollisionAlgorithmConstructionInfo() - Constructor for class com.bulletphysics.collision.broadphase.CollisionAlgorithmConstructionInfo
 
CollisionAlgorithmCreateFunc - Class in com.bulletphysics.collision.dispatch
Used by the CollisionDispatcher to register and create instances for CollisionAlgorithm.
CollisionAlgorithmCreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.CollisionAlgorithmCreateFunc
 
CollisionConfiguration - Class in com.bulletphysics.collision.dispatch
CollisionConfiguration allows to configure Bullet default collision algorithms.
CollisionConfiguration() - Constructor for class com.bulletphysics.collision.dispatch.CollisionConfiguration
 
CollisionDispatcher - Class in com.bulletphysics.collision.dispatch
CollisionDispatcher supports algorithms that handle ConvexConvex and ConvexConcave collision pairs.
CollisionDispatcher(CollisionConfiguration) - Constructor for class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
collisionFilterGroup - Variable in class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
collisionFilterGroup - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ConvexResultCallback
 
collisionFilterGroup - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
CollisionFilterGroups - Class in com.bulletphysics.collision.broadphase
Common collision filter groups.
CollisionFilterGroups() - Constructor for class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
collisionFilterMask - Variable in class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
collisionFilterMask - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ConvexResultCallback
 
collisionFilterMask - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
CollisionFlags - Class in com.bulletphysics.collision.dispatch
Flags for collision objects.
CollisionFlags() - Constructor for class com.bulletphysics.collision.dispatch.CollisionFlags
 
CollisionObject - Class in com.bulletphysics.collision.dispatch
CollisionObject can be used to manage collision detection objects.
CollisionObject() - Constructor for class com.bulletphysics.collision.dispatch.CollisionObject
 
collisionObject - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalRayResult
 
collisionObject - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
CollisionObjectType - Enum in com.bulletphysics.collision.dispatch
Collision object type.
CollisionShape - Class in com.bulletphysics.collision.shapes
CollisionShape class provides an interface for collision shapes that can be shared among CollisionObjects.
CollisionShape() - Constructor for class com.bulletphysics.collision.shapes.CollisionShape
 
collisionShape - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
CollisionWorld - Class in com.bulletphysics.collision.dispatch
CollisionWorld is interface and container for the collision detection.
CollisionWorld(Dispatcher, BroadphaseInterface, CollisionConfiguration) - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld
This constructor doesn't own the dispatcher and paircache/broadphase.
CollisionWorld.ClosestConvexResultCallback - Class in com.bulletphysics.collision.dispatch
 
CollisionWorld.ClosestConvexResultCallback(Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestConvexResultCallback
 
CollisionWorld.ClosestRayResultCallback - Class in com.bulletphysics.collision.dispatch
 
CollisionWorld.ClosestRayResultCallback(Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestRayResultCallback
 
CollisionWorld.ConvexResultCallback - Class in com.bulletphysics.collision.dispatch
 
CollisionWorld.ConvexResultCallback() - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld.ConvexResultCallback
 
CollisionWorld.LocalConvexResult - Class in com.bulletphysics.collision.dispatch
 
CollisionWorld.LocalConvexResult(CollisionObject, CollisionWorld.LocalShapeInfo, Vector3f, Vector3f, float) - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld.LocalConvexResult
 
CollisionWorld.LocalRayResult - Class in com.bulletphysics.collision.dispatch
 
CollisionWorld.LocalRayResult(CollisionObject, CollisionWorld.LocalShapeInfo, Vector3f, float) - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld.LocalRayResult
 
CollisionWorld.LocalShapeInfo - Class in com.bulletphysics.collision.dispatch
LocalShapeInfo gives extra information for complex shapes.
CollisionWorld.LocalShapeInfo() - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld.LocalShapeInfo
 
CollisionWorld.RayResultCallback - Class in com.bulletphysics.collision.dispatch
RayResultCallback is used to report new raycast results.
CollisionWorld.RayResultCallback() - Constructor for class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
com.bulletphysics - package com.bulletphysics
Contains global variables and callbacks.
com.bulletphysics.collision.broadphase - package com.bulletphysics.collision.broadphase
Broadphase collision code for fast determining of overlapping pairs.
com.bulletphysics.collision.dispatch - package com.bulletphysics.collision.dispatch
Dispatching code for collisions between various shapes.
com.bulletphysics.collision.narrowphase - package com.bulletphysics.collision.narrowphase
Narrow-phase collision.
com.bulletphysics.collision.shapes - package com.bulletphysics.collision.shapes
Collision shapes.
com.bulletphysics.dynamics - package com.bulletphysics.dynamics
DynamicsWorld and RigidBody.
com.bulletphysics.dynamics.character - package com.bulletphysics.dynamics.character
 
com.bulletphysics.dynamics.constraintsolver - package com.bulletphysics.dynamics.constraintsolver
Constraints and solvers.
com.bulletphysics.dynamics.vehicle - package com.bulletphysics.dynamics.vehicle
 
com.bulletphysics.extras.gimpact - package com.bulletphysics.extras.gimpact
Provides support for moving concave triangle meshes.
com.bulletphysics.linearmath - package com.bulletphysics.linearmath
Vector math library.
com.bulletphysics.linearmath.convexhull - package com.bulletphysics.linearmath.convexhull
Convex Hull library for converting point clouds to polygonal representation.
com.bulletphysics.util - package com.bulletphysics.util
Java-specific utility classes.
combinedFriction - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
combinedRestitution - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
CompoundCollisionAlgorithm - Class in com.bulletphysics.collision.dispatch
CompoundCollisionAlgorithm supports collision between CompoundShapes and other collision shapes.
CompoundCollisionAlgorithm() - Constructor for class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm
 
CompoundCollisionAlgorithm.CreateFunc - Class in com.bulletphysics.collision.dispatch
 
CompoundCollisionAlgorithm.CreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm.CreateFunc
 
CompoundCollisionAlgorithm.SwappedCreateFunc - Class in com.bulletphysics.collision.dispatch
 
CompoundCollisionAlgorithm.SwappedCreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm.SwappedCreateFunc
 
CompoundShape - Class in com.bulletphysics.collision.shapes
CompoundShape allows to store multiple other CollisionShapes.
CompoundShape() - Constructor for class com.bulletphysics.collision.shapes.CompoundShape
 
CompoundShapeChild - Class in com.bulletphysics.collision.shapes
Compound shape child.
CompoundShapeChild() - Constructor for class com.bulletphysics.collision.shapes.CompoundShapeChild
 
compute_points(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
compute_points(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
computeAngularImpulseDenominator(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
computeImpulseDenominator(Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
ConcaveShape - Class in com.bulletphysics.collision.shapes
ConcaveShape class provides an interface for non-moving (static) concave shapes.
ConcaveShape() - Constructor for class com.bulletphysics.collision.shapes.ConcaveShape
 
ConeShape - Class in com.bulletphysics.collision.shapes
ConeShape implements a cone shape primitive, centered around the origin and aligned with the Y axis.
ConeShape(float, float) - Constructor for class com.bulletphysics.collision.shapes.ConeShape
 
ConeShapeX - Class in com.bulletphysics.collision.shapes
ConeShape implements a cone shape, around the X axis.
ConeShapeX(float, float) - Constructor for class com.bulletphysics.collision.shapes.ConeShapeX
 
ConeShapeZ - Class in com.bulletphysics.collision.shapes
ConeShape implements a cone shape, around the Z axis.
ConeShapeZ(float, float) - Constructor for class com.bulletphysics.collision.shapes.ConeShapeZ
 
ConeTwistConstraint - Class in com.bulletphysics.dynamics.constraintsolver
ConeTwistConstraint can be used to simulate ragdoll joints (upper arm, leg etc).
ConeTwistConstraint() - Constructor for class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
ConeTwistConstraint(RigidBody, RigidBody, Transform, Transform) - Constructor for class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
ConeTwistConstraint(RigidBody, Transform) - Constructor for class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
ConstraintPersistentData - Class in com.bulletphysics.dynamics.constraintsolver
Stores some extra information to each contact point.
ConstraintPersistentData() - Constructor for class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
ConstraintSolver - Class in com.bulletphysics.dynamics.constraintsolver
Abstract class for constraint solvers.
ConstraintSolver() - Constructor for class com.bulletphysics.dynamics.constraintsolver.ConstraintSolver
 
constraintType - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
contactAdded(ManifoldPoint, CollisionObject, int, int, CollisionObject, int, int) - Method in class com.bulletphysics.ContactAddedCallback
 
ContactAddedCallback - Class in com.bulletphysics
Called when contact has been created between two collision objects.
ContactAddedCallback() - Constructor for class com.bulletphysics.ContactAddedCallback
 
ContactConstraint - Class in com.bulletphysics.dynamics.constraintsolver
Functions for resolving contacts.
ContactConstraint() - Constructor for class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
 
contactDestroyed(Object) - Method in class com.bulletphysics.ContactDestroyedCallback
 
ContactDestroyedCallback - Class in com.bulletphysics
Called when contact has been destroyed between two collision objects.
ContactDestroyedCallback() - Constructor for class com.bulletphysics.ContactDestroyedCallback
 
contactNormal - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
contactNormalWS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
contactPointWS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
contactProcessed(ManifoldPoint, Object, Object) - Method in class com.bulletphysics.ContactProcessedCallback
 
ContactProcessedCallback - Class in com.bulletphysics
Called when existing contact between two collision objects has been processed.
ContactProcessedCallback() - Constructor for class com.bulletphysics.ContactProcessedCallback
 
contactSolverFunc - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
ContactSolverFunc - Class in com.bulletphysics.dynamics.constraintsolver
Contact solving function.
ContactSolverFunc() - Constructor for class com.bulletphysics.dynamics.constraintsolver.ContactSolverFunc
 
ContactSolverInfo - Class in com.bulletphysics.dynamics.constraintsolver
Current state of contact solver.
ContactSolverInfo() - Constructor for class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
ContactSolverInfo(ContactSolverInfo) - Constructor for class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
contactSolverType - Variable in class com.bulletphysics.dynamics.RigidBody
 
Contain(DbvtAabbMm) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
CONVEX_DISTANCE_MARGIN - Static variable in class com.bulletphysics.BulletGlobals
 
ConvexCast - Class in com.bulletphysics.collision.narrowphase
ConvexCast is an interface for casting.
ConvexCast() - Constructor for class com.bulletphysics.collision.narrowphase.ConvexCast
 
ConvexCast.CastResult - Class in com.bulletphysics.collision.narrowphase
RayResult stores the closest result.
ConvexCast.CastResult() - Constructor for class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
ConvexConcaveCollisionAlgorithm - Class in com.bulletphysics.collision.dispatch
ConvexConcaveCollisionAlgorithm supports collision between convex shapes and (concave) trianges meshes.
ConvexConcaveCollisionAlgorithm() - Constructor for class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm
 
ConvexConcaveCollisionAlgorithm.CreateFunc - Class in com.bulletphysics.collision.dispatch
 
ConvexConcaveCollisionAlgorithm.CreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm.CreateFunc
 
ConvexConcaveCollisionAlgorithm.SwappedCreateFunc - Class in com.bulletphysics.collision.dispatch
 
ConvexConcaveCollisionAlgorithm.SwappedCreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm.SwappedCreateFunc
 
ConvexConvexAlgorithm - Class in com.bulletphysics.collision.dispatch
ConvexConvexAlgorithm collision algorithm implements time of impact, convex closest points and penetration depth calculations.
ConvexConvexAlgorithm() - Constructor for class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
ConvexConvexAlgorithm.CreateFunc - Class in com.bulletphysics.collision.dispatch
 
ConvexConvexAlgorithm.CreateFunc(SimplexSolverInterface, ConvexPenetrationDepthSolver) - Constructor for class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm.CreateFunc
 
convexFromWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestConvexResultCallback
 
ConvexHullShape - Class in com.bulletphysics.collision.shapes
ConvexHullShape implements an implicit convex hull of an array of vertices.
ConvexHullShape(ObjectArrayList<Vector3f>) - Constructor for class com.bulletphysics.collision.shapes.ConvexHullShape
TODO: This constructor optionally takes in a pointer to points.
ConvexInternalShape - Class in com.bulletphysics.collision.shapes
ConvexInternalShape is an internal base class, shared by most convex shape implementations.
ConvexInternalShape() - Constructor for class com.bulletphysics.collision.shapes.ConvexInternalShape
 
ConvexPenetrationDepthSolver - Class in com.bulletphysics.collision.narrowphase
ConvexPenetrationDepthSolver provides an interface for penetration depth calculation.
ConvexPenetrationDepthSolver() - Constructor for class com.bulletphysics.collision.narrowphase.ConvexPenetrationDepthSolver
 
ConvexPlaneCollisionAlgorithm - Class in com.bulletphysics.collision.dispatch
ConvexPlaneCollisionAlgorithm provides convex/plane collision detection.
ConvexPlaneCollisionAlgorithm() - Constructor for class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm
 
ConvexPlaneCollisionAlgorithm.CreateFunc - Class in com.bulletphysics.collision.dispatch
 
ConvexPlaneCollisionAlgorithm.CreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm.CreateFunc
 
convexShape - Variable in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
ConvexShape - Class in com.bulletphysics.collision.shapes
ConvexShape is an abstract shape class.
ConvexShape() - Constructor for class com.bulletphysics.collision.shapes.ConvexShape
 
convexShapeFrom - Variable in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
convexShapeTo - Variable in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
convexSweepTest(ConvexShape, Transform, Transform, CollisionWorld.ConvexResultCallback) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
convexTest performs a swept convex cast on all objects in the CollisionWorld, and calls the resultCallback This allows for several queries: first hit, all hits, any hit, dependent on the value return by the callback.
convexSweepTest(ConvexShape, Transform, Transform, CollisionWorld.ConvexResultCallback, float) - Method in class com.bulletphysics.collision.dispatch.GhostObject
 
convexToWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestConvexResultCallback
 
copy_from(TriangleContact) - Method in class com.bulletphysics.extras.gimpact.TriangleContact
 
countLeaves(Dbvt.Node) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
CProfileIterator - Class in com.bulletphysics.linearmath
Iterator to navigate through profile tree.
CProfileManager - Class in com.bulletphysics.linearmath
Manager for the profile system.
CProfileManager() - Constructor for class com.bulletphysics.linearmath.CProfileManager
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionAlgorithmCreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm.CreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm.SwappedCreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm.CreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm.SwappedCreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm.CreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm.CreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.EmptyAlgorithm.CreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm.CreateFunc
 
createCollisionAlgorithm(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm.CreateFunc
 
createConvexHull(HullDesc, HullResult) - Method in class com.bulletphysics.linearmath.convexhull.HullLibrary
Converts point cloud to polygonal representation.
createProxy(Vector3f, Vector3f, BroadphaseNativeType, Object, short, short, Dispatcher, Object) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
createProxy(Vector3f, Vector3f, BroadphaseNativeType, Object, short, short, Dispatcher, Object) - Method in class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
createProxy(Vector3f, Vector3f, BroadphaseNativeType, Object, short, short, Dispatcher, Object) - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
createProxy(Vector3f, Vector3f, BroadphaseNativeType, Object, short, short, Dispatcher, Object) - Method in class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
cross3(Vector3f, Vector4f, Vector4f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
curIter - Variable in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
currentLimit - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
currentLimitError - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
CUSTOM_MATERIAL_CALLBACK - Static variable in class com.bulletphysics.collision.dispatch.CollisionFlags
Enables calling ContactAddedCallback for collision objects.
CylinderShape - Class in com.bulletphysics.collision.shapes
CylinderShape class implements a cylinder shape primitive, centered around the origin.
CylinderShape(Vector3f) - Constructor for class com.bulletphysics.collision.shapes.CylinderShape
 
CylinderShapeX - Class in com.bulletphysics.collision.shapes
Cylinder shape around the X axis.
CylinderShapeX(Vector3f) - Constructor for class com.bulletphysics.collision.shapes.CylinderShapeX
 
CylinderShapeZ - Class in com.bulletphysics.collision.shapes
Cylinder shape around the Z axis.
CylinderShapeZ(Vector3f) - Constructor for class com.bulletphysics.collision.shapes.CylinderShapeZ
 

D

d - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
damping - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
damping - Variable in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint.ConstraintSetting
 
damping - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
damping - Variable in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
data - Variable in class com.bulletphysics.collision.broadphase.Dbvt.Node
 
Dbvt - Class in com.bulletphysics.collision.broadphase
 
Dbvt() - Constructor for class com.bulletphysics.collision.broadphase.Dbvt
 
Dbvt.IClone - Class in com.bulletphysics.collision.broadphase
 
Dbvt.IClone() - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.IClone
 
Dbvt.ICollide - Class in com.bulletphysics.collision.broadphase
 
Dbvt.ICollide() - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.ICollide
 
Dbvt.IWriter - Class in com.bulletphysics.collision.broadphase
 
Dbvt.IWriter() - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.IWriter
 
Dbvt.Node - Class in com.bulletphysics.collision.broadphase
 
Dbvt.Node() - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.Node
 
Dbvt.sStkCLN - Class in com.bulletphysics.collision.broadphase
 
Dbvt.sStkCLN(Dbvt.Node, Dbvt.Node) - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.sStkCLN
 
Dbvt.sStkNN - Class in com.bulletphysics.collision.broadphase
Stack element
Dbvt.sStkNN(Dbvt.Node, Dbvt.Node) - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.sStkNN
 
Dbvt.sStkNP - Class in com.bulletphysics.collision.broadphase
 
Dbvt.sStkNP(Dbvt.Node, int) - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.sStkNP
 
Dbvt.sStkNPS - Class in com.bulletphysics.collision.broadphase
 
Dbvt.sStkNPS() - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.sStkNPS
 
Dbvt.sStkNPS(Dbvt.Node, int, float) - Constructor for class com.bulletphysics.collision.broadphase.Dbvt.sStkNPS
 
DBVT_BP_MARGIN - Static variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
DbvtAabbMm - Class in com.bulletphysics.collision.broadphase
 
DbvtAabbMm() - Constructor for class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
DbvtAabbMm(DbvtAabbMm) - Constructor for class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
DbvtBroadphase - Class in com.bulletphysics.collision.broadphase
 
DbvtBroadphase() - Constructor for class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
DbvtBroadphase(OverlappingPairCache) - Constructor for class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
DbvtLeafCollider - Class in com.bulletphysics.collision.broadphase
 
DbvtLeafCollider(DbvtBroadphase, DbvtProxy) - Constructor for class com.bulletphysics.collision.broadphase.DbvtLeafCollider
 
DbvtProxy - Class in com.bulletphysics.collision.broadphase
 
DbvtProxy(Object, short, short) - Constructor for class com.bulletphysics.collision.broadphase.DbvtProxy
 
DbvtTreeCollider - Class in com.bulletphysics.collision.broadphase
 
DbvtTreeCollider(DbvtBroadphase) - Constructor for class com.bulletphysics.collision.broadphase.DbvtTreeCollider
 
DEBRIS_FILTER - Static variable in class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
DEBUG - Static variable in class com.bulletphysics.BulletGlobals
 
debugBodyId - Variable in class com.bulletphysics.dynamics.RigidBody
 
debugDraw - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
debugDraw(float) - Method in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
debugDraw(IDebugDraw) - Method in class com.bulletphysics.dynamics.ActionInterface
 
debugDraw(IDebugDraw) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
debugDrawer - Variable in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
DebugDrawModes - Class in com.bulletphysics.linearmath
Debug draw modes, used by demo framework.
DebugDrawModes() - Constructor for class com.bulletphysics.linearmath.DebugDrawModes
 
debugDrawObject(Transform, CollisionShape, Vector3f) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
debugDrawWorld() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
debugDrawWorld() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
debugDrawWorld() - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
DEFAULT - Static variable in class com.bulletphysics.linearmath.convexhull.HullFlags
 
DEFAULT_FILTER - Static variable in class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
DefaultCollisionConfiguration - Class in com.bulletphysics.collision.dispatch
Default implementation of CollisionConfiguration.
DefaultCollisionConfiguration() - Constructor for class com.bulletphysics.collision.dispatch.DefaultCollisionConfiguration
 
DefaultMotionState - Class in com.bulletphysics.linearmath
DefaultMotionState provides a common implementation to synchronize world transforms with offsets.
DefaultMotionState() - Constructor for class com.bulletphysics.linearmath.DefaultMotionState
Creates a new DefaultMotionState with all transforms set to identity.
DefaultMotionState(Transform) - Constructor for class com.bulletphysics.linearmath.DefaultMotionState
Creates a new DefaultMotionState with initial world transform and center of mass offset transform set to identity.
DefaultMotionState(Transform, Transform) - Constructor for class com.bulletphysics.linearmath.DefaultMotionState
Creates a new DefaultMotionState with initial world transform and center of mass offset transform.
DefaultNearCallback - Class in com.bulletphysics.collision.dispatch
Default implementation of NearCallback.
DefaultNearCallback() - Constructor for class com.bulletphysics.collision.dispatch.DefaultNearCallback
 
DefaultVehicleRaycaster - Class in com.bulletphysics.dynamics.vehicle
Default implementation of VehicleRaycaster.
DefaultVehicleRaycaster(DynamicsWorld) - Constructor for class com.bulletphysics.dynamics.vehicle.DefaultVehicleRaycaster
 
degenerate - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 
degenerateSimplex - Variable in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
deltaRotation - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
depth - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Results
 
Descent(Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.Dbvt.ICollide
 
destroy() - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
destroy() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
destroy() - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm
 
destroy() - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm
 
destroy() - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
destroy() - Method in class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm
 
destroy() - Method in class com.bulletphysics.collision.dispatch.EmptyAlgorithm
 
destroy() - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm
 
destroy() - Method in class com.bulletphysics.dynamics.RigidBody
 
destroy() - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
destroyProxy(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
destroyProxy(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
destroyProxy(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
destroyProxy(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
diagonalize(Matrix3f, Matrix3f, float, int) - Static method in class com.bulletphysics.linearmath.MatrixUtil
Diagonalizes this matrix by the Jacobi method. rot stores the rotation from the coordinate system in which the matrix is diagonal to the original coordinate system, i.e., old_this = rot * new_this * rot^T.
DISABLE_BULLET_LCP - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
DISABLE_DEACTIVATION - Static variable in class com.bulletphysics.collision.dispatch.CollisionObject
 
DISABLE_SIMULATION - Static variable in class com.bulletphysics.collision.dispatch.CollisionObject
 
DiscreteCollisionDetectorInterface - Class in com.bulletphysics.collision.narrowphase
This interface is made to be used by an iterative approach to do TimeOfImpact calculations.
DiscreteCollisionDetectorInterface() - Constructor for class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface
 
DiscreteCollisionDetectorInterface.ClosestPointInput - Class in com.bulletphysics.collision.narrowphase
 
DiscreteCollisionDetectorInterface.ClosestPointInput() - Constructor for class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.ClosestPointInput
 
DiscreteCollisionDetectorInterface.Result - Class in com.bulletphysics.collision.narrowphase
 
DiscreteCollisionDetectorInterface.Result() - Constructor for class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.Result
 
DiscreteDynamicsWorld - Class in com.bulletphysics.dynamics
DiscreteDynamicsWorld provides discrete rigid body simulation.
DiscreteDynamicsWorld(Dispatcher, BroadphaseInterface, ConstraintSolver, CollisionConfiguration) - Constructor for class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
dispatchAllCollisionPairs(OverlappingPairCache, DispatcherInfo, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
dispatchAllCollisionPairs(OverlappingPairCache, DispatcherInfo, Dispatcher) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
Dispatcher - Class in com.bulletphysics.collision.broadphase
Dispatcher abstract class can be used in combination with broadphase to dispatch calculations for overlapping pairs.
Dispatcher() - Constructor for class com.bulletphysics.collision.broadphase.Dispatcher
 
dispatcher1 - Variable in class com.bulletphysics.collision.broadphase.CollisionAlgorithmConstructionInfo
 
DispatcherInfo - Class in com.bulletphysics.collision.broadphase
Current state of Dispatcher.
DispatcherInfo() - Constructor for class com.bulletphysics.collision.broadphase.DispatcherInfo
 
dispatchFunc - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
DispatchFunc - Enum in com.bulletphysics.collision.broadphase
 
distance - Variable in class com.bulletphysics.collision.narrowphase.PointCollector
 
distance1 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
distFraction - Variable in class com.bulletphysics.dynamics.vehicle.VehicleRaycasterResult
 
div(Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
dot3(Vector4f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
dot3(Vector4f, Vector4f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
dot3(Vector3f, Vector4f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
DOUBLE_STACKSIZE - Static variable in class com.bulletphysics.collision.broadphase.Dbvt
 
draw3dText(Vector3f, String) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
DRAW_AABB - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
DRAW_CONTACT_POINTS - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
DRAW_FEATURES_TEXT - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
DRAW_TEXT - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
DRAW_WIREFRAME - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
drawAabb(Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
drawContactPoint(Vector3f, Vector3f, float, int, Vector3f) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
drawCoordSystem(Transform) - Method in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
drawLine(Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
drawTriangle(Vector3f, Vector3f, Vector3f, Vector3f, Vector3f, Vector3f, Vector3f, float) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
drawTriangle(Vector3f, Vector3f, Vector3f, Vector3f, float) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
dupdates - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
DYNAMIC_SET - Static variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
DynamicsWorld - Class in com.bulletphysics.dynamics
DynamicsWorld is the interface class for several dynamics implementation, basic, discrete, parallel, and continuous etc.
DynamicsWorld(Dispatcher, BroadphaseInterface, CollisionConfiguration) - Constructor for class com.bulletphysics.dynamics.DynamicsWorld
 
DynamicsWorldType - Enum in com.bulletphysics.dynamics
Dynamics world type.

E

e - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
empty() - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
EmptyAlgorithm - Class in com.bulletphysics.collision.dispatch
Empty algorithm, used as fallback when no collision algorithm is found for given shape type pair.
EmptyAlgorithm() - Constructor for class com.bulletphysics.collision.dispatch.EmptyAlgorithm
 
EmptyAlgorithm.CreateFunc - Class in com.bulletphysics.collision.dispatch
 
EmptyAlgorithm.CreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.EmptyAlgorithm.CreateFunc
 
emptySimplex() - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
emptySimplex() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
ENABLE_CCD - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
ENABLE_SAT_COMPARISON - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
enableAngularMotor(boolean, float, float) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
enableMotor - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
enableSatConvex - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
enableSPU - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
engineForce - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
ensureIndex(ObjectArrayList<T>, int, T) - Static method in class com.bulletphysics.linearmath.MiscUtil
Ensures valid index in provided list by filling list with provided values until the index is valid.
enterChild(int) - Method in class com.bulletphysics.linearmath.CProfileIterator
Make the given child the new parent.
enterParent() - Method in class com.bulletphysics.linearmath.CProfileIterator
Make the current parent's parent the new parent.
enumLeaves(Dbvt.Node, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
enumNodes(Dbvt.Node, Dbvt.ICollide) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
epa_iterations - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Results
 
equals(BroadphasePair) - Method in class com.bulletphysics.collision.broadphase.BroadphasePair
 
equals(Object) - Method in class com.bulletphysics.collision.shapes.CompoundShapeChild
 
equals(Object) - Method in class com.bulletphysics.linearmath.Transform
 
erp - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
ERP - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
erp2 - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
escapeIndex - Variable in class com.bulletphysics.collision.shapes.OptimizedBvhNode
 
Expand(Vector3f) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
Extents(Vector3f) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
extractLeaves(Dbvt.Node, ObjectArrayList<Dbvt.Node>) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 

F

f - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
find(int, int) - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
find(int) - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
find_triangle_collision_clip_method(PrimitiveTriangle, TriangleContact) - Method in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
Find collision using the clipping method.
findAlgorithm(CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
findAlgorithm(CollisionObject, CollisionObject, PersistentManifold) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
findAlgorithm(CollisionObject, CollisionObject, PersistentManifold) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
findPair(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
findPair(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
findUnions(Dispatcher, CollisionWorld) - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
first() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
FIXED_SET - Static variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
flags - Variable in class com.bulletphysics.linearmath.convexhull.HullDesc
Flags to use when generating the convex hull, see HullFlags.
FloatArrayList - Class in com.bulletphysics.util
 
FloatArrayList() - Constructor for class com.bulletphysics.util.FloatArrayList
 
FLT_EPSILON - Static variable in class com.bulletphysics.BulletGlobals
 
forceActivationState(int) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
forValue(int) - Static method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
 
fraction - Variable in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
free - Variable in class com.bulletphysics.collision.broadphase.Dbvt
 
free() - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
freeCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
freeCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
friction - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
friction - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
friction - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
friction - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
friction - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
Best simulation results when friction is non-zero.
frictionAngularComponent0A - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
frictionAngularComponent0B - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
frictionAngularComponent1A - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
frictionAngularComponent1B - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
frictionIndex - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
frictionSlip - Variable in class com.bulletphysics.dynamics.vehicle.VehicleTuning
 
frictionSlip - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
frictionSlip - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
frictionSolverFunc - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
frictionSolverType - Variable in class com.bulletphysics.dynamics.RigidBody
 
frictionWorldTangential0 - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
frictionWorldTangential1 - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
from - Variable in class com.bulletphysics.collision.narrowphase.TriangleRaycastCallback
 
FromCE(Vector3f, Vector3f, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
FromCR(Vector3f, float, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
FromMM(Vector3f, Vector3f, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
fsel(float, float, float) - Static method in class com.bulletphysics.linearmath.ScalarUtil
 
fullSimplex() - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
fullSimplex() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
fupdates - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
fuzzyZero(float) - Static method in class com.bulletphysics.linearmath.ScalarUtil
 

G

gAddedPairs - Static variable in class com.bulletphysics.BulletStats
 
GEN_clamped(float, float, float) - Static method in class com.bulletphysics.linearmath.MiscUtil
 
Generic6DofConstraint - Class in com.bulletphysics.dynamics.constraintsolver
Generic6DofConstraint between two rigidbodies each with a pivot point that descibes the axis location in local space.
Generic6DofConstraint() - Constructor for class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
Generic6DofConstraint(RigidBody, RigidBody, Transform, Transform, boolean) - Constructor for class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
GeometryUtil - Class in com.bulletphysics.linearmath
GeometryUtil helper class provides a few methods to convert between plane equations and vertices.
GeometryUtil() - Constructor for class com.bulletphysics.linearmath.GeometryUtil
 
get(Class) - Static method in class com.bulletphysics.util.ArrayPool
Returns per-thread array pool for given type, or create one if it doesn't exist.
get(int) - Method in class com.bulletphysics.util.FloatArrayList
 
get(int) - Method in class com.bulletphysics.util.IntArrayList
 
get(int) - Method in class com.bulletphysics.util.ObjectArrayList
 
get() - Method in class com.bulletphysics.util.ObjectPool
Returns instance from pool, or create one if pool is empty.
get(Class<T>) - Static method in class com.bulletphysics.util.ObjectPool
Returns per-thread object pool for given type, or create one if it doesn't exist.
get() - Method in class com.bulletphysics.util.StackList
Returns instance from stack pool, or create one if not present.
get_edge_plane(int, Vector4f) - Method in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
Calcs the plane which is paralele to the edge and perpendicular to the triangle plane.
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CompoundShape
getAabb's default implementation is brute force, expected derived classes to implement a fast dedicated version.
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
getAabb's default implementation is brute force, expected derived classes to implement a fast dedicated version.
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.SphereShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getAabb(Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
If the Bounding box is not updated, then this class attemps to calculate it.
getAabb(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.extras.gimpact.TriangleShapeEx
 
getAabbMax(int) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
getAabbMin(int) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
getAabbSlow(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
getAabbSlow(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
getAabbSlow(Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getAabbTree() - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getAction(int) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getAction(int) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getActivationState() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getAFrame(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
getAFrame(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.collision.dispatch.EmptyAlgorithm
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm
 
getAllContactManifolds(ObjectArrayList<PersistentManifold>) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
getAncorInA(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getAncorInB(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getAngDepth() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getAngle(int) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Get the relative Euler angle.
getAngle(Quat4f) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
getAngularDamping() - Method in class com.bulletphysics.dynamics.RigidBody
 
getAngularFactor() - Method in class com.bulletphysics.dynamics.RigidBody
 
getAngularMotionDisc() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getAngularOnly() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getAngularSleepingThreshold() - Method in class com.bulletphysics.dynamics.RigidBody
 
getAngularVelocity(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getAppliedImpulse() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
getAtLeast(int) - Method in class com.bulletphysics.util.ArrayPool
Returns array that has same or greater length, or create one if not present in the pool.
getAxis(int, Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Get the rotation axis in global coordinates.
getBFrame(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
getBFrame(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getBody0() - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
getBody1() - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
getBoundingSphere(Vector3f, float[]) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getBroadphase() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
getBroadphaseAabb(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
getBroadphaseAabb(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
getBroadphaseAabb(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
getBroadphaseAabb(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
getBroadphaseHandle() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getBroadphaseProxy() - Method in class com.bulletphysics.dynamics.RigidBody
 
getBulletTriangle(int, TriangleShapeEx) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getBulletTriangle(int, TriangleShapeEx) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getBulletTriangle(int, TriangleShapeEx) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
 
getCacheEntry(ManifoldPoint) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
getCalculatedTransformA(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Gets the global transform of the offset for body A.
getCalculatedTransformA(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getCalculatedTransformB(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Gets the global transform of the offset for body B.
getCalculatedTransformB(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getCcdMotionThreshold() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getCcdSquareMotionThreshold() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getCcdSweptSphereRadius() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getCenterOfMassPosition(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getCenterOfMassTransform(Transform) - Method in class com.bulletphysics.dynamics.RigidBody
 
getChassisWorldTransform(Transform) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getChildAabb(int, Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getChildAabb(int, Transform, Vector3f, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Retrieves the bound from a child.
getChildList() - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getChildShape(int) - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getChildShape() - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
getChildShape() - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getChildShape(int) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getChildShape(int) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getChildShape(int) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Gets the children.
getChildTransform(int, Transform) - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getChildTransform(int) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getChildTransform(int) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getChildTransform(int) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Gets the children transform.
getClosestPoints(DiscreteCollisionDetectorInterface.ClosestPointInput, DiscreteCollisionDetectorInterface.Result, IDebugDraw) - Method in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface
Give either closest points (distance > 0) or penetration (distance) the normal always points from B towards A.
getClosestPoints(DiscreteCollisionDetectorInterface.ClosestPointInput, DiscreteCollisionDetectorInterface.Result, IDebugDraw, boolean) - Method in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface
Give either closest points (distance > 0) or penetration (distance) the normal always points from B towards A.
getClosestPoints(DiscreteCollisionDetectorInterface.ClosestPointInput, DiscreteCollisionDetectorInterface.Result, IDebugDraw, boolean) - Method in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
getCollisionAlgorithmCreateFunc(BroadphaseNativeType, BroadphaseNativeType) - Method in class com.bulletphysics.collision.dispatch.CollisionConfiguration
 
getCollisionAlgorithmCreateFunc(BroadphaseNativeType, BroadphaseNativeType) - Method in class com.bulletphysics.collision.dispatch.DefaultCollisionConfiguration
 
getCollisionConfiguration() - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
getCollisionFlags() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getCollisionObjectArray() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
getCollisionShape() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getCollisionWorld() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getCompanionId() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getConeUpIndex() - Method in class com.bulletphysics.collision.shapes.ConeShape
 
getConstraint(int) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getConstraint(int) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getConstraintRef(int) - Method in class com.bulletphysics.dynamics.RigidBody
 
getConstraintSolver() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getConstraintSolver() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getConstraintSolver() - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
getConstraintType() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
getContactAddedCallback() - Static method in class com.bulletphysics.BulletGlobals
 
getContactBreakingThreshold() - Static method in class com.bulletphysics.BulletGlobals
 
getContactBreakingThreshold() - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
getContactDestroyedCallback() - Static method in class com.bulletphysics.BulletGlobals
 
getContactPoint(int) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
getContactProcessedCallback() - Static method in class com.bulletphysics.BulletGlobals
 
getCoord(long, int) - Static method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getCoord(Vector3f, int) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
getCount() - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
getCurrentName() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
getCurrentParentName() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
getCurrentParentTotalCalls() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
getCurrentParentTotalTime() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
getCurrentSpeedKmHour() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
Velocity of vehicle (positive if velocity vector has same direction as foward vector).
getCurrentTotalCalls() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
getCurrentTotalTime() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
getDampingDirAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getDampingDirLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getDampingLimAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getDampingLimLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getDampingOrthoAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getDampingOrthoLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getDeactivationTime() - Static method in class com.bulletphysics.BulletGlobals
 
getDeactivationTime() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getDebugDrawer() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
getDebugMode() - Method in class com.bulletphysics.linearmath.IDebugDraw
 
getDiagonal() - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
getDispatcher() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
getDispatchInfo() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
getDistance() - Method in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
getEdge(int, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getEdge(int, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getEdge(int, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getEdge(int, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
getEdge(int, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getElement(int) - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
getEnableAngularMotor() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getEscapeIndex(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getEscapeIndexOrTriangleIndex(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getFace0() - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
getFace1() - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
getFixed(int) - Method in class com.bulletphysics.util.ArrayPool
Returns array of exactly the same length as demanded, or create one if not present in the pool.
getForwardAxis() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getForwardVector(Vector3f) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
Worldspace forward vector.
getFrameCountSinceReset() - Static method in class com.bulletphysics.linearmath.CProfileManager
 
getFrameOffsetA(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
getFrameOffsetA(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getFrameOffsetB(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
getFrameOffsetB(Transform) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getFriction() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getGravity() - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
getGravity(Vector3f) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getGravity(Vector3f) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getGravity(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getGravity(Vector3f) - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
getHalfExtentsWithMargin(Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getHalfExtentsWithoutMargin(Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getHalfHeight() - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
getHandle(int) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
getHeight() - Method in class com.bulletphysics.collision.shapes.ConeShape
 
getHingeAngle() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getHitFraction() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getIndex(int) - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getIndex(int) - Method in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
getIndex(int) - Method in class com.bulletphysics.collision.shapes.VertexData
 
getIndexCount() - Method in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
getIndexCount() - Method in class com.bulletphysics.collision.shapes.VertexData
 
getIndexedMeshArray() - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
getIndexPointer() - Method in class com.bulletphysics.collision.shapes.ShapeHull
 
getInternalManifoldPointer() - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
getInternalManifoldPointer() - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
getInternalType() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getInterpolationAngularVelocity(Vector3f) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getInterpolationLinearVelocity(Vector3f) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getInterpolationWorldTransform(Transform) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getInvInertiaDiagLocal(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getInvInertiaTensorWorld(Matrix3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getInvMass() - Method in class com.bulletphysics.dynamics.RigidBody
 
getIslandTag() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getIterator() - Static method in class com.bulletphysics.linearmath.CProfileManager
 
getLifeTime() - Method in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
getLimitSign() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getLinDepth() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getLinearDamping() - Method in class com.bulletphysics.dynamics.RigidBody
 
getLinearPos() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getLinearSleepingThreshold() - Method in class com.bulletphysics.dynamics.RigidBody
 
getLinearVelocity(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getListCapacityForHash(ObjectArrayList<?>) - Static method in class com.bulletphysics.linearmath.MiscUtil
 
getListCapacityForHash(int) - Static method in class com.bulletphysics.linearmath.MiscUtil
 
getLocalAabbMax(Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
getLocalAabbMin(Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
getLocalBox(BoxCollision.AABB) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Obtains the local box, which is the global calculated box of the total of subshapes.
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getLocalScaling(Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
 
getLockedReadOnlyVertexIndexBase(int) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
getLockedReadOnlyVertexIndexBase(int) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
getLockedVertexIndexBase(int) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
Get read and write access to a subpart of a triangle mesh.
getLockedVertexIndexBase(int) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
getLowerAngLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getLowerLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getLowerLinLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getManifold() - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
getManifoldByIndexInternal(int) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
getManifoldByIndexInternal(int) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
getMargin() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getMargin() - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getMargin() - Method in class com.bulletphysics.collision.shapes.ConcaveShape
 
getMargin() - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
getMargin() - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
getMargin() - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
getMargin() - Method in class com.bulletphysics.collision.shapes.SphereShape
 
getMargin() - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getMargin() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getMatrix(Matrix4f) - Method in class com.bulletphysics.linearmath.Transform
 
getMaxAngMotorForce() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getMaxLinMotorForce() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getMaxMotorImpulse() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getMaxSlope() - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
getMeshInterface() - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
getMeshPart(int) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getMeshPartCount() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getMotionState() - Method in class com.bulletphysics.dynamics.RigidBody
 
getMotorTargetVelosity() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getName() - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getName() - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getName() - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
getName() - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
getName() - Method in class com.bulletphysics.collision.shapes.CapsuleShapeX
 
getName() - Method in class com.bulletphysics.collision.shapes.CapsuleShapeZ
 
getName() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getName() - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getName() - Method in class com.bulletphysics.collision.shapes.ConeShape
 
getName() - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getName() - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
getName() - Method in class com.bulletphysics.collision.shapes.CylinderShapeX
 
getName() - Method in class com.bulletphysics.collision.shapes.CylinderShapeZ
 
getName() - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
getName() - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
getName() - Method in class com.bulletphysics.collision.shapes.SphereShape
 
getName() - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
getName() - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
getName() - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getName() - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getName() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getName() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getNearCallback() - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
getNewManifold(Object, Object) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
getNewManifold(Object, Object) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
getNodeSize() - Static method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getNonDiagonal(JacobianEntry, float) - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
For two constraints on the same rigidbody (for example vehicle friction).
getNonDiagonal(JacobianEntry, float, float) - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
For two constraints on sharing two same rigidbodies (for example two contact points between two rigidbodies).
getNumActions() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getNumActions() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getNumChildShapes() - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getNumChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
getNumChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getNumChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Gets the number of children.
getNumCollisionObjects() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
getNumConstraintRefs() - Method in class com.bulletphysics.dynamics.RigidBody
 
getNumConstraints() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getNumConstraints() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getNumContacts() - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
getNumEdges() - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getNumEdges() - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getNumEdges() - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getNumEdges() - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
getNumEdges() - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getNumElements() - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
getNumHandles() - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
getNumManifolds() - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
getNumManifolds() - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
getNumOverlappingObjects() - Method in class com.bulletphysics.collision.dispatch.GhostObject
 
getNumOverlappingPairs() - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
getNumOverlappingPairs() - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
getNumPlanes() - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getNumPlanes() - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getNumPlanes() - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getNumPlanes() - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
getNumPlanes() - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getNumPoints() - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getNumPreferredPenetrationDirections() - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getNumPreferredPenetrationDirections() - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
getNumPreferredPenetrationDirections() - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
getNumPreferredPenetrationDirections() - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getNumPreferredPenetrationDirections() - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getNumSubParts() - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
getNumSubParts returns the number of seperate subparts.
getNumSubParts() - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
getNumSubParts returns the number of seperate subparts.
getNumVertices() - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getNumVertices() - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getNumVertices() - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
Currently just for debugging (drawing), perhaps future support for algebraic continuous collision detection.
getNumVertices() - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
getNumVertices() - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getNumWheels() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getOpenGLMatrix(float[]) - Method in class com.bulletphysics.linearmath.Transform
 
getOpenGLSubMatrix(Matrix3f, float[]) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
getOptimizedBvh() - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
getOrientation(Quat4f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getOverlapFilterCallback() - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
getOverlappingObject(int) - Method in class com.bulletphysics.collision.dispatch.GhostObject
 
getOverlappingPairArray() - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
getOverlappingPairArray() - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
getOverlappingPairCache() - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
getOverlappingPairCache() - Method in class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
getOverlappingPairCache() - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
getOverlappingPairCache() - Method in class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
getOverlappingPairCache() - Method in class com.bulletphysics.collision.dispatch.PairCachingGhostObject
 
getOverlappingPairs() - Method in class com.bulletphysics.collision.dispatch.GhostObject
 
getOverlappingPairUserCallback() - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
getOwnsBvh() - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
getPairCache() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
getPart() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getPart0() - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
getPart1() - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
getPartId(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getPersistentManifold() - Method in class com.bulletphysics.collision.dispatch.ManifoldResult
 
getPivotInA(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
getPivotInB(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
getPlane(Vector3f, Vector3f, int) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getPlane(Vector3f, Vector3f, int) - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getPlane(Vector3f, Vector3f, int) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getPlane(Vector3f, Vector3f, int) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
getPlane(Vector3f, Vector3f, int) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getPlaneConstant() - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
getPlaneEquation(Vector4f, int) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getPlaneEquation(int, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getPlaneEquationsFromVertices(ObjectArrayList<Vector3f>, ObjectArrayList<Vector4f>) - Static method in class com.bulletphysics.linearmath.GeometryUtil
 
getPlaneNormal(Vector3f) - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
getPoints() - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getPositionWorldOnA(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
getPositionWorldOnB(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
getPoweredAngMotor() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getPoweredLinMotor() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getPreferredPenetrationDirection(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getPreferredPenetrationDirection(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
getPreferredPenetrationDirection(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
getPreferredPenetrationDirection(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getPreferredPenetrationDirection(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getQuantizedAabbMax(int, int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getQuantizedAabbMax(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getQuantizedAabbMin(int, int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getQuantizedAabbMin(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getQuick(int) - Method in class com.bulletphysics.util.ObjectArrayList
 
getRadius() - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
getRadius() - Method in class com.bulletphysics.collision.shapes.ConeShape
 
getRadius() - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
getRadius() - Method in class com.bulletphysics.collision.shapes.CylinderShapeX
 
getRadius() - Method in class com.bulletphysics.collision.shapes.CylinderShapeZ
 
getRadius() - Method in class com.bulletphysics.collision.shapes.SphereShape
 
getRandSeed() - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
getRelativeVelocity(Vector3f, Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
getRestitution() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getRestitutionDirAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getRestitutionDirLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getRestitutionLimAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getRestitutionLimLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getRestitutionOrthoAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getRestitutionOrthoLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getRightAxis() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getRigidBody() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getRigidBodyA() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
getRigidBodyB() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
getRootCollisionShape() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getRotation(Matrix3f, Quat4f) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
getRotation(Quat4f) - Method in class com.bulletphysics.linearmath.Transform
 
getRotationalLimitMotor(int) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Retrieves the angular limit informacion.
getScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.ConeShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.SphereShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getShapeType() - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getShapeType() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
 
getSimplex(Vector3f[], Vector3f[], Vector3f[]) - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
getSimplex(Vector3f[], Vector3f[], Vector3f[]) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
getSimulationIslandManager() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getSoftnessDirAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSoftnessDirLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSoftnessLimAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSoftnessLimLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSoftnessOrthoAng() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSoftnessOrthoLin() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSolveAngLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSolveLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getSolveLinLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getSolverInfo() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getSolveSwingLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
getSolveTwistLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
getSteeringValue(int) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getSuspensionRestLength() - Method in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
getTargetAngMotorVelocity() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getTargetLinMotorVelocity() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getTimeMicroseconds() - Method in class com.bulletphysics.linearmath.Clock
Returns the time in microseconds since the last call to reset or since the Clock was created.
getTimeMilliseconds() - Method in class com.bulletphysics.linearmath.Clock
Returns the time in milliseconds since the last call to reset or since the Clock was created.
getTimeSinceReset() - Static method in class com.bulletphysics.linearmath.CProfileManager
 
getTransformA(Transform) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
getTransformB(Transform) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
getTranslationalLimitMotor() - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Retrieves the limit informacion.
getTriangle(int, Vector3f, Vector3f[]) - Method in class com.bulletphysics.collision.shapes.VertexData
 
getTriangleIndex(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
getTwistLimitSign() - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
getUid() - Method in class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
getUid() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
getUniformScalingFactor() - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
getUnionFind() - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
getUpAxis() - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
getUpAxis() - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
getUpAxis() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getUpperAngLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getUpperLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
getUpperLinLimit() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getUseLinearReferenceFrameA() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
getUserConstraintId() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
getUserConstraintType() - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
getUserPointer() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getUserPointer() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
getValue() - Method in enum com.bulletphysics.collision.broadphase.DispatchFunc
 
getVelocityInLocalPoint(Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
getVelocityInLocalPoint(Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
getVertex(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
getVertex(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
getVertex(int, T) - Method in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
getVertex(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
getVertex(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
getVertex(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getVertex(int, T) - Method in class com.bulletphysics.collision.shapes.VertexData
 
getVertex(int, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getVertexCount() - Method in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
getVertexCount() - Method in class com.bulletphysics.collision.shapes.VertexData
 
getVertexCount() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
getVertexPointer() - Method in class com.bulletphysics.collision.shapes.ShapeHull
 
getVertexPtr(int) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
getVerticesFromPlaneEquations(ObjectArrayList<Vector4f>, ObjectArrayList<Vector3f>) - Static method in class com.bulletphysics.linearmath.GeometryUtil
 
getWheelInfo(int) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getWheelTransformWS(int, Transform) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
getWorldTransform(Transform) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
getWorldTransform(Transform) - Method in class com.bulletphysics.linearmath.DefaultMotionState
 
getWorldTransform(Transform) - Method in class com.bulletphysics.linearmath.MotionState
Returns world transform.
getWorldType() - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
getWorldType() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
getWorldType() - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
getWorldUserInfo() - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
gFindPairs - Static variable in class com.bulletphysics.BulletStats
 
GhostObject - Class in com.bulletphysics.collision.dispatch
GhostObject can keep track of all objects that are overlapping.
GhostObject() - Constructor for class com.bulletphysics.collision.dispatch.GhostObject
 
GhostPairCallback - Class in com.bulletphysics.collision.dispatch
GhostPairCallback interfaces and forwards adding and removal of overlapping pairs from the BroadphaseInterface to GhostObject.
GhostPairCallback() - Constructor for class com.bulletphysics.collision.dispatch.GhostPairCallback
 
gid - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
gimpact_vs_compoundshape(CollisionObject, CollisionObject, GImpactShapeInterface, CompoundShape, boolean) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
gimpact_vs_concave(CollisionObject, CollisionObject, GImpactShapeInterface, ConcaveShape, boolean) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
gimpact_vs_gimpact(CollisionObject, CollisionObject, GImpactShapeInterface, GImpactShapeInterface) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
gimpact_vs_shape(CollisionObject, CollisionObject, GImpactShapeInterface, CollisionShape, boolean) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
GImpactCollisionAlgorithm - Class in com.bulletphysics.extras.gimpact
Collision Algorithm for GImpact Shapes.
GImpactCollisionAlgorithm() - Constructor for class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
GImpactCollisionAlgorithm.CreateFunc - Class in com.bulletphysics.extras.gimpact
 
GImpactCollisionAlgorithm.CreateFunc() - Constructor for class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm.CreateFunc
 
GImpactMeshShape - Class in com.bulletphysics.extras.gimpact
 
GImpactMeshShape(StridingMeshInterface) - Constructor for class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
GImpactMeshShapePart - Class in com.bulletphysics.extras.gimpact
This class manages a sub part of a mesh supplied by the StridingMeshInterface interface.
GImpactMeshShapePart() - Constructor for class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
GImpactMeshShapePart(StridingMeshInterface, int) - Constructor for class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
GImpactShapeInterface - Class in com.bulletphysics.extras.gimpact
Base class for gimpact shapes.
GImpactShapeInterface() - Constructor for class com.bulletphysics.extras.gimpact.GImpactShapeInterface
 
gjk_iterations - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Results
 
GjkConvexCast - Class in com.bulletphysics.collision.narrowphase
GjkConvexCast performs a raycast on a convex object using support mapping.
GjkConvexCast(ConvexShape, ConvexShape, SimplexSolverInterface) - Constructor for class com.bulletphysics.collision.narrowphase.GjkConvexCast
 
GjkEpaPenetrationDepthSolver - Class in com.bulletphysics.collision.narrowphase
GjkEpaPenetrationDepthSolver uses the Expanding Polytope Algorithm to calculate the penetration depth between two convex shapes.
GjkEpaPenetrationDepthSolver() - Constructor for class com.bulletphysics.collision.narrowphase.GjkEpaPenetrationDepthSolver
 
GjkEpaSolver - Class in com.bulletphysics.collision.narrowphase
GjkEpaSolver contributed under zlib by Nathanael Presson.
GjkEpaSolver() - Constructor for class com.bulletphysics.collision.narrowphase.GjkEpaSolver
 
GjkEpaSolver.Face - Class in com.bulletphysics.collision.narrowphase
 
GjkEpaSolver.Face() - Constructor for class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
GjkEpaSolver.He - Class in com.bulletphysics.collision.narrowphase
 
GjkEpaSolver.He() - Constructor for class com.bulletphysics.collision.narrowphase.GjkEpaSolver.He
 
GjkEpaSolver.Mkv - Class in com.bulletphysics.collision.narrowphase
 
GjkEpaSolver.Mkv() - Constructor for class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Mkv
 
GjkEpaSolver.Results - Class in com.bulletphysics.collision.narrowphase
 
GjkEpaSolver.Results() - Constructor for class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Results
 
GjkEpaSolver.ResultsStatus - Enum in com.bulletphysics.collision.narrowphase
 
GjkPairDetector - Class in com.bulletphysics.collision.narrowphase
GjkPairDetector uses GJK to implement the DiscreteCollisionDetectorInterface.
GjkPairDetector() - Constructor for class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
gNumAlignedAllocs - Static variable in class com.bulletphysics.BulletStats
 
gNumAlignedFree - Static variable in class com.bulletphysics.BulletStats
 
gNumClampedCcdMotions - Static variable in class com.bulletphysics.BulletStats
 
gNumDeepPenetrationChecks - Static variable in class com.bulletphysics.BulletStats
 
gNumGjkChecks - Static variable in class com.bulletphysics.BulletStats
 
gNumSplitImpulseRecoveries - Static variable in class com.bulletphysics.BulletStats
 
gOldPickingDist - Static variable in class com.bulletphysics.BulletStats
 
gOldPickingPos - Static variable in class com.bulletphysics.BulletStats
 
gOverlappingPairs - Static variable in class com.bulletphysics.BulletStats
 
gPickingConstraintId - Static variable in class com.bulletphysics.BulletStats
 
gProfileClock - Static variable in class com.bulletphysics.BulletStats
 
graphicsWorldTrans - Variable in class com.bulletphysics.linearmath.DefaultMotionState
Current interpolated world transform, used to draw object.
gRemovePairs - Static variable in class com.bulletphysics.BulletStats
 
groundObject - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
gTotalBytesAlignedAllocs - Static variable in class com.bulletphysics.BulletStats
 
gTotalContactPoints - Static variable in class com.bulletphysics.BulletStats
 

H

handleCollision(BroadphasePair, CollisionDispatcher, DispatcherInfo) - Method in class com.bulletphysics.collision.dispatch.DefaultNearCallback
 
handleCollision(BroadphasePair, CollisionDispatcher, DispatcherInfo) - Method in class com.bulletphysics.collision.dispatch.NearCallback
 
hardPointWS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
hasBoxSet() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Determines if this class has a hierarchy structure for sorting its primitives.
hasContactResponse() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
hasDeferredRemoval() - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
hasDeferredRemoval() - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
hashCode() - Method in class com.bulletphysics.collision.shapes.CompoundShapeChild
 
hashCode() - Method in class com.bulletphysics.linearmath.Transform
 
HashedOverlappingPairCache - Class in com.bulletphysics.collision.broadphase
Hash-space based OverlappingPairCache.
HashedOverlappingPairCache() - Constructor for class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
hasHit() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.ConvexResultCallback
 
hasHit() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
hasHullFlag(int) - Method in class com.bulletphysics.linearmath.convexhull.HullDesc
 
hasResult - Variable in class com.bulletphysics.collision.narrowphase.PointCollector
 
heapSort(ObjectArrayList<T>, Comparator<T>) - Static method in class com.bulletphysics.linearmath.MiscUtil
Sorts list using heap sort.
hiLimit - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
HingeConstraint - Class in com.bulletphysics.dynamics.constraintsolver
Hinge constraint between two rigid bodies each with a pivot point that descibes the axis location in local space.
HingeConstraint() - Constructor for class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
HingeConstraint(RigidBody, RigidBody, Vector3f, Vector3f, Vector3f, Vector3f) - Constructor for class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
HingeConstraint(RigidBody, Vector3f, Vector3f) - Constructor for class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
HingeConstraint(RigidBody, RigidBody, Transform, Transform) - Constructor for class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
HingeConstraint(RigidBody, Transform) - Constructor for class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
hitCollisionObject - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestConvexResultCallback
 
hitCollisionObject - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalConvexResult
 
hitFraction - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalConvexResult
 
hitFraction - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalRayResult
 
hitFraction - Variable in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
hitFraction - Variable in class com.bulletphysics.collision.narrowphase.TriangleRaycastCallback
 
hitNormalInWorld - Variable in class com.bulletphysics.dynamics.vehicle.VehicleRaycasterResult
 
hitNormalLocal - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalConvexResult
 
hitNormalLocal - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalRayResult
 
hitNormalWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestConvexResultCallback
 
hitNormalWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestRayResultCallback
 
hitPoint - Variable in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
hitPointInWorld - Variable in class com.bulletphysics.dynamics.vehicle.VehicleRaycasterResult
 
hitPointLocal - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalConvexResult
 
hitPointWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestConvexResultCallback
 
hitPointWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestRayResultCallback
 
hitTransformA - Variable in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
hitTransformB - Variable in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
HullDesc - Class in com.bulletphysics.linearmath.convexhull
Describes point cloud data and other input for conversion to polygonal representation.
HullDesc() - Constructor for class com.bulletphysics.linearmath.convexhull.HullDesc
 
HullDesc(int, int, ObjectArrayList<Vector3f>) - Constructor for class com.bulletphysics.linearmath.convexhull.HullDesc
 
HullDesc(int, int, ObjectArrayList<Vector3f>, int) - Constructor for class com.bulletphysics.linearmath.convexhull.HullDesc
 
HullFlags - Class in com.bulletphysics.linearmath.convexhull
Flags that affects convex hull generation, used in HullDesc.flags.
HullFlags() - Constructor for class com.bulletphysics.linearmath.convexhull.HullFlags
 
HullLibrary - Class in com.bulletphysics.linearmath.convexhull
HullLibrary class can create a convex hull from a collection of vertices, using the ComputeHull method.
HullLibrary() - Constructor for class com.bulletphysics.linearmath.convexhull.HullLibrary
 
HullResult - Class in com.bulletphysics.linearmath.convexhull
Contains resulting polygonal representation.
HullResult() - Constructor for class com.bulletphysics.linearmath.convexhull.HullResult
 

I

id - Variable in class com.bulletphysics.collision.dispatch.UnionFind.Element
 
IDebugDraw - Class in com.bulletphysics.linearmath
IDebugDraw interface class allows hooking up a debug renderer to visually debug simulations.
IDebugDraw() - Constructor for class com.bulletphysics.linearmath.IDebugDraw
 
impulseClamp - Variable in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint.ConstraintSetting
 
incrementFrameCounter() - Static method in class com.bulletphysics.linearmath.CProfileManager
 
index0 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
index1 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
index1a - Variable in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
indexCount - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
indexData - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
IndexedMesh - Class in com.bulletphysics.collision.shapes
IndexedMesh indexes into existing vertex and index arrays, in a similar way to OpenGL's glDrawElements.
IndexedMesh() - Constructor for class com.bulletphysics.collision.shapes.IndexedMesh
 
indexOf(T[], T) - Static method in class com.bulletphysics.linearmath.MiscUtil
Searches object in array.
indexOf(Object) - Method in class com.bulletphysics.util.ObjectArrayList
 
indexStride - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
indexType - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
indexType - Variable in class com.bulletphysics.collision.shapes.IndexedMesh
 
indices - Variable in class com.bulletphysics.linearmath.convexhull.HullResult
Array of indices.
init() - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
init(CollisionAlgorithmConstructionInfo) - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
init(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject, boolean) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm
 
init(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject, boolean) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm
 
init(PersistentManifold, CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject, SimplexSolverInterface, ConvexPenetrationDepthSolver) - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
init(PersistentManifold, CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject, boolean) - Method in class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm
 
init(CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.ManifoldResult
 
init(PersistentManifold, CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm
 
init(CollisionAlgorithmConstructionInfo) - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm
 
init() - Method in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.ClosestPointInput
 
init(ConvexShape, ConvexShape, SimplexSolverInterface, ConvexPenetrationDepthSolver) - Method in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
init(Vector3f, Vector3f, Vector3f, float) - Method in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
init(Object, Object, int) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
init(Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
init(Matrix3f, Matrix3f, Vector3f, Vector3f, Vector3f, Vector3f, float, Vector3f, float) - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
Constraint between two different rigidbodies.
init(Vector3f, Matrix3f, Matrix3f, Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
Angular constraint between two different rigidbodies.
init(Vector3f, Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
Angular constraint between two different rigidbodies.
init(Matrix3f, Vector3f, Vector3f, Vector3f, Vector3f, float) - Method in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
Constraint on one rigidbody.
init(CollisionAlgorithmConstructionInfo, CollisionObject, CollisionObject) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
initUnionFind(int) - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
insert(DbvtAabbMm, Object) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
inSimplex(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
inSimplex(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
IntArrayList - Class in com.bulletphysics.util
 
IntArrayList() - Constructor for class com.bulletphysics.util.IntArrayList
 
integrateTransform(Transform, Vector3f, Vector3f, float, Transform) - Static method in class com.bulletphysics.linearmath.TransformUtil
 
integrateVelocities(float) - Method in class com.bulletphysics.dynamics.RigidBody
 
internalApplyImpulse(Vector3f, Vector3f, float) - Method in class com.bulletphysics.dynamics.constraintsolver.SolverBody
Optimization for the iterative solver: avoid calculating constant terms involving inertia, normal, relative position.
internalApplyImpulse(Vector3f, Vector3f, float) - Method in class com.bulletphysics.dynamics.RigidBody
Optimization for the iterative solver: avoid calculating constant terms involving inertia, normal, relative position.
internalApplyPushImpulse(Vector3f, Vector3f, float) - Method in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
internalGetCreateFunc() - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
internalProcessAllTriangles(InternalTriangleIndexCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
internalProcessTriangleIndex(Vector3f[], int, int) - Method in class com.bulletphysics.collision.shapes.InternalTriangleIndexCallback
 
internalSetCreateFunc(CollisionAlgorithmCreateFunc) - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
internalSetTemporaryCollisionShape(CollisionShape) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
Avoid using this internal API call.
internalTick(DynamicsWorld, float) - Method in class com.bulletphysics.dynamics.InternalTickCallback
 
InternalTickCallback - Class in com.bulletphysics.dynamics
Callback called for each internal tick.
InternalTickCallback() - Constructor for class com.bulletphysics.dynamics.InternalTickCallback
 
InternalTriangleIndexCallback - Class in com.bulletphysics.collision.shapes
Callback for internal processing of triangles.
InternalTriangleIndexCallback() - Constructor for class com.bulletphysics.collision.shapes.InternalTriangleIndexCallback
 
Intersect(DbvtAabbMm, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
Intersect(DbvtAabbMm, DbvtAabbMm, Transform) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
Intersect(DbvtAabbMm, Vector3f) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
Intersect(DbvtAabbMm, Vector3f, Vector3f, int[]) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
inverse(Quat4f) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
inverse(Quat4f, Quat4f) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
inverse() - Method in class com.bulletphysics.linearmath.Transform
 
inverse(Transform) - Method in class com.bulletphysics.linearmath.Transform
 
invert(Matrix3f) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
invMass - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
invXform(Vector3f, Vector3f) - Method in class com.bulletphysics.linearmath.Transform
 
isActive() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
isCompound() - Method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
 
isCompound() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
isConcave() - Method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
 
isConcave() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
isConvex() - Method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
 
isConvex() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
isDeactivationDisabled() - Static method in class com.bulletphysics.BulletGlobals
 
isDone() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
isInContact - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
isInfinite() - Method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
 
isInfinite() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
isInside(Vector3f, float) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
isInside(Vector3f, float) - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
isInside(Vector3f, float) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
isInside(Vector3f, float) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
isInside(Vector3f, float) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
isinternal() - Method in class com.bulletphysics.collision.broadphase.Dbvt.Node
 
isInWorld() - Method in class com.bulletphysics.dynamics.RigidBody
Is this rigidbody added to a CollisionWorld/DynamicsWorld/Broadphase?
isKinematicObject() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
ISLAND_SLEEPING - Static variable in class com.bulletphysics.collision.dispatch.CollisionObject
 
isleaf() - Method in class com.bulletphysics.collision.broadphase.Dbvt.Node
 
isLeafNode(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
isLimited(int) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Test limit.
isLimited() - Method in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
Is limited?
isLimited(int) - Method in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
Test limit.
isPointInsidePlanes(ObjectArrayList<Vector4f>, Vector3f, float) - Static method in class com.bulletphysics.linearmath.GeometryUtil
 
isPolyhedral() - Method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
 
isPolyhedral() - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
isProfileEnabled() - Static method in class com.bulletphysics.BulletStats
 
isRoot(int) - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
isRoot() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
isStaticObject() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
isStaticOrKinematicObject() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
isValid() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 

J

jacDiagABInv - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
jacDiagABInv - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
jacDiagABInvTangent0 - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
jacDiagABInvTangent1 - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
JacobianEntry - Class in com.bulletphysics.dynamics.constraintsolver
Jacobian entry is an abstraction that allows to describe constraints.
JacobianEntry() - Constructor for class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
jump() - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 

K

KINEMATIC_FILTER - Static variable in class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
KINEMATIC_OBJECT - Static variable in class com.bulletphysics.collision.dispatch.CollisionFlags
Sets this collision object as kinematic.
KinematicCharacterController - Class in com.bulletphysics.dynamics.character
KinematicCharacterController is an object that supports a sliding motion in a world.
KinematicCharacterController(PairCachingGhostObject, ConvexShape, float) - Constructor for class com.bulletphysics.dynamics.character.KinematicCharacterController
 
KinematicCharacterController(PairCachingGhostObject, ConvexShape, float, int) - Constructor for class com.bulletphysics.dynamics.character.KinematicCharacterController
 

L

lastUsedMethod - Variable in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
lastW - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
lateralFrictionDir1 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
lateralFrictionDir2 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
lateralFrictionInitialized - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
leaf - Variable in class com.bulletphysics.collision.broadphase.DbvtProxy
 
leaves - Variable in class com.bulletphysics.collision.broadphase.Dbvt
 
Lengths(Vector3f) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
lengthSquared3(Vector4f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
lifeTime - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
limitSoftness - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
limitSoftness - Variable in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
linearDamping - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
linearJointAxis - Variable in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
linearSleepingThreshold - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
linearSlop - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
linearVelocity - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
links - Variable in class com.bulletphysics.collision.broadphase.DbvtProxy
 
lkhd - Variable in class com.bulletphysics.collision.broadphase.Dbvt
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConeShape
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
localGetSupportingVertex(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CapsuleShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConeShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CylinderShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CylinderShapeX
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.CylinderShapeZ
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.SphereShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleShape
 
localGetSupportingVertexWithoutMargin(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
localInertia - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
localPointA - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
localPointB - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
localShapeInfo - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalConvexResult
 
localShapeInfo - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalRayResult
 
lockChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
lockChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
lockChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Call when reading child shapes.
loLimit - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
lowerLimit - Variable in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
lowLevelOfDetail - Variable in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 

M

m_0MinvJt - Variable in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
m_1MinvJt - Variable in class com.bulletphysics.dynamics.constraintsolver.JacobianEntry
 
manifold - Variable in class com.bulletphysics.collision.broadphase.CollisionAlgorithmConstructionInfo
 
MANIFOLD_CACHE_SIZE - Static variable in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
ManifoldPoint - Class in com.bulletphysics.collision.narrowphase
ManifoldPoint collects and maintains persistent contactpoints.
ManifoldPoint() - Constructor for class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
ManifoldPoint(Vector3f, Vector3f, Vector3f, float) - Constructor for class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
manifoldPtr - Variable in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
ManifoldResult - Class in com.bulletphysics.collision.dispatch
ManifoldResult is helper class to manage contact results.
ManifoldResult() - Constructor for class com.bulletphysics.collision.dispatch.ManifoldResult
 
ManifoldResult(CollisionObject, CollisionObject) - Constructor for class com.bulletphysics.collision.dispatch.ManifoldResult
 
margin - Variable in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
 
mark - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
mask - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkNP
 
mask - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkNPS
 
mass - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
MatrixUtil - Class in com.bulletphysics.linearmath
Utility functions for matrices.
MatrixUtil() - Constructor for class com.bulletphysics.linearmath.MatrixUtil
 
MAX_DEBUG_DRAW_MODE - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
MAX_NUM_PARTS_IN_BITS - Static variable in class com.bulletphysics.collision.shapes.OptimizedBvh
 
MAX_PREFERRED_PENETRATION_DIRECTIONS - Static variable in class com.bulletphysics.collision.shapes.ConvexShape
 
MAX_SUBTREE_SIZE_IN_BYTES - Static variable in class com.bulletphysics.collision.shapes.OptimizedBvh
 
MAX_TRI_CLIPPING - Static variable in class com.bulletphysics.extras.gimpact.TriangleContact
 
maxAxis(Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
maxAxis4(Vector4f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
maxErrorReduction - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
maxFaces - Variable in class com.bulletphysics.linearmath.convexhull.HullDesc
Maximum number of faces to be considered for the hull.
maximumDistanceSquared - Variable in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.ClosestPointInput
 
maxLimitForce - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
maxMotorForce - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
Maxs() - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
maxSuspensionTravelCm - Variable in class com.bulletphysics.dynamics.vehicle.VehicleTuning
 
maxSuspensionTravelCm - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
maxSuspensionTravelCm - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
maxVertex() - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
maxVertex() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
maxVertices - Variable in class com.bulletphysics.linearmath.convexhull.HullDesc
Maximum number of vertices to be considered for the hull.
Merge(DbvtAabbMm, DbvtAabbMm, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
merge_points(Vector4f, float, ObjectArrayList<Vector3f>, int) - Method in class com.bulletphysics.extras.gimpact.TriangleContact
Classify points that are closer.
mergeInternalNodeAabb(int, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
mergesSimulationIslands() - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
MinkowskiSumShape - Class in com.bulletphysics.collision.shapes
MinkowskiSumShape is only for advanced users.
MinkowskiSumShape(ConvexShape, ConvexShape) - Constructor for class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
Mins() - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
MiscUtil - Class in com.bulletphysics.linearmath
Miscellaneous utility functions.
MiscUtil() - Constructor for class com.bulletphysics.linearmath.MiscUtil
 
motionState - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
When a motionState is provided, the rigid body will initialize its world transform from the motion state.
MotionState - Class in com.bulletphysics.linearmath
MotionState allows the dynamics world to synchronize the updated world transforms with graphics.
MotionState() - Constructor for class com.bulletphysics.linearmath.MotionState
 
mul(Quat4f, Vector3f) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
mul(Transform) - Method in class com.bulletphysics.linearmath.Transform
 
mul(Transform, Transform) - Method in class com.bulletphysics.linearmath.Transform
 
mul(Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
mulCoord(Vector3f, int, float) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
multiSapParentProxy - Variable in class com.bulletphysics.collision.broadphase.BroadphaseProxy
 

N

n - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
n - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.He
 
NearCallback - Class in com.bulletphysics.collision.dispatch
Callback for overriding collision filtering and more fine-grained control over collision detection.
NearCallback() - Constructor for class com.bulletphysics.collision.dispatch.NearCallback
 
nearest(IntArrayList, ObjectArrayList<Dbvt.sStkNPS>, float, int, int) - Static method in class com.bulletphysics.collision.broadphase.Dbvt
 
needApplyTorques() - Method in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
Need apply correction?
needBroadphaseCollision(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.broadphase.OverlapFilterCallback
Checks if given pair of collision objects needs collision.
needsBroadphaseCollision(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
needsCollision(CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
needsCollision(CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
needsCollision(BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.ConvexResultCallback
 
needsCollision(BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld.RayResultCallback
 
needsResponse(CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
needsResponse(CollisionObject, CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
needsRetrieveTetrahedrons() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
needsRetrieveTetrahedrons() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
needsRetrieveTetrahedrons() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Determines if this shape has tetrahedrons.
needsRetrieveTriangles() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
needsRetrieveTriangles() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
needsRetrieveTriangles() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Determines if this shape has triangles.
needsUpdate - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
next - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
next() - Method in class com.bulletphysics.linearmath.CProfileIterator
 
NO_CONTACT_RESPONSE - Static variable in class com.bulletphysics.collision.dispatch.CollisionFlags
Disables contact response.
NO_DEACTIVATION - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
NO_DEBUG - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
NO_HELP_TEXT - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
node - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkCLN
 
node - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkNP
 
node - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkNPS
 
NodeOverlapCallback - Class in com.bulletphysics.collision.shapes
Callback for operating with OptimizedBvh.
NodeOverlapCallback() - Constructor for class com.bulletphysics.collision.shapes.NodeOverlapCallback
 
normal - Variable in class com.bulletphysics.collision.narrowphase.ConvexCast.CastResult
 
normal - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Results
 
normalEpsilon - Variable in class com.bulletphysics.linearmath.convexhull.HullDesc
Epsilon value for removing duplicates.
normalize3(Vector4f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
normalOnBInWorld - Variable in class com.bulletphysics.collision.narrowphase.PointCollector
 
normalWorldOnB - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
NotEqual(DbvtAabbMm, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
numFaces - Variable in class com.bulletphysics.linearmath.convexhull.HullResult
Number of faces produced.
numIndices() - Method in class com.bulletphysics.collision.shapes.ShapeHull
 
numIndices - Variable in class com.bulletphysics.linearmath.convexhull.HullResult
Total number of indices.
numIterations - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
numOutputVertices - Variable in class com.bulletphysics.linearmath.convexhull.HullResult
Number of vertices in the output hull.
numTriangles - Variable in class com.bulletphysics.collision.shapes.IndexedMesh
 
numTriangles() - Method in class com.bulletphysics.collision.shapes.ShapeHull
 
numVertices() - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
numVertices - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
numVertices() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
numVertices - Variable in class com.bulletphysics.collision.shapes.IndexedMesh
 
numVertices() - Method in class com.bulletphysics.collision.shapes.ShapeHull
 

O

ObjectArrayList<T> - Class in com.bulletphysics.util
 
ObjectArrayList() - Constructor for class com.bulletphysics.util.ObjectArrayList
 
ObjectArrayList(int) - Constructor for class com.bulletphysics.util.ObjectArrayList
 
ObjectPool<T> - Class in com.bulletphysics.util
Object pool.
ObjectPool(Class<T>) - Constructor for class com.bulletphysics.util.ObjectPool
 
objectQuerySingle(ConvexShape, Transform, Transform, CollisionObject, CollisionShape, Transform, CollisionWorld.ConvexResultCallback, float) - Static method in class com.bulletphysics.collision.dispatch.CollisionWorld
objectQuerySingle performs a collision detection query and calls the resultCallback.
ObjectStackList<T> - Class in com.bulletphysics.util
Stack-based object pool for arbitrary objects, returning not supported.
ObjectStackList(Class<T>) - Constructor for class com.bulletphysics.util.ObjectStackList
 
onGround() - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
opath - Variable in class com.bulletphysics.collision.broadphase.Dbvt
 
optimizeBottomUp() - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
OptimizedBvh - Class in com.bulletphysics.collision.shapes
OptimizedBvh store an AABB tree that can be quickly traversed on CPU (and SPU, GPU in future).
OptimizedBvh() - Constructor for class com.bulletphysics.collision.shapes.OptimizedBvh
 
OptimizedBvhNode - Class in com.bulletphysics.collision.shapes
OptimizedBvhNode contains both internal and leaf node information.
OptimizedBvhNode() - Constructor for class com.bulletphysics.collision.shapes.OptimizedBvhNode
 
optimizeIncremental(int) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
optimizeTopDown() - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
optimizeTopDown(int) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
origin - Variable in class com.bulletphysics.linearmath.Transform
Translation vector of this Transform.
originalBody - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
originalContactPoint - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
outcode(Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.AabbUtil2
 
outputVertices - Variable in class com.bulletphysics.linearmath.convexhull.HullResult
Array of vertices.
overlap_test_conservative(PrimitiveTriangle) - Method in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
Test if triangles could collide.
overlap_test_conservative(TriangleShapeEx) - Method in class com.bulletphysics.extras.gimpact.TriangleShapeEx
 
OverlapCallback - Class in com.bulletphysics.collision.broadphase
OverlapCallback is used when processing all overlapping pairs in broadphase.
OverlapCallback() - Constructor for class com.bulletphysics.collision.broadphase.OverlapCallback
 
OverlapFilterCallback - Class in com.bulletphysics.collision.broadphase
Callback for filtering broadphase collisions.
OverlapFilterCallback() - Constructor for class com.bulletphysics.collision.broadphase.OverlapFilterCallback
 
OverlappingPairCache - Class in com.bulletphysics.collision.broadphase
OverlappingPairCache provides an interface for overlapping pair management (add, remove, storage), used by the BroadphaseInterface broadphases.
OverlappingPairCache() - Constructor for class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
OverlappingPairCallback - Class in com.bulletphysics.collision.broadphase
OverlappingPairCallback class is an additional optional broadphase user callback for adding/removing overlapping pairs, similar interface to OverlappingPairCache.
OverlappingPairCallback() - Constructor for class com.bulletphysics.collision.broadphase.OverlappingPairCallback
 
ownManifold - Variable in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 

P

paircache - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
PairCachingGhostObject - Class in com.bulletphysics.collision.dispatch
 
PairCachingGhostObject() - Constructor for class com.bulletphysics.collision.dispatch.PairCachingGhostObject
 
parent - Variable in class com.bulletphysics.collision.broadphase.Dbvt.Node
 
parent - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkCLN
 
partialRefitTree(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
For a fast incremental refit of parts of the tree.
partId0 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
partId1 - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
pbp - Variable in class com.bulletphysics.collision.broadphase.DbvtLeafCollider
 
pbp - Variable in class com.bulletphysics.collision.broadphase.DbvtTreeCollider
 
pdSolver - Variable in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm.CreateFunc
 
penetration - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
penetration - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
penetration_depth - Variable in class com.bulletphysics.extras.gimpact.TriangleContact
 
performConvexcast(TriangleCallback, Vector3f, Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
performDiscreteCollisionDetection() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
performRaycast(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
persistentLifeTime - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
PersistentManifold - Class in com.bulletphysics.collision.narrowphase
PersistentManifold is a contact point cache, it stays persistent as long as objects are overlapping in the broadphase.
PersistentManifold() - Constructor for class com.bulletphysics.collision.narrowphase.PersistentManifold
 
PersistentManifold(Object, Object, int) - Constructor for class com.bulletphysics.collision.narrowphase.PersistentManifold
 
pid - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
plane - Variable in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
 
planeSpace1(Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.TransformUtil
 
playerStep(CollisionWorld, float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
Point2PointConstraint - Class in com.bulletphysics.dynamics.constraintsolver
Point to point constraint between two rigid bodies each with a pivot point that descibes the "ballsocket" location in local space.
Point2PointConstraint() - Constructor for class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
Point2PointConstraint(RigidBody, RigidBody, Vector3f, Vector3f) - Constructor for class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
Point2PointConstraint(RigidBody, Vector3f) - Constructor for class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
Point2PointConstraint.ConstraintSetting - Class in com.bulletphysics.dynamics.constraintsolver
 
Point2PointConstraint.ConstraintSetting() - Constructor for class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint.ConstraintSetting
 
point_count - Variable in class com.bulletphysics.extras.gimpact.TriangleContact
 
PointCollector - Class in com.bulletphysics.collision.narrowphase
 
PointCollector() - Constructor for class com.bulletphysics.collision.narrowphase.PointCollector
 
pointInWorld - Variable in class com.bulletphysics.collision.narrowphase.PointCollector
 
pointOutsideOfPlane(Vector3f, Vector3f, Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
points - Variable in class com.bulletphysics.extras.gimpact.TriangleContact
 
polygons - Variable in class com.bulletphysics.linearmath.convexhull.HullResult
True if indices represents polygons, false indices are triangles.
PolyhedralConvexShape - Class in com.bulletphysics.collision.shapes
PolyhedralConvexShape is an internal interface class for polyhedral convex shapes.
PolyhedralConvexShape() - Constructor for class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
pop() - Method in class com.bulletphysics.util.StackList
Pops the stack.
popProfile() - Static method in class com.bulletphysics.BulletStats
Pops profile node.
positionWorldOnA - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
positionWorldOnB - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
postUpdate() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
postUpdate() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Tells to this object that is needed to refit the box set.
pProxy0 - Variable in class com.bulletphysics.collision.broadphase.BroadphasePair
 
pProxy1 - Variable in class com.bulletphysics.collision.broadphase.BroadphasePair
 
ppx - Variable in class com.bulletphysics.collision.broadphase.DbvtLeafCollider
 
preallocateIndices(int) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
preallocateIndices(int) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
preallocateVertices(int) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
preallocateVertices(int) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
predictedframes - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
predictIntegratedTransform(float, Transform) - Method in class com.bulletphysics.dynamics.RigidBody
Continuous collision detection needs prediction.
Prepare(Dbvt.Node, int) - Method in class com.bulletphysics.collision.broadphase.Dbvt.IWriter
 
prepareSolve(int, int) - Method in class com.bulletphysics.dynamics.constraintsolver.ConstraintSolver
 
preStep(CollisionWorld) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
prev - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
prevAppliedImpulse - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
PrimitiveTriangle - Class in com.bulletphysics.extras.gimpact
 
PrimitiveTriangle() - Constructor for class com.bulletphysics.extras.gimpact.PrimitiveTriangle
 
printStats() - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
printStats() - Method in class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
printStats() - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
printStats() - Method in class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
proceedToTransform(Transform) - Method in class com.bulletphysics.dynamics.RigidBody
 
Process(Dbvt.Node, Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.Dbvt.ICollide
 
Process(Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.Dbvt.ICollide
 
Process(Dbvt.Node, float) - Method in class com.bulletphysics.collision.broadphase.Dbvt.ICollide
 
Process(Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.DbvtLeafCollider
 
Process(Dbvt.Node, Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.DbvtTreeCollider
 
processAllOverlappingPairs(OverlapCallback, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
processAllOverlappingPairs(OverlapCallback, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
Perform bvh tree traversal and report overlapping triangles to 'callback'.
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ConcaveShape
 
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
processAllTriangles(TriangleCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Function for retrieve triangles.
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.broadphase.CollisionAlgorithm
 
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm
 
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm
 
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
Convex-Convex collision algorithm.
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm
 
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.EmptyAlgorithm
 
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm
 
processCollision(CollisionObject, CollisionObject, DispatcherInfo, ManifoldResult) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
processIsland(ObjectArrayList<CollisionObject>, int, ObjectArrayList<PersistentManifold>, int, int, int) - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager.IslandCallback
 
processNode(int, int) - Method in class com.bulletphysics.collision.shapes.NodeOverlapCallback
 
processOverlap(BroadphasePair) - Method in class com.bulletphysics.collision.broadphase.OverlapCallback
 
processTriangle(Vector3f[], int, int) - Method in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
processTriangle(Vector3f[], int, int) - Method in class com.bulletphysics.collision.narrowphase.TriangleRaycastCallback
 
processTriangle(Vector3f[], int, int) - Method in class com.bulletphysics.collision.shapes.TriangleCallback
 
PROFILE_TIMINGS - Static variable in class com.bulletphysics.linearmath.DebugDrawModes
 
profileGetTickRate() - Static method in class com.bulletphysics.BulletStats
 
profileGetTicks() - Static method in class com.bulletphysics.BulletStats
 
ProjectMinimum(Vector3f, int) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
Proximity(DbvtAabbMm, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
push() - Method in class com.bulletphysics.util.StackList
Pushes the stack.
pushProfile(String) - Static method in class com.bulletphysics.BulletStats
Pushes profile node.
pushVelocity - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 

Q

quantizedAabbMax - Variable in class com.bulletphysics.collision.shapes.BvhSubtreeInfo
 
quantizedAabbMin - Variable in class com.bulletphysics.collision.shapes.BvhSubtreeInfo
 
QuantizedBvhNodes - Class in com.bulletphysics.collision.shapes
QuantizedBvhNodes is array of compressed AABB nodes, each of 16 bytes.
QuantizedBvhNodes() - Constructor for class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
quantizeWithClamp(Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
QuaternionUtil - Class in com.bulletphysics.linearmath
Utility functions for quaternions.
QuaternionUtil() - Constructor for class com.bulletphysics.linearmath.QuaternionUtil
 
quatRotate(Quat4f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
quickSort(ObjectArrayList<T>, Comparator<T>) - Static method in class com.bulletphysics.linearmath.MiscUtil
Sorts list using quick sort.

R

r - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Mkv
 
rand2() - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
randInt2(int) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
rayAabb(Vector3f, Vector3f, Vector3f, Vector3f, float[], Vector3f) - Static method in class com.bulletphysics.linearmath.AabbUtil2
 
rayCast(WheelInfo) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
raycastInfo - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
RaycastVehicle - Class in com.bulletphysics.dynamics.vehicle
Raycast vehicle, very special constraint that turn a rigidbody into a vehicle.
RaycastVehicle(VehicleTuning, RigidBody, VehicleRaycaster) - Constructor for class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
rayFromWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestRayResultCallback
 
rayTest(Vector3f, Vector3f, CollisionWorld.RayResultCallback) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
rayTest performs a raycast on all objects in the CollisionWorld, and calls the resultCallback.
rayTest(Vector3f, Vector3f, CollisionWorld.RayResultCallback) - Method in class com.bulletphysics.collision.dispatch.GhostObject
 
rayTest(Vector3f, Vector3f, CollisionWorld.RayResultCallback) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
rayTest(Vector3f, Vector3f, CollisionWorld.RayResultCallback) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Virtual method for ray collision.
rayTestSingle(Transform, Transform, CollisionObject, CollisionShape, Transform, CollisionWorld.RayResultCallback) - Static method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
rayToWorld - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.ClosestRayResultCallback
 
readExternal(ObjectInput) - Method in class com.bulletphysics.util.ObjectArrayList
 
readVelocity() - Method in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
recalcLocalAabb() - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
recalcLocalAabb() - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
recalculateLocalAabb() - Method in class com.bulletphysics.collision.shapes.CompoundShape
Re-calculate the local Aabb.
recipSqrt(float) - Static method in class com.bulletphysics.linearmath.TransformUtil
 
reduceVertices(VoronoiSimplexSolver.UsageBitfield) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
refit(StridingMeshInterface) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
refitPartial(StridingMeshInterface, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
refitTree(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
refreshContactPoints() - Method in class com.bulletphysics.collision.dispatch.ManifoldResult
 
refreshContactPoints(Transform, Transform) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
registerAlgorithm(CollisionDispatcher) - Static method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
Use this function for register the algorithm externally.
registerCollisionCreateFunc(int, int, CollisionAlgorithmCreateFunc) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
release(T) - Method in class com.bulletphysics.util.ArrayPool
Releases array into object pool.
release(T) - Method in class com.bulletphysics.util.ObjectPool
Release instance into pool.
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.CollisionAlgorithmCreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm.CreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.CompoundCollisionAlgorithm.SwappedCreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm.CreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.ConvexConcaveCollisionAlgorithm.SwappedCreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm.CreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.ConvexPlaneCollisionAlgorithm.CreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.EmptyAlgorithm.CreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm.CreateFunc
 
releaseCollisionAlgorithm(CollisionAlgorithm) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm.CreateFunc
 
releaseIterator(CProfileIterator) - Static method in class com.bulletphysics.linearmath.CProfileManager
 
releaseManifold(PersistentManifold) - Method in class com.bulletphysics.collision.broadphase.Dispatcher
 
releaseManifold(PersistentManifold) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
releasepaircache - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
releaseResult(HullResult) - Method in class com.bulletphysics.linearmath.convexhull.HullLibrary
Release memory allocated for this result, we are done with it.
relpos1CrossNormal - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
relpos2CrossNormal - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
remove(Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
remove(int) - Method in class com.bulletphysics.util.FloatArrayList
 
remove(int) - Method in class com.bulletphysics.util.IntArrayList
 
remove(int) - Method in class com.bulletphysics.util.ObjectArrayList
 
removeAction(ActionInterface) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
removeAction(ActionInterface) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
removeChildShape(CollisionShape) - Method in class com.bulletphysics.collision.shapes.CompoundShape
Remove all children shapes that contain the specified shape.
removeCollisionObject(CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
removeConstraint(TypedConstraint) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
removeConstraint(TypedConstraint) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
removeConstraintRef(TypedConstraint) - Method in class com.bulletphysics.dynamics.RigidBody
 
removeContactPoint(int) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
removeHandle(int, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
removeOverlappingObjectInternal(BroadphaseProxy, Dispatcher, BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.GhostObject
This method is mainly for expert/internal use only.
removeOverlappingObjectInternal(BroadphaseProxy, Dispatcher, BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.PairCachingGhostObject
 
removeOverlappingPair(BroadphaseProxy, BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
removeOverlappingPair(BroadphaseProxy, BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCallback
 
removeOverlappingPair(BroadphaseProxy, BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.dispatch.GhostPairCallback
 
removeOverlappingPairsContainingProxy(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
removeOverlappingPairsContainingProxy(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCallback
 
removeOverlappingPairsContainingProxy(BroadphaseProxy, Dispatcher) - Method in class com.bulletphysics.collision.dispatch.GhostPairCallback
 
removeQuick(int) - Method in class com.bulletphysics.util.ObjectArrayList
 
removeRigidBody(RigidBody) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
removeRigidBody(RigidBody) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
removeRigidBody(RigidBody) - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
removeVehicle(RaycastVehicle) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
removeVehicle(RaycastVehicle) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
removeVertex(int) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
replaceContactPoint(ManifoldPoint, int) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
reportAabbOverlappingNodex(NodeOverlapCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
reportBoxCastOverlappingNodex(NodeOverlapCallback, Vector3f, Vector3f, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
reportErrorWarning(String) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
reportHit(Vector3f, Vector3f, float, int, int) - Method in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
reportHit(Vector3f, float, int, int) - Method in class com.bulletphysics.collision.narrowphase.TriangleRaycastCallback
 
reportRayOverlappingNodex(NodeOverlapCallback, Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
reset(int) - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
reset() - Method in class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
reset() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
Clear the simplex, remove all the vertices.
reset() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 
reset() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.UsageBitfield
 
reset() - Method in class com.bulletphysics.collision.shapes.BU_Simplex1to4
 
reset() - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
reset() - Method in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
reset() - Method in class com.bulletphysics.dynamics.constraintsolver.ConstraintSolver
Clear internal cached data and reset random seed.
reset() - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
reset() - Method in class com.bulletphysics.linearmath.Clock
Resets clock by setting start time to current.
reset() - Static method in class com.bulletphysics.linearmath.CProfileManager
 
resetSuspension() - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
resize(int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
resize(IntArrayList, int, int) - Static method in class com.bulletphysics.linearmath.MiscUtil
Resizes list to exact size, filling with given value when expanding.
resize(FloatArrayList, int, float) - Static method in class com.bulletphysics.linearmath.MiscUtil
Resizes list to exact size, filling with given value when expanding.
resize(ObjectArrayList<T>, int, Class<T>) - Static method in class com.bulletphysics.linearmath.MiscUtil
Resizes list to exact size, filling with new instances of given class type when expanding.
resolveContact(RigidBody, RigidBody, ManifoldPoint, ContactSolverInfo) - Method in class com.bulletphysics.dynamics.constraintsolver.ContactSolverFunc
 
resolveSingleBilateral(RigidBody, Vector3f, RigidBody, Vector3f, float, Vector3f, float[], float) - Static method in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
Bilateral constraint between two dynamic objects.
resolveSingleCollision - Static variable in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
 
resolveSingleCollision(RigidBody, RigidBody, ManifoldPoint, ContactSolverInfo) - Static method in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
Response between two dynamic objects with friction.
resolveSingleCollisionCombined - Static variable in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
 
resolveSingleCollisionCombined(RigidBody, RigidBody, ManifoldPoint, ContactSolverInfo) - Static method in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
velocity + friction
response between two dynamic objects with friction
resolveSingleFriction - Static variable in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
 
resolveSingleFriction(RigidBody, RigidBody, ManifoldPoint, ContactSolverInfo) - Static method in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
 
resolveSingleFrictionEmpty(RigidBody, RigidBody, ManifoldPoint, ContactSolverInfo) - Static method in class com.bulletphysics.dynamics.constraintsolver.ContactConstraint
 
restitution - Variable in class com.bulletphysics.dynamics.constraintsolver.ConstraintPersistentData
 
restitution - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
restitution - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
restitution - Variable in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
restitution - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
Best simulation results using zero restitution.
returning(T) - Method in class com.bulletphysics.util.StackList
Copies given instance into one slot static instance and returns it.
REVERSE_ORDER - Static variable in class com.bulletphysics.linearmath.convexhull.HullFlags
 
RigidBody - Class in com.bulletphysics.dynamics
RigidBody is the main class for rigid body objects.
RigidBody(RigidBodyConstructionInfo) - Constructor for class com.bulletphysics.dynamics.RigidBody
 
RigidBody(float, MotionState, CollisionShape) - Constructor for class com.bulletphysics.dynamics.RigidBody
 
RigidBody(float, MotionState, CollisionShape, Vector3f) - Constructor for class com.bulletphysics.dynamics.RigidBody
 
RigidBodyConstructionInfo - Class in com.bulletphysics.dynamics
RigidBodyConstructionInfo provides information to create a rigid body.
RigidBodyConstructionInfo(float, MotionState, CollisionShape) - Constructor for class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
RigidBodyConstructionInfo(float, MotionState, CollisionShape, Vector3f) - Constructor for class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
rollInfluence - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
root - Variable in class com.bulletphysics.collision.broadphase.Dbvt
 
rootNodeIndex - Variable in class com.bulletphysics.collision.shapes.BvhSubtreeInfo
 
rotation - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
RotationalLimitMotor - Class in com.bulletphysics.dynamics.constraintsolver
Rotation limit structure for generic joints.
RotationalLimitMotor() - Constructor for class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
RotationalLimitMotor(RotationalLimitMotor) - Constructor for class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 

S

saveKinematicState(float) - Method in class com.bulletphysics.dynamics.RigidBody
 
ScalarType - Enum in com.bulletphysics.collision.shapes
Scalar type, used when accessing triangle mesh data.
ScalarUtil - Class in com.bulletphysics.linearmath
Utility functions for scalars (floats).
ScalarUtil() - Constructor for class com.bulletphysics.linearmath.ScalarUtil
 
scale(Matrix3f, Matrix3f, Vector3f) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
ScaledBvhTriangleMeshShape - Class in com.bulletphysics.collision.shapes
The ScaledBvhTriangleMeshShape allows to instance a scaled version of an existing BvhTriangleMeshShape.
ScaledBvhTriangleMeshShape(BvhTriangleMeshShape, Vector3f) - Constructor for class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
SENSOR_TRIGGER - Static variable in class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
separating_normal - Variable in class com.bulletphysics.extras.gimpact.TriangleContact
 
SequentialImpulseConstraintSolver - Class in com.bulletphysics.dynamics.constraintsolver
SequentialImpulseConstraintSolver uses a Propagation Method and Sequentially applies impulses.
SequentialImpulseConstraintSolver() - Constructor for class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
set(BroadphasePair) - Method in class com.bulletphysics.collision.broadphase.BroadphasePair
 
set(Dbvt.sStkNPS) - Method in class com.bulletphysics.collision.broadphase.Dbvt.sStkNPS
 
set(DbvtAabbMm) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
set(GjkEpaSolver.Mkv) - Method in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Mkv
 
set(ManifoldPoint) - Method in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
set(OptimizedBvhNode) - Method in class com.bulletphysics.collision.shapes.OptimizedBvhNode
 
set(int, QuantizedBvhNodes, int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
set(PrimitiveTriangle) - Method in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
 
set(TriangleContact) - Method in class com.bulletphysics.extras.gimpact.TriangleContact
 
set(Transform) - Method in class com.bulletphysics.linearmath.Transform
 
set(Matrix3f) - Method in class com.bulletphysics.linearmath.Transform
 
set(Matrix4f) - Method in class com.bulletphysics.linearmath.Transform
 
set(int, float) - Method in class com.bulletphysics.util.FloatArrayList
 
set(int, int) - Method in class com.bulletphysics.util.IntArrayList
 
set(int, T) - Method in class com.bulletphysics.util.ObjectArrayList
 
setAabb(BroadphaseProxy, Vector3f, Vector3f, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
setAabb(BroadphaseProxy, Vector3f, Vector3f, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.BroadphaseInterface
 
setAabb(BroadphaseProxy, Vector3f, Vector3f, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
setAabb(BroadphaseProxy, Vector3f, Vector3f, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
setAabbFromQuantizeNode(QuantizedBvhNodes, int) - Method in class com.bulletphysics.collision.shapes.BvhSubtreeInfo
 
setActivationState(int) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setAngularFactor(float) - Method in class com.bulletphysics.dynamics.RigidBody
 
setAngularLowerLimit(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
setAngularOnly(boolean) - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
setAngularOnly(boolean) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
setAngularUpperLimit(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
setAngularVelocity(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
setBarycentricCoordinates(float, float, float, float) - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 
setBodies(Object, Object) - Method in class com.bulletphysics.collision.narrowphase.PersistentManifold
 
setBrake(float, int) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
setBroadphase(BroadphaseInterface) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
setBroadphaseHandle(BroadphaseProxy) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setCachedSeperatingAxis(Vector3f) - Method in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
setCcdMotionThreshold(float) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setCcdSweptSphereRadius(float) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setCenterOfMassTransform(Transform) - Method in class com.bulletphysics.dynamics.RigidBody
 
setChildTransform(int, Transform) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
setChildTransform(int, Transform) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
setChildTransform(int, Transform) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Sets the children transform.
setCollisionConfiguration(CollisionConfiguration) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
setCollisionFlags(int) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setCollisionShape(CollisionShape) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setCompanionId(int) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setConstraintSolver(ConstraintSolver) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
setConstraintSolver(ConstraintSolver) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
setConstraintSolver(ConstraintSolver) - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
setContactAddedCallback(ContactAddedCallback) - Static method in class com.bulletphysics.BulletGlobals
 
setContactBreakingThreshold(float) - Static method in class com.bulletphysics.BulletGlobals
 
setContactDestroyedCallback(ContactDestroyedCallback) - Static method in class com.bulletphysics.BulletGlobals
 
setContactProcessedCallback(ContactProcessedCallback) - Static method in class com.bulletphysics.BulletGlobals
 
setContactSolverFunc(ContactSolverFunc, int, int) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
Advanced: Override the default contact solving function for contacts, for certain types of rigidbody
See RigidBody.contactSolverType and RigidBody.frictionSolverType
setCoord(Vector3f, int, float) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
setCoordinateSystem(int, int, int) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
setDamping(float, float) - Method in class com.bulletphysics.dynamics.RigidBody
 
setDampingDirAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setDampingDirLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setDampingLimAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setDampingLimLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setDampingOrthoAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setDampingOrthoLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setDeactivationDisabled(boolean) - Static method in class com.bulletphysics.BulletGlobals
 
setDeactivationTime(float) - Static method in class com.bulletphysics.BulletGlobals
 
setDeactivationTime(float) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setDebugDrawer(IDebugDraw) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
setDebugMode(int) - Method in class com.bulletphysics.linearmath.IDebugDraw
 
setDistance(float) - Method in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
setEscapeIndexOrTriangleIndex(int, int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
setEuler(Quat4f, float, float, float) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
setEulerZYX(Matrix3f, float, float, float) - Static method in class com.bulletphysics.linearmath.MatrixUtil
Sets rotation matrix from euler angles.
setFace0(int) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
setFace1(int) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
setFallSpeed(float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
setFriction(float) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setFrictionSolverFunc(ContactSolverFunc, int, int) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
Advanced: Override the default friction solving function for contacts, for certain types of rigidbody
See RigidBody.contactSolverType and RigidBody.frictionSolverType
setFromOpenGLMatrix(float[]) - Method in class com.bulletphysics.linearmath.Transform
 
setFromOpenGLSubMatrix(Matrix3f, float[]) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
setGravity(float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
setGravity(Vector3f) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
setGravity(Vector3f) - Method in class com.bulletphysics.dynamics.DynamicsWorld
Once a rigidbody is added to the dynamics world, it will get this gravity assigned.
setGravity(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
setGravity(Vector3f) - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
setHitFraction(float) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setHullFlag(int) - Method in class com.bulletphysics.linearmath.convexhull.HullDesc
 
setIdentity() - Method in class com.bulletphysics.linearmath.Transform
 
setIgnoreMargin(boolean) - Method in class com.bulletphysics.collision.narrowphase.GjkPairDetector
Don't use setIgnoreMargin, it's for Bullet's internal use.
setInternalGhostPairCallback(OverlappingPairCallback) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
setInternalGhostPairCallback(OverlappingPairCallback) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
setInternalNodeAabbMax(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
setInternalNodeAabbMin(int, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
setInternalNodeEscapeIndex(int, int) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
setInternalTickCallback(InternalTickCallback, Object) - Method in class com.bulletphysics.dynamics.DynamicsWorld
Set the callback for when an internal tick (simulation substep) happens, optional user info.
setInterpolate3(Vector3f, Vector3f, Vector3f, float) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
setInterpolationAngularVelocity(Vector3f) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setInterpolationLinearVelocity(Vector3f) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setInterpolationWorldTransform(Transform) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setInvInertiaDiagLocal(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
setIslandTag(int) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setJumpSpeed(float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
setLimit(float, float, float) - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
setLimit(float, float, float, float, float, float) - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
setLimit(int, float, float) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
first 3 are linear, next 3 are angular
setLimit(float, float) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
setLimit(float, float, float, float, float) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
setLinearLowerLimit(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
setLinearUpperLimit(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
setLinearVelocity(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexHullShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.PolyhedralConvexShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.ScaledBvhTriangleMeshShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.StaticPlaneShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.TriangleMeshShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
setLocalScaling(Vector3f) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
You must call updateBound() for update the box set.
setLowerAngLimit(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setLowerLinLimit(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setLowLevelOfDetail(boolean) - Method in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.BoxShape
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.CompoundShape
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.ConcaveShape
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.ConvexInternalShape
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.ConvexShape
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.SphereShape
 
setMargin(float) - Method in class com.bulletphysics.collision.shapes.UniformScalingShape
 
setMargin(float) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
setMargin(float) - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
setMargin(float) - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
 
setMassProps(float, Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
setMax(Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
setMaxAngMotorForce(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setMaxJumpHeight(float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
setMaxLinMotorForce(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setMaxSlope(float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
setMin(Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.VectorUtil
 
setMinkowskiA(ConvexShape) - Method in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
setMinkowskiB(ConvexShape) - Method in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
setMotionState(MotionState) - Method in class com.bulletphysics.dynamics.RigidBody
 
setNearCallback(NearCallback) - Method in class com.bulletphysics.collision.dispatch.CollisionDispatcher
 
setNewBroadphaseProxy(BroadphaseProxy) - Method in class com.bulletphysics.dynamics.RigidBody
 
setNumTasks(int) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
setOptimizedBvh(OptimizedBvh) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
setOptimizedBvh(OptimizedBvh, Vector3f) - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 
setOverlapFilterCallback(OverlapFilterCallback) - Method in class com.bulletphysics.collision.broadphase.HashedOverlappingPairCache
 
setOverlapFilterCallback(OverlapFilterCallback) - Method in class com.bulletphysics.collision.broadphase.OverlappingPairCache
 
setOverlappingPairUserCallback(OverlappingPairCallback) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
setPart0(int) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
setPart1(int) - Method in class com.bulletphysics.extras.gimpact.GImpactCollisionAlgorithm
 
setPenetrationDepthSolver(ConvexPenetrationDepthSolver) - Method in class com.bulletphysics.collision.narrowphase.GjkPairDetector
 
setPersistentManifold(PersistentManifold) - Method in class com.bulletphysics.collision.dispatch.ManifoldResult
 
setPitchControl(float) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
setPivotA(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
setPivotB(Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
setPoweredAngMotor(boolean) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setPoweredLinMotor(boolean) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setProfileEnabled(boolean) - Static method in class com.bulletphysics.BulletStats
 
setQuantizationValues(Vector3f, Vector3f) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
setQuantizationValues(Vector3f, Vector3f, float) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
setQuantizedAabbMax(int, long) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
setQuantizedAabbMax(int, int, int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
setQuantizedAabbMin(int, long) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
setQuantizedAabbMin(int, int, int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
setQuick(int, T) - Method in class com.bulletphysics.util.ObjectArrayList
 
setRandSeed(long) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
setRestitution(float) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setRestitutionDirAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setRestitutionDirLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setRestitutionLimAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setRestitutionLimLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setRestitutionOrthoAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setRestitutionOrthoLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setRotation(Matrix3f, Quat4f) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
setRotation(Quat4f, Vector3f, float) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
setRotation(Quat4f) - Method in class com.bulletphysics.linearmath.Transform
 
sets - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
setScaling(Vector3f) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
setShapeIdentifiers(int, int, int, int) - Method in class com.bulletphysics.collision.dispatch.ManifoldResult
 
setShapeIdentifiers(int, int, int, int) - Method in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.Result
 
setShapeIdentifiers(int, int, int, int) - Method in class com.bulletphysics.collision.narrowphase.PointCollector
 
setSleepingThresholds(float, float) - Method in class com.bulletphysics.dynamics.RigidBody
 
setSoftnessDirAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setSoftnessDirLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setSoftnessLimAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setSoftnessLimLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setSoftnessOrthoAng(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setSoftnessOrthoLin(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setSteeringValue(float, int) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
setTargetAngMotorVelocity(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setTargetLinMotorVelocity(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setting - Variable in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
setTransformA(Transform) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
setTransformB(Transform) - Method in class com.bulletphysics.collision.shapes.MinkowskiSumShape
 
setUpAxis(int) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
setUpperAngLimit(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setUpperLinLimit(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
setUserConstraintId(int) - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
setUserConstraintType(int) - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
setUserPointer(Object) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setUserPointer(Object) - Method in class com.bulletphysics.collision.shapes.CollisionShape
 
setVelocityForTimeInterval(Vector3f, float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
Caller provides a velocity with which the character should move for the given time period.
setVertex(int, float, float, float) - Method in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
setVertex(int, float, float, float) - Method in class com.bulletphysics.collision.shapes.VertexData
 
setVertex(int, Tuple3f) - Method in class com.bulletphysics.collision.shapes.VertexData
 
setWalkDirection(Vector3f) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
This should probably be called setPositionIncrementPerSimulatorStep.
setWorldTransform(Transform) - Method in class com.bulletphysics.collision.dispatch.CollisionObject
 
setWorldTransform(Transform) - Method in class com.bulletphysics.linearmath.DefaultMotionState
 
setWorldTransform(Transform) - Method in class com.bulletphysics.linearmath.MotionState
Sets world transform.
setWorldUserInfo(Object) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
ShapeHull - Class in com.bulletphysics.collision.shapes
ShapeHull takes a ConvexShape, builds the convex hull using HullLibrary and provides triangle indices and vertices.
ShapeHull(ConvexShape) - Constructor for class com.bulletphysics.collision.shapes.ShapeHull
 
shapePart - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalShapeInfo
 
shortestArcQuat(Vector3f, Vector3f, Quat4f) - Static method in class com.bulletphysics.linearmath.QuaternionUtil
 
SignedExpand(Vector3f) - Method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
SIMD_2_PI - Static variable in class com.bulletphysics.BulletGlobals
 
SIMD_DEGS_PER_RAD - Static variable in class com.bulletphysics.BulletGlobals
 
SIMD_EPSILON - Static variable in class com.bulletphysics.BulletGlobals
 
SIMD_HALF_PI - Static variable in class com.bulletphysics.BulletGlobals
 
SIMD_INFINITY - Static variable in class com.bulletphysics.BulletGlobals
 
SIMD_PI - Static variable in class com.bulletphysics.BulletGlobals
 
SIMD_RADS_PER_DEG - Static variable in class com.bulletphysics.BulletGlobals
 
SIMDSQRT12 - Static variable in class com.bulletphysics.linearmath.TransformUtil
 
SIMPLE_STACKSIZE - Static variable in class com.bulletphysics.collision.broadphase.Dbvt
 
SimpleBroadphase - Class in com.bulletphysics.collision.broadphase
SimpleBroadphase is just a unit-test for AxisSweep3, AxisSweep3_32, or DbvtBroadphase, so use those classes instead.
SimpleBroadphase() - Constructor for class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
SimpleBroadphase(int) - Constructor for class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
SimpleBroadphase(int, OverlappingPairCache) - Constructor for class com.bulletphysics.collision.broadphase.SimpleBroadphase
 
SimpleDynamicsWorld - Class in com.bulletphysics.dynamics
SimpleDynamicsWorld serves as unit-test and to verify more complicated and optimized dynamics worlds.
SimpleDynamicsWorld(Dispatcher, BroadphaseInterface, ConstraintSolver, CollisionConfiguration) - Constructor for class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
simplexPointsP - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
simplexPointsQ - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
simplexSolver - Variable in class com.bulletphysics.collision.dispatch.ConvexConvexAlgorithm.CreateFunc
 
SimplexSolverInterface - Class in com.bulletphysics.collision.narrowphase
SimplexSolverInterface can incrementally calculate distance between origin and up to 4 vertices.
SimplexSolverInterface() - Constructor for class com.bulletphysics.collision.narrowphase.SimplexSolverInterface
 
simplexVectorW - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
SimulationIslandManager - Class in com.bulletphysics.collision.dispatch
SimulationIslandManager creates and handles simulation islands, using UnionFind.
SimulationIslandManager() - Constructor for class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
SimulationIslandManager.IslandCallback - Class in com.bulletphysics.collision.dispatch
 
SimulationIslandManager.IslandCallback() - Constructor for class com.bulletphysics.collision.dispatch.SimulationIslandManager.IslandCallback
 
size() - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
size() - Method in class com.bulletphysics.util.FloatArrayList
 
size() - Method in class com.bulletphysics.util.IntArrayList
 
size() - Method in class com.bulletphysics.util.ObjectArrayList
 
skidInfo - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
SLIDER_CONSTRAINT_DEF_DAMPING - Static variable in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
SLIDER_CONSTRAINT_DEF_RESTITUTION - Static variable in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
SLIDER_CONSTRAINT_DEF_SOFTNESS - Static variable in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
SliderConstraint - Class in com.bulletphysics.dynamics.constraintsolver
 
SliderConstraint() - Constructor for class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
SliderConstraint(RigidBody, RigidBody, Transform, Transform, boolean) - Constructor for class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
solveAngularLimits(float, Vector3f, float, RigidBody, RigidBody) - Method in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
Apply the correction impulses for two bodies.
solveCombinedContactFriction(RigidBody, RigidBody, ManifoldPoint, ContactSolverInfo, int, IDebugDraw) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
solveConstraint(float) - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
solveConstraint(float) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
solveConstraint(float) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
solveConstraint(float) - Method in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
solveConstraint(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
solveConstraint(float) - Method in class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
solveConstraint(float) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
solveConstraintInt(RigidBody, RigidBody) - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
solveGroup(ObjectArrayList<CollisionObject>, int, ObjectArrayList<PersistentManifold>, int, int, ObjectArrayList<TypedConstraint>, int, int, ContactSolverInfo, IDebugDraw, Dispatcher) - Method in class com.bulletphysics.dynamics.constraintsolver.ConstraintSolver
Solve a group of constraints.
solveGroup(ObjectArrayList<CollisionObject>, int, ObjectArrayList<PersistentManifold>, int, int, ObjectArrayList<TypedConstraint>, int, int, ContactSolverInfo, IDebugDraw, Dispatcher) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
Sequentially applies impulses.
solveGroupCacheFriendly(ObjectArrayList<CollisionObject>, int, ObjectArrayList<PersistentManifold>, int, int, ObjectArrayList<TypedConstraint>, int, int, ContactSolverInfo, IDebugDraw) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
solveGroupCacheFriendlyIterations(ObjectArrayList<CollisionObject>, int, ObjectArrayList<PersistentManifold>, int, int, ObjectArrayList<TypedConstraint>, int, int, ContactSolverInfo, IDebugDraw) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
solveGroupCacheFriendlySetup(ObjectArrayList<CollisionObject>, int, ObjectArrayList<PersistentManifold>, int, int, ObjectArrayList<TypedConstraint>, int, int, ContactSolverInfo, IDebugDraw) - Method in class com.bulletphysics.dynamics.constraintsolver.SequentialImpulseConstraintSolver
 
solveLinearAxis(float, float, RigidBody, Vector3f, RigidBody, Vector3f, int, Vector3f, Vector3f) - Method in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
SOLVER_CACHE_FRIENDLY - Static variable in class com.bulletphysics.dynamics.constraintsolver.SolverMode
 
SOLVER_FRICTION_SEPARATE - Static variable in class com.bulletphysics.dynamics.constraintsolver.SolverMode
 
SOLVER_RANDMIZE_ORDER - Static variable in class com.bulletphysics.dynamics.constraintsolver.SolverMode
 
SOLVER_USE_WARMSTARTING - Static variable in class com.bulletphysics.dynamics.constraintsolver.SolverMode
 
SolverBody - Class in com.bulletphysics.dynamics.constraintsolver
SolverBody is an internal data structure for the constraint solver.
SolverBody() - Constructor for class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
solverBodyIdA - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
solverBodyIdB - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
SolverConstraint - Class in com.bulletphysics.dynamics.constraintsolver
1D constraint along a normal axis between bodyA and bodyB.
SolverConstraint() - Constructor for class com.bulletphysics.dynamics.constraintsolver.SolverConstraint
 
SolverConstraintType - Enum in com.bulletphysics.dynamics.constraintsolver
Solver constraint type.
solverMode - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
SolverMode - Class in com.bulletphysics.dynamics.constraintsolver
Solver flags.
SolverMode() - Constructor for class com.bulletphysics.dynamics.constraintsolver.SolverMode
 
sor - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
sortIslands() - Method in class com.bulletphysics.collision.dispatch.UnionFind
This is a special operation, destroying the content of UnionFind.
SphereShape - Class in com.bulletphysics.collision.shapes
SphereShape implements an implicit sphere, centered around a local origin with radius.
SphereShape(float) - Constructor for class com.bulletphysics.collision.shapes.SphereShape
 
SphereSphereCollisionAlgorithm - Class in com.bulletphysics.collision.dispatch
Provides collision detection between two spheres.
SphereSphereCollisionAlgorithm() - Constructor for class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm
 
SphereSphereCollisionAlgorithm.CreateFunc - Class in com.bulletphysics.collision.dispatch
 
SphereSphereCollisionAlgorithm.CreateFunc() - Constructor for class com.bulletphysics.collision.dispatch.SphereSphereCollisionAlgorithm.CreateFunc
 
splitImpulse - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
splitImpulsePenetrationThreshold - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
StackList<T> - Class in com.bulletphysics.util
Stack-based object pool, see the example for usage.
StackList() - Constructor for class com.bulletphysics.util.StackList
 
stage - Variable in class com.bulletphysics.collision.broadphase.DbvtProxy
 
STAGECOUNT - Static variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
stageCurrent - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
stageRoots - Variable in class com.bulletphysics.collision.broadphase.DbvtBroadphase
 
startProfile(String) - Static method in class com.bulletphysics.linearmath.CProfileManager
 
startWorldTrans - Variable in class com.bulletphysics.linearmath.DefaultMotionState
Initial world transform.
startWorldTransform - Variable in class com.bulletphysics.dynamics.RigidBodyConstructionInfo
 
STATIC_FILTER - Static variable in class com.bulletphysics.collision.broadphase.CollisionFilterGroups
 
STATIC_OBJECT - Static variable in class com.bulletphysics.collision.dispatch.CollisionFlags
Sets this collision object as static.
StaticPlaneShape - Class in com.bulletphysics.collision.shapes
StaticPlaneShape simulates an infinite non-moving (static) collision plane.
StaticPlaneShape(Vector3f, float) - Constructor for class com.bulletphysics.collision.shapes.StaticPlaneShape
 
status - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Results
 
steering - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
stepCount - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
stepSimulation(float, int, float) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
stepSimulation(float) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
stepSimulation(float, int) - Method in class com.bulletphysics.dynamics.DynamicsWorld
 
stepSimulation(float, int, float) - Method in class com.bulletphysics.dynamics.DynamicsWorld
Proceeds the simulation over 'timeStep', units in preferably in seconds.
stepSimulation(float, int, float) - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
maxSubSteps/fixedTimeStep for interpolation is currently ignored for SimpleDynamicsWorld, use DiscreteDynamicsWorld instead.
stepSimulationTime - Static variable in class com.bulletphysics.BulletStats
 
stopProfile() - Static method in class com.bulletphysics.linearmath.CProfileManager
 
storeIslandActivationState(CollisionWorld) - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
StridingMeshInterface - Class in com.bulletphysics.collision.shapes
StridingMeshInterface is the abstract class for high performance access to triangle meshes.
StridingMeshInterface() - Constructor for class com.bulletphysics.collision.shapes.StridingMeshInterface
 
subPart - Variable in class com.bulletphysics.collision.shapes.OptimizedBvhNode
 
SubsimplexConvexCast - Class in com.bulletphysics.collision.narrowphase
SubsimplexConvexCast 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.
SubsimplexConvexCast(ConvexShape, ConvexShape, SimplexSolverInterface) - Constructor for class com.bulletphysics.collision.narrowphase.SubsimplexConvexCast
 
subtreeSize - Variable in class com.bulletphysics.collision.shapes.BvhSubtreeInfo
 
suspensionCompression - Variable in class com.bulletphysics.dynamics.vehicle.VehicleTuning
 
suspensionDamping - Variable in class com.bulletphysics.dynamics.vehicle.VehicleTuning
 
suspensionLength - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
suspensionRelativeVelocity - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
suspensionRestLength - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
suspensionRestLength1 - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
suspensionStiffness - Variable in class com.bulletphysics.dynamics.vehicle.VehicleTuning
 
suspensionStiffness - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
suspensionStiffness - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
swap(DbvtAabbMm, DbvtAabbMm) - Static method in class com.bulletphysics.collision.broadphase.DbvtAabbMm
 
swap(int, int) - Method in class com.bulletphysics.collision.shapes.QuantizedBvhNodes
 
swapLeafNodes(int, int) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
swapped - Variable in class com.bulletphysics.collision.dispatch.CollisionAlgorithmCreateFunc
 
synchronizeMotionStates() - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
sz - Variable in class com.bulletphysics.collision.dispatch.UnionFind.Element
 

T

targetVelocity - Variable in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
 
tau - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
tau - Variable in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint.ConstraintSetting
 
testAabbAgainstAabb2(Vector3f, Vector3f, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.AabbUtil2
Conservative test for overlap between two AABBs.
testAabbOverlap(BroadphaseProxy, BroadphaseProxy) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
testAngLimits() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
testAngularLimitMotor(int) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
Test angular limit.
testLimitValue(float) - Method in class com.bulletphysics.dynamics.constraintsolver.RotationalLimitMotor
Calculates error.
testLinLimits() - Method in class com.bulletphysics.dynamics.constraintsolver.SliderConstraint
 
testTriangleAgainstAabb2(Vector3f[], Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.AabbUtil2
Conservative test for overlap between triangle and AABB.
timeOfImpact - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
timeStep - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
timeStep - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
to - Variable in class com.bulletphysics.collision.narrowphase.TriangleRaycastCallback
 
transform - Variable in class com.bulletphysics.collision.shapes.CompoundShapeChild
 
Transform - Class in com.bulletphysics.linearmath
Transform represents translation and rotation (rigid transform).
Transform() - Constructor for class com.bulletphysics.linearmath.Transform
 
Transform(Matrix3f) - Constructor for class com.bulletphysics.linearmath.Transform
 
Transform(Matrix4f) - Constructor for class com.bulletphysics.linearmath.Transform
 
Transform(Transform) - Constructor for class com.bulletphysics.linearmath.Transform
 
transform(Vector3f) - Method in class com.bulletphysics.linearmath.Transform
 
transformA - Variable in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.ClosestPointInput
 
transformAabb(Vector3f, float, Transform, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.AabbUtil2
 
transformAabb(Vector3f, Vector3f, float, Transform, Vector3f, Vector3f) - Static method in class com.bulletphysics.linearmath.AabbUtil2
 
transformB - Variable in class com.bulletphysics.collision.narrowphase.DiscreteCollisionDetectorInterface.ClosestPointInput
 
TransformUtil - Class in com.bulletphysics.linearmath
Utility functions for transforms.
TransformUtil() - Constructor for class com.bulletphysics.linearmath.TransformUtil
 
translate(Vector3f) - Method in class com.bulletphysics.dynamics.RigidBody
 
TranslationalLimitMotor - Class in com.bulletphysics.dynamics.constraintsolver
 
TranslationalLimitMotor() - Constructor for class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
TranslationalLimitMotor(TranslationalLimitMotor) - Constructor for class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
transposeTransform(Vector3f, Vector3f, Matrix3f) - Static method in class com.bulletphysics.linearmath.MatrixUtil
 
TraversalMode - Enum in com.bulletphysics.collision.shapes
Traversal mode for OptimizedBvh.
TriangleCallback - Class in com.bulletphysics.collision.shapes
TriangleCallback provides a callback for each overlapping triangle when calling processAllTriangles.
TriangleCallback() - Constructor for class com.bulletphysics.collision.shapes.TriangleCallback
 
triangleCollisionMargin - Variable in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
TriangleContact - Class in com.bulletphysics.extras.gimpact
 
TriangleContact() - Constructor for class com.bulletphysics.extras.gimpact.TriangleContact
 
TriangleContact(TriangleContact) - Constructor for class com.bulletphysics.extras.gimpact.TriangleContact
 
TriangleConvexcastCallback - Class in com.bulletphysics.collision.narrowphase
 
TriangleConvexcastCallback(ConvexShape, Transform, Transform, Transform, float) - Constructor for class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
triangleIndex - Variable in class com.bulletphysics.collision.dispatch.CollisionWorld.LocalShapeInfo
 
triangleIndex - Variable in class com.bulletphysics.collision.shapes.OptimizedBvhNode
 
triangleIndexBase - Variable in class com.bulletphysics.collision.shapes.IndexedMesh
 
triangleIndexStride - Variable in class com.bulletphysics.collision.shapes.IndexedMesh
 
TriangleIndexVertexArray - Class in com.bulletphysics.collision.shapes
TriangleIndexVertexArray allows to use multiple meshes, by indexing into existing triangle/index arrays.
TriangleIndexVertexArray() - Constructor for class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
TriangleIndexVertexArray(int, ByteBuffer, int, int, ByteBuffer, int) - Constructor for class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
Just to be backwards compatible.
TriangleMeshShape - Class in com.bulletphysics.collision.shapes
Concave triangle mesh abstract class.
TriangleRaycastCallback - Class in com.bulletphysics.collision.narrowphase
 
TriangleRaycastCallback(Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.narrowphase.TriangleRaycastCallback
 
TRIANGLES - Static variable in class com.bulletphysics.linearmath.convexhull.HullFlags
 
TriangleShape - Class in com.bulletphysics.collision.shapes
Single triangle shape.
TriangleShape() - Constructor for class com.bulletphysics.collision.shapes.TriangleShape
 
TriangleShape(Vector3f, Vector3f, Vector3f) - Constructor for class com.bulletphysics.collision.shapes.TriangleShape
 
TriangleShapeEx - Class in com.bulletphysics.extras.gimpact
 
TriangleShapeEx() - Constructor for class com.bulletphysics.extras.gimpact.TriangleShapeEx
 
TriangleShapeEx(Vector3f, Vector3f, Vector3f) - Constructor for class com.bulletphysics.extras.gimpact.TriangleShapeEx
 
triangleToWorld - Variable in class com.bulletphysics.collision.narrowphase.TriangleConvexcastCallback
 
turnVelocity - Variable in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
TypedConstraint - Class in com.bulletphysics.dynamics.constraintsolver
TypedConstraint is the base class for Bullet constraints and vehicles.
TypedConstraint(TypedConstraintType) - Constructor for class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
TypedConstraint(TypedConstraintType, RigidBody) - Constructor for class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
TypedConstraint(TypedConstraintType, RigidBody, RigidBody) - Constructor for class com.bulletphysics.dynamics.constraintsolver.TypedConstraint
 
TypedConstraintType - Enum in com.bulletphysics.dynamics.constraintsolver
Typed constraint type.

U

UniformScalingShape - Class in com.bulletphysics.collision.shapes
UniformScalingShape allows to re-use uniform scaled instances of ConvexShape in a memory efficient way.
UniformScalingShape(ConvexShape, float) - Constructor for class com.bulletphysics.collision.shapes.UniformScalingShape
 
UnionFind - Class in com.bulletphysics.collision.dispatch
UnionFind calculates connected subsets.
UnionFind() - Constructor for class com.bulletphysics.collision.dispatch.UnionFind
 
UnionFind.Element - Class in com.bulletphysics.collision.dispatch
 
UnionFind.Element() - Constructor for class com.bulletphysics.collision.dispatch.UnionFind.Element
 
uniqueId - Variable in class com.bulletphysics.collision.broadphase.BroadphaseProxy
 
unite(int, int) - Method in class com.bulletphysics.collision.dispatch.UnionFind
 
unlockChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShape
 
unlockChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactMeshShapePart
 
unlockChildShapes() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
 
unLockReadOnlyVertexBase(int) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
 
unLockReadOnlyVertexBase(int) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
 
unLockVertexBase(int) - Method in class com.bulletphysics.collision.shapes.StridingMeshInterface
unLockVertexBase finishes the access to a subpart of the triangle mesh.
unLockVertexBase(int) - Method in class com.bulletphysics.collision.shapes.TriangleIndexVertexArray
unLockVertexBase finishes the access to a subpart of the triangle mesh.
unQuantize(Vector3f, long) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
upcast(CollisionObject) - Static method in class com.bulletphysics.collision.dispatch.GhostObject
 
upcast(CollisionObject) - Static method in class com.bulletphysics.dynamics.RigidBody
To keep collision detection and dynamics separate we don't store a rigidbody pointer, but a rigidbody is derived from CollisionObject, so we can safely perform an upcast.
update(Dbvt.Node) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
update(Dbvt.Node, int) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
update(Dbvt.Node, DbvtAabbMm) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
update(Dbvt.Node, DbvtAabbMm, Vector3f, float) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
update(Dbvt.Node, DbvtAabbMm, Vector3f) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
update(Dbvt.Node, DbvtAabbMm, float) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
updateAabbs() - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
updateAabbs() - Method in class com.bulletphysics.dynamics.SimpleDynamicsWorld
 
updateAction(CollisionWorld, float) - Method in class com.bulletphysics.dynamics.ActionInterface
 
updateAction(CollisionWorld, float) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
updateActions(float) - Method in class com.bulletphysics.dynamics.DiscreteDynamicsWorld
 
updateActivationState(CollisionWorld, Dispatcher) - Method in class com.bulletphysics.collision.dispatch.SimulationIslandManager
 
updateBound() - Method in class com.bulletphysics.extras.gimpact.GImpactShapeInterface
Performs refit operation.
updateBvhNodes(StridingMeshInterface, int, int, int) - Method in class com.bulletphysics.collision.shapes.OptimizedBvh
 
updateClosestVectorAndPoints() - Method in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
updateDeactivation(float) - Method in class com.bulletphysics.dynamics.RigidBody
 
updateFriction(float) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
updateHandle(int, Vector3f, Vector3f, Dispatcher) - Method in class com.bulletphysics.collision.broadphase.AxisSweep3Internal
 
updateInertiaTensor() - Method in class com.bulletphysics.dynamics.RigidBody
 
updateRHS(float) - Method in class com.bulletphysics.dynamics.constraintsolver.ConeTwistConstraint
 
updateRHS(float) - Method in class com.bulletphysics.dynamics.constraintsolver.Generic6DofConstraint
 
updateRHS(float) - Method in class com.bulletphysics.dynamics.constraintsolver.HingeConstraint
 
updateRHS(float) - Method in class com.bulletphysics.dynamics.constraintsolver.Point2PointConstraint
 
updateSingleAabb(CollisionObject) - Method in class com.bulletphysics.collision.dispatch.CollisionWorld
 
updateSuspension(float) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
updateTime - Static variable in class com.bulletphysics.BulletStats
 
updateVehicle(float) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
updateWheel(RigidBody, WheelInfo.RaycastInfo) - Method in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
updateWheelTransform(int) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
updateWheelTransform(int, boolean) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
updateWheelTransformsWS(WheelInfo) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
updateWheelTransformsWS(WheelInfo, boolean) - Method in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
upperLimit - Variable in class com.bulletphysics.dynamics.constraintsolver.TranslationalLimitMotor
 
useContinuous - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
usedVertexA - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.UsageBitfield
 
usedVertexB - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.UsageBitfield
 
usedVertexC - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.UsageBitfield
 
usedVertexD - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.UsageBitfield
 
usedVertices - Variable in class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 
useEpa - Variable in class com.bulletphysics.collision.broadphase.DispatcherInfo
 
userInfo - Variable in class com.bulletphysics.collision.broadphase.BroadphasePair
 
userPersistentData - Variable in class com.bulletphysics.collision.narrowphase.ManifoldPoint
 
usesQuantizedAabbCompression() - Method in class com.bulletphysics.collision.shapes.BvhTriangleMeshShape
 

V

v - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Face
 
v - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.He
 
value - Variable in class com.bulletphysics.collision.broadphase.Dbvt.sStkNPS
 
valueOf(String) - Static method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.collision.broadphase.DispatchFunc
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.collision.dispatch.CollisionObjectType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.collision.narrowphase.GjkEpaSolver.ResultsStatus
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.collision.shapes.ScalarType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.collision.shapes.TraversalMode
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.dynamics.constraintsolver.SolverConstraintType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.dynamics.constraintsolver.TypedConstraintType
Returns the enum constant of this type with the specified name.
valueOf(String) - Static method in enum com.bulletphysics.dynamics.DynamicsWorldType
Returns the enum constant of this type with the specified name.
values() - Static method in enum com.bulletphysics.collision.broadphase.BroadphaseNativeType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.collision.broadphase.DispatchFunc
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.collision.dispatch.CollisionObjectType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.collision.narrowphase.GjkEpaSolver.ResultsStatus
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.collision.shapes.ScalarType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.collision.shapes.TraversalMode
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.dynamics.constraintsolver.SolverConstraintType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.dynamics.constraintsolver.TypedConstraintType
Returns an array containing the constants of this enum type, in the order they are declared.
values() - Static method in enum com.bulletphysics.dynamics.DynamicsWorldType
Returns an array containing the constants of this enum type, in the order they are declared.
vcount - Variable in class com.bulletphysics.linearmath.convexhull.HullDesc
Number of vertices in the input point cloud.
VectorUtil - Class in com.bulletphysics.linearmath
Utility functions for vectors.
VectorUtil() - Constructor for class com.bulletphysics.linearmath.VectorUtil
 
VehicleRaycaster - Class in com.bulletphysics.dynamics.vehicle
VehicleRaycaster is provides interface for between vehicle simulation and raycasting.
VehicleRaycaster() - Constructor for class com.bulletphysics.dynamics.vehicle.VehicleRaycaster
 
VehicleRaycasterResult - Class in com.bulletphysics.dynamics.vehicle
Vehicle raycaster result.
VehicleRaycasterResult() - Constructor for class com.bulletphysics.dynamics.vehicle.VehicleRaycasterResult
 
VehicleTuning - Class in com.bulletphysics.dynamics.vehicle
Vehicle tuning parameters.
VehicleTuning() - Constructor for class com.bulletphysics.dynamics.vehicle.VehicleTuning
 
vertexBase - Variable in class com.bulletphysics.collision.shapes.IndexedMesh
 
vertexCount - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
vertexData - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
VertexData - Class in com.bulletphysics.collision.shapes
Allows accessing vertex data.
VertexData() - Constructor for class com.bulletphysics.collision.shapes.VertexData
 
vertexIndexMapping - Variable in class com.bulletphysics.linearmath.convexhull.HullLibrary
 
vertexStride - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
vertexStride - Variable in class com.bulletphysics.collision.shapes.IndexedMesh
 
vertexType - Variable in class com.bulletphysics.collision.shapes.ByteBufferVertexData
 
vertices - Variable in class com.bulletphysics.extras.gimpact.PrimitiveTriangle
 
vertices - Variable in class com.bulletphysics.linearmath.convexhull.HullDesc
Array of vertices.
vertices1 - Variable in class com.bulletphysics.collision.shapes.TriangleShape
 
volume - Variable in class com.bulletphysics.collision.broadphase.Dbvt.Node
 
VoronoiSimplexSolver - Class in com.bulletphysics.collision.narrowphase
VoronoiSimplexSolver is an implementation of the closest point distance algorithm from a 1-4 points simplex to the origin.
VoronoiSimplexSolver() - Constructor for class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver
 
VoronoiSimplexSolver.SubSimplexClosestResult - Class in com.bulletphysics.collision.narrowphase
 
VoronoiSimplexSolver.SubSimplexClosestResult() - Constructor for class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.SubSimplexClosestResult
 
VoronoiSimplexSolver.UsageBitfield - Class in com.bulletphysics.collision.narrowphase
 
VoronoiSimplexSolver.UsageBitfield() - Constructor for class com.bulletphysics.collision.narrowphase.VoronoiSimplexSolver.UsageBitfield
 

W

w - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Mkv
 
WANTS_DEACTIVATION - Static variable in class com.bulletphysics.collision.dispatch.CollisionObject
 
wantsSleeping() - Method in class com.bulletphysics.dynamics.RigidBody
 
warmstartingFactor - Variable in class com.bulletphysics.dynamics.constraintsolver.ContactSolverInfo
 
warp(Vector3f) - Method in class com.bulletphysics.dynamics.character.KinematicCharacterController
 
wheelAxleCS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
wheelAxleCS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
wheelAxleWS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
wheelDirectionCS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
wheelDirectionCS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
wheelDirectionWS - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
wheelInfo - Variable in class com.bulletphysics.dynamics.vehicle.RaycastVehicle
 
WheelInfo - Class in com.bulletphysics.dynamics.vehicle
WheelInfo contains information per wheel about friction and suspension.
WheelInfo(WheelInfoConstructionInfo) - Constructor for class com.bulletphysics.dynamics.vehicle.WheelInfo
 
WheelInfo.RaycastInfo - Class in com.bulletphysics.dynamics.vehicle
 
WheelInfo.RaycastInfo() - Constructor for class com.bulletphysics.dynamics.vehicle.WheelInfo.RaycastInfo
 
WheelInfoConstructionInfo - Class in com.bulletphysics.dynamics.vehicle
 
WheelInfoConstructionInfo() - Constructor for class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
wheelRadius - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
wheelsDampingCompression - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
wheelsDampingCompression - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
wheelsDampingRelaxation - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
wheelsDampingRelaxation - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfoConstructionInfo
 
wheelsRadius - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
wheelsSuspensionForce - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
witnesses - Variable in class com.bulletphysics.collision.narrowphase.GjkEpaSolver.Results
 
worldTransform - Variable in class com.bulletphysics.dynamics.vehicle.WheelInfo
 
write(Dbvt.IWriter) - Method in class com.bulletphysics.collision.broadphase.Dbvt
 
writebackVelocity() - Method in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
writebackVelocity(float) - Method in class com.bulletphysics.dynamics.constraintsolver.SolverBody
 
writeExternal(ObjectOutput) - Method in class com.bulletphysics.util.ObjectArrayList
 
WriteLeaf(Dbvt.Node, int, int) - Method in class com.bulletphysics.collision.broadphase.Dbvt.IWriter
 
WriteNode(Dbvt.Node, int, int, int, int) - Method in class com.bulletphysics.collision.broadphase.Dbvt.IWriter
 

A B C D E F G H I J K L M N O P Q R S T U V W