Jolt Physics
A multi core friendly Game Physics Engine
Loading...
Searching...
No Matches
Class Hierarchy
This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 12345]
 CAABBTreeBuilderHelper class to build an AABB tree
 CAABBTreeBuilderStats
 CAABBTreeToBuffer< TriangleCodec, NodeCodec >Conversion algorithm that converts an AABB tree to an optimized binary buffer
 CAABoxAxis aligned box
 CAABoxCastStructure that holds AABox moving linearly through 3d space
 CAddConvexRadius< ConvexObject >Structure that adds a convex radius
 CRagdollSettings::AdditionalConstraintA constraint that connects two bodies in a ragdoll (for non parent child related constraints)
 CQuadTree::AddStateTemporary data structure to pass information between AddBodiesPrepare and AddBodiesFinalize/Abort
 CAllocatorHasReallocate< T >Default implementation of AllocatorHasReallocate which tells if an allocator has a reallocate function
 CAllocatorHasReallocate< STLAllocator< T > >The STLAllocator implements the reallocate function if the alignment of the class is smaller or equal to the default alignment for the platform
 CAngleConstraintPart
 CSkeletalAnimation::AnimatedJointContains the animation for a single joint
 CAxisConstraintPart
 CRTTI::BaseClassBase class information
 CFixedSizeFreeList< Object >::BatchA batch of objects that can be destructed
 CBodyActivationListener
 CBodyCreationSettingsSettings for constructing a rigid body
 CBodyIDID of a body. This is a way of reasoning about bodies in a multithreaded simulation while avoiding race conditions
 CBodyPairStructure that holds a body pair
 CPhysicsUpdateContext::BodyPairQueue
 CBodyManager::BodyStatsHelper struct that counts the number of bodies of each type
 CBroadPhaseCastResultStructure that holds a ray cast or other object cast hit
 CBroadPhaseLayer
 CBVec16A vector consisting of 16 bytes
 CCalculateSolverStepsClass used to calculate the total number of velocity and position steps
 CCastConvexVsTrianglesCollision detection helper that casts a convex object vs one or more triangles
 CCompoundShape::CastRayVisitor
 CCompoundShape::CastRayVisitorCollector
 CCompoundShape::CastShapeVisitor
 CCastSphereVsTrianglesCollision detection helper that casts a sphere vs one or more triangles
 CPhysicsUpdateContext::Step::CCDBodyContains the information needed to cast a body through the scene to do continuous collision detection
 CSkeletonMapper::ChainA joint chain that starts with a 1-on-1 mapped joint and ends with a 1-on-1 mapped joint with intermediate joints that cannot be mapped
 CCharacterContactListenerThis class receives callbacks when a virtual character hits something
 CCharacterContactSettingsThis class contains settings that allow you to override the behavior of a character's collision response
 CConvexHullShape::CHSGetTrianglesContext
 CCollectorType
 CCompoundShape::CollectTransformedShapesVisitor
 CCompoundShape::CollideCompoundVsShapeVisitor
 CCollideConvexVsTrianglesCollision detection helper that collides a convex object vs one or more triangles
 CCollidePointResultStructure that holds the result of colliding a point against a shape
 CCompoundShape::CollidePointVisitor
 CCollideSettingsBaseSettings to be passed with a collision query
 CCollideShapeResultClass that contains all information of two colliding shapes
 CCompoundShape::CollideShapeVsCompoundVisitor
 CCollideSoftBodyVertexIterator
 CCollideSoftBodyVerticesVsTrianglesCollision detection helper that collides soft body vertices vs triangles
 CCollideSphereVsTrianglesCollision detection helper that collides a sphere vs one or more triangles
 CCollisionCollector< ResultTypeArg, TraitsType >Virtual interface that allows collecting multiple collision results
 CCollisionCollectorTraitsCastRayTraits to use for CastRay
 CCollisionCollectorTraitsCastShapeTraits to use for CastShape
 CCollisionCollectorTraitsCollideShapeTraits to use for CollideShape
 CCollisionDispatchDispatch function, main function to handle collisions between shapes
 CCollisionEstimationResultA structure that contains the estimated contact and friction impulses and the resulting body velocities
 CCollisionGroup
 CColorClass that holds an RGBA color with 8-bits per component
 CPhysicsScene::ConnectedConstraintA constraint and how it is connected to the bodies in the scene
 CHashTable< Key, KeyValue, HashTableDetail, Hash, KeyEqual >::const_iteratorConst iterator
 CCharacterVirtual::Contact
 CContactListener
 CContactManifoldManifold class, describes the contact surface between two bodies
 CContactSettings
 CConvexShape::CSGetTrianglesContext
 CDebugRendererPlaybackClass that can read a recorded stream from DebugRendererRecorder and plays it back trough a DebugRenderer
 CHeightFieldShape::DecodingContext
 CNodeCodecQuadTreeHalfFloat::DecodingContextThis class decodes and decompresses quad tree nodes
 CTriangleCodecIndexed8BitPackSOA4Flags::DecodingContextThis class is used to decode and decompress triangle data packed by the EncodingContext
 CSoftBodySharedSettings::DihedralBend
 CDMat44Holds a 4x4 matrix of floats with the last column consisting of doubles
 CDouble3Class that holds 3 doubles. Used as a storage class. Convert to DVec3 for calculations
 CBodyManager::DrawSettingsDraw settings
 CSkeletonPose::DrawSettingsDraw settings
 CDualAxisConstraintPart
 CDummyCalculateSolverStepsDummy class to replace the steps calculator when we don't need the result
 CDVec3
 CDynMatrixDynamic resizable matrix class
 CEPAConvexHullBuilder::EdgeClass that holds the information of an edge
 CSoftBodySharedSettings::EdgeAn edge keeps two vertices at a constant distance using a spring: |x1 - x2| = rest length
 CEllipse
 CNodeCodecQuadTreeHalfFloat::EncodingContextThis class encodes and compresses quad tree nodes
 CTriangleCodecIndexed8BitPackSOA4Flags::EncodingContextThis class is used to encode and compress triangle data into a byte buffer
 CEPAPenetrationDepth
 CCharacterVirtual::ExtendedUpdateSettingsSettings struct with settings for ExtendedUpdate
 CSoftBodySharedSettings::FaceA face defines the surface of the body
 CFactoryThis class is responsible for creating instances of classes based on their name or hash and is mainly used for deserialization of saved data
 CFloat2Class that holds 2 floats, used as a storage class mainly
 CFloat3Class that holds 3 floats. Used as a storage class. Convert to Vec3 for calculations
 CFloat4Class that holds 4 float values. Convert to Vec4 to perform calculations
 CFPExceptionDisableDivByZero
 CFPExceptionDisableInvalid
 CFPExceptionDisableOverflow
 CFPExceptionsEnableDummy implementations
 CDebugRendererRecorder::FrameAll information for a single frame
 CGearConstraintPart
 CDebugRendererRecorder::GeometryBlobHolds a single geometry draw call
 CCompoundShape::GetIntersectingSubShapesVisitor< BoxType >
 CShape::GetTrianglesContextAn opaque buffer that holds shape specific information during GetTrianglesStart/Next
 CGetTrianglesContextMultiVertexListImplementation of GetTrianglesStart/Next that uses a multiple fixed lists of vertices for the triangles. These are transformed into world space when getting the triangles
 CGetTrianglesContextVertexListImplementation of GetTrianglesStart/Next that uses a fixed list of vertices for the triangles. These are transformed into world space when getting the triangles
 CHash< T >Fallback hash function that calls T::GetHash()
 CHash< const char * >A hash function for character pointers
 CHash< double >A hash function for doubles
 CHash< float >A hash function for floats
 Cstd::hash< JPH::StaticArray< T, N > >Declare std::hash for StaticArray
 Cstd::hash< JPH::String >Declare std::hash for String, for some reason on Linux based platforms template deduction takes the wrong variant
 CHash< std::string_view >A hash function for std::string_view
 CHash< String >A hash function for String
 CHash< T * >A fallback function for generic pointers
 CHashTable< Key, KeyValue, HashTableDetail, Hash, KeyEqual >
 CHashTable< const RTTI *, const RTTI *, UnorderedSetDetail< const RTTI * >, JPH::Hash< const RTTI * >, std::equal_to< const RTTI * > >
 CHashTable< const void *, std::pair< const void *, ObjectInfo >, UnorderedMapDetail< const void *, ObjectInfo >, JPH::Hash< const void * >, std::equal_to< const void * > >
 CHashTable< float, std::pair< float, GeometryRef >, UnorderedMapDetail< float, GeometryRef >, JPH::Hash< float >, std::equal_to< float > >
 CHashTable< GeometryRef, std::pair< GeometryRef, uint32 >, UnorderedMapDetail< GeometryRef, uint32 >, JPH::Hash< GeometryRef >, std::equal_to< GeometryRef > >
 CHashTable< Identifier, std::pair< Identifier, ObjectInfo >, UnorderedMapDetail< Identifier, ObjectInfo >, JPH::Hash< Identifier >, std::equal_to< Identifier > >
 CHashTable< Key, Key, UnorderedSetDetail< Key >, JPH::Hash< Key >, std::equal_to< Key > >
 CHashTable< Key, std::pair< Key, Value >, UnorderedMapDetail< Key, Value >, JPH::Hash< Key >, std::equal_to< Key > >
 CHashTable< String, std::pair< String, ClassDescription >, UnorderedMapDetail< String, ClassDescription >, JPH::Hash< String >, std::equal_to< String > >
 CHashTable< String, std::pair< String, uint32 >, UnorderedMapDetail< String, uint32 >, JPH::Hash< String >, std::equal_to< String > >
 CHashTable< string_view, std::pair< string_view, const RTTI * >, UnorderedMapDetail< string_view, const RTTI * >, JPH::Hash< string_view >, std::equal_to< string_view > >
 CHashTable< SwingConeLimits, std::pair< SwingConeLimits, GeometryRef >, UnorderedMapDetail< SwingConeLimits, GeometryRef >, SwingConeLimitsHasher, std::equal_to< SwingConeLimits > >
 CHashTable< SwingPyramidLimits, std::pair< SwingPyramidLimits, GeometryRef >, UnorderedMapDetail< SwingPyramidLimits, GeometryRef >, SwingPyramidLimitsHasher, std::equal_to< SwingPyramidLimits > >
 CHashTable< TaperedCylinder, std::pair< TaperedCylinder, GeometryRef >, UnorderedMapDetail< TaperedCylinder, GeometryRef >, TaperedCylinderHasher, std::equal_to< TaperedCylinder > >
 CHashTable< uint32, std::pair< uint32, const RTTI * >, UnorderedMapDetail< uint32, const RTTI * >, JPH::Hash< uint32 >, std::equal_to< uint32 > >
 CHashTable< uint32, std::pair< uint32, Ref >, UnorderedMapDetail< uint32, Ref >, JPH::Hash< uint32 >, std::equal_to< uint32 > >
 CHashTable< uint32, std::pair< uint32, String >, UnorderedMapDetail< uint32, String >, JPH::Hash< uint32 >, std::equal_to< uint32 > >
 CNodeCodecQuadTreeHalfFloat::HeaderHeader for the tree
 CHingeRotationConstraintPart
 CHeightFieldShape::HSGetTrianglesContext
 CCollisionEstimationResult::Impulse
 CIndependentAxisConstraintPart
 CIndexedTriangleNoMaterialTriangle with 32-bit indices
 CSoftBodySharedSettings::InvBindAn inverse bind matrix take a skinned vertex from its bind pose into joint local space
 CHashTable< Key, KeyValue, HashTableDetail, Hash, KeyEqual >::iteratorNon-const iterator
 CLockFreeHashMap< Key, Value >::IteratorNon-const iterator
 CJobSystem::JobA class that contains information for a single unit of work
 CSkeleton::JointDeclare internal structure for a joint
 CSkeletalAnimation::JointStateContains the current state of a joint, a local space transformation relative to its parent joint
 CLockFreeHashMap< Key, Value >::KeyValueA key / value pair that is inserted in the map
 CLinearCurve
 CDebugRendererRecorder::LineBlobHolds a single line segment
 CSkeletonMapper::LockedJoints that should have their translation locked (fixed)
 CDebugRenderer::LODA single level of detail
 CSoftBodySharedSettings::LRA
 CSkeletonMapper::MappingA joint that maps 1-on-1 to a joint in the other skeleton
 CMassPropertiesDescribes the mass and inertia properties of a body. Used during body construction only
 CMat44Holds a 4x4 matrix of floats, but supports also operations on the 3x3 upper left part of the matrix
 CMatrix< Rows, Cols >Templatized matrix class
 CMatrix< 2, 2 >
 CMinkowskiDifference< ConvexObjectA, ConvexObjectB >Structure that performs a Minkowski difference A - B
 CMortonCode
 CMotionPropertiesThe Body class only keeps track of state for static bodies, the MotionProperties class keeps the additional state needed for a moving Body. It has a 1-on-1 relationship with the body
 CMotorSettings
 CMeshShape::MSGetTrianglesContext
 CAABBTreeBuilder::NodeA node in the tree, contains the AABox for the tree and any child nodes or triangles
 CNodeCodecQuadTreeHalfFloat::NodeNode structure
 CNodeCodecQuadTreeHalfFloat
 CNonCopyableClass that makes another class non-copyable. Usage: Inherit from NonCopyable
 CSoftBodySharedSettings::OptimizationResultsInformation about the optimization of the soft body, the indices of certain elements may have changed
 COrientedBoxOriented box
 CPhysicsLock
 CPhysicsSettings
 CPhysicsStepListenerA listener class that receives a callback before every physics simulation step
 CPhysicsStepListenerContextContext information for the step listener
 CPlaneAn infinite plane described by the formula X . Normal + Constant = 0
 CLinearCurve::PointA point on the curve
 CPathConstraintPathHermite::Point
 CPolyhedronSubmergedVolumeCalculator::PointA helper class that contains cached information about a polyhedron vertex
 CPointConstraintPart
 CPointConvexSupportClass that wraps a point so that it can be used with convex collision detection
 CPolygonConvexSupport< VERTEX_ARRAY >Class that wraps a polygon so that it can used with convex collision detection
 CPolyhedronSubmergedVolumeCalculator
 CPlaneShape::PSGetTrianglesContext
 CQuat
 CRackAndPinionConstraintPart
 CTriangleSplitter::RangeHelper struct to indicate triangle range before and after the split
 CRayCastSettingsSettings to be passed with a ray cast
 CRayCastT< Vec, Mat, RayCastType >Structure that holds a single ray cast
 CRayCastT< RVec3, RMat44, RRayCast >
 CRayCastT< Vec3, Mat44, RayCast >
 CRayInvDirectionHelper structure holding the reciprocal of a ray for Ray vs AABox testing
 CSTLAlignedAllocator< T, N >::rebind< T2 >Converting to allocator for other type
 CSTLAllocator< T >::rebind< T2 >Converting to allocator for other type
 CSTLTempAllocator< T >::rebind< T2 >Converting to allocator for other type
 CRef< T >
 CRef< Constraint >
 CRef< Geometry >
 CRef< Job >
 CRef< RefTargetVirtual >
 CRef< Shape >
 CRef< Skeleton >
 CRef< TwoBodyConstraint >
 CRef< TwoBodyConstraintSettings >
 CRef< VehicleControllerSettings >
 CRef< WheelSettings >
 CRefConst< T >
 CRefConst< Constraint >
 CRefConst< GroupFilter >
 CRefConst< PathConstraintPath >
 CRefConst< PhysicsMaterial >
 CRefConst< RagdollSettings >
 CRefConst< Shape >
 CRefConst< ShapeSettings >
 CRefConst< Skeleton >
 CRefConst< SoftBodySharedSettings >
 CRefConst< TwoBodyConstraintSettings >
 CRefConst< VehicleCollisionTester >
 CRefConst< WheelSettings >
 CRefTarget< T >
 CRefTarget< CharacterBase >
 CRefTarget< CharacterBaseSettings >
 CRefTarget< Constraint >
 CRefTarget< ConstraintSettings >
 CRefTarget< Geometry >
 CRefTarget< GroupFilter >
 CRefTarget< PathConstraintPath >
 CRefTarget< PhysicsMaterial >
 CRefTarget< PhysicsScene >
 CRefTarget< Ragdoll >
 CRefTarget< RagdollSettings >
 CRefTarget< Shape >
 CRefTarget< ShapeSettings >
 CRefTarget< SkeletalAnimation >
 CRefTarget< Skeleton >
 CRefTarget< SkeletonMapper >
 CRefTarget< SoftBodySharedSettings >
 CRefTarget< VehicleCollisionTester >
 CRefTarget< VehicleController >
 CRefTarget< VehicleControllerSettings >
 CRefTarget< WheelSettings >
 CRefTargetVirtualPure virtual version of RefTarget
 CResult< Type >Helper class that either contains a valid result or an error
 CResult< Ref< Shape > >
 CRotationEulerConstraintPart
 CRotationQuatConstraintPart
 CRTTI
 CSoftBodyShape::SBSGetTrianglesContext
 CSemaphore
 CSerializableAttributeAttributes are members of classes that need to be serialized
 CShapeCastT< Vec, Mat, ShapeCastType >Structure that holds a single shape cast (a shape moving along a linear path in 3d space with no rotation)
 CShapeCastT< RVec3, RMat44, RShapeCast >
 CShapeCastT< Vec3, Mat44, ShapeCast >
 CShapeFunctionsFunction table for functions on shapes
 CSimShapeFilterWrapperUnion
 CSkeletonPoseInstance of a skeleton, contains the pose the current skeleton is in
 CSoftBodySharedSettings::SkinnedA constraint that skins a vertex to joints and limits the distance that the simulated vertex can travel from this vertex
 CSoftBodySharedSettings::SkinWeightA joint and its skin weight
 CSoftBodyContactListener
 CSoftBodyContactSettings
 CSoftBodyCreationSettings
 CSoftBodyManifoldAn interface to query which vertices of a soft body are colliding with other bodies
 CSoftBodyVertex
 CSphere
 CLargeIslandSplitter::SplitDescribes a split of constraints and contacts
 CLargeIslandSplitter::SplitsStructure that describes the resulting splits from the large island splitter
 CSpringPartClass used in other constraint parts to calculate the required bias factor in the lagrange multiplier for creating springs
 CSpringSettingsSettings for a linear or angular spring
 CStateRecorderFilterUser callbacks that allow determining which parts of the simulation should be saved by a StateRecorder
 CStaticArray< T, N >Simple variable length array backed by a fixed size buffer
 CStaticArray< BodyPairQueue, cMaxConcurrency >
 CStaticArray< CollideShapeResult, cMaxDelayedResults >
 CStaticArray< Impulse, ContactPoints::Capacity >
 CStaticArray< JobHandle, cMaxConcurrency >
 CStaticArray< Part, 3 >
 CStaticArray< RTTI::BaseClass, 4 >
 CStaticArray< SerializableAttribute, 32 >
 CStaticArray< Vec3, 1026 >
 CStaticArray< Vec3, 32 >
 CStaticArray< Vec3, 384 >
 CStaticArray< Vec3, 64 >
 CStaticArray< Vec3, cMaxPointsInHull >
 CStaticArray< Voided, cMaxVoidedFeatures >
 CStaticArray< WorldContactPoint, MaxContactPoints >
 CShape::StatsClass that holds information about the shape that can be used for logging / data collection purposes
 CTriangleSplitter::Stats
 CPhysicsUpdateContext::StepStructure that contains data needed for each collision step
 CSTLAlignedAllocator< T, N >STL allocator that takes care that memory is aligned to N bytes
 CSTLAllocator< T >STL allocator that forwards to our allocation functions
 CSTLAllocator< AABBTreeBuilder::Node >
 CSTLAllocator< AdditionalConstraint >
 CSTLAllocator< AnimatedJoint >
 CSTLAllocator< AttributeDescription >
 CSTLAllocator< Bin >
 CSTLAllocator< Body * >
 CSTLAllocator< BodyCreationSettings >
 CSTLAllocator< BodyID >
 CSTLAllocator< BodyIdxPair >
 CSTLAllocator< Bounds >
 CSTLAllocator< BroadPhaseLayer >
 CSTLAllocator< Chain >
 CSTLAllocator< CharacterVirtual * >
 CSTLAllocator< ClosestKinematic >
 CSTLAllocator< CollidingSensor >
 CSTLAllocator< CollidingShape >
 CSTLAllocator< const char * >
 CSTLAllocator< const RTTI * >
 CSTLAllocator< const void * >
 CSTLAllocator< Contact >
 CSTLAllocator< Coplanar >
 CSTLAllocator< DebugRenderer::LOD >
 CSTLAllocator< DebugRendererRecorder::Frame >
 CSTLAllocator< DebugRendererRecorder::GeometryBlob >
 CSTLAllocator< DebugRendererRecorder::LineBlob >
 CSTLAllocator< DebugRendererRecorder::TextBlob >
 CSTLAllocator< DebugRendererRecorder::TriangleBlob >
 CSTLAllocator< Face * >
 CSTLAllocator< Face >
 CSTLAllocator< float >
 CSTLAllocator< Float3 >
 CSTLAllocator< IndexedTriangle >
 CSTLAllocator< int >
 CSTLAllocator< Joint >
 CSTLAllocator< JointState >
 CSTLAllocator< Keyframe >
 CSTLAllocator< LeafShape >
 CSTLAllocator< Link >
 CSTLAllocator< Locked >
 CSTLAllocator< Mapping >
 CSTLAllocator< Mat44 >
 CSTLAllocator< Node >
 CSTLAllocator< Part >
 CSTLAllocator< PhysicsScene::ConnectedConstraint >
 CSTLAllocator< PhysicsStepListener * >
 CSTLAllocator< Plane >
 CSTLAllocator< Point >
 CSTLAllocator< ProfileThread * >
 CSTLAllocator< Ref >
 CSTLAllocator< Ref< Constraint > >
 CSTLAllocator< Ref< TwoBodyConstraint > >
 CSTLAllocator< Ref< WheelSettings > >
 CSTLAllocator< RefConst< PhysicsMaterial > >
 CSTLAllocator< ResultType >
 CSTLAllocator< SkinState >
 CSTLAllocator< SoftBodyCreationSettings >
 CSTLAllocator< SoftBodySharedSettings::DihedralBend >
 CSTLAllocator< SoftBodySharedSettings::Edge >
 CSTLAllocator< SoftBodySharedSettings::Face >
 CSTLAllocator< SoftBodySharedSettings::InvBind >
 CSTLAllocator< SoftBodySharedSettings::LRA >
 CSTLAllocator< SoftBodySharedSettings::Skinned >
 CSTLAllocator< SoftBodySharedSettings::Vertex >
 CSTLAllocator< SoftBodySharedSettings::Volume >
 CSTLAllocator< SoftBodyVertex >
 CSTLAllocator< SubShape >
 CSTLAllocator< SubShapeSettings >
 CSTLAllocator< thread >
 CSTLAllocator< Triangle >
 CSTLAllocator< uint >
 CSTLAllocator< uint32 >
 CSTLAllocator< uint8 >
 CSTLAllocator< Unmapped >
 CSTLAllocator< UpdateGroup >
 CSTLAllocator< Vec3 >
 CSTLAllocator< VehicleAntiRollBar >
 CSTLAllocator< VehicleDifferentialSettings >
 CSTLAllocator< Wheel * >
 CSTLTempAllocator< T >STL allocator that wraps around TempAllocator
 CSTLTempAllocator< Step >
 CStaticArray< T, N >::Storage
 CStridedPtr< T >
 CStridedPtr< const float >
 CStridedPtr< const Vec3 >
 CStridedPtr< float >
 CStridedPtr< int >
 CStridedPtr< Plane >
 CCompoundShape::SubShape
 CSubShapeIDA sub shape id contains a path to an element (usually a triangle or other primitive type) of a compound shape
 CSubShapeIDCreator
 CSubShapeIDPairA pair of bodies and their sub shape ID's. Can be used as a key in a map to find a contact point
 CCompoundShapeSettings::SubShapeSettings
 CConvexShape::SupportFunction that provides an interface for GJK
 CConvexShape::SupportBufferBuffer to hold a Support object, used to avoid dynamic memory allocations
 CSwingTwistConstraintPart
 CTaperedCylinderShape::TCSGetTrianglesContext
 CDebugRendererRecorder::TextBlobHolds a single text entry
 CQuadTree::TrackingData to track location of a Body in the tree
 CTransformedConvexObject< ConvexObject >
 CTransformedShape
 CDebugRenderer::TriangleA single triangle
 CTriangleA simple triangle and its material
 CDebugRendererRecorder::TriangleBlobHolds a single triangle
 CTriangleCodecIndexed8BitPackSOA4Flags::TriangleBlockA block of 4 triangles
 CTriangleCodecIndexed8BitPackSOA4Flags::TriangleBlockHeaderA triangle header, will be followed by one or more TriangleBlocks
 CTriangleCodecIndexed8BitPackSOA4Flags
 CTriangleConvexSupportClass that wraps a triangle so that it can used with convex collision detection
 CTriangleCodecIndexed8BitPackSOA4Flags::TriangleHeader
 CTriangleShape::TSGetTrianglesContext
 CSkeletonMapper::UnmappedJoints that could not be mapped from skeleton 1 to 2
 CUnorderedMapDetail< Key, Value >Internal helper class to provide context for UnorderedMap
 CUnorderedSetDetail< Key >Internal helper class to provide context for UnorderedSet
 CBroadPhase::UpdateStateContext used during broadphase update
 CQuadTree::UpdateState
 CUVec4
 CTriangleCodecIndexed8BitPackSOA4Flags::ValidationContextThis class is used to validate that the triangle data will not be degenerate after compression
 CVec3
 CVec4
 CVector< Rows >Templatized vector class
 CVector< 2 >
 CVehicleAntiRollBar
 CVehicleDifferentialSettings
 CVehicleEngineSettingsGeneric properties for a vehicle engine
 CVehicleTrackSettingsGeneric properties for tank tracks
 CVehicleTransmissionSettingsConfiguration for the transmission of a vehicle (gear box)
 CDebugRenderer::VertexVertex format used by the triangle renderer
 CSoftBodySharedSettings::VertexA vertex is a particle, the data in this structure is only used during creation of the soft body and not during simulation
 CSoftBodySharedSettings::VertexAttributes
 CTriangleCodecIndexed8BitPackSOA4Flags::VertexDataA single packed vertex
 CSoftBodySharedSettings::VolumeVolume constraint, keeps the volume of a tetrahedron constant
 Cmutex
 Cshared_mutex