Classes | Functions
hpp::fcl::internal Namespace Reference

Classes

struct  Loader
 
struct  memory_footprint_evaluator
 
struct  memory_footprint_evaluator< ::hpp::fcl::BVHModel< BV > >
 
struct  Neighbors
 
struct  obbDisjoint_check_Ai_cross_Bi
 
struct  TriangleAndVertices
 

Functions

HPP_FCL_DLLAPI void buildMesh (const fcl::Vec3f &scale, const aiScene *scene, unsigned vertices_offset, TriangleAndVertices &tv)
 Recursive procedure for building a mesh. More...
 
void computeNeighbors (const std::vector< boost::array< FCL_REAL, 6 > > &boxes, std::vector< Neighbors > &neighbors)
 
template<class BoundingVolume >
void meshFromAssimpScene (const fcl::Vec3f &scale, const aiScene *scene, const shared_ptr< BVHModel< BoundingVolume > > &mesh)
 Convert an assimp scene to a mesh. More...
 
FCL_REAL obbDisjoint_check_A_axis (const Vec3f &T, const Vec3f &a, const Vec3f &b, const Matrix3f &Bf)
 
FCL_REAL obbDisjoint_check_B_axis (const Matrix3f &B, const Vec3f &T, const Vec3f &a, const Vec3f &b, const Matrix3f &Bf)
 
unsigned recurseBuildMesh (const fcl::Vec3f &scale, const aiScene *scene, const aiNode *node, unsigned vertices_offset, TriangleAndVertices &tv)
 Recursive procedure for building a mesh. More...
 
void updateDistanceLowerBoundFromBV (const CollisionRequest &, CollisionResult &res, const FCL_REAL &sqrDistLowerBound)
 
void updateDistanceLowerBoundFromLeaf (const CollisionRequest &, CollisionResult &res, const FCL_REAL &distance, const Vec3f &p0, const Vec3f &p1)
 

Function Documentation

◆ buildMesh()

void hpp::fcl::internal::buildMesh ( const fcl::Vec3f scale,
const aiScene *  scene,
unsigned  vertices_offset,
TriangleAndVertices tv 
)

Recursive procedure for building a mesh.

Parameters
[in]scaleScale to apply when reading the ressource
[in]scenePointer to the assimp scene
[in]vertices_offsetCurrent number of vertices in the model
tvTriangles and Vertices of the mesh submodels

Definition at line 158 of file assimp.cpp.

◆ computeNeighbors()

void hpp::fcl::internal::computeNeighbors ( const std::vector< boost::array< FCL_REAL, 6 > > &  boxes,
std::vector< Neighbors > &  neighbors 
)

Definition at line 57 of file src/octree.cpp.

◆ meshFromAssimpScene()

template<class BoundingVolume >
void hpp::fcl::internal::meshFromAssimpScene ( const fcl::Vec3f scale,
const aiScene *  scene,
const shared_ptr< BVHModel< BoundingVolume > > &  mesh 
)
inline

Convert an assimp scene to a mesh.

Parameters
[in]scaleScale to apply when reading the ressource
[in]scenePointer to the assimp scene
[out]meshThe mesh that must be built

Definition at line 91 of file assimp.h.

◆ obbDisjoint_check_A_axis()

FCL_REAL hpp::fcl::internal::obbDisjoint_check_A_axis ( const Vec3f T,
const Vec3f a,
const Vec3f b,
const Matrix3f Bf 
)
inline

Definition at line 290 of file OBB.cpp.

◆ obbDisjoint_check_B_axis()

FCL_REAL hpp::fcl::internal::obbDisjoint_check_B_axis ( const Matrix3f B,
const Vec3f T,
const Vec3f a,
const Vec3f b,
const Matrix3f Bf 
)
inline

Definition at line 298 of file OBB.cpp.

◆ recurseBuildMesh()

unsigned hpp::fcl::internal::recurseBuildMesh ( const fcl::Vec3f scale,
const aiScene *  scene,
const aiNode *  node,
unsigned  vertices_offset,
TriangleAndVertices tv 
)

Recursive procedure for building a mesh.

Parameters
[in]scaleScale to apply when reading the ressource
[in]scenePointer to the assimp scene
[in]nodeCurrent node of the scene
[in]vertices_offsetCurrent number of vertices in the model
tvTriangles and Vertices of the mesh submodels

Definition at line 109 of file assimp.cpp.

◆ updateDistanceLowerBoundFromBV()

void hpp::fcl::internal::updateDistanceLowerBoundFromBV ( const CollisionRequest ,
CollisionResult res,
const FCL_REAL sqrDistLowerBound 
)
inline

Definition at line 538 of file collision_data.h.

◆ updateDistanceLowerBoundFromLeaf()

void hpp::fcl::internal::updateDistanceLowerBoundFromLeaf ( const CollisionRequest ,
CollisionResult res,
const FCL_REAL distance,
const Vec3f p0,
const Vec3f p1 
)
inline

Definition at line 547 of file collision_data.h.



hpp-fcl
Author(s):
autogenerated on Fri Jun 2 2023 02:39:03