_ccd_simplex_t | |
_ccd_support_t | |
fcl::AABB | A class describing the AABB collision structure, which is a box in 3D space determined by two diagonal points |
fcl::details::internal::assign< Derived, Size > | |
fcl::details::internal::assign< Derived, 3 > | |
fcl::details::internal::assign< Derived, 4 > | |
fcl::BallEulerJoint | |
Eigen::BinaryReturnType< Derived, OtherDerived > | |
fcl::Box | Center at zero point, axis aligned box |
fcl::BroadPhaseCollisionManager | 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 |
fcl::BroadPhaseContinuousCollisionManager | 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 |
fcl::BVFitter< BV > | The class for the default algorithm fitting a bounding volume to a set of points |
fcl::BVFitter< kIOS > | Specification of BVFitter for kIOS bounding volume |
fcl::BVFitter< OBB > | Specification of BVFitter for OBB bounding volume |
fcl::BVFitter< OBBRSS > | Specification of BVFitter for OBBRSS bounding volume |
fcl::BVFitter< RSS > | Specification of BVFitter for RSS bounding volume |
fcl::BVFitterBase< BV > | Interface for fitting a bv given the triangles or points inside it |
fcl::BVHCollisionTraversalNode< BV > | Traversal node for collision between BVH models |
fcl::BVHContinuousCollisionPair | Traversal node for continuous collision between BVH models |
fcl::BVHDistanceTraversalNode< BV > | Traversal node for distance computation between BVH models |
fcl::BVHFrontNode | 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 |
fcl::BVHModel< BV > | A class describing the bounding hierarchy of a mesh model or a point cloud model (which is viewed as a degraded version of mesh) |
fcl::BVHShapeCollisionTraversalNode< BV, S > | Traversal node for collision between BVH and shape |
fcl::BVHShapeDistanceTraversalNode< BV, S > | Traversal node for distance computation between BVH and shape |
fcl::BVMotionBoundVisitor | Compute the motion bound for a bounding volume, given the closest direction n between two query objects |
fcl::BVNode< BV > | 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 |
fcl::BVNodeBase | BVNodeBase encodes the tree structure for BVH |
fcl::BVSplitter< BV > | A class describing the split rule that splits each BV node |
fcl::BVSplitterBase< BV > | Base interface for BV splitting algorithm |
fcl::Capsule | Center at zero point capsule |
fcl::CollisionFunctionMatrix< NarrowPhaseSolver > | Collision matrix stores the functions for collision between different types of objects and provides a uniform call interface |
fcl::CollisionGeometry | The geometry for the object for collision or distance computation |
fcl::CollisionObject | Object for collision or distance computation, contains the geometry and the transform information |
fcl::CollisionRequest | Request to the collision algorithm |
fcl::CollisionResult | Collision result |
fcl::CollisionTraversalNodeBase | Node structure encoding the information required for collision traversal |
fcl::Cone | Center at zero cone |
fcl::ConservativeAdvancementFunctionMatrix< NarrowPhaseSolver > | |
fcl::ConservativeAdvancementStackData | |
fcl::Contact | Contact information returned by collision |
fcl::ContinuousCollisionObject | Object for continuous collision or distance computation, contains the geometry and the motion information |
fcl::ContinuousCollisionRequest | |
fcl::ContinuousCollisionResult | Continuous collision result |
fcl::Convex | Convex polytope |
fcl::CostSource | Cost source describes an area with a cost. The area is described by an AABB region |
fcl::Cylinder | Center at zero cylinder |
internal::deduce_fcl_type< Derived, OtherDerived, coefwise > | |
Eigen::internal::deduce_fcl_type< Derived, OtherDerived, coefwise > | |
internal::deduce_fcl_type< Derived, OtherDerived, false > | |
Eigen::internal::deduce_fcl_type< Derived, OtherDerived, false > | |
internal::deduce_fcl_type< Derived, OtherDerived, true > | |
Eigen::internal::deduce_fcl_type< Derived, OtherDerived, true > | |
fcl::DistanceFunctionMatrix< NarrowPhaseSolver > | Distance matrix stores the functions for distance between different types of objects and provides a uniform call interface |
fcl::DistanceRequest | Request to the distance computation |
fcl::DistanceResult | Distance result |
fcl::DistanceTraversalNodeBase | Node structure encoding the information required for distance traversal |
fcl::DynamicAABBTreeCollisionManager | |
fcl::DynamicAABBTreeCollisionManager_Array | |
fcl::Convex::Edge | |
fcl::details::eigen_m3< T > | |
fcl::details::eigen_v3< T > | |
fcl::details::eigen_wrapper_m3< T > | |
fcl::details::eigen_wrapper_v3< T > | |
fcl::details::eigen_wrapper_v4< T > | |
fcl::IntervalTreeCollisionManager::EndPoint | SAP end point |
fcl::SaPCollisionManager::EndPoint | End point for an interval |
fcl::details::EPA | Class for EPA algorithm |
fcl::Exception | |
Eigen::FclMatrix< T, Cols, _Options > | Vector3 class wrapper. The core data is in the template parameter class |
Eigen::FclOp< EigenOp > | |
FclProduct< Derived, OtherDerived > | |
Eigen::FclProduct< Derived, OtherDerived > | |
fcl::FclType< Derived > | |
fcl::details::GJK | Class for GJK algorithm |
fcl::details::GJKInitializer< T > | Initialize GJK stuffs |
fcl::details::GJKInitializer< Box > | Initialize GJK Box |
fcl::details::GJKInitializer< Capsule > | Initialize GJK Capsule |
fcl::details::GJKInitializer< Cone > | Initialize GJK Cone |
fcl::details::GJKInitializer< Convex > | Initialize GJK Convex |
fcl::details::GJKInitializer< Cylinder > | Initialize GJK Cylinder |
fcl::details::GJKInitializer< Sphere > | Initialize GJK Sphere |
fcl::GJKSolver_indep | Collision and distance solver based on GJK algorithm implemented in fcl (rewritten the code from the GJK in bullet) |
fcl::GJKSolver_libccd | Collision and distance solver based on libccd library |
fcl::GreedyKCenters< _T > | An instance of this class can be used to greedily select a given number of representatives from a set of data points that are all far apart from each other |
fcl::Halfspace | Half Space: this is equivalent to the Plane in ODE |
fcl::HierarchyTree< BV > | Class for hierarchy tree structure |
fcl::implementation_array::HierarchyTree< BV > | Class for hierarchy tree structure |
fcl::IMatrix3 | |
fcl::InterpMotion | Linear interpolation motion Each Motion is assumed to have constant linear velocity and angular velocity The motion is R(t)(p - p_ref) + p_ref + T(t) Therefore, R(0) = R0, R(1) = R1 T(0) = T0 + R0 p_ref - p_ref T(1) = T1 + R1 p_ref - p_ref |
fcl::Interpolation | |
fcl::InterpolationFactory | |
fcl::InterpolationLinear | |
fcl::Intersect | CCD intersect kernel among primitives |
fcl::Interval | Interval class for [a, b] |
fcl::IntervalTree | Interval tree |
fcl::IntervalTreeCollisionManager | Collision manager based on interval tree |
fcl::IntervalTreeNode | The node for interval tree |
fcl::SaPCollisionManager::isNotValidPair | Functor to help remove collision pairs no longer valid (i.e., should be culled away) |
fcl::SaPCollisionManager::isUnregistered | Functor to help unregister one object |
fcl::Item< N > | |
fcl::IVector3 | |
fcl::Joint | Base Joint |
fcl::JointConfig | |
fcl::KDOP< N > | KDOP class describes the KDOP collision structures |
fcl::kIOS | A class describing the kIOS collision structure, which is a set of spheres |
fcl::Link | |
fcl::details::Matrix3Data< T > | |
fcl::Matrix3fX< T > | Matrix2 class wrapper. the core data is in the template parameter class |
fcl::MeshCollisionTraversalNode< BV > | Traversal node for collision between two meshes |
fcl::MeshCollisionTraversalNodekIOS | |
fcl::MeshCollisionTraversalNodeOBB | Traversal node for collision between two meshes if their underlying BVH node is oriented node (OBB, RSS, OBBRSS, kIOS) |
fcl::MeshCollisionTraversalNodeOBBRSS | |
fcl::MeshCollisionTraversalNodeRSS | |
fcl::MeshConservativeAdvancementTraversalNode< BV > | Continuous collision node using conservative advancement. when using this default version, must refit the BVH in current configuration (R_t, T_t) into default configuration |
fcl::MeshConservativeAdvancementTraversalNodeOBBRSS | |
fcl::MeshConservativeAdvancementTraversalNodeRSS | |
fcl::MeshContinuousCollisionTraversalNode< BV > | Traversal node for continuous collision between meshes |
fcl::MeshDistanceTraversalNode< BV > | Traversal node for distance computation between two meshes |
fcl::MeshDistanceTraversalNodekIOS | |
fcl::MeshDistanceTraversalNodeOBBRSS | |
fcl::MeshDistanceTraversalNodeRSS | Traversal node for distance computation between two meshes if their underlying BVH node is oriented node (RSS, OBBRSS, kIOS) |
fcl::MeshOcTreeCollisionTraversalNode< BV, NarrowPhaseSolver > | Traversal node for mesh-octree collision |
fcl::MeshOcTreeDistanceTraversalNode< BV, NarrowPhaseSolver > | Traversal node for mesh-octree distance |
fcl::MeshShapeCollisionTraversalNode< BV, S, NarrowPhaseSolver > | Traversal node for collision between mesh and shape |
fcl::MeshShapeCollisionTraversalNodekIOS< S, NarrowPhaseSolver > | |
fcl::MeshShapeCollisionTraversalNodeOBB< S, NarrowPhaseSolver > | Traversal node for mesh and shape, when mesh BVH is one of the oriented node (OBB, RSS, OBBRSS, kIOS) |
fcl::MeshShapeCollisionTraversalNodeOBBRSS< S, NarrowPhaseSolver > | |
fcl::MeshShapeCollisionTraversalNodeRSS< S, NarrowPhaseSolver > | |
fcl::MeshShapeConservativeAdvancementTraversalNode< BV, S, NarrowPhaseSolver > | Traversal node for conservative advancement computation between BVH and shape |
fcl::MeshShapeConservativeAdvancementTraversalNodeOBBRSS< S, NarrowPhaseSolver > | |
fcl::MeshShapeConservativeAdvancementTraversalNodeRSS< S, NarrowPhaseSolver > | |
fcl::MeshShapeDistanceTraversalNode< BV, S, NarrowPhaseSolver > | Traversal node for distance between mesh and shape |
fcl::MeshShapeDistanceTraversalNodekIOS< S, NarrowPhaseSolver > | |
fcl::MeshShapeDistanceTraversalNodeOBBRSS< S, NarrowPhaseSolver > | |
fcl::MeshShapeDistanceTraversalNodeRSS< S, NarrowPhaseSolver > | Traversal node for distance between mesh and shape, when mesh BVH is one of the oriented node (RSS, OBBRSS, kIOS) |
fcl::details::MinkowskiDiff | Minkowski difference class of two shapes |
fcl::Model | |
fcl::ModelConfig | |
fcl::ModelParseError | |
fcl::morton_functor< T > | Functor to compute the morton code for a given AABB |
fcl::morton_functor< boost::dynamic_bitset<> > | Functor to compute n bit morton code for a given AABB |
fcl::morton_functor< FCL_UINT32 > | Functor to compute 30 bit morton code for a given AABB |
fcl::morton_functor< FCL_UINT64 > | Functor to compute 60 bit morton code for a given AABB |
fcl::MotionBase | |
fcl::NaiveCollisionManager | Brute force N-body collision manager |
fcl::NearestNeighbors< _T > | Abstract representation of a container that can perform nearest neighbors queries |
fcl::NearestNeighborsGNAT< _T > | Geometric Near-neighbor Access Tree (GNAT), a data structure for nearest neighbor search |
fcl::NearestNeighborsLinear< _T > | A nearest neighbors datastructure that uses linear search |
fcl::NearestNeighborsSqrtApprox< _T > | A nearest neighbors datastructure that uses linear search |
fcl::NearestNeighborsGNAT< _T >::Node | The class used internally to define the GNAT |
fcl::NodeBase< BV > | Dynamic AABB tree node |
fcl::implementation_array::NodeBase< BV > | |
fcl::implementation_array::nodeBaseLess< BV > | Functor comparing two nodes |
noncopyable | |
fcl::OBB | Oriented bounding box class |
fcl::OBBRSS | Class merging the OBB and RSS, can handle collision and distance simultaneously |
fcl::OcTree | Octree is one type of collision geometry which can encode uncertainty information in the sensor data |
fcl::OcTreeCollisionTraversalNode< NarrowPhaseSolver > | Traversal node for octree collision |
fcl::OcTreeDistanceTraversalNode< NarrowPhaseSolver > | Traversal node for octree distance |
fcl::OcTreeMeshCollisionTraversalNode< BV, NarrowPhaseSolver > | Traversal node for octree-mesh collision |
fcl::OcTreeMeshDistanceTraversalNode< BV, NarrowPhaseSolver > | Traversal node for octree-mesh distance |
fcl::OcTreeShapeCollisionTraversalNode< S, NarrowPhaseSolver > | Traversal node for octree-shape collision |
fcl::OcTreeShapeDistanceTraversalNode< S, NarrowPhaseSolver > | Traversal node for octree-shape distance |
fcl::OcTreeSolver< NarrowPhaseSolver > | Algorithms for collision related with octree |
fcl::PenetrationDepthRequest | |
fcl::PenetrationDepthResult | |
fcl::Plane | Infinite plane |
fcl::PolySolver | A class solves polynomial degree (1,2,3) equations |
fcl::PredictResult | |
fcl::PrismaticJoint | |
fcl::tools::Profiler | This is a simple thread-safe tool for counting time spent in various chunks of code |
fcl::Project | Project functions |
fcl::Project::ProjectResult | |
fcl::Quaternion3f | Quaternion used locally by InterpMotion |
Eigen::internal::remove_fcl< Derived > | |
Eigen::internal::remove_fcl< const FclMatrix< T, Col, Options > > | |
Eigen::internal::remove_fcl< const FclOp< Derived > > | |
Eigen::internal::remove_fcl< FclMatrix< T, Col, Options > > | |
Eigen::internal::remove_fcl< FclOp< Derived > > | |
fcl::RevoluteJoint | |
fcl::RNG | Random number generation |
fcl::RSS | A class for rectangle sphere-swept bounding volume |
fcl::SamplerBase | |
fcl::SamplerR< N > | |
fcl::SamplerSE2 | |
fcl::SamplerSE2_disk | |
fcl::SamplerSE3Euler | |
fcl::SamplerSE3Euler_ball | |
fcl::SamplerSE3Quat | |
fcl::SamplerSE3Quat_ball | |
fcl::SaPCollisionManager::SaPAABB | SAP interval for one object |
fcl::SaPCollisionManager | Rigorous SAP collision manager |
fcl::IntervalTreeCollisionManager::SAPInterval | Extention interval tree's interval to SAP interval, adding more information |
fcl::SaPCollisionManager::SaPPair | A pair of objects that are not culling away and should further check collision |
fcl::Scaler< N > | |
fcl::tools::Profiler::ScopedBlock | This instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope |
fcl::tools::Profiler::ScopedStart | This instance will call Profiler::start() when constructed and Profiler::stop() when it goes out of scope |
fcl::ScrewMotion | |
fcl::ShapeBase | Base class for all basic geometric shapes |
fcl::ShapeBVHCollisionTraversalNode< S, BV > | Traversal node for collision between shape and BVH |
fcl::ShapeBVHDistanceTraversalNode< S, BV > | Traversal node for distance computation between shape and BVH |
fcl::ShapeCollisionTraversalNode< S1, S2, NarrowPhaseSolver > | Traversal node for collision between two shapes |
fcl::ShapeConservativeAdvancementTraversalNode< S1, S2, NarrowPhaseSolver > | |
fcl::ShapeDistanceTraversalNode< S1, S2, NarrowPhaseSolver > | Traversal node for distance between two shapes |
fcl::ShapeMeshCollisionTraversalNode< S, BV, NarrowPhaseSolver > | Traversal node for collision between shape and mesh |
fcl::ShapeMeshCollisionTraversalNodekIOS< S, NarrowPhaseSolver > | |
fcl::ShapeMeshCollisionTraversalNodeOBB< S, NarrowPhaseSolver > | Traversal node for shape and mesh, when mesh BVH is one of the oriented node (OBB, RSS, OBBRSS, kIOS) |
fcl::ShapeMeshCollisionTraversalNodeOBBRSS< S, NarrowPhaseSolver > | |
fcl::ShapeMeshCollisionTraversalNodeRSS< S, NarrowPhaseSolver > | |
fcl::ShapeMeshConservativeAdvancementTraversalNode< S, BV, NarrowPhaseSolver > | |
fcl::ShapeMeshConservativeAdvancementTraversalNodeOBBRSS< S, NarrowPhaseSolver > | |
fcl::ShapeMeshConservativeAdvancementTraversalNodeRSS< S, NarrowPhaseSolver > | |
fcl::ShapeMeshDistanceTraversalNode< S, BV, NarrowPhaseSolver > | Traversal node for distance between shape and mesh |
fcl::ShapeMeshDistanceTraversalNodekIOS< S, NarrowPhaseSolver > | |
fcl::ShapeMeshDistanceTraversalNodeOBBRSS< S, NarrowPhaseSolver > | |
fcl::ShapeMeshDistanceTraversalNodeRSS< S, NarrowPhaseSolver > | |
fcl::ShapeOcTreeCollisionTraversalNode< S, NarrowPhaseSolver > | Traversal node for shape-octree collision |
fcl::ShapeOcTreeDistanceTraversalNode< S, NarrowPhaseSolver > | Traversal node for shape-octree distance |
fcl::SimpleHashTable< Key, Data, HashFnc > | A simple hash table implemented as multiple buckets. HashFnc is any extended hash function: HashFnc(key) = {index1, index2, ..., } |
fcl::SimpleInterval | Interval trees implemented using red-black-trees as described in the book Introduction_To_Algorithms_ by Cormen, Leisserson, and Rivest |
fcl::details::GJK::Simplex | |
fcl::details::GJK::SimplexV | |
fcl::SparseHashTable< Key, Data, HashFnc, TableT > | A hash table implemented using unordered_map |
fcl::SpatialHash | Spatial hash function: hash an AABB to a set of integer values |
fcl::SpatialHashingCollisionManager< HashTable > | Spatial hashing collision mananger |
fcl::Sphere | Center at zero point sphere |
fcl::SplineMotion | |
fcl::SSaPCollisionManager | Simple SAP collision manager |
fcl::details::sse_meta_d4 | |
fcl::details::sse_meta_f12 | |
fcl::details::sse_meta_f16 | |
fcl::details::sse_meta_f4 | |
fcl::SVMClassifier< N > | |
fcl::TaylorModel | TaylorModel implements a third order Taylor model, i.e., a cubic approximation of a function over a time interval, with an interval remainder |
fcl::TaylorReturnType< Col > | |
fcl::TaylorReturnType< 1 > | |
fcl::TaylorReturnType< 3 > | |
fcl::TBVMotionBoundVisitor< BV > | |
fcl::TimeInterval | |
fcl::TMatrix3 | |
Eigen::internal::traits< FclMatrix< T, Cols, _Options > > | |
Eigen::internal::traits< FclOp< T > > | |
fcl::Transform3f | Simple transform class used locally by InterpMotion |
fcl::TranslationMotion | |
fcl::TraversalNodeBase | Node structure encoding the information required for traversal |
fcl::Triangle | Triangle with 3 indices for points |
fcl::TriangleDistance | Triangle distance functions |
fcl::TriangleMotionBoundVisitor | |
fcl::TriangleP | Triangle stores the points instead of only indices of points |
fcl::TVector3 | |
Eigen::UnaryReturnType< Derived > | |
fcl::unordered_map_hash_table< U, V > | |
fcl::Variance3f | Class for variance matrix in 3d |
fcl::details::Vec3Data< T > | |
fcl::Vec3fX< T > | Vector3 class wrapper. The core data is in the template parameter class |
fcl::Vec_n< T, N > | |
fcl::Vecnf< N > | |