Cphysx::Gu::ContactBuffer | |
Cphysx::Gu::ContactPoint | |
Cphysx::Gu::NarrowPhaseParams | |
CPx1DConstraint | A constraint |
CPx1DConstraintFlag | Constraint row flags |
CPxActorFlag | Flags which control the behavior of an actor |
▶CPxActorShape | Collection of set bits defined in PxHitFlag |
▶CPxQueryHit | Scene query hit information |
▶CPxLocationHit | Scene query hit information for raycasts and sweeps returning hit position and normal information |
CPxRaycastHit | Stores results of raycast queries |
CPxSweepHit | Stores results of sweep queries |
CPxOverlapHit | Stores results of overlap queries |
CPxActorType | Identifies each type of actor |
CPxActorTypeFlag | Identifies each type of actor for retrieving actors from a scene |
▶CPxAllocatorCallback | Abstract base class for an application defined memory allocator that can be used by the Nv library |
CPxDefaultAllocator | Default implementation of the allocator interface required by the SDK |
CPxArticulationAxis | |
CPxArticulationCache | |
CPxArticulationDriveCache | Articulation drive cache |
CPxArticulationFlag | |
CPxArticulationJointDriveType | The type of joint drive to use for the articulation joint |
CPxArticulationJointType | |
CPxArticulationMotion | |
CPxArticulationRootLinkData | |
CPxAssertHandler | |
▶CPxBase | Base class for objects that can be members of a PxCollection |
▶CPxActor | PxActor is the base class for the main simulation objects in the physics SDK |
▶CPxRigidActor | PxRigidActor represents a base class shared between dynamic and static rigid bodies in the physics SDK |
▶CPxRigidBody | PxRigidBody is a base class shared between dynamic rigid body objects |
CPxArticulationLink | Component of an articulation that represents a rigid body |
CPxRigidDynamic | PxRigidDynamic represents a dynamic rigid simulation object in the physics SDK |
CPxRigidStatic | PxRigidStatic represents a static rigid body simulation object in the physics SDK |
CPxAggregate | Class to aggregate actors into a single broad-phase entry |
▶CPxArticulationBase | Tree structure of bodies connected by joints that is treated as a unit by the dynamics solver |
CPxArticulation | Tree structure of bodies connected by joints that is treated as a unit by the dynamics solver |
CPxArticulationReducedCoordinate | Tree structure of bodies connected by joints that is treated as a unit by the dynamics solver |
▶CPxArticulationJointBase | |
CPxArticulationJoint | Joint between two links in an articulation |
CPxArticulationJointReducedCoordinate | Joint between two links in an articulation |
CPxBVHStructure | Class representing the bounding volume hierarchy structure |
CPxConstraint | A plugin class for implementing constraints |
CPxConvexMesh | A convex mesh |
CPxHeightField | A height field class |
▶CPxJoint | Base interface providing common functionality for PhysX joints |
CPxContactJoint | Joint that maintains an upper or lower bound (or both) on the distance between two points on different objects |
CPxD6Joint | A D6 joint is a general constraint between two actors |
CPxDistanceJoint | Joint that maintains an upper or lower bound (or both) on the distance between two points on different objects |
CPxFixedJoint | A fixed joint permits no relative movement between two bodies. ie the bodies are glued together |
CPxPrismaticJoint | A prismatic joint permits relative translational movement between two bodies along an axis, but no relative rotational movement |
CPxRevoluteJoint | A joint which behaves in a similar way to a hinge or axle |
CPxSphericalJoint | A joint which behaves in a similar way to a ball and socket |
CPxMaterial | Material class to represent a set of surface properties |
CPxPruningStructure | A precomputed pruning structure to accelerate scene queries against newly added actors |
CPxShape | Abstract class for collision shapes |
▶CPxTriangleMesh | A triangle mesh, also called a 'polygon soup' |
CPxBVH33TriangleMesh | A triangle mesh containing the PxMeshMidPhase::eBVH33 structure |
CPxBVH34TriangleMesh | A triangle mesh containing the PxMeshMidPhase::eBVH34 structure |
▶CPxVehicleWheels | Data structure with instanced dynamics data and configuration data of a vehicle with just wheels |
▶CPxVehicleDrive | A complete vehicle with instance dynamics data and configuration data for wheels and engine,clutch,gears,autobox |
CPxVehicleDrive4W | Data structure with instanced dynamics data and configuration data of a vehicle with up to 4 driven wheels and up to 16 non-driven wheels |
CPxVehicleDriveNW | Data structure with instanced dynamics data and configuration data of a vehicle with up to PX_MAX_NB_WHEELS driven wheels |
CPxVehicleDriveTank | Data structure with instanced dynamics data and configuration data of a tank |
CPxVehicleNoDrive | Data structure with instanced dynamics data and configuration data of a vehicle with no drive model |
CPxBaseFlag | Flags for PxBase |
▶Cphysx::PxBaseTask | Base class of all task types |
Cphysx::PxLightCpuTask | A PxBaseTask implementation with immediate execution and simple dependencies |
▶Cphysx::PxTask | A PxBaseTask implementation with deferred execution and full dependencies |
Cphysx::PxGpuTask | PxTask implementation for launching CUDA work |
CPxBatchQuery | Batched queries object. This is used to perform several queries at the same time |
CPxBatchQueryDesc | Descriptor class for PxBatchQuery |
CPxBatchQueryMemory | Struct for PxBatchQuery memory pointers |
CPxBatchQueryResult< HitType > | Generic struct for receiving results of single query in a batch. Gets templated on hit type PxRaycastHit, PxSweepHit or PxOverlapHit |
CPxBatchQueryStatus | Batched query status |
CPxBinaryConverter | Binary converter for serialized streams |
CPxBitAndDataT< storageType, bitMask > | |
CPxBitAndDataT< unsigned char, 0x80 > | |
CPxBounds3 | Class representing 3D range or axis aligned bounding box |
CPxBroadPhaseCallback | Broad-phase callback to receive broad-phase related events |
CPxBroadPhaseCaps | Caps class for broad phase |
CPxBroadPhaseExt | |
CPxBroadPhaseRegion | "Region of interest" for the broad-phase |
CPxBroadPhaseRegionInfo | Information & stats structure for a region |
CPxBroadPhaseType | Broad phase algorithm used in the simulation |
CPxBVH33MidphaseDesc | Structure describing parameters affecting BVH33 midphase mesh structure |
CPxBVH34MidphaseDesc | Structure describing parameters affecting BVH34 midphase mesh structure |
CPxBVHStructureDesc | Descriptor class for PxBVHStructure |
CPxCache | A structure to cache contact information produced by LL contact gen functions |
CPxCacheAllocator | |
CPxCapsuleClimbingMode | |
CPxCCDContactModifyCallback | An interface class that the user can implement in order to modify CCD contact constraints |
CPxCollection | Collection class for serialization |
CPxCollectionExt | |
CPxCombineMode | Enumeration that determines the way in which two material properties will be combined to yield a friction or restitution coefficient for a collision |
CPxConcreteType | Enumeration of concrete classes inheriting from PxBase |
CPxConstraintAllocator | |
CPxConstraintBatchHeader | |
CPxConstraintConnector | This class connects a custom constraint to the SDK |
CPxConstraintExtIDs | Unique identifiers for extensions classes which implement a constraint based on PxConstraint |
CPxConstraintFlag | Table of function pointers for a constraint |
CPxConstraintInfo | Descriptor for a broken constraint |
CPxConstraintInvMassScale | |
CPxConstraintShaderTable | |
CPxConstraintSolveHint | Constraint type hints which the solver uses to optimize constraint handling |
CPxConstraintVisualizationFlag | Flags for determining which components of the constraint should be visualized |
CPxConstraintVisualizer | |
▶CPxContact | Contact point data including face (feature) indices |
▶CPxExtendedContact | |
CPxModifiableContact | A modifiable contact point. This has additional fields per-contact to permit modification by user |
CPxContactModifyCallback | An interface class that the user can implement in order to modify contact constraints |
CPxContactModifyPair | An array of instances of this class is passed to PxContactModifyCallback::onContactModify() |
CPxContactPair | Contact report pair information |
▶CPxContactPairExtraDataItem | Base class for items in the extra data stream of contact pairs |
CPxContactPairIndex | Marker for the beginning of a new item set in the extra data stream |
CPxContactPairPose | World space actor poses of the contact pair rigid bodies |
CPxContactPairVelocity | Velocities of the contact pair rigid bodies |
CPxContactPairExtraDataIterator | A class to iterate over a contact pair extra data stream |
CPxContactPairExtraDataType | Extra data item types for contact pairs |
CPxContactPairFlag | Collection of flags providing information on contact report pairs |
CPxContactPairHeader | An Instance of this class is passed to PxSimulationEventCallback.onContact() |
CPxContactPairHeaderFlag | Collection of flags providing information on contact report pairs |
CPxContactPairPoint | A contact point as used by contact notification |
CPxContactPatch | Header for contact patch where all points share same material and normal |
CPxContactRecorder | Callback class to record contact points produced by immediate::PxGenerateContacts |
CPxContactSet | An array of contact points, as passed to contact modification |
CPxContactStreamIterator | A class to iterate over a compressed contact stream. This supports read-only access to the various contact formats |
▶CPxController | Base class for character controllers |
CPxBoxController | Box character controller |
CPxCapsuleController | A capsule character controller |
CPxControllerBehaviorCallback | User behavior callback |
CPxControllerBehaviorFlag | Controller behavior |
CPxControllerCollisionFlag | Which sides a character is colliding with |
CPxControllerDebugRenderFlag | Debug-rendering flags |
▶CPxControllerDesc | Descriptor class for a character controller |
CPxBoxControllerDesc | Descriptor for a box character controller |
CPxCapsuleControllerDesc | A descriptor for a capsule character controller |
CPxControllerFilterCallback | Dedicated filtering callback for CCT vs CCT |
CPxControllerFilters | Filtering data for "move" call |
▶CPxControllerHit | Describes a generic CCT hit |
CPxControllerObstacleHit | Describes a hit between a CCT and a user-defined obstacle. Passed to onObstacleHit() |
CPxControllerShapeHit | Describes a hit between a CCT and a shape. Passed to onShapeHit() |
CPxControllersHit | Describes a hit between a CCT and another CCT. Passed to onControllerHit() |
CPxControllerManager | Manages an array of character controllers |
CPxControllerNonWalkableMode | How a CCT interacts with non-walkable parts |
CPxControllerShapeType | The type of controller, eg box, sphere or capsule |
CPxControllerState | Describes a controller's internal state |
CPxControllerStats | Describes a controller's internal statistics |
CPxConverterReportMode | |
CPxConvexFlag | Flags which describe the format and behavior of a convex mesh |
CPxConvexMeshCookingResult | Result from convex cooking |
CPxConvexMeshCookingType | Enumeration for convex mesh cooking algorithms |
CPxConvexMeshDesc | Descriptor class for PxConvexMesh |
CPxConvexMeshGeometryFlag | Flags controlling the simulated behavior of the convex mesh geometry |
CPxCooking | |
CPxCookingParams | Structure describing parameters affecting mesh cooking |
Cphysx::PxCpuDispatcher | A CpuDispatcher is responsible for scheduling the execution of tasks passed to it by the SDK |
▶CPxCpuDispatcher | |
CPxDefaultCpuDispatcher | A default implementation for a CPU task dispatcher |
CPxD6Axis | Used to specify one of the degrees of freedom of a D6 joint |
CPxD6Drive | Used to specify which axes of a D6 joint are driven |
CPxD6JointDriveFlag | Flags for configuring the drive model of a PxD6Joint |
CPxD6Motion | Used to specify the range of motions allowed for a degree of freedom in a D6 joint |
CPxDataAccessFlag | |
CPxDebugColor | Default color values used for debug rendering |
CPxDebugLine | Used to store a single line and colour for debug rendering |
CPxDebugPoint | Used to store a single point and colour for debug rendering |
CPxDebugText | Used to store a text for debug rendering. Doesn't own 'string' array |
CPxDebugTriangle | Used to store a single triangle and colour for debug rendering |
CPxDelayLoadHook | PxDelayLoadHook |
CPxDeletionEventFlag | Flags specifying deletion event types |
CPxDeletionListener | Interface to get notification on object deletion |
CPxDeserializationContext | Binary deserialization context class |
CPxDistanceJointFlag | Flags for configuring the drive of a PxDistanceJoint |
CPxDominanceGroupPair | Expresses the dominance relationship of a contact. For the time being only three settings are permitted: |
▶CPxErrorCallback | User defined interface class. Used by the library to emit debug information |
CPxDefaultErrorCallback | Default implementation of the error callback |
CPxErrorCode | Error codes |
CPxExtendedVec3 | |
CPxFileBuf | Callback class for data serialization |
CPxFilterData | PxFilterData is user-definable data which gets passed into the collision filtering shader and/or callback |
CPxFilterFlag | Collection of flags describing the filter actions to take for a collision pair |
CPxFilterObjectFlag | |
CPxFilterObjectType | Identifies each type of filter object |
CPxFilterOp | Collision filtering operations |
CPxFixedSizeLookupTable< NB_ELEMENTS > | |
CPxFixedSizeLookupTable< eMAX_NB_ENGINE_TORQUE_CURVE_ENTRIES > | |
CPxFlags< enumtype, storagetype > | Container for bitfield flag variables associated with a specific enum type |
CPxFlags< PxBaseFlag::Enum, PxU16 > | |
CPxFlags< PxContactPairFlag::Enum, PxU16 > | |
CPxFlags< PxContactPairHeaderFlag::Enum, PxU16 > | |
CPxFlags< PxConvexFlag::Enum, PxU16 > | |
CPxFlags< PxConvexMeshGeometryFlag::Enum, PxU8 > | |
CPxFlags< PxD6JointDriveFlag::Enum, PxU32 > | |
CPxFlags< PxHeightFieldFlag::Enum, PxU16 > | |
CPxFlags< PxMeshFlag::Enum, PxU16 > | |
CPxFlags< PxMeshGeometryFlag::Enum, PxU8 > | |
CPxFlags< PxMeshPreprocessingFlag::Enum, PxU32 > | |
CPxFlags< PxPairFlag::Enum, PxU16 > | |
CPxFlags< PxQueryFlag::Enum, PxU16 > | |
CPxFlags< PxSceneFlag::Enum, PxU32 > | |
CPxFlags< PxTriggerPairFlag::Enum, PxU8 > | |
CPxForceMode | Parameter to addForce() and addTorque() calls, determines the exact operation that is carried out |
CPxFoundation | Foundation SDK singleton class |
CPxFrictionType | Enum for selecting the friction algorithm used for simulation |
CPxgDynamicsMemoryConfig | Sizes of pre-allocated buffers use for GPU dynamics |
▶CPxGeometry | A geometry object |
CPxBoxGeometry | Class representing the geometry of a box |
CPxCapsuleGeometry | Class representing the geometry of a capsule |
CPxConvexMeshGeometry | Convex mesh geometry class |
CPxHeightFieldGeometry | Height field geometry class |
CPxPlaneGeometry | Class describing a plane geometry |
CPxSphereGeometry | A class representing the geometry of a sphere |
CPxTriangleMeshGeometry | Triangle mesh geometry class |
CPxGeometryHolder | Geometry holder class |
CPxGeometryQuery | Collection of geometry object queries (sweeps, raycasts, overlaps, ...) |
CPxGeometryType | A geometry type |
Cphysx::PxGpuDispatcher | A GpuTask dispatcher |
Cphysx::PxGpuTaskHint | Define the 'flavor' of a PxGpuTask |
CPxGroupsMask | 64-bit mask used for collision filtering |
CPxHeightFieldDesc | Descriptor class for PxHeightField |
CPxHeightFieldFlag | Enum with flag values to be used in PxHeightFieldDesc.flags |
CPxHeightFieldFormat | Describes the format of height field samples |
CPxHeightFieldMaterial | Special material index values for height field samples |
CPxHeightFieldSample | Heightfield sample format |
CPxHeightFieldTessFlag | Determines the tessellation of height field cells |
▶CPxHitCallback< HitType > | This callback class facilitates reporting scene query hits (intersections) to the user |
CPxHitBuffer< HitType > | Returns scene query hits (intersections) to the user in a preallocated buffer |
▶CPxHitCallback< PxOverlapHit > | |
▶CPxHitBuffer< PxOverlapHit > | |
CPxOverlapBufferN< N > | Returns touching overlap hits to the user in a fixed size array embedded in the buffer class |
▶CPxHitCallback< PxRaycastHit > | |
▶CPxHitBuffer< PxRaycastHit > | |
CPxRaycastBufferN< N > | Returns touching raycast hits to the user in a fixed size array embedded in the buffer class |
▶CPxHitCallback< PxSweepHit > | |
▶CPxHitBuffer< PxSweepHit > | |
CPxSweepBufferN< N > | Returns touching sweep hits to the user in a fixed size array embedded in the buffer class |
CPxHitFlag | Scene query and geometry query behavior flags |
CPxHullPolygon | Polygon data |
▶CPxInputStream | Input stream class for I/O |
▶CPxInputData | Input data class for I/O which provides random read access |
CPxDefaultFileInputData | Default implementation of a file read stream |
CPxDefaultMemoryInputData | Default implementation of a memory read stream |
CPxJacobianRow | Joint that maintains an upper or lower bound (or both) on the distance between two points on different objects |
CPxJointActorIndex | Enumeration for specifying one or other of the actors referenced by a joint |
CPxJointConcreteType | Enumeration of PhysX' built-in joint types |
▶CPxJointLimitParameters | Describes the parameters for a joint limit |
CPxJointAngularLimitPair | |
CPxJointLimitCone | Describes an elliptical conical joint limit. Note that very small or highly elliptical limit cones may result in jitter |
CPxJointLimitPyramid | Describes a pyramidal joint limit |
CPxJointLinearLimit | Describes a one-sided linear limit |
CPxJointLinearLimitPair | Describes a two-sided limit |
CPxKinematicJacobian | |
CPxLockedData | Parent class for bulk data that is shared between the SDK and the application |
CPxMassModificationProps | |
CPxMassProperties | Utility class to compute and manipulate mass and inertia tensor properties |
CPxMat33 | 3x3 matrix class |
CPxMat44 | 4x4 matrix class |
CPxMaterialFlag | Flags which control the behavior of a material |
CPxMeshCookingHint | Enumeration for mesh cooking hints |
CPxMeshFlag | Enum with flag values to be used in PxSimpleTriangleMesh::flags |
CPxMeshGeometryFlag | Flags controlling the simulated behavior of the triangle mesh geometry |
CPxMeshMidPhase | Mesh midphase structure. This enum is used to select the desired acceleration structure for midphase queries (i.e. raycasts, overlaps, sweeps vs triangle meshes) |
CPxMeshOverlapUtil | Utility class to find mesh triangles touched by a specified geometry object |
CPxMeshPreprocessingFlag | Enum for the set of mesh pre-processing parameters |
CPxMeshQuery | |
CPxMeshScale | A class expressing a nonuniform scaling transformation |
CPxMetaDataEntry | Struct to store meta data definitions |
CPxMetaDataFlag | Flags used to configure binary meta data entries, typically set through PX_DEF_BIN_METADATA defines |
CPxMidphaseDesc | Structure describing parameters affecting midphase mesh structure |
▶CPxObstacle | Base class for obstacles |
CPxBoxObstacle | A box obstacle |
CPxCapsuleObstacle | A capsule obstacle |
CPxObstacleContext | Context class for obstacles |
▶CPxOutputStream | Output stream class for I/O |
CPxDefaultFileOutputStream | Default implementation of a file write stream |
CPxDefaultMemoryOutputStream | Default implementation of a memory write stream |
CPxPackValidation | |
CPxPadding< TNumBytes > | |
CPxPadding< 3 > | |
CPxPairFilteringMode | |
CPxPairFlag | Collection of flags describing the actions to take for a collision pair |
CPxPhysics | Abstract singleton factory class used for instancing objects in the Physics SDK |
CPxPhysicsInsertionCallback | Callback interface that permits PxCooking to insert a TriangleMesh, HeightfieldMesh or ConvexMesh directly into PxPhysics without the need to store the cooking results into a stream |
CPxPlane | Representation of a plane |
CPxPrismaticJointFlag | Flags specific to the prismatic joint |
CPxProcessPxBaseCallback | Callback class used to process PxBase objects |
▶Cphysx::PxProfilerCallback | The pure virtual callback interface for general purpose instrumentation and profiling of GameWorks modules as well as applications |
CPxPvd | PxPvd is the top-level class for the PVD framework, and the main customer interface for PVD configuration.It is a singleton class, instantiated and owned by the application |
Cphysx::PxProfileScoped | |
CPxPruningStructureType | Pruning structure used to accelerate scene queries |
CPxPvdInstrumentationFlag | Types of instrumentation that PVD can do |
CPxPvdSceneClient | Special client for PxScene. It provides access to the PxPvdSceneFlag. It also provides simple user debug services that associated scene position such as immediate rendering and camera updates |
CPxPvdSceneFlag | PVD scene Flags. They are disabled by default, and only works if PxPvdInstrumentationFlag::eDEBUG is set |
CPxPvdTransport | PxPvdTransport is an interface representing the data transport mechanism. This class defines all services associated with the transport: configuration, connection, reading, writing etc. It is owned by the application, and can be realized as a file or a socket (using one-line PxDefault<...> methods in PhysXExtensions) or in a custom implementation. This is a class that is intended for use by PVD, not by the application, the application entry points are PxPvd and PvdClient |
CPxPvdUpdateType | |
CPxQuat | This is a quaternion class. For more information on quaternion mathematics consult a mathematics source on complex numbers |
CPxQueryCache | Single hit cache for scene queries |
CPxQueryFilterCallback | Scene query filtering callbacks |
CPxQueryFilterData | Scene query filtering data |
CPxQueryFlag | Filtering flags for scene queries |
CPxQueryHitType | Classification of scene query hits (intersections) |
CPxRenderBuffer | Interface for points, lines, triangles, and text buffer |
CPxRepXInstantiationArgs | Arguments required to instantiate a serializable object from RepX |
CPxRepXObject | Helper class containing the mapping of id to object, and type name |
CPxRepXSerializer | Serializer interface for RepX (Xml) serialization |
CPxRevoluteJointFlag | Flags specific to the Revolute Joint |
CPxRigidActorExt | Utility functions for use with PxRigidActor and subclasses |
CPxRigidBodyData | Structure to store rigid body properties |
CPxRigidBodyExt | Utility functions for use with PxRigidBody and subclasses |
CPxRigidBodyFlag | Collection of flags describing the behavior of a rigid body |
CPxRigidDynamicLockFlag | Collection of flags providing a mechanism to lock motion along/around a specific axis |
CPxScene | A scene is a collection of bodies and constraints which can interact |
CPxSceneDesc | Descriptor class for scenes. See PxScene |
CPxSceneFlag | Flags for configuring properties of the scene |
CPxSceneLimits | Class used to retrieve limits(e.g. maximum number of bodies) for a scene. The limits are used as a hint to the size of the scene, not as a hard limit (i.e. it will be possible to create more objects than specified in the scene limits) |
CPxSceneQueryExt | Utility functions for use with PxScene, related to scene queries |
CPxSceneQueryUpdateMode | Scene query update mode |
CPxSceneReadLock | RAII wrapper for the PxScene read lock |
CPxSceneWriteLock | RAII wrapper for the PxScene write lock |
CPxSerialization | Utility functions for serialization |
CPxSerializationContext | Binary serialization context class |
CPxSerializationRegistry | Class serving as a registry for XML (RepX) and binary serializable types |
▶CPxSerializer | Serialization interface class |
CPxSerializerDefaultAdapter< T > | Default PxSerializer implementation |
CPxShapeExt | Utility functions for use with PxShape |
CPxShapeFlag | Flags which affect the behavior of PxShapes |
▶CPxSimpleTriangleMesh | A structure describing a triangle mesh |
CPxTriangleMeshDesc | Descriptor class for PxTriangleMesh |
CPxSimulationEventCallback | An interface class that the user can implement in order to receive simulation events |
CPxSimulationFilterCallback | Filter callback to specify handling of collision pairs |
CPxSimulationStatistics | Class used to retrieve statistics for a simulation step |
CPxSolverBody | |
CPxSolverBodyData | |
CPxSolverConstraintDesc | |
▶CPxSolverConstraintPrepDescBase | |
CPxSolverConstraintPrepDesc | |
CPxSolverContactDesc | |
CPxSolverType | Enum for selecting the type of solver used for the simulation |
CPxSphericalJointFlag | Flags specific to the spherical joint |
▶CPxSpring | |
CPxD6JointDrive | Parameters for configuring the drive model of a PxD6Joint |
▶CPxStridedData | |
CPxBoundedData | |
CPxStrideIterator< T > | Iterator class for iterating over arrays of data that may be interleaved with other data |
CPxStringTable | Table to manage strings. Strings allocated through this object are expected to be owned by this object |
CPxStringTableExt | Factory class for creating PxStringTable with a specific allocator |
Cphysx::PxTaskManager | The PxTaskManager interface |
Cphysx::PxTaskType | Identifies the type of each heavyweight PxTask object |
CPxTolerancesScale | Class to define the scale at which simulation runs. Most simulation tolerances are calculated in terms of the values here |
CPxTransform | Class representing a rigid euclidean transform as a quaternion and a vector |
CPxTriangle | Triangle class |
CPxTriangleMeshCookingResult | Result from triangle mesh cooking |
CPxTriangleMeshFlag | Flags for the mesh geometry properties |
CPxTriggerPair | Descriptor for a trigger pair |
CPxTriggerPairFlag | Collection of flags providing information on trigger report pairs |
CPxTypedStridedData< TDataType > | |
CPxTypedStridedData< PxMaterialTableIndex > | |
CPxTypeInfo< T > | Structure containing per-type information for types inheriting from PxBase |
CPxUserControllerHitReport | User callback class for character controller events |
CPxVec2 | 2 Element vector class |
CPxVec3 | 3 Element vector class |
CPxVec4 | 4 Element vector class |
CPxVehicleAckermannGeometryData | |
CPxVehicleAntiRollBarData | |
CPxVehicleAutoBoxData | |
CPxVehicleChassisData | |
CPxVehicleClutchAccuracyMode | Choose between a potentially more expensive but more accurate solution to the clutch model or a potentially cheaper but less accurate solution |
CPxVehicleClutchData | |
CPxVehicleConcreteType | An enumeration of concrete vehicle classes inheriting from PxBase |
CPxVehicleConcurrentUpdateData | Structure containing data that is computed for a vehicle and its wheels during concurrent calls to PxVehicleUpdates but which cannot be safely concurrently applied |
CPxVehicleCopyDynamicsMap | Used by PxVehicleCopyDynamicsData |
CPxVehicleDifferential4WData | |
CPxVehicleDifferentialNWData | |
CPxVehicleDrivableSurfaceToTireFrictionPairs | Friction for each combination of driving surface type and tire type |
CPxVehicleDrivableSurfaceType | Driving surface type. Each PxMaterial is associated with a corresponding PxVehicleDrivableSurfaceType |
CPxVehicleDrive4WControl | The control inputs for a PxVehicleDrive4W |
▶CPxVehicleDrive4WRawInputData | Used to produce smooth vehicle driving control values from analog and digital inputs |
CPxVehicleDriveNWRawInputData | Used to produce smooth vehicle driving control values from analog and digital inputs |
CPxVehicleDrive4WWheelOrder | The ordering of the driven and steered wheels of a PxVehicleDrive4W |
CPxVehicleDriveDynData | Data structure with instanced dynamics data for vehicle with engine, clutch, gears, autobox |
CPxVehicleDriveNWControl | The control inputs for a PxVehicleDriveNW |
▶CPxVehicleDriveSimData | Data structure describing non-wheel configuration data of a vehicle that has engine, gears, clutch, and auto-box |
CPxVehicleDriveSimData4W | Data structure describing the drive model components of a vehicle with up to 4 driven wheels and up to 16 un-driven wheels. The drive model incorporates engine, clutch, gears, autobox, differential, and Ackermann steer correction |
CPxVehicleDriveSimDataNW | Data structure describing configuration data of a vehicle with up to PX_MAX_NB_WHEELS driven equally through the differential. The vehicle has an engine, clutch, gears, autobox, differential |
CPxVehicleDriveTankControl | The control inputs for a PxVehicleDriveTank |
CPxVehicleDriveTankControlModel | Two driving models are supported |
CPxVehicleDriveTankRawInputData | Used to produce smooth analog tank control values from analog and digital inputs |
CPxVehicleDriveTankWheelOrder | The ordering of the wheels of a PxVehicleDriveTank |
CPxVehicleEngineData | |
CPxVehicleGearsData | |
CPxVehicleKeySmoothingData | Used to produce smooth vehicle driving control values from key inputs |
CPxVehiclePadSmoothingData | Used to produce smooth analog vehicle control values from analog inputs |
CPxVehicleSuspensionData | |
CPxVehicleTireData | |
CPxVehicleTireLoadFilterData | Tire load variation can be strongly dependent on the time-step so it is a good idea to filter it to give less jerky handling behavior |
CPxVehicleTypes | |
CPxVehicleUpdateMode | |
CPxVehicleWheelConcurrentUpdateData | Structure containing data that is computed for a wheel during concurrent calls to PxVehicleUpdates but which cannot be safely concurrently applied |
CPxVehicleWheelData | |
CPxVehicleWheelQueryResult | |
CPxVehicleWheelsDynData | Data structure with instanced dynamics data for wheels |
CPxVehicleWheelsSimData | Data structure describing configuration data of a vehicle with up to 20 wheels |
CPxVisualizationParameter | Debug visualization parameters |
CPxWheelQueryResult | Structure containing data describing the non-persistent state of each suspension/wheel/tire unit. This structure is filled out in PxVehicleUpdates and PxVehicleUpdateSingleVehicleAndStoreTelemetryData |
CPxSerialization::PxXmlMiscParameter | Additional PxScene and PxPhysics options stored in XML serialized data |
CRaycastCCDManager | Raycast-CCD manager |