Go to the documentation of this file.
26 #ifndef TESSERACT_COLLISION_CONVEX_DECOMPOSITION_VHACD_H
27 #define TESSERACT_COLLISION_CONVEX_DECOMPOSITION_VHACD_H
29 #define ENABLE_VHACD_IMPLEMENTATION 1
69 using Ptr = std::shared_ptr<ConvexDecompositionVHACD>;
70 using ConstPtr = std::shared_ptr<const ConvexDecompositionVHACD>;
76 const Eigen::VectorXi& faces)
const override;
83 #endif // TESSERACT_COLLISION_CONVEX_DECOMPOSITION_VHACD_H
std::shared_ptr< const ConvexDecomposition > ConstPtr
uint32_t min_edge_length
Once a voxel patch has an edge length of less than 4 on all 3 sides, we don't keep recursing.
Convex decomposition interface.
double minimum_volume_percent_error_allowed
if the voxels are within 1% of the volume of the hull, we consider this a close enough approximation
#define TESSERACT_COMMON_IGNORE_WARNINGS_PUSH
std::shared_ptr< ConvexDecomposition > Ptr
ConvexDecompositionVHACD()=default
uint32_t max_convex_hulls
The maximum number of convex hulls to produce.
bool find_best_plane
Whether or not to attempt to split planes along the best location. Experimental feature....
std::vector< Eigen::Vector3d > VectorVector3d
VHACD::FillMode fill_mode
How to fill the interior of the voxelized mesh.
uint32_t resolution
The voxel resolution to use.
uint32_t max_recursion_depth
The maximum recursion depth.
bool async_ACD
Whether or not to run asynchronously, taking advantage of additional cores.
std::vector< std::shared_ptr< tesseract_geometry::ConvexMesh > > compute(const tesseract_common::VectorVector3d &vertices, const Eigen::VectorXi &faces) const override
Run convex decomposition algorithm.
uint32_t max_num_vertices_per_ch
The maximum number of vertices allowed in any output convex hull.
bool shrinkwrap
Whether or not to shrinkwrap the voxel positions to the source mesh on output.