Creactphysics3d::AABB | This class represents a bounding volume of type "Axis Aligned
Bounding Box" |
Creactphysics3d::Array< T > | This class represents a simple dynamic array with custom memory allocator |
Creactphysics3d::Array< decimal > | |
Creactphysics3d::Array< int > | |
Creactphysics3d::Array< int32 > | |
Creactphysics3d::Array< reactphysics3d::Body * > | |
Creactphysics3d::Array< reactphysics3d::Collider * > | |
Creactphysics3d::Array< reactphysics3d::ContactManifold > | |
Creactphysics3d::Array< reactphysics3d::ContactManifoldInfo > | |
Creactphysics3d::Array< reactphysics3d::ContactPair > | |
Creactphysics3d::Array< reactphysics3d::ContactPoint > | |
Creactphysics3d::Array< reactphysics3d::ContactPointInfo > | |
Creactphysics3d::Array< reactphysics3d::DebugRenderer::DebugLine > | |
Creactphysics3d::Array< reactphysics3d::DebugRenderer::DebugTriangle > | |
Creactphysics3d::Array< reactphysics3d::DefaultLogger::Destination * > | |
Creactphysics3d::Array< reactphysics3d::Entity > | |
Creactphysics3d::Array< reactphysics3d::HalfEdgeStructure::Edge > | |
Creactphysics3d::Array< reactphysics3d::HalfEdgeStructure::Face > | |
Creactphysics3d::Array< reactphysics3d::HalfEdgeStructure::Vertex > | |
Creactphysics3d::Array< reactphysics3d::NarrowPhaseInfoBatch::NarrowPhaseInfo > | |
Creactphysics3d::Array< reactphysics3d::OverlappingPairs::ConcaveOverlappingPair > | |
Creactphysics3d::Array< reactphysics3d::OverlappingPairs::ConvexOverlappingPair > | |
Creactphysics3d::Array< reactphysics3d::Pair< int32, int32 > > | |
Creactphysics3d::Array< reactphysics3d::RigidBody * > | |
Creactphysics3d::Array< reactphysics3d::Vector3 > | |
Creactphysics3d::Array< uint > | |
Creactphysics3d::Array< uint32 > | |
Creactphysics3d::Array< uint64 > | |
Creactphysics3d::Array< uint8 > | |
Creactphysics3d::BallAndSocketJointComponents::BallAndSocketJointComponent | Structure for the data of a transform component |
►Creactphysics3d::Body | This class represents a body |
Creactphysics3d::RigidBody | This class represents a rigid body of the physics engine |
Creactphysics3d::BodyComponents::BodyComponent | Structure for the data of a collision body component |
Creactphysics3d::BroadPhaseSystem | This class represents the broad-phase collision detection |
Creactphysics3d::CollisionCallback::CallbackData | This class contains data about contacts between bodies |
Creactphysics3d::OverlapCallback::CallbackData | This class contains data about overlap between bodies |
Creactphysics3d::Collider | A collider has a collision shape (box, sphere, capsule, ...) and is attached to a RigidBody |
Creactphysics3d::ColliderComponents::ColliderComponent | Structure for the data of a collider component |
►Creactphysics3d::CollisionCallback | This abstract class can be used to register a callback for collision test queries |
►Creactphysics3d::EventListener | This class can be used to receive notifications about events that occur during the simulation |
Creactphysics3d::DebugRenderer | This class is used to display physics debug information directly into the user application view |
Creactphysics3d::CollisionDetectionSystem | This class computes the collision detection algorithms |
Creactphysics3d::CollisionDispatch | This is the collision dispatch configuration use in ReactPhysics3D |
►Creactphysics3d::CollisionShape | This abstract class represents the collision shape associated with a body that is used during the narrow-phase collision detection |
►Creactphysics3d::ConcaveShape | This abstract class represents a concave collision shape associated with a body that is used during the narrow-phase collision detection |
Creactphysics3d::ConcaveMeshShape | This class represents a static concave mesh shape |
Creactphysics3d::HeightFieldShape | This class represents a static height field that can be used to represent a terrain |
►Creactphysics3d::ConvexShape | This abstract class represents a convex collision shape associated with a body that is used during the narrow-phase collision detection |
Creactphysics3d::CapsuleShape | This class represents a capsule collision shape that is defined around the Y axis |
►Creactphysics3d::ConvexPolyhedronShape | This abstract class represents a convex polyhedron collision shape associated with a body that is used during the narrow-phase collision detection |
Creactphysics3d::BoxShape | This class represents a 3D box shape |
Creactphysics3d::ConvexMeshShape | This class represents a convex mesh shape |
Creactphysics3d::TriangleShape | This class represents a triangle collision shape that is centered at the origin and defined three points |
Creactphysics3d::SphereShape | This class represents a sphere collision shape that is centered at the origin and defined by its radius |
►Creactphysics3d::Components | This class represent the abstract class to store components of the ECS |
Creactphysics3d::BallAndSocketJointComponents | This class represent the component of the ECS with data for the BallAndSocketJoint |
Creactphysics3d::BodyComponents | This class represent the component of the ECS that contains data about a body |
Creactphysics3d::ColliderComponents | This class represent the component of the ECS that contains data about the the colliders of the different bodies |
Creactphysics3d::FixedJointComponents | This class represent the component of the ECS with data for the FixedJoint |
Creactphysics3d::HingeJointComponents | This class represent the component of the ECS with data for the HingeJoint |
Creactphysics3d::JointComponents | This class represent the component of the ECS that contains generic information about all the joints |
Creactphysics3d::RigidBodyComponents | This class represent the component of the ECS that contains data about a rigid body |
Creactphysics3d::SliderJointComponents | This class represent the component of the ECS with data for the SliderJoint |
Creactphysics3d::TransformComponents | This class represent the component of the ECS that contains the transforms of the different entities |
Creactphysics3d::ConstraintSolverData | This structure contains data from the constraint solver that are used to solve each joint constraint |
Creactphysics3d::ConstraintSolverSystem | This class represents the constraint solver that is used to solve constraints between the rigid bodies |
Creactphysics3d::ContactManifold | This class represents a set of contact points between two bodies that all have a similar contact normal direction |
Creactphysics3d::ContactManifoldInfo | This structure contains informations about a collision contact manifold computed during the narrow-phase collision detection |
Creactphysics3d::CollisionCallback::ContactPair | This class represents the contact between two colliders of the physics world |
Creactphysics3d::ContactPair | This structure represents a pair of shapes that are in contact during narrow-phase |
Creactphysics3d::CollisionCallback::ContactPoint | This class represents a contact point between two colliders of the physics world |
Creactphysics3d::ContactPoint | This class represents a collision contact point between two bodies in the physics engine |
Creactphysics3d::ContactPointInfo | This structure contains informations about a collision contact computed during the narrow-phase collision detection |
Creactphysics3d::ContactSolverSystem | This class represents the contact solver system that is used to solve rigid bodies contacts |
Creactphysics3d::ConvexMesh | This class describes a convex mesh made of faces and vertices |
Creactphysics3d::DebugRenderer::DebugLine | Struture that represents a line of the DebugRenderer |
Creactphysics3d::DebugRenderer::DebugTriangle | Struture that represents a triangle of the DebugRenderer |
Creactphysics3d::Deque< T > | This class represents a Deque |
Creactphysics3d::Deque< uint32 > | |
►Creactphysics3d::DefaultLogger::Destination | Destination for the logs |
Creactphysics3d::DefaultLogger::FileDestination | File destination for the logs |
Creactphysics3d::DefaultLogger::StreamDestination | Stream destination for the logs |
Creactphysics3d::DynamicAABBTree | This class implements a dynamic AABB tree that is used for broad-phase collision detection |
►Creactphysics3d::DynamicAABBTreeOverlapCallback | Overlapping callback method that has to be used as parameter of the reportAllShapesOverlappingWithNode() method |
Creactphysics3d::AABBOverlapCallback | This class represents a callback when two AABB overlap |
Creactphysics3d::ConvexTriangleAABBOverlapCallback | This class represents a callback when an overlap occurs |
►Creactphysics3d::DynamicAABBTreeRaycastCallback | Raycast callback in the Dynamic AABB Tree called when the AABB of a leaf node is hit by the ray |
Creactphysics3d::BroadPhaseRaycastCallback | Callback called when the AABB of a leaf node is hit by a ray the broad-phase Dynamic AABB Tree |
Creactphysics3d::ConcaveMeshRaycastCallback | Class ConcaveMeshRaycastCallback |
Creactphysics3d::DynamicsSystem | This class is responsible to compute and update the dynamics of the bodies that are simulated using physics |
Creactphysics3d::HalfEdgeStructure::Edge | Edge |
Creactphysics3d::QHHalfEdgeStructure::Edge | An half-edge |
Creactphysics3d::Entity | This class is used to identify an entity in the Entity-Component-System |
Creactphysics3d::EntityManager | This class is responsible to manage the entities of the ECS |
Creactphysics3d::HalfEdgeStructure::Face | Face |
Creactphysics3d::QHHalfEdgeStructure::Face | A face |
Creactphysics3d::FixedJointComponents::FixedJointComponent | Structure for the data of a transform component |
►Creactphysics3d::DefaultLogger::Formatter | Log formatter |
Creactphysics3d::DefaultLogger::HtmlFormatter | Format the logs with HTML |
Creactphysics3d::DefaultLogger::TextFormatter | Format the logs with simple text |
Creactphysics3d::GJKAlgorithm | This class implements a narrow-phase collision detection algorithm |
Creactphysics3d::HalfEdgeStructure | This class describes a polyhedron mesh made of faces and vertices |
Cstd::hash< reactphysics3d::DebugRenderer::DebugItem > | |
Cstd::hash< reactphysics3d::DefaultLogger::Format > | |
Cstd::hash< reactphysics3d::Entity > | |
Cstd::hash< reactphysics3d::Pair< T1, T2 > > | |
Creactphysics3d::HeightField | This class represents a static height field that can be used to represent a terrain |
Creactphysics3d::HingeJointComponents::HingeJointComponent | Structure for the data of a transform component |
Creactphysics3d::Island | An island represent an isolated group of awake bodies that are connected with each other by some contraints (contacts or joints) |
Creactphysics3d::Islands | This class contains all the islands of bodies during a frame |
Creactphysics3d::Array< T >::Iterator | Class Iterator |
Creactphysics3d::Deque< T >::Iterator | Class Iterator |
Creactphysics3d::Map< K, V, Hash, KeyEqual >::Iterator | Class Iterator |
Creactphysics3d::Set< V, Hash, KeyEqual >::Iterator | Class Iterator |
►Creactphysics3d::Joint | This abstract class represents a joint between two bodies |
Creactphysics3d::BallAndSocketJoint | This class represents a ball-and-socket joint that allows arbitrary rotation between two bodies |
Creactphysics3d::FixedJoint | This class represents a fixed joint that is used to forbid any translation or rotation between two bodies |
Creactphysics3d::HingeJoint | This class represents a hinge joint that allows arbitrary rotation between two bodies around a single axis |
Creactphysics3d::SliderJoint | This class represents a slider joint |
Creactphysics3d::JointComponents::JointComponent | Structure for the data of a transform component |
►Creactphysics3d::JointInfo | This structure is used to gather the information needed to create a joint |
Creactphysics3d::BallAndSocketJointInfo | This structure is used to gather the information needed to create a ball-and-socket joint |
Creactphysics3d::FixedJointInfo | This structure is used to gather the information needed to create a fixed joint |
Creactphysics3d::HingeJointInfo | This structure is used to gather the information needed to create a hinge joint |
Creactphysics3d::SliderJointInfo | This structure is used to gather the information needed to create a slider joint |
Creactphysics3d::LastFrameCollisionInfo | This structure contains collision info about the last frame |
Creactphysics3d::LinkedList< T > | This class represents a simple generic linked list |
Creactphysics3d::LinkedList< T >::ListElement | Element of the linked list |
►Creactphysics3d::Logger | This abstract class is the base class used to log information, warnings or errors during the execution of the library code for easier debugging |
Creactphysics3d::DefaultLogger | This class is the default logger class used to log information, warnings or errors during the execution of the library code for easier debugging |
Creactphysics3d::Map< K, V, Hash, KeyEqual > | This class represents a simple generic associative map |
Creactphysics3d::Map< DebugItem, uint32 > | |
Creactphysics3d::Map< Format, reactphysics3d::DefaultLogger::Formatter * > | |
Creactphysics3d::Map< int, reactphysics3d::Entity > | |
Creactphysics3d::Map< reactphysics3d::Entity, uint32 > | |
Creactphysics3d::Map< reactphysics3d::Pair, reactphysics3d::QHHalfEdgeStructure::Edge * > | |
Creactphysics3d::Map< uint64, reactphysics3d::LastFrameCollisionInfo * > | |
Creactphysics3d::Map< uint64, uint > | |
Creactphysics3d::Map< uint64, uint64 > | |
Creactphysics3d::Material | This class contains the material properties of a collider that will be use for the dynamics simulation like the friction coefficient or the bounciness of the rigid body |
Creactphysics3d::Matrix2x2 | This class represents a 2x2 matrix |
Creactphysics3d::Matrix3x3 | This class represents a 3x3 matrix |
►Creactphysics3d::MemoryAllocator | Abstract class with the basic interface of all the derived memory allocators |
Creactphysics3d::DefaultAllocator | This class represents a default memory allocator that uses standard C++ functions to allocated 16-bytes aligned memory |
Creactphysics3d::HeapAllocator | This class is used to efficiently allocate memory on the heap |
Creactphysics3d::PoolAllocator | This class is used to efficiently allocate memory on the heap |
Creactphysics3d::SingleFrameAllocator | This class represent a memory allocator used to efficiently allocate memory on the heap that is used during a single frame |
Creactphysics3d::MemoryManager | The memory manager is used to store the different memory allocators that are used by the library |
Creactphysics3d::Message | This structure represent a message that can be returned to the user |
►Creactphysics3d::NarrowPhaseAlgorithm | This abstract class is the base class for a narrow-phase collision detection algorithm |
Creactphysics3d::CapsuleVsCapsuleAlgorithm | This class is used to compute the narrow-phase collision detection between two capsules collision shapes |
Creactphysics3d::CapsuleVsConvexPolyhedronAlgorithm | This class is used to compute the narrow-phase collision detection between a capsule and a convex polyhedron |
Creactphysics3d::ConvexPolyhedronVsConvexPolyhedronAlgorithm | This class is used to compute the narrow-phase collision detection between two convex polyhedra |
Creactphysics3d::SphereVsCapsuleAlgorithm | This class is used to compute the narrow-phase collision detection between a sphere collision shape and a capsule collision shape |
Creactphysics3d::SphereVsConvexPolyhedronAlgorithm | This class is used to compute the narrow-phase collision detection between a sphere and a convex polyhedron |
Creactphysics3d::SphereVsSphereAlgorithm | This class is used to compute the narrow-phase collision detection between two sphere collision shapes |
Creactphysics3d::NarrowPhaseCallback | This abstract class is the base class for a narrow-phase collision callback class |
Creactphysics3d::NarrowPhaseInfoBatch::NarrowPhaseInfo | A potential collision between two colliders from the middle-phase algorithm that have to be tested during narrow-phase collision detection |
Creactphysics3d::NarrowPhaseInfoBatch | This structure collects all the potential collisions from the middle-phase algorithm that have to be tested during narrow-phase collision detection |
Creactphysics3d::NarrowPhaseInput | This structure contains everything that is needed to perform the narrow-phase collision detection |
Creactphysics3d::OverlapCallback | This class can be used to register a callback for collision overlap queries between bodies |
Creactphysics3d::OverlapCallback::OverlapPair | This class represents the contact between two colliders of the physics world |
►Creactphysics3d::OverlappingPairs::OverlappingPair | A base overlapping pair |
Creactphysics3d::OverlappingPairs::ConcaveOverlappingPair | An overlapping pair between a convex collider and a concave collider |
Creactphysics3d::OverlappingPairs::ConvexOverlappingPair | An overlapping pair between two convex colliders |
Creactphysics3d::OverlappingPairs | This class contains pairs of two colliders that are overlapping during the broad-phase collision detection |
Creactphysics3d::Pair< T1, T2 > | This class represents a simple generic pair |
Creactphysics3d::Pair< DebugItem, uint32 > | |
Creactphysics3d::Pair< Format, reactphysics3d::DefaultLogger::Formatter * > | |
Creactphysics3d::Pair< int, reactphysics3d::Entity > | |
Creactphysics3d::Pair< int32, int32 > | |
Creactphysics3d::Pair< K, V > | |
Creactphysics3d::Pair< reactphysics3d::Entity, uint32 > | |
Creactphysics3d::Pair< reactphysics3d::Pair, reactphysics3d::QHHalfEdgeStructure::Edge * > | |
Creactphysics3d::Pair< uint64, reactphysics3d::LastFrameCollisionInfo * > | |
Creactphysics3d::Pair< uint64, uint > | |
Creactphysics3d::Pair< uint64, uint64 > | |
Creactphysics3d::PhysicsCommon | This class is a singleton that needs to be instanciated once at the beginning |
Creactphysics3d::PhysicsWorld | This class represents a physics world |
Creactphysics3d::PolygonVertexArray::PolygonFace | Represent a polygon face of the mesh |
Creactphysics3d::PolygonVertexArray | This class is used to describe the vertices and faces of a mesh |
Creactphysics3d::QHHalfEdgeStructure | This class describes a polyhedron mesh made of faces and vertices |
Creactphysics3d::Quaternion | This class represents a quaternion |
Creactphysics3d::QuickHull | This class implements the Quickhull algorithm to compute a convex mesh from a set of 3D points |
Creactphysics3d::Ray | This structure represents a 3D ray represented by two points |
Creactphysics3d::RaycastCallback | This class can be used to register a callback for ray casting queries |
Creactphysics3d::RaycastInfo | This structure contains the information about a raycast hit |
Creactphysics3d::RaycastTest | Structure RaycastTest |
Creactphysics3d::RigidBodyComponents::RigidBodyComponent | Structure for the data of a rigid body component |
Creactphysics3d::SATAlgorithm | This class implements the Separating Axis Theorem algorithm (SAT) |
Creactphysics3d::Set< V, Hash, KeyEqual > | This class represents a simple generic set |
Creactphysics3d::Set< int > | |
Creactphysics3d::Set< Profiler * > | |
Creactphysics3d::Set< reactphysics3d::BoxShape * > | |
Creactphysics3d::Set< reactphysics3d::CapsuleShape * > | |
Creactphysics3d::Set< reactphysics3d::ConcaveMeshShape * > | |
Creactphysics3d::Set< reactphysics3d::ConvexMesh * > | |
Creactphysics3d::Set< reactphysics3d::ConvexMeshShape * > | |
Creactphysics3d::Set< reactphysics3d::DefaultLogger * > | |
Creactphysics3d::Set< reactphysics3d::HeightField * > | |
Creactphysics3d::Set< reactphysics3d::HeightFieldShape * > | |
Creactphysics3d::Set< reactphysics3d::Pair > | |
Creactphysics3d::Set< reactphysics3d::PhysicsWorld * > | |
Creactphysics3d::Set< reactphysics3d::SphereShape * > | |
Creactphysics3d::Set< reactphysics3d::TriangleMesh * > | |
Creactphysics3d::SliderJointComponents::SliderJointComponent | Structure for the data of a transform component |
Creactphysics3d::SolveBallAndSocketJointSystem | This class is responsible to solve the BallAndSocketJoint constraints |
Creactphysics3d::SolveFixedJointSystem | This class is responsible to solve the FixedJoint constraints |
Creactphysics3d::SolveHingeJointSystem | This class is responsible to solve the BallAndSocketJoint constraints |
Creactphysics3d::SolveSliderJointSystem | This class is responsible to solve the SliderJoint constraints |
Creactphysics3d::Stack< T > | This class represents a simple generic stack |
Creactphysics3d::Transform | This class represents a position and an orientation in 3D |
Creactphysics3d::TransformComponents::TransformComponent | Structure for the data of a transform component |
Creactphysics3d::TreeNode | This structure represents a node of the dynamic AABB tree |
Creactphysics3d::TriangleCallback | This class is used to encapsulate a callback method for a single triangle of a ConcaveMesh |
Creactphysics3d::TriangleMesh | This class represents a mesh made of triangles |
Creactphysics3d::TriangleVertexArray | This class is used to describe the vertices and faces of a triangular mesh |
Creactphysics3d::Vector2 | This class represents a 2D vector |
Creactphysics3d::Vector3 | This class represents a 3D vector |
Creactphysics3d::HalfEdgeStructure::Vertex | Vertex |
Creactphysics3d::QHHalfEdgeStructure::Vertex | A vertex |
Creactphysics3d::VertexArray | This class is used to describe an array of vertices |
Creactphysics3d::VoronoiSimplex | This class represents a simplex which is a set of 3D points |
Creactphysics3d::PhysicsWorld::WorldSettings | Structure WorldSettings |