Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 12345]
 Chpp::fcl::AABBA class describing the AABB collision structure, which is a box in 3D space determined by two diagonal points
 CorgQhull::AbsoluteSumOfAbsolute sum of the elements in a container
 Cbase_traits
 CBenchmarkResult
 Chpp::fcl::BenchTimer
 Chpp::fcl::BroadPhaseCollisionManagerBase 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
 Chpp::fcl::BroadPhaseContinuousCollisionManager< S >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
 Chpp::fcl::BVFitter< BV >The class for the default algorithm fitting a bounding volume to a set of points
 Chpp::fcl::BVFitterTpl< BV >The class for the default algorithm fitting a bounding volume to a set of points
 Chpp::fcl::BVFitterTpl< AABB >
 Chpp::fcl::BVFitterTpl< kIOS >
 Chpp::fcl::BVFitterTpl< OBB >
 Chpp::fcl::BVFitterTpl< OBBRSS >
 Chpp::fcl::BVFitterTpl< RSS >
 Chpp::fcl::details::bvh_shape_traits< T_BVH, T_SH >
 Chpp::fcl::BVHFrontNodeFront 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
 CBVHModelBaseWrapper
 Chpp::fcl::BVHShapeCollider< T_BVH, T_SH, _Options >
 Chpp::fcl::BVHShapeDistancer< T_BVH, T_SH >
 Chpp::fcl::BVHShapeDistancer< kIOS, T_SH >
 Chpp::fcl::BVHShapeDistancer< OBBRSS, T_SH >
 Chpp::fcl::BVHShapeDistancer< RSS, T_SH >
 Chpp::fcl::BVNodeBaseBVNodeBase encodes the tree structure for BVH
 Chpp::fcl::BVSplitter< BV >A class describing the split rule that splits each BV node
 Chpp::fcl::BVTBounding volume test structure
 Chpp::fcl::BVT_ComparerComparer between two BVT
 Chpp::fcl::BVTQ
 CCallBackData
 Cdoxygen::class_doc_impl< _class >
 Chpp::fcl::CollisionCallBackBaseBase 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)
 Chpp::fcl::CollisionDataCollision data stores the collision request and the result given by collision algorithm
 CCollisionDataForUniquenessChecking
 Chpp::fcl::CollisionFunctionMatrixCollision matrix stores the functions for collision between different types of objects and provides a uniform call interface
 Chpp::fcl::CollisionGeometryThe geometry for the object for collision or distance computation
 Chpp::fcl::CollisionObjectObject for collision or distance computation, contains the geometry and the transform information
 Chpp::fcl::ComputeCollisionThis class reduces the cost of identifying the geometry pair. This is mostly useful for repeated shape-shape queries
 Chpp::fcl::ComputeDistance
 CorgQhull::Coordinates::const_iterator
 CorgQhull::QhullLinkedList< T >::const_iterator
 CorgQhull::QhullSet< T >::const_iterator
 Chpp::fcl::ContactContact information returned by collision
 Chpp::fcl::details::ContactPoint
 CConvexBaseWrapper
 CConvexWrapper< PolygonT >
 CorgQhull::Coordinates
 CorgQhull::CoordinatesIterator
 Chpp::fcl::CPUTimes
 Cdef_visitor
 Cdefault_call_policies
 Chpp::fcl::DistanceCallBackBaseBase 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)
 Chpp::fcl::DistanceDataDistance data stores the distance request and the result given by distance algorithm
 Chpp::fcl::DistanceFunctionMatrixDistance matrix stores the functions for distance between different types of objects and provides a uniform call interface
 CDistanceRequestWrapper
 Chpp::fcl::DistanceRes
 Chpp::fcl::IntervalTreeCollisionManager::EndPointSAP end point
 Chpp::fcl::SaPCollisionManager::EndPointEnd point for an interval
 Chpp::fcl::details::EPAClass for EPA algorithm
 Cexception
 CfacetT
 CGeometry
 Chpp::fcl::details::GJKClass for GJK algorithm
 Chpp::fcl::GJKSolverCollision and distance solver based on GJK algorithm implemented in fcl (rewritten the code from the GJK in bullet)
 Chpp::fcl::HeightFieldShapeCollider< BV, Shape >Collider functor for HeightField data structure
 Chpp::fcl::HeightFieldShapeDistancer< T_HF, T_SH >
 Chpp::fcl::HFNodeBase
 Chpp::fcl::detail::HierarchyTree< BV >Class for hierarchy tree structure
 Chpp::fcl::detail::implementation_array::HierarchyTree< BV >Class for hierarchy tree structure
 Chpp::fcl::detail::implementation_array::HierarchyTree< hpp::fcl::AABB >
 Chpp::fcl::detail::HierarchyTree< hpp::fcl::AABB >
 Cdoxygen_xml_parser.Index
 Chpp::fcl::detail::IntervalTreeInterval tree
 Chpp::fcl::detail::IntervalTreeNodeThe node for interval tree
 CintrealT
 Chpp::fcl::SaPCollisionManager::isNotValidPairFunctor to help remove collision pairs no longer valid (i.e., should be culled away)
 Chpp::fcl::SaPCollisionManager::isUnregisteredFunctor to help unregister one object
 Chpp::fcl::detail::it_recursion_nodeClass 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
 CorgQhull::Coordinates::iterator
 CorgQhull::QhullLinkedList< T >::iterator
 CorgQhull::QhullSet< T >::iterator
 Chpp::fcl::KDOP< N >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
 Chpp::fcl::CachedMeshLoader::Key
 Chpp::fcl::kIOSA class describing the kIOS collision structure, which is a set of spheres
 Chpp::fcl::kIOS::kIOS_SphereOne sphere in kIOS
 Chpp::fcl::internal::Loader
 CobbDisjoint_impls::loop_case_1< ia, ib, ja, ka, jb, kb >
 CobbDisjoint_impls::loop_case_2< ib, jb, kb >
 Chpp::fcl::internal::memory_footprint_evaluator< T >
 Chpp::fcl::internal::memory_footprint_evaluator< ::hpp::fcl::BVHModel< BV > >
 CmergeT
 Cmesh_mesh_run_test
 Chpp::fcl::MeshLoader
 CMeshShapeDistanceTraversalNode
 Chpp::fcl::details::MinkowskiDiffMinkowski difference class of two shapes
 CorgQhull::MutableCoordinatesIterator
 Chpp::fcl::internal::Neighbors
 Chpp::fcl::ConvexBase::Neighbors
 Chpp::fcl::detail::NodeBase< BV >Dynamic AABB tree node
 Chpp::fcl::detail::implementation_array::NodeBase< BV >
 Chpp::fcl::detail::implementation_array::nodeBaseLess< BV >Functor comparing two nodes
 Chpp::fcl::OBBOriented bounding box class
 Chpp::fcl::internal::obbDisjoint_check_Ai_cross_Bi< ib, jb, kb >
 Chpp::fcl::OBBRSSClass merging the OBB and RSS, can handle collision and distance simultaneously
 Cobject
 Cpickle_suite
 CorgQhull::PointCoordinatesIterator
 CorgQhull::QhullFacet::PrintCenter
 CorgQhull::QhullFacet::PrintFacet
 CorgQhull::QhullFacetList::PrintFacetList
 CorgQhull::QhullFacetList::PrintFacets
 CorgQhull::QhullFacetSet::PrintFacetSet
 CorgQhull::QhullFacet::PrintFlags
 CorgQhull::QhullFacet::PrintHeader
 CorgQhull::QhullHyperplane::PrintHyperplane
 CorgQhull::QhullFacetSet::PrintIdentifiers
 CorgQhull::QhullPointSet::PrintIdentifiers
 CorgQhull::QhullVertexSet::PrintIdentifiers
 CorgQhull::QhullPoint::PrintPoint
 CorgQhull::QhullPoints::PrintPoints
 CorgQhull::QhullPointSet::PrintPointSet
 CorgQhull::QhullRidge::PrintRidge
 CorgQhull::QhullFacet::PrintRidges
 CorgQhull::QhullVertex::PrintVertex
 CorgQhull::QhullVertexSet::PrintVertexSet
 CorgQhull::QhullFacetList::PrintVertices
 CqhmemT
 CqhstatT
 CqhT
 CorgQhull::QhullInterface to Qhull from C++
 CorgQhull::QhullFacetA QhullFacet is the C++ equivalent to Qhull's facetT*
 CorgQhull::QhullHyperplane
 CorgQhull::QhullLinkedList< T >
 CorgQhull::QhullLinkedList< QhullFacet >
 CorgQhull::QhullLinkedListIterator< T >
 CorgQhull::QhullPoint
 CorgQhull::QhullPointsJava-style iterator
 CorgQhull::QhullPointsIterator
 CorgQhull::QhullRidge
 CorgQhull::QhullSetBase
 CorgQhull::QhullSetIterator< T >Faster then interator/const_iterator due to T::base_type
 CorgQhull::QhullVertex
 CQObject
 Chpp::fcl::QuadrilateralQuadrilateral with 4 indices for points
 Chpp::fcl::QueryRequestBase class for all query requests
 Chpp::fcl::QueryResultBase class for all query results
 CrboxT
 CResult
 CResults
 CridgeT
 CorgQhull::RoadLogEvent
 Chpp::fcl::RSSA class for rectangle sphere-swept bounding volume
 Chpp::fcl::SaPCollisionManager::SaPAABBSAP interval for one object
 Chpp::fcl::SaPCollisionManager::SaPPairA pair of objects that are not culling away and should further check collision
 Chpp::fcl::detail::SelectImpl< S, BV >
 Chpp::fcl::detail::implementation_array::SelectImpl< S, BV >
 Chpp::fcl::detail::implementation_array::SelectImpl< S, AABB >
 Chpp::fcl::detail::SelectImpl< S, AABB >
 CsetelemT
 CsetT
 Chpp::fcl::shape_traits_base
 CShapeBVHDistanceTraversalNode
 Chpp::fcl::details::MinkowskiDiff::ShapeData
 Chpp::fcl::detail::SimpleHashTable< Key, Data, HashFnc >A simple hash table implemented as multiple buckets. HashFnc is any extended hash function: HashFnc(key) = {index1, index2, ..., }
 Chpp::fcl::detail::SimpleHashTable< AABB, CollisionObject *, detail::SpatialHash >
 Chpp::fcl::detail::SimpleIntervalInterval trees implemented using red-black-trees as described in the book Introduction_To_Algorithms_ by Cormen, Leisserson, and Rivest
 Chpp::fcl::details::GJK::Simplex
 Chpp::fcl::details::EPA::SimplexF
 Chpp::fcl::details::EPA::SimplexHorizon
 Chpp::fcl::details::EPA::SimplexList
 Chpp::fcl::details::GJK::SimplexV
 Chpp::fcl::detail::implementation_array::HierarchyTree< BV >::SortByMorton
 Chpp::fcl::detail::HierarchyTree< BV >::SortByMorton
 Chpp::fcl::SortByXLowFunctor sorting objects according to the AABB lower x bound
 Chpp::fcl::SortByYLowFunctor sorting objects according to the AABB lower y bound
 Chpp::fcl::SortByZLowFunctor sorting objects according to the AABB lower z bound
 Chpp::fcl::detail::SparseHashTable< Key, Data, HashFnc, TableT >A hash table implemented using unordered_map
 Chpp::fcl::detail::SpatialHashSpatial hash function: hash an AABB to a set of integer values
 CorgQhull::SumOfSum of the elements in a container
 CorgQhull::SumSquaresOfSum of squares of the elements in a container
 CTestCase
 Chpp::fcl::TimerThis 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
 Ctraits< BV >
 Ctraits< kIOS >
 Ctraits< OBB >
 Ctraits< OBBRSS >
 Ctraits< RSS >
 Chpp::fcl::Transform3fSimple transform class used locally by InterpMotion
 Chpp::fcl::TraversalTraitsCollision< TypeA, TypeB >
 Chpp::fcl::TraversalTraitsDistance< TypeA, TypeB >
 Chpp::fcl::TriangleTriangle with 3 indices for points
 Chpp::fcl::internal::TriangleAndVertices
 CTriangleWrapper
 Chpp::fcl::TStruct
 Cunordered_map
 Chpp::fcl::details::UpdateBoundingVolume< BV >
 Chpp::fcl::details::UpdateBoundingVolume< AABB >
 Chpp::fcl::detail::UpdateImpl< S, BV >
 Chpp::fcl::CachedMeshLoader::Value
 CvertexT
 Cwrap< T >
 Cwrapper


hpp-fcl
Author(s):
autogenerated on Fri Aug 2 2024 02:45:17