Namespaces | |
namespace | io |
Classes | |
class | AdvancingFront |
class | AdvancingTest |
class | Allocator |
class | Append |
class | AreaPreservingTextureOptimizer |
class | AttributeSeam |
class | AverageColorCell |
class | BallPivoting |
struct | BaseMeshTypeHolder |
class | BitQuad |
class | BitQuadCreation |
class | BitQuadOptimization |
class | Clean |
Class of static functions to clean/correct/restore meshs. More... | |
class | ClosestFaceIterator |
class | ClosestVertexIterator |
class | Clustering |
class | ConnectedIterator |
struct | Der |
struct | DummyContainer |
class | EdgeCollapse |
class | EMCLookUpTable |
struct | EuclideanDistance |
struct | EvenParam |
struct | EvenPointLoop |
class | ExtendedMarchingCubes |
This class implements the Extended Marching Cubes algorithm. More... | |
class | FaceTmark |
class | FourPCS |
class | FrontEdge |
class | GenericVertexInterpolator |
class | Geo |
class | GeometricInterpolator |
class | HalfEdgeTopology |
Class containing functions to modify the topology of a halfedge based mesh. More... | |
class | HashedPoint3i |
struct | Hinge |
class | Hole |
class | Inertia |
struct | InsertedV |
class | Inside |
class | MarchingCubes |
This class implements the Marching Cubes algorithm. More... | |
class | MCLookUpTable |
struct | MeshTypeHolder |
struct | MeshTypeHolder< T, CONT, AllTypes::AEdgeType > |
struct | MeshTypeHolder< T, CONT, AllTypes::AFaceType > |
struct | MeshTypeHolder< T, CONT, AllTypes::AHEdgeType > |
struct | MeshTypeHolder< T, CONT, AllTypes::AVertexType > |
class | MinimumWeightEar |
class | NearestToCenter |
struct | OddPointLoop |
class | Pivot |
class | PlanarEdgeFlip |
struct | PolygonSupport |
This class is used convert between polygonal meshes and triangular meshes. More... | |
class | QInfoStandard |
class | Resampler |
class | SelfIntersectionEar |
class | Smooth |
Class of static functions to smooth and fair meshes and their attributes. More... | |
class | Stat |
class | SurfaceSampling |
class | TextureOptimizer |
class | Tmark |
class | TopoEdgeFlip |
class | TriEdgeCollapse |
class | TriEdgeCollapseQuadric |
class | TriEdgeCollapseQuadricParameter |
class | TriEdgeFlip |
class | TriMesh |
class | TriMeshClipper |
class | TriRayIterator |
class | TrivialEar |
class | TrivialSampler |
class | TrivialWalker |
class | UpdateBounding |
Management, updating and computation of per-vertex and per-face normals. More... | |
class | UpdateColor |
Generation of per-vertex and per-face colors according to various strategy. More... | |
class | UpdateCurvature |
Management, updating and computation of per-vertex and per-face normals. More... | |
class | UpdateCurvatureFitting |
Computation of per-vertex directions and values of curvature. More... | |
class | UpdateEdges |
This class is used to compute or update the precomputed data used to efficiently compute point-face distances. More... | |
class | UpdateFlags |
Management, updating and computation of per-vertex and per-face flags (like border flags). More... | |
class | UpdateHalfEdges |
This class is used to build edge based data structure from indexed data structure and viceversa. More... | |
struct | UpdateIndexed |
class | UpdateNormals |
Management, updating and computation of per-vertex and per-face normals. More... | |
class | UpdatePosition |
This class is used to update vertex position according to a transformation matrix. More... | |
class | UpdateQuality |
Generation of per-vertex and per-face qualities. More... | |
class | UpdateSelection |
Management, updating and computation of per-vertex and per-face normals. More... | |
class | UpdateTexture |
This class is used to update vertex position according to a transformation matrix. More... | |
class | UpdateTopology |
Generation of per-vertex and per-face topological information. More... | |
class | VertTmark |
Functions | |
template<class MeshType > | |
void | Box (MeshType &in, const typename MeshType::BoxType &bb) |
template<class MeshType , class V , class F > | |
void | Build (MeshType &in, const V &v, const F &f) |
template<class MeshType > | |
void | Cone (MeshType &in, const typename MeshType::ScalarType r1, const typename MeshType::ScalarType r2, const typename MeshType::ScalarType h, const int SubDiv=36) |
r1 = raggio 1, r2 = raggio2, h = altezza (asse y) | |
template<class MESH_TYPE > | |
void | CreaseCut (MESH_TYPE &m, float angleRad) |
template<class MeshType > | |
void | Cylinder (int slices, int stacks, MeshType &m) |
template<class DodMeshType > | |
void | Dodecahedron (DodMeshType &in) |
template<class MESH , class GRID > | |
GRID::ObjPtr | DoRay (MESH &mesh, GRID &gr, const Ray3< typename GRID::ScalarType > &_ray, const typename GRID::ScalarType &_maxDist, typename GRID::ScalarType &_t, typename GRID::CoordType &_normf) |
template<class MESH , class GRID > | |
GRID::ObjPtr | DoRay (MESH &mesh, GRID &gr, const Ray3< typename GRID::ScalarType > &_ray, const typename GRID::ScalarType &_maxDist, typename GRID::ScalarType &_t) |
template<class MeshType > | |
void | FaceGrid (MeshType &in, const std::vector< int > &grid, int w, int h) |
template<class MeshType > | |
void | FaceGrid (MeshType &in, int w, int h) |
template<class MeshType > | |
void | GenerateCameraMesh (MeshType &in) |
template<class MESH , class GRID > | |
MESH::FaceType * | GetClosestFace (MESH &mesh, GRID &gr, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_maxDist, typename GRID::ScalarType &_minDist, typename GRID::CoordType &_closestPt) |
template<class MESH , class GRID > | |
MESH::FaceType * | GetClosestFace (MESH &mesh, GRID &gr, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_maxDist, typename GRID::ScalarType &_minDist, typename GRID::CoordType &_closestPt, typename GRID::CoordType &_normf, typename GRID::CoordType &_ip) |
template<class MESH , class GRID > | |
MESH::FaceType * | GetClosestFaceNormal (MESH &mesh, GRID &gr, const typename MESH::VertexType &_p, const typename GRID::ScalarType &_maxDist, typename GRID::ScalarType &_minDist, typename GRID::CoordType &_closestPt) |
template<class MESH , class GRID > | |
MESH::VertexType * | GetClosestVertex (MESH &mesh, GRID &gr, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_maxDist, typename GRID::ScalarType &_minDist) |
template<class MESH , class GRID > | |
MESH::VertexType * | GetClosestVertexNormal (MESH &mesh, GRID &gr, const typename MESH::VertexType &_p, const typename GRID::ScalarType &_maxDist, typename GRID::ScalarType &_minDist) |
template<class MESH , class GRID , class OBJPTRCONTAINER > | |
unsigned int | GetInBoxFace (MESH &mesh, GRID &gr, const vcg::Box3< typename GRID::ScalarType > _bbox, OBJPTRCONTAINER &_objectPtrs) |
template<class MESH , class GRID , class OBJPTRCONTAINER > | |
unsigned int | GetInBoxVertex (MESH &mesh, GRID &gr, const vcg::Box3< typename GRID::ScalarType > _bbox, OBJPTRCONTAINER &_objectPtrs) |
template<class MESH , class GRID , class OBJPTRCONTAINER , class DISTCONTAINER , class POINTCONTAINER > | |
unsigned int | GetInSphereFace (MESH &mesh, GRID &gr, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_r, OBJPTRCONTAINER &_objectPtrs, DISTCONTAINER &_distances, POINTCONTAINER &_points) |
template<class MESH , class GRID , class OBJPTRCONTAINER , class DISTCONTAINER , class POINTCONTAINER > | |
unsigned int | GetInSphereVertex (MESH &mesh, GRID &gr, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_r, OBJPTRCONTAINER &_objectPtrs, DISTCONTAINER &_distances, POINTCONTAINER &_points) |
template<class MESH , class GRID , class OBJPTRCONTAINER , class DISTCONTAINER , class POINTCONTAINER > | |
unsigned int | GetKClosestFace (MESH &mesh, GRID &gr, const unsigned int _k, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_maxDist, OBJPTRCONTAINER &_objectPtrs, DISTCONTAINER &_distances, POINTCONTAINER &_points) |
template<class MESH , class GRID , class OBJPTRCONTAINER , class DISTCONTAINER , class POINTCONTAINER > | |
unsigned int | GetKClosestFaceBase (MESH &mesh, GRID &gr, const unsigned int _k, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_maxDist, OBJPTRCONTAINER &_objectPtrs, DISTCONTAINER &_distances, POINTCONTAINER &_points) |
template<class MESH , class GRID , class OBJPTRCONTAINER , class DISTCONTAINER , class POINTCONTAINER > | |
unsigned int | GetKClosestVertex (MESH &mesh, GRID &gr, const unsigned int _k, const typename GRID::CoordType &_p, const typename GRID::ScalarType &_maxDist, OBJPTRCONTAINER &_objectPtrs, DISTCONTAINER &_distances, POINTCONTAINER &_points) |
template<class MeshType > | |
void | Grid (MeshType &in, int w, int h, float wl, float hl, float *data) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasEEAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasEFAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasEHAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasEVAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasFEAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertContainerType , class FaceType , class Container1 , class Container2 > | |
bool | HasFFAdjacency (const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasFFAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasFHAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasFVAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasHEAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasHFAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasHNextAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasHOppAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasHPrevAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasHVAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class MESH_TYPE > | |
bool | HasPerFaceAttribute (const MESH_TYPE &m, std::string name) |
template<class VertContainerType , class FaceType , class Container1 , class Container2 > | |
bool | HasPerFaceColor (const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerFaceColor (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerFaceFlags (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertContainerType , class FaceType , class Container1 , class Container2 > | |
bool | HasPerFaceMark (const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerFaceMark (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerFaceNormal (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertContainerType , class FaceType , class Container1 , class Container2 > | |
bool | HasPerFaceQuality (const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerFaceQuality (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertContainerType , class FaceType , class Container1 , class Container2 > | |
bool | HasPerFaceVFAdjacency (const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerFaceVFAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class MESH_TYPE > | |
bool | HasPerMeshAttribute (const MESH_TYPE &m, std::string name) |
template<class MESH_TYPE > | |
bool | HasPerVertexAttribute (const MESH_TYPE &m, std::string name) |
template<class VertexType , class ContainerType0 , class ContainerType1 , class ContainerType2 > | |
bool | HasPerVertexColor (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexColor (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertexType , class ContainerType0 , class ContainerType1 , class ContainerType2 > | |
bool | HasPerVertexCurvature (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexCurvature (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertexType , class ContainerType0 , class ContainerType1 , class ContainerType2 > | |
bool | HasPerVertexCurvatureDir (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexCurvatureDir (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexFlags (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexMark (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertexType , class ContainerType0 , class ContainerType1 , class ContainerType2 > | |
bool | HasPerVertexNormal (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexNormal (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertexType , class ContainerType0 , class ContainerType1 , class ContainerType2 > | |
bool | HasPerVertexQuality (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexQuality (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertexType , class ContainerType0 , class ContainerType1 , class ContainerType2 > | |
bool | HasPerVertexRadius (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexRadius (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertexType , class ContainerType0 , class ContainerType1 , class ContainerType2 > | |
bool | HasPerVertexTexCoord (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexTexCoord (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertexType , class ContainerType0 , class Container1 , class Container2 > | |
bool | HasPerVertexVFAdjacency (const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, Container1, Container2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerVertexVFAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerWedgeColor (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerWedgeNormal (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class VertContainerType , class FaceType , class Container1 , class Container2 > | |
bool | HasPerWedgeTexCoord (const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > &m) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasPerWedgeTexCoord (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasVEAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class ContainerType0 , class ContainerType1 , class ContainerType2 , class ContainerType3 > | |
bool | HasVHAdjacency (const TriMesh< ContainerType0, ContainerType1, ContainerType2, ContainerType3 > &) |
template<class MeshType > | |
void | Hexahedron (MeshType &in) |
template<class IcoMeshType > | |
void | Icosahedron (IcoMeshType &in) |
template<class MeshType > | |
int & | IMark (MeshType &m) |
template<class MeshType > | |
size_t | Index (MeshType &m, typename MeshType::HEdgeType *h) |
template<class MeshType > | |
size_t | Index (MeshType &m, typename MeshType::EdgeType *e) |
template<class MeshType > | |
size_t | Index (MeshType &m, const typename MeshType::FaceType *fp) |
template<class MeshType > | |
size_t | Index (MeshType &m, const typename MeshType::VertexType *vp) |
template<class MeshType > | |
size_t | Index (MeshType &m, typename MeshType::HEdgeType &h) |
template<class MeshType > | |
size_t | Index (MeshType &m, typename MeshType::EdgeType &e) |
template<class MeshType > | |
size_t | Index (MeshType &m, typename MeshType::FaceType &f) |
template<class MeshType > | |
size_t | Index (MeshType &m, typename MeshType::VertexType &v) |
template<class MeshType > | |
void | InitFaceIMark (MeshType &m) |
Initialize the imark-system of the faces. | |
template<class MeshType > | |
void | InitVertexIMark (MeshType &m) |
Initialize the imark-system of the vertices. | |
template<class MESH_TYPE > | |
bool | IsFoldFree (MESH_TYPE &m) |
template<class MeshType > | |
bool | IsMarked (MeshType &m, typename MeshType::ConstFacePointer f) |
template<class MeshType > | |
bool | IsMarked (MeshType &m, typename MeshType::ConstVertexPointer v) |
template<class MeshType > | |
void | Mark (MeshType &m, typename MeshType::FacePointer f) |
template<class MeshType > | |
void | Mark (MeshType &m, typename MeshType::VertexPointer v) |
template<class MESH_TYPE > | |
int | MarkFolds (MESH_TYPE &m) |
template<class OctMeshType > | |
void | Octahedron (OctMeshType &in) |
template<class MESH , class GRID , class OBJPTRCONTAINER , class COORDCONTAINER > | |
void | RaySpherical (MESH &mesh, GRID &gr, const Ray3< typename GRID::ScalarType > &_ray, const typename GRID::ScalarType &_maxDist, const typename GRID::ScalarType &_theta_interval, const typename GRID::ScalarType &_phi_interval, const int &n_samples, OBJPTRCONTAINER &_objectPtrs, COORDCONTAINER &_pos, COORDCONTAINER &_norm) |
template<class MESH_TYPE , class ODD_VERT , class EVEN_VERT > | |
bool | RefineOddEven (MESH_TYPE &m, ODD_VERT odd, EVEN_VERT even, float length, bool RefineSelected=false, CallBackPos *cbOdd=0, CallBackPos *cbEven=0) |
template<class MESH_TYPE , class ODD_VERT , class EVEN_VERT , class PREDICATE > | |
bool | RefineOddEvenE (MESH_TYPE &m, ODD_VERT odd, EVEN_VERT even, PREDICATE edgePred, bool RefineSelected=false, CallBackPos *cbOdd=0, CallBackPos *cbEven=0) |
template<class MeshType , class ATTR_CONT > | |
void | ReorderAttribute (ATTR_CONT &c, std::vector< size_t > &newVertIndex, MeshType &) |
template<class FaceType > | |
void | ReorderFace (std::vector< size_t > &newFaceIndex, face::vector_ocf< FaceType > &faceVec) |
template<class face_type > | |
void | ReorderFace (std::vector< size_t > &, std::vector< face_type > &) |
template<class VertexType > | |
void | ReorderVert (std::vector< size_t > &newVertIndex, vertex::vector_ocf< VertexType > &vertVec) |
template<class vertex_type > | |
void | ReorderVert (std::vector< size_t > &, std::vector< vertex_type > &) |
template<class MeshType , class ATTR_CONT > | |
void | ResizeAttribute (ATTR_CONT &c, const int &, MeshType &m) |
template<class MESH_TYPE > | |
void | SmoothTextureCoords (MESH_TYPE &m) |
template<class MeshType > | |
void | Sphere (MeshType &in, const int subdiv=3) |
template<class MeshType > | |
void | Square (MeshType &in) |
template<class S_MESH_TYPE , class STL_CONT > | |
void | SubSet (S_MESH_TYPE &m, STL_CONT &subSet) |
template<class TetraMeshType > | |
void | Tetrahedron (TetraMeshType &in) |
template<class MeshType > | |
void | UnMarkAll (MeshType &m) |
Unmark the mesh. |
void vcg::tri::CreaseCut | ( | MESH_TYPE & | m, | |
float | angleRad | |||
) | [inline] |
Definition at line 55 of file crease_cut.h.
GRID::ObjPtr vcg::tri::DoRay | ( | MESH & | mesh, | |
GRID & | gr, | |||
const Ray3< typename GRID::ScalarType > & | _ray, | |||
const typename GRID::ScalarType & | _maxDist, | |||
typename GRID::ScalarType & | _t, | |||
typename GRID::CoordType & | _normf | |||
) | [inline] |
Definition at line 421 of file complex/trimesh/closest.h.
GRID::ObjPtr vcg::tri::DoRay | ( | MESH & | mesh, | |
GRID & | gr, | |||
const Ray3< typename GRID::ScalarType > & | _ray, | |||
const typename GRID::ScalarType & | _maxDist, | |||
typename GRID::ScalarType & | _t | |||
) | [inline] |
Definition at line 405 of file complex/trimesh/closest.h.
MESH::FaceType* vcg::tri::GetClosestFace | ( | MESH & | mesh, | |
GRID & | gr, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
typename GRID::ScalarType & | _minDist, | |||
typename GRID::CoordType & | _closestPt | |||
) | [inline] |
Definition at line 241 of file complex/trimesh/closest.h.
MESH::FaceType* vcg::tri::GetClosestFace | ( | MESH & | mesh, | |
GRID & | gr, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
typename GRID::ScalarType & | _minDist, | |||
typename GRID::CoordType & | _closestPt, | |||
typename GRID::CoordType & | _normf, | |||
typename GRID::CoordType & | _ip | |||
) | [inline] |
Definition at line 195 of file complex/trimesh/closest.h.
MESH::FaceType* vcg::tri::GetClosestFaceNormal | ( | MESH & | mesh, | |
GRID & | gr, | |||
const typename MESH::VertexType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
typename GRID::ScalarType & | _minDist, | |||
typename GRID::CoordType & | _closestPt | |||
) | [inline] |
Definition at line 256 of file complex/trimesh/closest.h.
MESH::VertexType* vcg::tri::GetClosestVertex | ( | MESH & | mesh, | |
GRID & | gr, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
typename GRID::ScalarType & | _minDist | |||
) | [inline] |
Definition at line 272 of file complex/trimesh/closest.h.
MESH::VertexType* vcg::tri::GetClosestVertexNormal | ( | MESH & | mesh, | |
GRID & | gr, | |||
const typename MESH::VertexType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
typename GRID::ScalarType & | _minDist | |||
) | [inline] |
Definition at line 288 of file complex/trimesh/closest.h.
unsigned int vcg::tri::GetInBoxFace | ( | MESH & | mesh, | |
GRID & | gr, | |||
const vcg::Box3< typename GRID::ScalarType > | _bbox, | |||
OBJPTRCONTAINER & | _objectPtrs | |||
) | [inline] |
Definition at line 381 of file complex/trimesh/closest.h.
unsigned int vcg::tri::GetInBoxVertex | ( | MESH & | mesh, | |
GRID & | gr, | |||
const vcg::Box3< typename GRID::ScalarType > | _bbox, | |||
OBJPTRCONTAINER & | _objectPtrs | |||
) | [inline] |
Definition at line 393 of file complex/trimesh/closest.h.
unsigned int vcg::tri::GetInSphereFace | ( | MESH & | mesh, | |
GRID & | gr, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _r, | |||
OBJPTRCONTAINER & | _objectPtrs, | |||
DISTCONTAINER & | _distances, | |||
POINTCONTAINER & | _points | |||
) | [inline] |
Definition at line 346 of file complex/trimesh/closest.h.
unsigned int vcg::tri::GetInSphereVertex | ( | MESH & | mesh, | |
GRID & | gr, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _r, | |||
OBJPTRCONTAINER & | _objectPtrs, | |||
DISTCONTAINER & | _distances, | |||
POINTCONTAINER & | _points | |||
) | [inline] |
Definition at line 363 of file complex/trimesh/closest.h.
unsigned int vcg::tri::GetKClosestFace | ( | MESH & | mesh, | |
GRID & | gr, | |||
const unsigned int | _k, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
OBJPTRCONTAINER & | _objectPtrs, | |||
DISTCONTAINER & | _distances, | |||
POINTCONTAINER & | _points | |||
) | [inline] |
Definition at line 304 of file complex/trimesh/closest.h.
unsigned int vcg::tri::GetKClosestFaceBase | ( | MESH & | mesh, | |
GRID & | gr, | |||
const unsigned int | _k, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
OBJPTRCONTAINER & | _objectPtrs, | |||
DISTCONTAINER & | _distances, | |||
POINTCONTAINER & | _points | |||
) | [inline] |
Definition at line 319 of file complex/trimesh/closest.h.
unsigned int vcg::tri::GetKClosestVertex | ( | MESH & | mesh, | |
GRID & | gr, | |||
const unsigned int | _k, | |||
const typename GRID::CoordType & | _p, | |||
const typename GRID::ScalarType & | _maxDist, | |||
OBJPTRCONTAINER & | _objectPtrs, | |||
DISTCONTAINER & | _distances, | |||
POINTCONTAINER & | _points | |||
) | [inline] |
Definition at line 332 of file complex/trimesh/closest.h.
bool vcg::tri::HasFFAdjacency | ( | const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > & | m | ) | [inline] |
Definition at line 684 of file face/component_ocf.h.
bool vcg::tri::HasPerFaceColor | ( | const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > & | m | ) | [inline] |
Definition at line 698 of file face/component_ocf.h.
bool vcg::tri::HasPerFaceMark | ( | const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > & | m | ) | [inline] |
Definition at line 712 of file face/component_ocf.h.
bool vcg::tri::HasPerFaceQuality | ( | const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > & | m | ) | [inline] |
Definition at line 705 of file face/component_ocf.h.
bool vcg::tri::HasPerFaceVFAdjacency | ( | const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > & | m | ) | [inline] |
Definition at line 677 of file face/component_ocf.h.
bool vcg::tri::HasPerVertexColor | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > & | m | ) | [inline] |
Definition at line 723 of file vertex/component_ocf.h.
bool vcg::tri::HasPerVertexCurvature | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > & | m | ) | [inline] |
Definition at line 730 of file vertex/component_ocf.h.
bool vcg::tri::HasPerVertexCurvatureDir | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > & | m | ) | [inline] |
Definition at line 737 of file vertex/component_ocf.h.
bool vcg::tri::HasPerVertexNormal | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > & | m | ) | [inline] |
Definition at line 716 of file vertex/component_ocf.h.
bool vcg::tri::HasPerVertexQuality | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > & | m | ) | [inline] |
Definition at line 702 of file vertex/component_ocf.h.
bool vcg::tri::HasPerVertexRadius | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > & | m | ) | [inline] |
Definition at line 695 of file vertex/component_ocf.h.
bool vcg::tri::HasPerVertexTexCoord | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, ContainerType1, ContainerType2 > & | m | ) | [inline] |
Definition at line 709 of file vertex/component_ocf.h.
bool vcg::tri::HasPerVertexVFAdjacency | ( | const TriMesh< vertex::vector_ocf< VertexType >, ContainerType0, Container1, Container2 > & | m | ) | [inline] |
Definition at line 688 of file vertex/component_ocf.h.
bool vcg::tri::HasPerWedgeTexCoord | ( | const TriMesh< VertContainerType, face::vector_ocf< FaceType >, Container1, Container2 > & | m | ) | [inline] |
Definition at line 691 of file face/component_ocf.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
typename MeshType::HEdgeType * | h | |||
) | [inline] |
Definition at line 56 of file trimesh/allocate.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
typename MeshType::EdgeType * | e | |||
) | [inline] |
Definition at line 54 of file trimesh/allocate.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
const typename MeshType::FaceType * | fp | |||
) | [inline] |
Definition at line 52 of file trimesh/allocate.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
const typename MeshType::VertexType * | vp | |||
) | [inline] |
Definition at line 50 of file trimesh/allocate.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
typename MeshType::HEdgeType & | h | |||
) | [inline] |
Definition at line 47 of file trimesh/allocate.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
typename MeshType::EdgeType & | e | |||
) | [inline] |
Definition at line 45 of file trimesh/allocate.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
typename MeshType::FaceType & | f | |||
) | [inline] |
Definition at line 43 of file trimesh/allocate.h.
size_t vcg::tri::Index | ( | MeshType & | m, | |
typename MeshType::VertexType & | v | |||
) | [inline] |
Definition at line 41 of file trimesh/allocate.h.
bool vcg::tri::IsFoldFree | ( | MESH_TYPE & | m | ) | [inline] |
Definition at line 354 of file textcoord_optimization.h.
int vcg::tri::MarkFolds | ( | MESH_TYPE & | m | ) | [inline] |
Definition at line 375 of file textcoord_optimization.h.
void vcg::tri::RaySpherical | ( | MESH & | mesh, | |
GRID & | gr, | |||
const Ray3< typename GRID::ScalarType > & | _ray, | |||
const typename GRID::ScalarType & | _maxDist, | |||
const typename GRID::ScalarType & | _theta_interval, | |||
const typename GRID::ScalarType & | _phi_interval, | |||
const int & | n_samples, | |||
OBJPTRCONTAINER & | _objectPtrs, | |||
COORDCONTAINER & | _pos, | |||
COORDCONTAINER & | _norm | |||
) | [inline] |
Iteratively Do Ray sampling on spherical coordinates sampling along the two angles
find the normal
Definition at line 453 of file complex/trimesh/closest.h.
bool vcg::tri::RefineOddEven | ( | MESH_TYPE & | m, | |
ODD_VERT | odd, | |||
EVEN_VERT | even, | |||
float | length, | |||
bool | RefineSelected = false , |
|||
CallBackPos * | cbOdd = 0 , |
|||
CallBackPos * | cbEven = 0 | |||
) | [inline] |
Definition at line 192 of file refine_loop.h.
bool vcg::tri::RefineOddEvenE | ( | MESH_TYPE & | m, | |
ODD_VERT | odd, | |||
EVEN_VERT | even, | |||
PREDICATE | edgePred, | |||
bool | RefineSelected = false , |
|||
CallBackPos * | cbOdd = 0 , |
|||
CallBackPos * | cbEven = 0 | |||
) | [inline] |
Definition at line 200 of file refine_loop.h.
void vcg::tri::ReorderAttribute | ( | ATTR_CONT & | c, | |
std::vector< size_t > & | newVertIndex, | |||
MeshType & | ||||
) | [inline] |
Definition at line 69 of file trimesh/allocate.h.
void vcg::tri::ReorderFace | ( | std::vector< size_t > & | newFaceIndex, | |
face::vector_ocf< FaceType > & | faceVec | |||
) | [inline] |
Definition at line 719 of file face/component_ocf.h.
void vcg::tri::ReorderFace | ( | std::vector< size_t > & | , | |
std::vector< face_type > & | ||||
) | [inline] |
Definition at line 62 of file trimesh/allocate.h.
void vcg::tri::ReorderVert | ( | std::vector< size_t > & | newVertIndex, | |
vertex::vector_ocf< VertexType > & | vertVec | |||
) | [inline] |
Definition at line 744 of file vertex/component_ocf.h.
void vcg::tri::ReorderVert | ( | std::vector< size_t > & | , | |
std::vector< vertex_type > & | ||||
) | [inline] |
Definition at line 65 of file trimesh/allocate.h.
void vcg::tri::ResizeAttribute | ( | ATTR_CONT & | c, | |
const int & | , | |||
MeshType & | m | |||
) | [inline] |
Definition at line 76 of file trimesh/allocate.h.
void vcg::tri::SmoothTextureCoords | ( | MESH_TYPE & | m | ) | [inline] |
Definition at line 414 of file textcoord_optimization.h.
void vcg::tri::SubSet | ( | S_MESH_TYPE & | m, | |
STL_CONT & | subSet | |||
) | [inline] |
Definition at line 107 of file trimesh/subset.h.