| ►Napi | |
| CTestMainAPI | |
| ►Nboost | |
| ►Nserialization | |
| ►Ninternal | |
| CBVHModelAccessor | |
| CBVHModelBaseAccessor | |
| CBVSplitterAccessor | |
| CConvexAccessor | |
| CConvexBaseAccessor | |
| CHeightFieldAccessor | |
| ►Ncollision | |
| CTestMainAPI | |
| ►Ndoxygen | |
| ►Nvisitor | |
| Cmember_func_impl | |
| Cclass_doc_impl | |
| ►Ndoxygen_xml_parser | |
| CClassCompound | |
| CCompoundBase | |
| CIndex | |
| CMemberDef | |
| CNamespaceCompound | |
| COutputStreams | |
| CReference | |
| ►Ngeometric_shapes | |
| CTestGeometricShapes | |
| ►Nhpp | Main namespace |
| ►Nfcl | |
| ►Ndetail | |
| ►Nimplementation_array | |
| ►CHierarchyTree | Class for hierarchy tree structure |
| CSortByMorton | |
| CNodeBase | |
| CnodeBaseLess | Functor comparing two nodes |
| CSelectImpl | |
| CSelectImpl< S, AABB > | |
| ►CHierarchyTree | Class for hierarchy tree structure |
| CSortByMorton | |
| CIntervalTree | Interval tree |
| CIntervalTreeNode | The node for interval tree |
| Cit_recursion_node | Class describes the information needed when we take the right branch in searching for intervals but possibly come back and check the left branch as well |
| CNodeBase | Dynamic AABB tree node |
| CSelectImpl | |
| CSelectImpl< S, AABB > | |
| CSimpleHashTable | A simple hash table implemented as multiple buckets. HashFnc is any extended hash function: HashFnc(key) = {index1, index2, ..., } |
| CSimpleInterval | Interval trees implemented using red-black-trees as described in the book Introduction_To_Algorithms_ by Cormen, Leisserson, and Rivest |
| CSparseHashTable | A hash table implemented using unordered_map |
| CSpatialHash | Spatial hash function: hash an AABB to a set of integer values |
| Cunordered_map_hash_table | |
| CUpdateImpl | |
| ►Ndetails | |
| Cbvh_shape_traits | |
| CContactPoint | |
| ►CEPA | Class for EPA algorithm |
| CSimplexF | |
| CSimplexHorizon | |
| CSimplexList | |
| ►CGJK | Class for GJK algorithm |
| CSimplex | |
| CSimplexV | |
| CLargeConvex | |
| ►CMinkowskiDiff | Minkowski difference class of two shapes |
| CShapeData | |
| CSmallConvex | |
| CUpdateBoundingVolume | |
| CUpdateBoundingVolume< AABB > | |
| ►Ninternal | |
| CLoader | |
| Cmemory_footprint_evaluator | |
| Cmemory_footprint_evaluator< ::hpp::fcl::BVHModel< BV > > | |
| CNeighbors | |
| CobbDisjoint_check_Ai_cross_Bi | |
| CTriangleAndVertices | |
| ►Npython | |
| Cdeprecated_function | |
| Cdeprecated_member | |
| Cdeprecated_warning_policy | |
| CAABB | A class describing the AABB collision structure, which is a box in 3D space determined by two diagonal points |
| CBenchTimer | |
| CBox | Center at zero point, axis aligned box |
| CBroadPhaseCollisionManager | Base class for broad phase collision. It helps to accelerate the collision/distance between N objects. Also support self collision, self distance and collision/distance with another M objects |
| CBroadPhaseCollisionManagerWrapper | |
| CBroadPhaseContinuousCollisionManager | Base class for broad phase continuous collision. It helps to accelerate the continuous collision/distance between N objects. Also support self collision, self distance and collision/distance with another M objects |
| CBVFitter | The class for the default algorithm fitting a bounding volume to a set of points |
| CBVFitter< AABB > | Specification of BVFitter for AABB bounding volume |
| CBVFitter< kIOS > | Specification of BVFitter for kIOS bounding volume |
| CBVFitter< OBB > | Specification of BVFitter for OBB bounding volume |
| CBVFitter< OBBRSS > | Specification of BVFitter for OBBRSS bounding volume |
| CBVFitter< RSS > | Specification of BVFitter for RSS bounding volume |
| CBVFitterTpl | The class for the default algorithm fitting a bounding volume to a set of points |
| CBVHFrontNode | Front list acceleration for collision Front list is a set of internal and leaf nodes in the BVTT hierarchy, where the traversal terminates while performing a query during a given time instance. The front list reflects the subset of a BVTT that is traversed for that particular proximity query |
| CBVHModel | A class describing the bounding hierarchy of a mesh model or a point cloud model (which is viewed as a degraded version of mesh) |
| CBVHModelBase | A base class describing the bounding hierarchy of a mesh model or a point cloud model (which is viewed as a degraded version of mesh) |
| CBVHShapeCollider | |
| CBVHShapeDistancer | |
| CBVHShapeDistancer< kIOS, T_SH > | |
| CBVHShapeDistancer< OBBRSS, T_SH > | |
| CBVHShapeDistancer< RSS, T_SH > | |
| CBVNode | A class describing a bounding volume node. It includes the tree structure providing in BVNodeBase and also the geometry data provided in BV template parameter |
| CBVNodeBase | BVNodeBase encodes the tree structure for BVH |
| CBVSplitter | A class describing the split rule that splits each BV node |
| CBVT | Bounding volume test structure |
| CBVT_Comparer | Comparer between two BVT |
| CBVTQ | |
| ►CCachedMeshLoader | |
| CKey | |
| CCapsule | Capsule It is where is the distance between the point x and the capsule segment AB, with |
| CCollisionCallBackBase | Base callback class for collision queries. This class can be supersed by child classes to provide desired behaviors according to the application (e.g, only listing the potential CollisionObjects in collision) |
| CCollisionCallBackBaseWrapper | |
| CCollisionCallBackCollect | Collision callback to collect collision pairs potentially in contacts |
| CCollisionCallBackDefault | Default collision callback to check collision between collision objects |
| CCollisionData | Collision data stores the collision request and the result given by collision algorithm |
| CCollisionFunctionMatrix | Collision matrix stores the functions for collision between different types of objects and provides a uniform call interface |
| CCollisionGeometry | The geometry for the object for collision or distance computation |
| CCollisionObject | Object for collision or distance computation, contains the geometry and the transform information |
| CCollisionRequest | Request to the collision algorithm |
| CCollisionResult | Collision result |
| CComputeCollision | This class reduces the cost of identifying the geometry pair. This is mostly useful for repeated shape-shape queries |
| CComputeDistance | |
| CCone | Cone The base of the cone is at and the top is at |
| CContact | Contact information returned by collision |
| CConvex | Convex polytope |
| ►CConvexBase | Base for convex polytope |
| CNeighbors | |
| CCPUTimes | |
| CCylinder | Cylinder along Z axis. The cylinder is defined at its centroid |
| CDistanceCallBackBase | Base callback class for distance queries. This class can be supersed by child classes to provide desired behaviors according to the application (e.g, only listing the potential CollisionObjects in collision) |
| CDistanceCallBackBaseWrapper | |
| CDistanceCallBackDefault | Default distance callback to check collision between collision objects |
| CDistanceData | Distance data stores the distance request and the result given by distance algorithm |
| CDistanceFunctionMatrix | Distance matrix stores the functions for distance between different types of objects and provides a uniform call interface |
| CDistanceRequest | Request to the distance computation |
| CDistanceRes | |
| CDistanceResult | Distance result |
| CDummyCollisionObject | Dummy collision object with a point AABB |
| CDynamicAABBTreeArrayCollisionManager | |
| CDynamicAABBTreeCollisionManager | |
| CEllipsoid | Ellipsoid centered at point zero |
| CGJKSolver | Collision and distance solver based on GJK algorithm implemented in fcl (rewritten the code from the GJK in bullet) |
| CHalfspace | Half Space: this is equivalent to the Plane in ODE. The separation plane is defined as n * x = d; Points in the negative side of the separation plane (i.e. {x | n * x < d}) are inside the half space and points in the positive side of the separation plane (i.e. {x | n * x > d}) are outside the half space |
| CHeightField | Data structure depicting a height field given by the base grid dimensions and the elevation along the grid |
| CHeightFieldShapeCollider | Collider functor for HeightField data structure |
| CHeightFieldShapeDistancer | |
| CHFNode | |
| CHFNodeBase | |
| ►CIntervalTreeCollisionManager | Collision manager based on interval tree |
| CEndPoint | SAP end point |
| CSAPInterval | Extention interval tree's interval to SAP interval, adding more information |
| CKDOP | KDOP class describes the KDOP collision structures. K is set as the template parameter, which should be 16, 18, or 24 The KDOP structure is defined by some pairs of parallel planes defined by some axes. For K = 16, the planes are 6 AABB planes and 10 diagonal planes that cut off some space of the edges: (-1,0,0) and (1,0,0) -> indices 0 and 8 (0,-1,0) and (0,1,0) -> indices 1 and 9 (0,0,-1) and (0,0,1) -> indices 2 and 10 (-1,-1,0) and (1,1,0) -> indices 3 and 11 (-1,0,-1) and (1,0,1) -> indices 4 and 12 (0,-1,-1) and (0,1,1) -> indices 5 and 13 (-1,1,0) and (1,-1,0) -> indices 6 and 14 (-1,0,1) and (1,0,-1) -> indices 7 and 15 For K = 18, the planes are 6 AABB planes and 12 diagonal planes that cut off some space of the edges: (-1,0,0) and (1,0,0) -> indices 0 and 9 (0,-1,0) and (0,1,0) -> indices 1 and 10 (0,0,-1) and (0,0,1) -> indices 2 and 11 (-1,-1,0) and (1,1,0) -> indices 3 and 12 (-1,0,-1) and (1,0,1) -> indices 4 and 13 (0,-1,-1) and (0,1,1) -> indices 5 and 14 (-1,1,0) and (1,-1,0) -> indices 6 and 15 (-1,0,1) and (1,0,-1) -> indices 7 and 16 (0,-1,1) and (0,1,-1) -> indices 8 and 17 For K = 18, the planes are 6 AABB planes and 18 diagonal planes that cut off some space of the edges: (-1,0,0) and (1,0,0) -> indices 0 and 12 (0,-1,0) and (0,1,0) -> indices 1 and 13 (0,0,-1) and (0,0,1) -> indices 2 and 14 (-1,-1,0) and (1,1,0) -> indices 3 and 15 (-1,0,-1) and (1,0,1) -> indices 4 and 16 (0,-1,-1) and (0,1,1) -> indices 5 and 17 (-1,1,0) and (1,-1,0) -> indices 6 and 18 (-1,0,1) and (1,0,-1) -> indices 7 and 19 (0,-1,1) and (0,1,-1) -> indices 8 and 20 (-1, -1, 1) and (1, 1, -1) –> indices 9 and 21 (-1, 1, -1) and (1, -1, 1) –> indices 10 and 22 (1, -1, -1) and (-1, 1, 1) –> indices 11 and 23 |
| ►CkIOS | A class describing the kIOS collision structure, which is a set of spheres |
| CkIOS_Sphere | One sphere in kIOS |
| CMeshLoader | |
| CNaiveCollisionManager | Brute force N-body collision manager |
| COBB | Oriented bounding box class |
| COBBRSS | Class merging the OBB and RSS, can handle collision and distance simultaneously |
| COcTree | Octree is one type of collision geometry which can encode uncertainty information in the sensor data |
| CPlane | Infinite plane |
| CQuadrilateral | Quadrilateral with 4 indices for points |
| CQueryRequest | Base class for all query requests |
| CQueryResult | Base class for all query results |
| CRSS | A class for rectangle sphere-swept bounding volume |
| ►CSaPCollisionManager | Rigorous SAP collision manager |
| CEndPoint | End point for an interval |
| CisNotValidPair | Functor to help remove collision pairs no longer valid (i.e., should be culled away) |
| CisUnregistered | Functor to help unregister one object |
| CSaPAABB | SAP interval for one object |
| CSaPPair | A pair of objects that are not culling away and should further check collision |
| Cshape_traits | |
| Cshape_traits< Box > | |
| Cshape_traits< Capsule > | |
| Cshape_traits< Cone > | |
| Cshape_traits< ConvexBase > | |
| Cshape_traits< Cylinder > | |
| Cshape_traits< Ellipsoid > | |
| Cshape_traits< Halfspace > | |
| Cshape_traits< Sphere > | |
| Cshape_traits< TriangleP > | |
| Cshape_traits_base | |
| CShapeBase | Base class for all basic geometric shapes |
| CSortByXLow | Functor sorting objects according to the AABB lower x bound |
| CSortByYLow | Functor sorting objects according to the AABB lower y bound |
| CSortByZLow | Functor sorting objects according to the AABB lower z bound |
| CSpatialHashingCollisionManager | Spatial hashing collision mananger |
| CSphere | Center at zero point sphere |
| CSSaPCollisionManager | Simple SAP collision manager |
| CTimer | This class mimics the way "boost/timer/timer.hpp" operates while using the modern std::chrono library. Importantly, this class will only have an effect for C++11 and more |
| CTransform3f | Simple transform class used locally by InterpMotion |
| CTraversalTraitsCollision | |
| CTraversalTraitsDistance | |
| CTriangle | Triangle with 3 indices for points |
| CTriangleP | Triangle stores the points instead of only indices of points |
| CTStruct | |
| ►Nhppfcl | |
| ►NobbDisjoint_impls | |
| Cloop_case_1 | |
| Cloop_case_2 | |
| ►NorgQhull | QhullRidge – Qhull's ridge structure, ridgeT, as a C++ class |
| CAbsoluteSumOf | Absolute sum of the elements in a container |
| ►CCoordinates | |
| Cconst_iterator | |
| Citerator | |
| CCoordinates_test | |
| CCoordinatesIterator | |
| CMutableCoordinatesIterator | |
| CPointCoordinates | |
| CPointCoordinates_test | |
| CPointCoordinatesIterator | |
| CQhull | Interface to Qhull from C++ |
| CQhull_test | |
| CQhullError | |
| ►CQhullFacet | A QhullFacet is the C++ equivalent to Qhull's facetT* |
| CPrintCenter | |
| CPrintFacet | |
| CPrintFlags | |
| CPrintHeader | |
| CPrintRidges | |
| CQhullFacet_test | |
| ►CQhullFacetList | |
| CPrintFacetList | |
| CPrintFacets | |
| CPrintVertices | |
| CQhullFacetList_test | |
| ►CQhullFacetSet | |
| CPrintFacetSet | |
| CPrintIdentifiers | |
| CQhullFacetSet_test | |
| ►CQhullHyperplane | |
| CPrintHyperplane | |
| CQhullHyperplane_test | |
| ►CQhullLinkedList | |
| Cconst_iterator | |
| Citerator | |
| CQhullLinkedList_test | |
| CQhullLinkedListIterator | |
| ►CQhullPoint | |
| CPrintPoint | |
| CQhullPoint_test | |
| ►CQhullPoints | Java-style iterator |
| Cconst_iterator | |
| Citerator | |
| CPrintPoints | |
| CQhullPoints_test | |
| ►CQhullPointSet | |
| CPrintIdentifiers | |
| CPrintPointSet | |
| CQhullPointSet_test | |
| CQhullPointsIterator | |
| CQhullQh | POD type equivalent to qhT. No virtual members |
| ►CQhullRidge | |
| CPrintRidge | |
| CQhullRidge_test | |
| ►CQhullSet | |
| Cconst_iterator | |
| Citerator | |
| CQhullSet_test | |
| CQhullSetBase | |
| CQhullSetIterator | Faster then interator/const_iterator due to T::base_type |
| CQhullStat | |
| ►CQhullVertex | |
| CPrintVertex | |
| CQhullVertex_test | |
| ►CQhullVertexSet | |
| CPrintIdentifiers | |
| CPrintVertexSet | |
| CQhullVertexSet_test | |
| CRboxPoints | |
| CRboxPoints_test | |
| CRoadError | |
| CRoadLogEvent | |
| CRoadTest | |
| CSumOf | Sum of the elements in a container |
| CSumSquaresOf | Sum of squares of the elements in a container |
| ►Npickling | |
| CTestGeometryPickling | |
| ►Ntest_case | |
| CTestCase | |
| ►Nxml_docstring | |
| CXmlDocString | |
| Cbase_traits | |
| CBenchmarkResult | |
| CBVHModelBaseWrapper | |
| CCallBackData | |
| CCollisionDataForUniquenessChecking | |
| CCollisionFunctionForUniquenessChecking | |
| CConvexBaseWrapper | |
| CConvexWrapper | |
| CDistanceCallBackDerived | |
| CDistanceRequestWrapper | |
| CfacetT | |
| CGeometry | |
| CintrealT | |
| CmergeT | |
| Cmesh_mesh_run_test | |
| CMeshShapeDistanceTraversalNodekIOS | |
| CMeshShapeDistanceTraversalNodeOBBRSS | |
| CMeshShapeDistanceTraversalNodeRSS | Traversal node for distance between mesh and shape, when mesh BVH is one of the oriented node (RSS, kIOS, OBBRSS) |
| CPickleObject | |
| CqhmemT | |
| CqhstatT | |
| CqhT | |
| CrboxT | |
| CResult | |
| CResults | |
| CridgeT | |
| CsetelemT | |
| CsetT | |
| CShapeMeshDistanceTraversalNode | Traversal node for distance between shape and mesh |
| CShapeMeshDistanceTraversalNodekIOS | |
| CShapeMeshDistanceTraversalNodeOBBRSS | |
| CShapeMeshDistanceTraversalNodeRSS | Traversal node for distance between shape and mesh, when mesh BVH is one of the oriented node (RSS, kIOS, OBBRSS) |
| Ctraits | |
| Ctraits< KDOP< N >, Oriented, recursive > | |
| Ctraits< kIOS > | |
| Ctraits< OBB > | |
| Ctraits< OBBRSS > | |
| Ctraits< RSS > | |
| CTriangleWrapper | |
| CvertexT | |
| Cwrap | |