Search Java Classes and Packages

Search Java Frameworks and Libraries

255581 classes and counting ...
Search Tips Index Status



# Classes and Interfaces in #JBullet - 179 results found.
NameDescriptionTypePackageFramework
AabbUtil2Utility functions for axis aligned bounding boxes (AABB).Classcom.bulletphysics.linearmathJBullet
ActionInterfaceBasic interface to allow actions such as vehicles and characters to be updated inside a DynamicsWorld.Classcom.bulletphysics.dynamicsJBullet
ArrayPoolObject pool for arrays.Classcom.bulletphysics.utilJBullet
AxisSweep3AxisSweep3 is an efficient implementation of the 3D axis sweep and prune broadphase.Classcom.bulletphysics.collision.broadphaseJBullet
AxisSweep3_32AxisSweep3_32 allows higher precision quantization and more objects compared to the AxisSweep3 sweep and prune.Classcom.bulletphysics.collision.broadphaseJBullet
AxisSweep3InternalAxisSweep3Internal is an internal base class that implements sweep and prune.Classcom.bulletphysics.collision.broadphaseJBullet
BoxShapeBoxShape is a box primitive around the origin, its sides axis aligned with length specified by half extents, in local shape coordinates.Classcom.bulletphysics.collision.shapesJBullet
BroadphaseInterfaceBroadphaseInterface for AABB overlapping object pairs.Classcom.bulletphysics.collision.broadphaseJBullet
BroadphaseNativeTypeenum BroadphaseNativeTypeextends EnumDispatcher uses these types.Classcom.bulletphysics.collision.broadphaseJBullet
BroadphasePairBroadphasePair class contains a pair of AABB-overlapping objects.Classcom.bulletphysics.collision.broadphaseJBullet
BroadphaseProxyBroadphaseProxy is the main class that can be used with the Bullet broadphases.Classcom.bulletphysics.collision.broadphaseJBullet
BU_Simplex1to4BU_Simplex1to4 implements feature based and implicit simplex of up to 4 vertices (tetrahedron, triangle, line, vertex).Classcom.bulletphysics.collision.shapesJBullet
BulletGlobalsBullet global settings and constants.Classcom.bulletphysicsJBullet
BulletStatsBullet statistics and profile support.Classcom.bulletphysicsJBullet
BvhSubtreeInfoBvhSubtreeInfo provides info to gather a subtree of limited size.Classcom.bulletphysics.collision.shapesJBullet
BvhTriangleMeshShapeBvhTriangleMeshShape is a static-triangle mesh shape with several optimizations, such as bounding volume hierarchy.Classcom.bulletphysics.collision.shapesJBullet
ByteBufferVertexDataClasscom.bulletphysics.collision.shapesJBullet
CapsuleShapeCapsuleShape represents a capsule around the Y axis, there is also the CapsuleShapeX aligned around the X axis and CapsuleShapeZ aroundClasscom.bulletphysics.collision.shapesJBullet
CapsuleShapeXCapsuleShapeX represents a capsule around the X axis.Classcom.bulletphysics.collision.shapesJBullet
CapsuleShapeZCapsuleShapeZ represents a capsule around the Z axis.Classcom.bulletphysics.collision.shapesJBullet
ClockClock is a portable basic clock that measures accurate time in seconds, use for profiling.Classcom.bulletphysics.linearmathJBullet
CollisionAlgorithmCollision algorithm for handling narrowphase or midphase collision detection between two collision object types.Classcom.bulletphysics.collision.broadphaseJBullet
CollisionAlgorithmConstructionInfoConstruction information for collision algorithms.Classcom.bulletphysics.collision.broadphaseJBullet
CollisionAlgorithmCreateFuncUsed by the CollisionDispatcher to register and create instances for CollisionAlgorithm.Classcom.bulletphysics.collision.dispatchJBullet
CollisionConfigurationCollisionConfiguration allows to configure Bullet default collision algorithms.Classcom.bulletphysics.collision.dispatchJBullet
CollisionDispatcherCollisionDispatcher supports algorithms that handle ConvexConvex and ConvexConcave collision pairs.Classcom.bulletphysics.collision.dispatchJBullet
CollisionFilterGroupsCommon collision filter groups.Classcom.bulletphysics.collision.broadphaseJBullet
CollisionFlagsFlags for collision objects.Classcom.bulletphysics.collision.dispatchJBullet
CollisionObjectCollisionObject can be used to manage collision detection objects.Classcom.bulletphysics.collision.dispatchJBullet
CollisionObjectTypeenum CollisionObjectTypeextends EnumCollision object type.Classcom.bulletphysics.collision.dispatchJBullet
CollisionShapeCollisionShape class provides an interface for collision shapes that can be shared among CollisionObjects.Classcom.bulletphysics.collision.shapesJBullet
CollisionWorldCollisionWorld is interface and container for the collision detection.Classcom.bulletphysics.collision.dispatchJBullet
CompoundCollisionAlgorithmCompoundCollisionAlgorithm supports collision between CompoundShapes and other collision shapes.Classcom.bulletphysics.collision.dispatchJBullet
CompoundShapeCompoundShape allows to store multiple other CollisionShapes.Classcom.bulletphysics.collision.shapesJBullet
CompoundShapeChildCompound shape child.Classcom.bulletphysics.collision.shapesJBullet
ConcaveShapeConcaveShape class provides an interface for non-moving (static) concave shapes.Classcom.bulletphysics.collision.shapesJBullet
ConeShapeConeShape implements a cone shape primitive, centered around the origin and aligned with the Y axis.Classcom.bulletphysics.collision.shapesJBullet
ConeShapeXConeShape implements a cone shape, around the X axis.Classcom.bulletphysics.collision.shapesJBullet
ConeShapeZConeShape implements a cone shape, around the Z axis.Classcom.bulletphysics.collision.shapesJBullet
ConeTwistConstraintConeTwistConstraint can be used to simulate ragdoll joints (upper arm, leg etc).Classcom.bulletphysics.dynamics.constraintsolverJBullet
ConstraintPersistentDataStores some extra information to each contact point.Classcom.bulletphysics.dynamics.constraintsolverJBullet
ConstraintSolverAbstract class for constraint solvers.Classcom.bulletphysics.dynamics.constraintsolverJBullet
ContactAddedCallbackCalled when contact has been created between two collision objects.Classcom.bulletphysicsJBullet
ContactConstraintFunctions for resolving contacts.Classcom.bulletphysics.dynamics.constraintsolverJBullet
ContactDestroyedCallbackCalled when contact has been destroyed between two collision objects.Classcom.bulletphysicsJBullet
ContactProcessedCallbackCalled when existing contact between two collision objects has been processed.Classcom.bulletphysicsJBullet
ContactSolverFuncContact solving function.Classcom.bulletphysics.dynamics.constraintsolverJBullet
ContactSolverInfoCurrent state of contact solver.Classcom.bulletphysics.dynamics.constraintsolverJBullet
ConvexCastConvexCast is an interface for casting.Classcom.bulletphysics.collision.narrowphaseJBullet
ConvexConcaveCollisionAlgorithmConvexConcaveCollisionAlgorithm supports collision between convex shapes and (concave) trianges meshes.Classcom.bulletphysics.collision.dispatchJBullet
ConvexConvexAlgorithmConvexConvexAlgorithm collision algorithm implements time of impact, convex closest points and penetration depth calculations.Classcom.bulletphysics.collision.dispatchJBullet
ConvexHullShapeConvexHullShape implements an implicit convex hull of an array of vertices.Classcom.bulletphysics.collision.shapesJBullet
ConvexInternalShapeConvexInternalShape is an internal base class, shared by most convex shape implementations.Classcom.bulletphysics.collision.shapesJBullet
ConvexPenetrationDepthSolverConvexPenetrationDepthSolver provides an interface for penetration depth calculation.Classcom.bulletphysics.collision.narrowphaseJBullet
ConvexPlaneCollisionAlgorithmConvexPlaneCollisionAlgorithm provides convex/plane collision detection.Classcom.bulletphysics.collision.dispatchJBullet
ConvexShapeConvexShape is an abstract shape class.Classcom.bulletphysics.collision.shapesJBullet
CProfileIteratorIterator to navigate through profile tree.Classcom.bulletphysics.linearmathJBullet
CProfileManagerManager for the profile system.Classcom.bulletphysics.linearmathJBullet
CylinderShapeCylinderShape class implements a cylinder shape primitive, centered around the origin.Classcom.bulletphysics.collision.shapesJBullet
CylinderShapeXCylinder shape around the X axis.Classcom.bulletphysics.collision.shapesJBullet
CylinderShapeZCylinder shape around the Z axis.Classcom.bulletphysics.collision.shapesJBullet
DbvtClasscom.bulletphysics.collision.broadphaseJBullet
DbvtAabbMmClasscom.bulletphysics.collision.broadphaseJBullet
DbvtBroadphaseClasscom.bulletphysics.collision.broadphaseJBullet
DbvtLeafColliderClasscom.bulletphysics.collision.broadphaseJBullet
DbvtProxyFields inherited from class com.Classcom.bulletphysics.collision.broadphaseJBullet
DbvtTreeColliderClasscom.bulletphysics.collision.broadphaseJBullet
DebugDrawModesDebug draw modes, used by demo framework.Classcom.bulletphysics.linearmathJBullet
DefaultCollisionConfigurationDefault implementation of CollisionConfiguration.Classcom.bulletphysics.collision.dispatchJBullet
DefaultMotionStateClasscom.bulletphysics.linearmathJBullet
DefaultNearCallbackDefault implementation of NearCallback.Classcom.bulletphysics.collision.dispatchJBullet
DefaultVehicleRaycasterDefault implementation of VehicleRaycaster.Classcom.bulletphysics.dynamics.vehicleJBullet
DiscreteCollisionDetectorInterfaceThis interface is made to be used by an iterative approach to do TimeOfImpact calculations.Classcom.bulletphysics.collision.narrowphaseJBullet
DiscreteDynamicsWorldDiscreteDynamicsWorld provides discrete rigid body simulation.Classcom.bulletphysics.dynamicsJBullet
DispatcherDispatcher abstract class can be used in combination with broadphase to dispatch calculations for overlapping pairs.Classcom.bulletphysics.collision.broadphaseJBullet
DispatcherInfoCurrent state of Dispatcher.Classcom.bulletphysics.collision.broadphaseJBullet
DispatchFuncenum DispatchFuncextends EnumEnum Constant SummaryDISPATCH_CONTINUOUSClasscom.bulletphysics.collision.broadphaseJBullet
DynamicsWorldDynamicsWorld is the interface class for several dynamics implementation, basic, discrete, parallel, and continuous etc.Classcom.bulletphysics.dynamicsJBullet
DynamicsWorldTypeenum DynamicsWorldTypeextends EnumDynamics world type.Classcom.bulletphysics.dynamicsJBullet
EmptyAlgorithmClasscom.bulletphysics.collision.dispatchJBullet
FloatArrayListClasscom.bulletphysics.utilJBullet
Generic6DofConstraintGeneric6DofConstraint between two rigidbodies each with a pivot point that descibes the axis location in local space.Classcom.bulletphysics.dynamics.constraintsolverJBullet
GeometryUtilGeometryUtil helper class provides a few methods to convert between plane equations and vertices.Classcom.bulletphysics.linearmathJBullet
GhostObjectGhostObject can keep track of all objects that are overlapping.Classcom.bulletphysics.collision.dispatchJBullet
GhostPairCallbackGhostPairCallback interfaces and forwards adding and removal of overlapping pairs from the BroadphaseInterface to GhostObject.Classcom.bulletphysics.collision.dispatchJBullet
GImpactCollisionAlgorithmCollision Algorithm for GImpact Shapes.Classcom.bulletphysics.extras.gimpactJBullet
GImpactMeshShapeClasscom.bulletphysics.extras.gimpactJBullet
GImpactMeshShapePartThis class manages a sub part of a mesh supplied by the StridingMeshInterface interface.Classcom.bulletphysics.extras.gimpactJBullet
GImpactShapeInterfaceBase class for gimpact shapes.Classcom.bulletphysics.extras.gimpactJBullet
GjkConvexCastGjkConvexCast performs a raycast on a convex object using support mapping.Classcom.bulletphysics.collision.narrowphaseJBullet
GjkEpaPenetrationDepthSolverGjkEpaPenetrationDepthSolver uses the Expanding Polytope Algorithm to calculate the penetration depth between two convex shapes.Classcom.bulletphysics.collision.narrowphaseJBullet
GjkEpaSolverGjkEpaSolver contributed under zlib by Nathanael Presson.Classcom.bulletphysics.collision.narrowphaseJBullet
GjkPairDetectorGjkPairDetector uses GJK to implement the DiscreteCollisionDetectorInterface.Classcom.bulletphysics.collision.narrowphaseJBullet
HashedOverlappingPairCacheHash-space based OverlappingPairCache.Classcom.bulletphysics.collision.broadphaseJBullet
HingeConstraintHinge constraint between two rigid bodies each with a pivot point that descibes the axis location in local space.Classcom.bulletphysics.dynamics.constraintsolverJBullet
HullDescDescribes point cloud data and other input for conversion to polygonal representation.Classcom.bulletphysics.linearmath.convexhullJBullet
HullFlagsFlags that affects convex hull generation, used in HullDesc.Classcom.bulletphysics.linearmath.convexhullJBullet
HullLibraryHullLibrary class can create a convex hull from a collection of vertices, using the ComputeHull method.Classcom.bulletphysics.linearmath.convexhullJBullet
HullResultContains resulting polygonal representation.Classcom.bulletphysics.linearmath.convexhullJBullet
IDebugDrawIDebugDraw interface class allows hooking up a debug renderer to visually debug Typical use case: create a debug drawer object, and assign it to a CollisionWorldClasscom.bulletphysics.linearmathJBullet
IndexedMeshIndexedMesh indexes into existing vertex and index arrays, in a similar way to OpenGL's glDrawElements.Classcom.bulletphysics.collision.shapesJBullet
IntArrayListClasscom.bulletphysics.utilJBullet
InternalTickCallbackCallback called for each internal tick.Classcom.bulletphysics.dynamicsJBullet
InternalTriangleIndexCallbackCallback for internal processing of triangles.Classcom.bulletphysics.collision.shapesJBullet
JacobianEntryJacobian entry is an abstraction that allows to describe constraints.Classcom.bulletphysics.dynamics.constraintsolverJBullet
KinematicCharacterControllerKinematicCharacterController is an object that supports a sliding motion in a world.Classcom.bulletphysics.dynamics.characterJBullet
ManifoldPointManifoldPoint collects and maintains persistent contactpoints.Classcom.bulletphysics.collision.narrowphaseJBullet
ManifoldResultManifoldResult is helper class to manage contact results.Classcom.bulletphysics.collision.dispatchJBullet
MatrixUtilUtility functions for matrices.Classcom.bulletphysics.linearmathJBullet
MinkowskiSumShapeMinkowskiSumShape is only for advanced users.Classcom.bulletphysics.collision.shapesJBullet
MiscUtilMiscellaneous utility functions.Classcom.bulletphysics.linearmathJBullet
MotionStateMotionState allows the dynamics world to synchronize the updated world transforms with graphics.Classcom.bulletphysics.linearmathJBullet
NearCallbackCallback for overriding collision filtering and more fine-grained control over collision detection.Classcom.bulletphysics.collision.dispatchJBullet
NodeOverlapCallbackCallback for operating with OptimizedBvh.Classcom.bulletphysics.collision.shapesJBullet
ObjectArrayListSee Also:Serialized FormConstructor SummaryObjectArrayList()Classcom.bulletphysics.utilJBullet
ObjectPoolClasscom.bulletphysics.utilJBullet
ObjectStackListStack-based object pool for arbitrary objects, returning not supported.Classcom.bulletphysics.utilJBullet
OptimizedBvhOptimizedBvh store an AABB tree that can be quickly traversed on CPU (and SPU, GPU in future).Classcom.bulletphysics.collision.shapesJBullet
OptimizedBvhNodeOptimizedBvhNode contains both internal and leaf node information.Classcom.bulletphysics.collision.shapesJBullet
OverlapCallbackOverlapCallback is used when processing all overlapping pairs in broadphase.Classcom.bulletphysics.collision.broadphaseJBullet
OverlapFilterCallbackCallback for filtering broadphase collisions.Classcom.bulletphysics.collision.broadphaseJBullet
OverlappingPairCacheOverlappingPairCache provides an interface for overlapping pair management (add, remove, storage), used by the BroadphaseInterface broadphases.Classcom.bulletphysics.collision.broadphaseJBullet
OverlappingPairCallbackOverlappingPairCallback class is an additional optional broadphase user callback for adding/removing overlapping pairs, similar interface to OverlappingPairCache.Classcom.bulletphysics.collision.broadphaseJBullet
PairCachingGhostObjectFields inherited from class com.Classcom.bulletphysics.collision.dispatchJBullet
PersistentManifoldPersistentManifold is a contact point cache, it stays persistent as long as objects are overlapping in the broadphase.Classcom.bulletphysics.collision.narrowphaseJBullet
Point2PointConstraintPoint to point constraint between two rigid bodies each with a pivot point that descibes the "ballsocket" location in local space.Classcom.bulletphysics.dynamics.constraintsolverJBullet
PointCollectorClasscom.bulletphysics.collision.narrowphaseJBullet
PolyhedralConvexShapePolyhedralConvexShape is an internal interface class for polyhedral convex shapes.Classcom.bulletphysics.collision.shapesJBullet
PrimitiveTriangleClasscom.bulletphysics.extras.gimpactJBullet
QuantizedBvhNodesQuantizedBvhNodes is array of compressed AABB nodes, each of 16 bytes.Classcom.bulletphysics.collision.shapesJBullet
QuaternionUtilUtility functions for quaternions.Classcom.bulletphysics.linearmathJBullet
RaycastVehicleRaycast vehicle, very special constraint that turn a rigidbody into a vehicle.Classcom.bulletphysics.dynamics.vehicleJBullet
RigidBodyRigidBody is the main class for rigid body objects.Classcom.bulletphysics.dynamicsJBullet
RigidBodyConstructionInfoRigidBodyConstructionInfo provides information to create a rigid body.Classcom.bulletphysics.dynamicsJBullet
RotationalLimitMotorRotation limit structure for generic joints.Classcom.bulletphysics.dynamics.constraintsolverJBullet
ScalarTypeenum ScalarTypeextends EnumScalar type, used when accessing triangle mesh data.Classcom.bulletphysics.collision.shapesJBullet
ScalarUtilUtility functions for scalars (floats).Classcom.bulletphysics.linearmathJBullet
ScaledBvhTriangleMeshShapeThe ScaledBvhTriangleMeshShape allows to instance a scaled version of an existing BvhTriangleMeshShape.Classcom.bulletphysics.collision.shapesJBullet
SequentialImpulseConstraintSolverSequentialImpulseConstraintSolver uses a Propagation Method and Sequentially applies impulses.Classcom.bulletphysics.dynamics.constraintsolverJBullet
ShapeHullShapeHull takes a ConvexShape, builds the convex hull using HullLibrary and provides triangle indices and vertices.Classcom.bulletphysics.collision.shapesJBullet
SimpleBroadphaseSimpleBroadphase is just a unit-test for AxisSweep3, AxisSweep3_32, or DbvtBroadphase, so use those classes instead.Classcom.bulletphysics.collision.broadphaseJBullet
SimpleDynamicsWorldSimpleDynamicsWorld serves as unit-test and to verify more complicated and optimized dynamics worlds.Classcom.bulletphysics.dynamicsJBullet
SimplexSolverInterfaceSimplexSolverInterface can incrementally calculate distance between origin and up to 4 vertices.Classcom.bulletphysics.collision.narrowphaseJBullet
SimulationIslandManagerSimulationIslandManager creates and handles simulation islands, using UnionFind.Classcom.bulletphysics.collision.dispatchJBullet
SliderConstraintClasscom.bulletphysics.dynamics.constraintsolverJBullet
SolverBodySolverBody is an internal data structure for the constraint solver.Classcom.bulletphysics.dynamics.constraintsolverJBullet
SolverConstraint1D constraint along a normal axis between bodyA and bodyB.Classcom.bulletphysics.dynamics.constraintsolverJBullet
SolverConstraintTypeenum SolverConstraintTypeextends EnumSolver constraint type.Classcom.bulletphysics.dynamics.constraintsolverJBullet
SolverModeClasscom.bulletphysics.dynamics.constraintsolverJBullet
SphereShapeSphereShape implements an implicit sphere, centered around a local origin with radius.Classcom.bulletphysics.collision.shapesJBullet
SphereSphereCollisionAlgorithmProvides collision detection between two spheres.Classcom.bulletphysics.collision.dispatchJBullet
StackListStack-based object pool, see the example for usage.Classcom.bulletphysics.utilJBullet
StaticPlaneShapeStaticPlaneShape simulates an infinite non-moving (static) collision plane.Classcom.bulletphysics.collision.shapesJBullet
StridingMeshInterfaceStridingMeshInterface is the abstract class for high performance access to triangle meshes.Classcom.bulletphysics.collision.shapesJBullet
SubsimplexConvexCastSubsimplexConvexCast implements Gino van den Bergens' paper "Ray Casting against bteral Convex Objects with Application to Continuous Collision Detection"Classcom.bulletphysics.collision.narrowphaseJBullet
TransformTransform represents translation and rotation (rigid transform).Classcom.bulletphysics.linearmathJBullet
TransformUtilUtility functions for transforms.Classcom.bulletphysics.linearmathJBullet
TranslationalLimitMotorClasscom.bulletphysics.dynamics.constraintsolverJBullet
TraversalModeenum TraversalModeextends EnumTraversal mode for OptimizedBvh.Classcom.bulletphysics.collision.shapesJBullet
TriangleCallbackTriangleCallback provides a callback for each overlapping triangle when calling processAllTriangles.Classcom.bulletphysics.collision.shapesJBullet
TriangleContactClasscom.bulletphysics.extras.gimpactJBullet
TriangleConvexcastCallbackClasscom.bulletphysics.collision.narrowphaseJBullet
TriangleIndexVertexArrayTriangleIndexVertexArray allows to use multiple meshes, by indexing into existing triangle/index arrays.Classcom.bulletphysics.collision.shapesJBullet
TriangleMeshShapeConcave triangle mesh abstract class.Classcom.bulletphysics.collision.shapesJBullet
TriangleRaycastCallbackClasscom.bulletphysics.collision.narrowphaseJBullet
TriangleShapeSingle triangle shape.Classcom.bulletphysics.collision.shapesJBullet
TriangleShapeExFields inherited from class com.Classcom.bulletphysics.extras.gimpactJBullet
TypedConstraintTypedConstraint is the base class for Bullet constraints and vehicles.Classcom.bulletphysics.dynamics.constraintsolverJBullet
TypedConstraintTypeenum TypedConstraintTypeextends EnumTyped constraint type.Classcom.bulletphysics.dynamics.constraintsolverJBullet
UniformScalingShapeUniformScalingShape allows to re-use uniform scaled instances of ConvexShape in a memory efficient way.Classcom.bulletphysics.collision.shapesJBullet
UnionFindUnionFind calculates connected subsets.Classcom.bulletphysics.collision.dispatchJBullet
VectorUtilUtility functions for vectors.Classcom.bulletphysics.linearmathJBullet
VehicleRaycasterVehicleRaycaster is provides interface for between vehicle simulation and raycasting.Classcom.bulletphysics.dynamics.vehicleJBullet
VehicleRaycasterResultVehicle raycaster result.Classcom.bulletphysics.dynamics.vehicleJBullet
VehicleTuningVehicle tuning parameters.Classcom.bulletphysics.dynamics.vehicleJBullet
VertexDataAllows accessing vertex data.Classcom.bulletphysics.collision.shapesJBullet
VoronoiSimplexSolverVoronoiSimplexSolver is an implementation of the closest point distance algorithm from a 1-4 points simplex to the origin.Classcom.bulletphysics.collision.narrowphaseJBullet
WheelInfoWheelInfo contains information per wheel about friction and suspension.Classcom.bulletphysics.dynamics.vehicleJBullet
WheelInfoConstructionInfoClasscom.bulletphysics.dynamics.vehicleJBullet