, including all inherited members.
_constrainValues | pcl::poisson::Octree< Degree > | [private] |
_minDepth | pcl::poisson::Octree< Degree > | [private] |
_pointCount | pcl::poisson::Octree< Degree > | [private] |
_points | pcl::poisson::Octree< Degree > | [private] |
_sNodes | pcl::poisson::Octree< Degree > | [private] |
AddTriangles(pcl::poisson::CoredMeshData *mesh, std::vector< pcl::poisson::CoredPointIndex > &edges, std::vector< pcl::poisson::Point3D< float > > *interiorPositions, int offSet, bool polygonMesh, std::vector< pcl::poisson::Point3D< float > > *barycenters) | pcl::poisson::Octree< Degree > | [private, static] |
ClipTree(void) | pcl::poisson::Octree< Degree > | |
DownSample(int depth, const SortedTreeNodes &sNodes, C *constraints) const | pcl::poisson::Octree< Degree > | [private] |
DownSampleFinerConstraints(int depth, SortedTreeNodes &sNodes) const | pcl::poisson::Octree< Degree > | [private] |
EdgeRootCount(const TreeOctNode *node, int edgeIndex, int maxDepth) | pcl::poisson::Octree< Degree > | [private, static] |
fData | pcl::poisson::Octree< Degree > | |
finalize(void) | pcl::poisson::Octree< Degree > | |
getCenterValue(const TreeOctNode::ConstNeighborKey3 &neighborKey3, const TreeOctNode *node) | pcl::poisson::Octree< Degree > | [private] |
getCornerNormal(const TreeOctNode::ConstNeighborKey5 &neighborKey5, const TreeOctNode *node, int corner, const Real *metSolution) | pcl::poisson::Octree< Degree > | [private] |
getCornerValue(const TreeOctNode::ConstNeighborKey3 &neighborKey3, const TreeOctNode *node, int corner, const Real *metSolution) | pcl::poisson::Octree< Degree > | [private] |
getCornerValue(const TreeOctNode::ConstNeighborKey3 &neighborKey3, const TreeOctNode *node, int corner, const Real *metSolution, const double stencil1[3][3][3], const double stencil2[3][3][3]) | pcl::poisson::Octree< Degree > | [private] |
GetDivergence(const TreeOctNode *node1, const TreeOctNode *node2, const pcl::poisson::Point3D< Real > &normal1) const | pcl::poisson::Octree< Degree > | [private] |
GetDivergenceMinusLaplacian(const TreeOctNode *node1, const TreeOctNode *node2, Real value1, const pcl::poisson::Point3D< Real > &normal1) const | pcl::poisson::Octree< Degree > | [private] |
GetEdgeLoops(std::vector< std::pair< RootInfo, RootInfo > > &edges, std::vector< std::vector< std::pair< RootInfo, RootInfo > > > &loops) | pcl::poisson::Octree< Degree > | [private, static] |
GetFixedDepthLaplacian(pcl::poisson::SparseSymmetricMatrix< float > &matrix, int depth, const SortedTreeNodes &sNodes, Real *subConstraints) | pcl::poisson::Octree< Degree > | [private] |
GetIsoValue(void) | pcl::poisson::Octree< Degree > | |
GetLaplacian(const int index[DIMENSION]) const | pcl::poisson::Octree< Degree > | [private] |
GetLaplacian(const TreeOctNode *node1, const TreeOctNode *node2) const | pcl::poisson::Octree< Degree > | [private] |
GetMatrixRowSize(const TreeOctNode::Neighbors5 &neighbors5) const | pcl::poisson::Octree< Degree > | [private] |
GetMatrixRowSize(const TreeOctNode::Neighbors5 &neighbors5, int xStart, int xEnd, int yStart, int yEnd, int zStart, int zEnd) const | pcl::poisson::Octree< Degree > | [private] |
GetMCIsoEdges(TreeOctNode *node, int sDepth, std::vector< std::pair< RootInfo, RootInfo > > &edges) | pcl::poisson::Octree< Degree > | [private] |
GetMCIsoTriangles(TreeOctNode *node, pcl::poisson::CoredMeshData *mesh, RootData &rootData, std::vector< pcl::poisson::Point3D< float > > *interiorPositions, int offSet, int sDepth, bool polygonMesh, std::vector< pcl::poisson::Point3D< float > > *barycenters) | pcl::poisson::Octree< Degree > | [private] |
GetMCIsoTriangles(Real isoValue, int subdivideDepth, pcl::poisson::CoredMeshData *mesh, int fullDepthIso=0, int nonLinearFit=1, bool addBarycenter=false, bool polygonMesh=false) | pcl::poisson::Octree< Degree > | |
GetRestrictedFixedDepthLaplacian(pcl::poisson::SparseSymmetricMatrix< float > &matrix, int depth, const int *entries, int entryCount, const TreeOctNode *rNode, Real radius, const SortedTreeNodes &sNodes, Real *subConstraints) | pcl::poisson::Octree< Degree > | [private] |
GetRoot(const RootInfo &ri, Real isoValue, TreeOctNode::ConstNeighborKey5 &neighborKey5, pcl::poisson::Point3D< Real > &position, RootData &rootData, int sDepth, const Real *metSolution, int nonLinearFit) | pcl::poisson::Octree< Degree > | [private] |
GetRootIndex(const TreeOctNode *node, int edgeIndex, int maxDepth, RootInfo &ri) | pcl::poisson::Octree< Degree > | [private, static] |
GetRootIndex(const TreeOctNode *node, int edgeIndex, int maxDepth, int sDepth, RootInfo &ri) | pcl::poisson::Octree< Degree > | [private, static] |
GetRootIndex(const RootInfo &ri, RootData &rootData, pcl::poisson::CoredPointIndex &index) | pcl::poisson::Octree< Degree > | [private, static] |
GetRootPair(const RootInfo &root, int maxDepth, RootInfo &pair) | pcl::poisson::Octree< Degree > | [private, static] |
GetRootSpan(const RootInfo &ri, pcl::poisson::Point3D< float > &start, pcl::poisson::Point3D< float > &end) | pcl::poisson::Octree< Degree > | [private, static] |
GetSolutionGrid(int &res, float isoValue=0.f, int depth=-1) | pcl::poisson::Octree< Degree > | |
GetValue(const PointInfo points[3][3][3], const bool hasPoints[3][3], const int d[3]) const | pcl::poisson::Octree< Degree > | [private] |
GetWeightGrid(int &res, int depth=-1) | pcl::poisson::Octree< Degree > | |
HasNormals(TreeOctNode *node, Real epsilon) | pcl::poisson::Octree< Degree > | [private] |
InteriorFaceRootCount(const TreeOctNode *node, const int &faceIndex, int maxDepth) | pcl::poisson::Octree< Degree > | [private, static] |
IsBoundaryEdge(const TreeOctNode *node, int edgeIndex, int subdivideDepth) | pcl::poisson::Octree< Degree > | [private, static] |
IsBoundaryEdge(const TreeOctNode *node, int dir, int x, int y, int subidivideDepth) | pcl::poisson::Octree< Degree > | [private, static] |
IsBoundaryFace(const TreeOctNode *node, int faceIndex, int subdivideDepth) | pcl::poisson::Octree< Degree > | [private, static] |
LaplacianMatrixIteration(int subdivideDepth, bool showResidual, int minIters, double accuracy) | pcl::poisson::Octree< Degree > | |
maxMemoryUsage | pcl::poisson::Octree< Degree > | [static] |
MemoryUsage(void) | pcl::poisson::Octree< Degree > | [static] |
neighborKey | pcl::poisson::Octree< Degree > | [private] |
neighborKey2 | pcl::poisson::Octree< Degree > | [private] |
NonLinearGetSampleDepthAndWeight(TreeOctNode *node, const pcl::poisson::Point3D< Real > &position, Real samplesPerNode, Real &depth, Real &weight) | pcl::poisson::Octree< Degree > | [private] |
NonLinearGetSampleWeight(TreeOctNode *node, const pcl::poisson::Point3D< Real > &position) | pcl::poisson::Octree< Degree > | [private] |
NonLinearSplatOrientedPoint(TreeOctNode *node, const pcl::poisson::Point3D< Real > &point, const pcl::poisson::Point3D< Real > &normal) | pcl::poisson::Octree< Degree > | [private] |
NonLinearSplatOrientedPoint(const pcl::poisson::Point3D< Real > &point, const pcl::poisson::Point3D< Real > &normal, int kernelDepth, Real samplesPerNode, int minDepth, int maxDepth) | pcl::poisson::Octree< Degree > | [private] |
NonLinearUpdateWeightContribution(TreeOctNode *node, const pcl::poisson::Point3D< Real > &position, Real weight=Real(1.0)) | pcl::poisson::Octree< Degree > | [private] |
normals | pcl::poisson::Octree< Degree > | |
Octree(void) | pcl::poisson::Octree< Degree > | |
postNormalSmooth | pcl::poisson::Octree< Degree > | |
radius | pcl::poisson::Octree< Degree > | [private] |
RefineBoundary(int subdivisionDepth) | pcl::poisson::Octree< Degree > | |
SetBoundaryMCRootPositions(int sDepth, Real isoValue, RootData &rootData, pcl::poisson::CoredMeshData *mesh, int nonLinearFit) | pcl::poisson::Octree< Degree > | [private] |
setBSplineData(int maxDepth, Real normalSmooth=-1, bool reflectBoundary=false) | pcl::poisson::Octree< Degree > | |
SetCoarserPointValues(int depth, const SortedTreeNodes &sNodes, Real *metSolution) | pcl::poisson::Octree< Degree > | [private] |
SetDivergenceStencil(int depth, pcl::poisson::Point3D< double > *stencil, bool scatter) const | pcl::poisson::Octree< Degree > | [private] |
SetDivergenceStencils(int depth, Stencil< pcl::poisson::Point3D< double >, 5 > stencil[2][2][2], bool scatter) const | pcl::poisson::Octree< Degree > | [private] |
SetEvaluationStencils(int depth, Stencil< double, 3 > stencil1[8], Stencil< double, 3 > stencil2[8][8]) const | pcl::poisson::Octree< Degree > | [private] |
SetIsoCorners(Real isoValue, TreeOctNode *leaf, SortedTreeNodes::CornerTableData &cData, char *valuesSet, Real *values, TreeOctNode::ConstNeighborKey3 &nKey, const Real *metSolution, const Stencil< double, 3 > stencil1[8], const Stencil< double, 3 > stencil2[8][8]) | pcl::poisson::Octree< Degree > | [private] |
SetLaplacianConstraints(void) | pcl::poisson::Octree< Degree > | |
SetLaplacianStencil(int depth, double stencil[5][5][5]) const | pcl::poisson::Octree< Degree > | [private] |
SetLaplacianStencils(int depth, Stencil< double, 5 > stencil[2][2][2]) const | pcl::poisson::Octree< Degree > | [private] |
SetMatrixRow(const TreeOctNode::Neighbors5 &neighbors5, pcl::poisson::MatrixEntry< float > *row, int offset, const double stencil[5][5][5]) const | pcl::poisson::Octree< Degree > | [private] |
SetMatrixRow(const TreeOctNode::Neighbors5 &neighbors5, pcl::poisson::MatrixEntry< float > *row, int offset, const double stencil[5][5][5], int xStart, int xEnd, int yStart, int yEnd, int zStart, int zEnd) const | pcl::poisson::Octree< Degree > | [private] |
SetMatrixRowBounds(const TreeOctNode *node, int rDepth, const int rOff[3], int &xStart, int &xEnd, int &yStart, int &yEnd, int &zStart, int &zEnd) const | pcl::poisson::Octree< Degree > | [private] |
SetMCRootPositions(TreeOctNode *node, int sDepth, Real isoValue, TreeOctNode::ConstNeighborKey5 &neighborKey5, RootData &rootData, std::vector< pcl::poisson::Point3D< float > > *interiorPositions, pcl::poisson::CoredMeshData *mesh, const Real *metSolution, int nonLinearFit) | pcl::poisson::Octree< Degree > | [private] |
setTree(boost::shared_ptr< const pcl::PointCloud< PointNT > > input_, int maxDepth, int minDepth, int kernelDepth, Real samplesPerNode, Real scaleFactor, Point3D< Real > ¢er, Real &scale, int useConfidence, Real constraintWeight, bool adaptiveWeights) | pcl::poisson::Octree< Degree > | |
SolveFixedDepthMatrix(int depth, const SortedTreeNodes &sNodes, Real *subConstraints, bool showResidual, int minIters, double accuracy) | pcl::poisson::Octree< Degree > | [private] |
SolveFixedDepthMatrix(int depth, const SortedTreeNodes &sNodes, Real *subConstraints, int startingDepth, bool showResidual, int minIters, double accuracy) | pcl::poisson::Octree< Degree > | [private] |
threads | pcl::poisson::Octree< Degree > | |
tree | pcl::poisson::Octree< Degree > | |
UpdateCoarserSupportBounds(const TreeOctNode *node, int &startX, int &endX, int &startY, int &endY, int &startZ, int &endZ) | pcl::poisson::Octree< Degree > | [private, static] |
UpdateConstraintsFromCoarser(const TreeOctNode::NeighborKey5 &neighborKey5, TreeOctNode *node, Real *metSolution, const Stencil< double, 5 > &stencil) const | pcl::poisson::Octree< Degree > | [private] |
UpSample(int depth, const SortedTreeNodes &sNodes, C *coefficients) const | pcl::poisson::Octree< Degree > | [private] |
UpSampleCoarserSolution(int depth, const SortedTreeNodes &sNodes, pcl::poisson::Vector< Real > &solution) const | pcl::poisson::Octree< Degree > | [private] |
WeightedCoarserFunctionValue(const TreeOctNode::NeighborKey3 &neighborKey3, const TreeOctNode *node, Real *metSolution) const | pcl::poisson::Octree< Degree > | [private] |
width | pcl::poisson::Octree< Degree > | [private] |