Classes |
class | BitFlags |
| Component: Per face Flags More...
|
class | Color |
class | Color4b |
class | Color4bOcc |
class | Color4bOcf |
class | ColorOcc |
| *-------------------------- COLOR ----------------------------------------*/ More...
|
class | ColorOcf |
| *-------------------------- COLOR ----------------------------------*/ More...
|
class | CurvatureDir |
struct | CurvatureDirBaseType |
class | CurvatureDird |
class | CurvatureDirdOcf |
class | CurvatureDirf |
class | CurvatureDirfOcf |
class | CurvatureDirOcf |
struct | CurvatureDirOcfBaseType |
class | EdgePlane |
| Per Face Precomputed Edge/Plane. More...
|
struct | EdgePlaneInfo |
class | EFAdj |
class | EmptyCore |
class | EmptyEdgePlane |
class | FEAdj |
class | FFAdj |
| Component: Per Face Face-Face adjacency relation More...
|
class | FFAdjOcc |
class | FFAdjOccBase |
class | FFAdjOcf |
struct | FFAdjTypeSup |
class | FHAdj |
class | InfoOcc |
class | InfoOccBase |
| *-------------------------- FACEINFO ----------------------------------------*/ More...
|
class | InfoOcf |
| *-------------------------- InfoOpt ----------------------------------*/ More...
|
class | JumpingPos |
class | Mark |
| Per vertex Incremental Mark. More...
|
class | MarkOcc |
| *-------------------------- MARK ----------------------------------------*/ More...
|
class | MarkOcf |
| *-------------------------- MARK ----------------------------------*/ More...
|
class | Normal3d |
class | Normal3dOcc |
class | Normal3dOcf |
class | Normal3f |
class | Normal3fOcc |
class | Normal3fOcf |
class | Normal3s |
class | Normal3sOcc |
class | Normal3sOcf |
class | NormalAbs |
class | NormalOcc |
| *-------------------------- NORMAL ----------------------------------------*/ More...
|
class | NormalOcf |
class | PFEAdj |
class | PFFAdj |
class | PFHAdj |
class | PFVAdj |
class | PointDistanceBaseFunctor |
class | PointDistanceEPFunctor |
class | PointNormalDistanceFunctor |
class | PolyInfo |
class | Pos |
class | PVFAdj |
class | Quality |
class | Quality3 |
class | Quality3d |
class | Quality3f |
class | Quality3s |
class | Qualityd |
class | Qualityf |
class | QualityfOcf |
class | QualityOcf |
| *-------------------------- QUALITY ----------------------------------*/ More...
|
class | Qualitys |
class | vector_ocf |
class | VertexRef |
| The references to the vertexes of a triangular face. More...
|
class | VertexRefOcc |
class | VFAdj |
| Component: Per Face Vertex-Face adjacency relation More...
|
class | VFAdjOcc |
class | VFAdjOccBase |
class | VFAdjOcf |
struct | VFAdjTypeSup |
class | VFIterator |
class | WedgeColor |
class | WedgeColor4b |
class | WedgeColor4bOcf |
class | WedgeColor4f |
class | WedgeColorOcf |
| *-------------------------- WEDGE COLOR ----------------------------------*/ More...
|
class | WedgeNormal |
class | WedgeNormal3dOcf |
class | WedgeNormal3fOcf |
class | WedgeNormal3sOcf |
class | WedgeNormalOcf |
| *-------------------------- WEDGE NORMAL ----------------------------------*/ More...
|
class | WedgeRealNormal |
class | WedgeRealNormal3d |
class | WedgeRealNormal3f |
class | WedgeRealNormal3s |
class | WedgeTexCoord |
class | WedgeTexCoord2d |
class | WedgeTexCoord2f |
class | WedgeTexCoord2s |
class | WedgeTexCoordfOcc |
class | WedgeTexCoordfOcf |
class | WedgeTexCoordOcc |
| *-------------------------- WedgeTexCoordOcc ----------------------------------------*/ More...
|
class | WedgeTexCoordOcf |
| *-------------------------- WEDGE TEXCOORD ----------------------------------*/ More...
|
Functions |
template<class FaceType > |
void | AssertAdj (FaceType &f) |
template<class FaceType > |
int | BorderCount (FaceType const &f) |
| Count border edges of the face.
|
template<class FaceType > |
bool | CheckFlipEdge (FaceType &f, int z) |
template<class FaceType > |
bool | CheckFlipEdgeNormal (FaceType &f, const int z, const float angleRad) |
template<class FaceType > |
bool | CheckOrientation (FaceType &f, int z) |
template<class FaceType > |
int | ComplexSize (FaceType &f, const int e) |
| Counts the number of incident faces in a complex edge.
|
template<class T > |
void | ComputeNormal (T &f) |
template<class FaceType > |
int | CountSharedVertex (FaceType *f0, FaceType *f1) |
template<class FaceType > |
FaceType::ScalarType | DihedralAngleRad (FaceType &f, const int i) |
| Compute the signed dihedral angle between the normals of two adjacent faces.
|
template<class FaceType > |
void | EFStarFF (FaceType *fp, int ei, std::vector< FaceType * > &faceVec, std::vector< int > &indVed) |
| Compute the set of faces incident onto a given edge using FF adjacency.
|
template<class FaceType > |
void | FFAttach (FaceType *&f, int z1, FaceType *&f2, int z2) |
template<class FaceType > |
void | FFAttachManifold (FaceType *&f1, int z1, FaceType *&f2, int z2) |
template<class FaceType > |
bool | FFCorrectness (FaceType &f, const int e) |
template<class FaceType > |
void | FFDetach (FaceType &f, const int e) |
template<class FaceType > |
void | FFDetachManifold (FaceType &f, const int e) |
template<class MeshType > |
void | FFEdgeCollapse (MeshType &m, typename MeshType::FaceType &f, const int z) |
template<class FaceType > |
static void | FFExtendedStarFF (FaceType *fp, const int num_step, std::vector< FaceType * > &faceVec) |
template<class FaceType > |
bool | FFLinkCondition (FaceType &f, const int z) |
template<class FaceType > |
void | FFSetBorder (FaceType *&f1, int z1) |
template<class FaceType > |
bool | FindSharedEdge (FaceType *f0, FaceType *f1, int &i, int &j) |
template<class FaceType > |
bool | FindSharedFaces (typename FaceType::VertexType *v0, typename FaceType::VertexType *v1, FaceType *&f0, FaceType *&f1, int &e0, int &e1) |
template<class FaceType > |
bool | FindSharedVertex (FaceType *f0, FaceType *f1, int &i, int &j) |
template<class FaceType > |
void | FlipEdge (FaceType &f, const int z) |
template<class FaceType > |
bool | IsBorder (FaceType const &f, const int j) |
template<class FaceType > |
bool | IsManifold (FaceType const &f, const int j) |
template<class FaceType > |
bool | PointDistanceBase (const FaceType &f, const vcg::Point3< typename FaceType::ScalarType > &q, typename FaceType::ScalarType &dist, vcg::Point3< typename FaceType::ScalarType > &p) |
template<class FaceType > |
bool | PointDistanceEP (const FaceType &f, const vcg::Point3< typename FaceType::ScalarType > &q, typename FaceType::ScalarType &dist, vcg::Point3< typename FaceType::ScalarType > &p) |
template<class FaceType > |
bool | ShareEdgeFF (FaceType *f0, FaceType *f1, int *i0=0, int *i1=0) |
template<class FaceType > |
void | SwapEdge (FaceType &f, const int z) |
template<class FaceType , bool UpdateTopology> |
void | SwapEdge (FaceType &f, const int z) |
template<class FaceType > |
void | VFAppend (FaceType *&f, int z) |
| Append a face in VF list of vertex f->V(z)
|
template<class FaceType > |
void | VFDetach (FaceType &f) |
template<class FaceType > |
void | VFDetach (FaceType &f, int z) |
template<class FaceType > |
void | VFExtendedStarVF (typename FaceType::VertexType *vp, const int num_step, std::vector< FaceType * > &faceVec) |
| Compute the set of faces adjacent to a given vertex using VF adjacency.
|
template<class FaceType > |
void | VFOrderedStarFF (const Pos< FaceType > &startPos, std::vector< Pos< FaceType > > &posVec) |
| Compute the ordered set of faces adjacent to a given vertex using FF adiacency.
|
template<class FaceType > |
void | VFOrderedStarFF (const Pos< FaceType > &startPos, std::vector< FaceType * > &faceVec, std::vector< int > &edgeVec) |
| Compute the ordered set of faces adjacent to a given vertex using FF adiacency.
|
template<class FaceType > |
void | VFStarVF (typename FaceType::VertexType *vp, std::vector< FaceType * > &faceVec, std::vector< int > &indexes) |
| Compute the set of faces adjacent to a given vertex using VF adjacency.
|
template<class FaceType > |
void | VVExtendedStarVF (typename FaceType::VertexType *vp, const int num_step, std::vector< typename FaceType::VertexType * > &vertVec) |
| Compute the set of vertices adjacent to a given vertex using VF adjacency.
|
template<class FaceType > |
void | VVOrderedStarFF (Pos< FaceType > &startPos, std::vector< typename FaceType::VertexType * > &vertexVec) |
| Compute the ordered set of vertices adjacent to a given vertex using FF adiacency.
|
template<class FaceType > |
void | VVStarVF (typename FaceType::VertexType *vp, std::vector< typename FaceType::VertexType * > &starVec) |
| Compute the set of vertices adjacent to a given vertex using VF adjacency.
|