![]() |
ACloudViewer
3.9.4
A Modern Library for 3D Data Processing
|
Generic file read and write utility for python interface. More...
Namespaces | |
| benchmarks | |
| camera | |
| core | |
| data | |
| docstring | |
| geometry | |
| gpu | |
| io | |
| ml | |
| pipelines | |
| ply_pointcloud_reader | |
| ply_trianglemesh_reader | |
| pybind_utils | |
| reconstruction | |
| system | |
| t | |
| utility | |
| visualization | |
| visualizer | |
Classes | |
| class | AutoSegmentationTools |
| class | BoundingBoxTpl |
| Bounding box structure. More... | |
| class | ChamferDistanceTransform |
| Class to compute a Chamfer distance field on a 3D grid. More... | |
| class | CloudSamplingTools |
| Several point cloud resampling algorithms (octree-based, random, etc.) More... | |
| class | ConjugateGradient |
| A class to perform a conjugate gradient optimization. More... | |
| class | KDTree |
| class | CCMiscTools |
| Miscellaneous useful functions (geometrical elements handling) More... | |
| class | PointCloud |
| class | CVToolbox |
| Empty class - for classification purpose only. More... | |
| class | Delaunay2dMesh |
| A class to compute and handle a Delaunay 2D mesh on a subset of points. More... | |
| class | DgmOctree |
| The octree structure used throughout the library. More... | |
| class | DgmOctreeReferenceCloud |
| A kind of ReferenceCloud based on the DgmOctree::NeighboursSet structure. More... | |
| class | DistanceComputationTools |
| class | ErrorFunction |
| A class to compute the Error function (erf) More... | |
| class | FastMarching |
| Fast Marching algorithm (front propagation) More... | |
| class | FastMarchingForPropagation |
| Fast Marching algorithm for surface front propagation. More... | |
| class | GenericCloud |
| class | GenericDistribution |
| A generic class to handle a probability distribution. More... | |
| class | GenericIndexedCloud |
| A generic 3D point cloud with index-based point access. More... | |
| class | GenericIndexedCloudPersist |
| A generic 3D point cloud with index-based and presistent access to points. More... | |
| struct | VerticesIndexes |
| Triangle described by the indexes of its 3 vertices. More... | |
| class | GenericIndexedMesh |
| A generic mesh with index-based vertex access. More... | |
| class | GenericMesh |
| class | GenericOctree |
| class | GenericProgressCallback |
| class | NormalizedProgress |
| class | GenericTriangle |
| A generic triangle interface. More... | |
| class | GeometricalAnalysisTools |
| class | Grid3D |
| Simple 3D grid structure. More... | |
| class | LocalModel |
| Local modelization (generic interface) More... | |
| class | ManualSegmentationTools |
| Manual segmentation algorithms (inside/outside a polyline, etc.) More... | |
| class | MathTools |
| Empty class - for classification purpose only. More... | |
| class | MeshSamplingTools |
| Mesh sampling algorithms. More... | |
| class | Neighbourhood |
| class | NormalDistribution |
| The Normal/Gaussian statistical distribution. More... | |
| class | OrientedBoundingBox |
| A bounding box oriented along an arbitrary frame of reference. More... | |
| class | PointCloudTpl |
| class | PointProjectionTools |
| class | Polyline |
| A simple polyline class. More... | |
| class | ReferenceCloud |
| A very simple point cloud (no point duplication) More... | |
| class | RegistrationTools |
| Common point cloud registration algorithms. More... | |
| class | HornRegistrationTools |
| Horn point cloud registration algorithm. More... | |
| class | ICPRegistrationTools |
| ICP point cloud registration algorithm (Besl et al.). More... | |
| class | FPCSRegistrationTools |
| class | SaitoSquaredDistanceTransform |
| class | ScalarField |
| A simple scalar field (to be associated to a point cloud) More... | |
| struct | KMeanClass |
| A K-mean class position and boundaries. More... | |
| class | ScalarFieldTools |
| Several scalar field treatment algorithms (gradient, classification, etc.) More... | |
| class | SimpleMesh |
| A simple mesh structure, with index-based vertex access. More... | |
| class | SimpleRefTriangle |
| A simple triangle class. More... | |
| class | SimpleTriangle |
| A simple triangle class. More... | |
| class | SquareMatrixTpl |
| Square matrix. More... | |
| class | StaticVector |
| class | StatisticalTestingTools |
| class | TrueKdTree |
| Proper KD-tree implementation. More... | |
| struct | uni_elt |
| class | Universe |
| Allows to perform labelling by creating node and connecting them. More... | |
| class | WeibullDistribution |
| The Weibull statistical parametric distribution. More... | |
| struct | TriangleList |
| List of triangles (indexes) More... | |
| struct | OctreeAndMeshIntersection |
| class | AlignmentSession |
| class | VisualizerForAlignment |
| class | AutomaticReconstructionWidget |
| class | BundleAdjustmentWidget |
| class | AutomaticReconstructionController |
| class | ViewInterpolate |
| The ViewInterpolate class. More... | |
| class | TwoViewInfoTab |
| class | MatchesTab |
| class | TwoViewGeometriesTab |
| class | OverlappingImagesWidget |
| class | CameraTab |
| class | ImageTab |
| class | DatabaseManagementWidget |
| class | DenseReconstructionOptionsWidget |
| class | DenseReconstructionWidget |
| class | ExtractionWidget |
| class | SIFTExtractionWidget |
| class | ImportFeaturesWidget |
| class | FeatureExtractionWidget |
| class | FeatureMatchingTab |
| class | ExhaustiveMatchingTab |
| class | SequentialMatchingTab |
| class | VocabTreeMatchingTab |
| class | SpatialMatchingTab |
| class | TransitiveMatchingTab |
| class | CustomMatchingTab |
| class | FeatureMatchingWidget |
| class | ImageViewerGraphicsScene |
| class | ImageViewerWidget |
| class | FeatureImageViewerWidget |
| class | DatabaseImageViewerWidget |
| class | StandardOutputRedirector |
| class | LogWidget |
| class | MatchMatrixWidget |
| class | ModelViewerWidget |
| class | MovieGrabberWidget |
| class | PointViewerWidget |
| class | ProjectWidget |
| class | ReconstructionManagerWidget |
| class | MapperGeneralOptionsWidget |
| class | MapperTriangulationOptionsWidget |
| class | MapperRegistrationOptionsWidget |
| class | MapperInitializationOptionsWidget |
| class | MapperBundleAdjustmentOptionsWidget |
| class | MapperFilteringOptionsWidget |
| class | ReconstructionOptionsWidget |
| class | ReconstructionStatsWidget |
| class | ReconstructionWidget |
| class | RenderOptionsWidget |
| class | ThreadControlWidget |
| class | UndistortionWidget |
Typedefs | |
| using | ReferenceCloudContainer = std::vector< ReferenceCloud * > |
| A standard container to store several subsets of points. More... | |
| using | BoundingBox = BoundingBoxTpl< PointCoordinateType > |
| Default bounding-box type. More... | |
| using | SquareMatrix = SquareMatrixTpl< PointCoordinateType > |
| Default CC square matrix type (PointCoordinateType) More... | |
| using | SquareMatrixf = SquareMatrixTpl< float > |
| Float square matrix type. More... | |
| using | SquareMatrixd = SquareMatrixTpl< double > |
| Double square matrix type. More... | |
| using | StaticVectorBool = StaticVector< char > |
| using | BundleAdjustmentController = colmap::BundleAdjustmentController |
| using | OptionManager = colmap::OptionManager |
| using | PointColormapBase = colmap::PointColormapBase |
| using | ImageColormapBase = colmap::ImageColormapBase |
| using | RenderOptions = colmap::RenderOptions |
| using | IncrementalMapperController = colmap::IncrementalMapperController |
| using | IncrementalMapperOptions = colmap::IncrementalMapperOptions |
| using | ImageColormapNameFilter = colmap::ImageColormapNameFilter |
Enumerations | |
| enum | TRIANGULATION_TYPES { DELAUNAY_2D_AXIS_ALIGNED , DELAUNAY_2D_BEST_LS_PLANE = 2 } |
| Triangulation types. More... | |
Functions | |
| bool | LessThanEpsilon (float x) |
| Test a floating point number against our epsilon (a very small number). More... | |
| bool | LessThanEpsilon (double x) |
| Test a floating point number against our epsilon (a very small number). More... | |
| bool | GreaterThanEpsilon (float x) |
| Test a floating point number against our epsilon (a very small number). More... | |
| bool | GreaterThanEpsilon (double x) |
| Test a floating point number against our epsilon (a very small number). More... | |
| bool | GreaterThanSquareEpsilon (double x) |
| bool | LessThanSquareEpsilon (double x) |
| float | RadiansToDegrees (int radians) |
| Convert radians to degrees. More... | |
| float | RadiansToDegrees (float radians) |
| Convert radians to degrees. More... | |
| double | RadiansToDegrees (double radians) |
| Convert radians to degrees. More... | |
| float | DegreesToRadians (int degrees) |
| Convert degrees to radians. More... | |
| float | DegreesToRadians (float degrees) |
| Convert degrees to radians. More... | |
| double | DegreesToRadians (double degrees) |
| Convert degrees to radians. More... | |
| template<class T > | |
| int | sizeOfStaticVector (const StaticVector< T > *a) |
| template<class T > | |
| int | sizeOfStaticVector (const StaticVector< T > &a) |
| template<class T > | |
| int | indexOf (T *arr, int n, const T &what) |
| template<class T > | |
| void | saveArrayOfArraysToFile (std::string fileName, StaticVector< StaticVector< T > * > *aa) |
| template<class T > | |
| void | saveArrayOfArraysToFile (const std::string fileName, StaticVector< StaticVector< T >> &aa) |
| template<class T > | |
| StaticVector< StaticVector< T > * > * | loadArrayOfArraysFromFile (const std::string &fileName) |
| template<class T > | |
| void | loadArrayOfArraysFromFile (StaticVector< StaticVector< T >> &out_aa, const std::string &fileName) |
| template<class T > | |
| void | saveArrayToFile (const std::string &fileName, const StaticVector< T > &a, bool docompress=true) |
| template<class T > | |
| void | saveArrayToFile (const std::string &fileName, const StaticVector< T > *a, bool docompress=true) |
| template<class T > | |
| StaticVector< T > * | loadArrayFromFile (const std::string &fileName, bool printfWarning=false) |
| template<class T > | |
| bool | loadArrayFromFile (StaticVector< T > &out, const std::string &fileName, bool printfWarning=false) |
| template<class T > | |
| void | loadArrayFromFileIntoArray (StaticVector< T > *a, const std::string &fileName, bool printfWarning=false) |
| int | getArrayLengthFromFile (std::string fileName) |
| template<class T > | |
| void | deleteArrayOfArrays (StaticVector< StaticVector< T > * > **aa) |
| template<class T > | |
| void | deleteArrayOfArrays (StaticVector< StaticVector< T > * > &aa) |
| template<class T > | |
| StaticVector< StaticVector< T > * > * | cloneArrayOfArrays (StaticVector< StaticVector< T > * > *inAOA) |
| template<typename scalar_t , typename T > | |
| CLOUDVIEWER_HOST_DEVICE bool | IsClose (const scalar_t &x, const T &y, const double rtol=1e-4) |
| template<typename scalar_t > | |
| CLOUDVIEWER_HOST_DEVICE scalar_t | Square (const scalar_t &x) |
| PYBIND11_MODULE (pybind, m) | |
| template<class T > | |
| T | InterpolateNumber (T start, T end, double interpolationFraction) |
Variables | |
| static const double | c_erfRelativeError = 1e-12 |
| Relative error for Error Function computation. More... | |
| const int | c_FastMarchingNeighbourPosShift [] |
| Grid neighboring cells positions. More... | |
Generic file read and write utility for python interface.
Gives static access to file loader and writer
| using cloudViewer::BoundingBox = typedef BoundingBoxTpl<PointCoordinateType> |
Default bounding-box type.
Definition at line 304 of file BoundingBox.h.
| using cloudViewer::BundleAdjustmentController = typedef colmap::BundleAdjustmentController |
Definition at line 17 of file BundleAdjustmentWidget.cpp.
| using cloudViewer::ImageColormapBase = typedef colmap::ImageColormapBase |
Definition at line 33 of file ModelViewerWidget.h.
| using cloudViewer::ImageColormapNameFilter = typedef colmap::ImageColormapNameFilter |
Definition at line 22 of file RenderOptionsWidget.h.
| using cloudViewer::IncrementalMapperController = typedef colmap::IncrementalMapperController |
Definition at line 38 of file ReconstructionWidget.h.
| using cloudViewer::IncrementalMapperOptions = typedef colmap::IncrementalMapperOptions |
Definition at line 39 of file ReconstructionWidget.h.
| typedef colmap::OptionManager cloudViewer::OptionManager |
Definition at line 19 of file BundleAdjustmentWidget.h.
| using cloudViewer::PointColormapBase = typedef colmap::PointColormapBase |
Definition at line 32 of file ModelViewerWidget.h.
| using cloudViewer::ReferenceCloudContainer = typedef std::vector<ReferenceCloud*> |
A standard container to store several subsets of points.
Several algorithms of the AutoSegmentationTools toolbox return a collection of subsets of points corresponding to each segmented part. Such a collection is generally stored in this type of container.
Definition at line 28 of file AutoSegmentationTools.h.
| typedef colmap::RenderOptions cloudViewer::RenderOptions |
Definition at line 35 of file ModelViewerWidget.h.
| using cloudViewer::SquareMatrix = typedef SquareMatrixTpl<PointCoordinateType> |
Default CC square matrix type (PointCoordinateType)
Definition at line 1020 of file SquareMatrix.h.
| using cloudViewer::SquareMatrixd = typedef SquareMatrixTpl<double> |
Double square matrix type.
Definition at line 1026 of file SquareMatrix.h.
| using cloudViewer::SquareMatrixf = typedef SquareMatrixTpl<float> |
Float square matrix type.
Definition at line 1023 of file SquareMatrix.h.
| using cloudViewer::StaticVectorBool = typedef StaticVector<char> |
Definition at line 145 of file StaticVector.h.
Triangulation types.
| Enumerator | |
|---|---|
| DELAUNAY_2D_AXIS_ALIGNED | Delaunay 2D triangulation in an axis-aligned plane |
| DELAUNAY_2D_BEST_LS_PLANE | Delaunay 2D with points projected on the best least square fitting plane |
Definition at line 22 of file PointProjectionTools.h.
| StaticVector<StaticVector<T>*>* cloudViewer::cloneArrayOfArrays | ( | StaticVector< StaticVector< T > * > * | inAOA | ) |
Definition at line 714 of file StaticVector.h.
References NULL, cloudViewer::StaticVector< T >::push_back(), cloudViewer::StaticVector< T >::push_back_arr(), cloudViewer::StaticVector< T >::reserve(), and size.
|
inline |
|
inline |
|
inline |
Convert degrees to radians.
| degrees | Degrees to convert |
Definition at line 98 of file CVMath.h.
References M_PI.
Referenced by PdmsTools::PdmsCommands::Orientation::axisFromCoords(), ConvertAngleToRad(), ecvPrimitiveFactoryDlg::createPrimitive(), define_CCMath(), cloudViewer::PointProjectionTools::developCloudOnCone(), ccKdTreeForFacetExtraction::FuseCells(), ccRasterizeTool::generateHillshade(), qHoughNormalsDialog::getParameters(), PdmsTools::PdmsCommands::NumericalValue::getValue(), ccCompass::importFoliations(), ccCompassImport::importFoliations(), ccCompass::importLineations(), ccCompassImport::importLineations(), StereogramWidget::init(), ccApplyTransformationDlg::onEulerValueChanged(), ccApplyTransformationDlg::onRotAngleValueChanged(), StereogramWidget::paintEvent(), ecvGenericDisplayTools::Perspective(), ecvDisplayTools::SetCameraFovy(), ccApplyTransformationDlg::updateAll(), ccCamSensorProjectionDlg::updateCamSensor(), ccGBLSensorProjectionDlg::updateGBLSensor(), and ccPlaneEditDlg::updatePlane().
| void cloudViewer::deleteArrayOfArrays | ( | StaticVector< StaticVector< T > * > & | aa | ) |
Definition at line 703 of file StaticVector.h.
| void cloudViewer::deleteArrayOfArrays | ( | StaticVector< StaticVector< T > * > ** | aa | ) |
Definition at line 692 of file StaticVector.h.
| int cloudViewer::getArrayLengthFromFile | ( | std::string | fileName | ) |
Definition at line 14 of file StaticVector.cpp.
References CVLog::Warning().
|
inline |
Test a floating point number against our epsilon (a very small number).
| x | The number to test |
Definition at line 44 of file CVMath.h.
References ZERO_TOLERANCE_D.
|
inline |
Test a floating point number against our epsilon (a very small number).
| x | The number to test |
Definition at line 37 of file CVMath.h.
References ZERO_TOLERANCE_F.
Referenced by ccScalarFieldArithmeticsDlg::Apply(), cloudViewer::StatisticalTestingTools::computeAdaptativeChi2Dist(), cloudViewer::GeometricalAnalysisTools::ComputeApproxPointsDensityInACellAtLevel(), cloudViewer::DistanceComputationTools::computeCloud2PolylineEquation(), ComputeFacetExtensions(), cloudViewer::WeibullDistribution::ComputeG(), define_CCMath(), qFacets::exportFacets(), cloudViewer::WeibullDistribution::FindGRoot(), ccGLMatrixTpl< T >::getParameters(), ccSubsamplingDlg::getSampledCloud(), cloudViewer::DistanceComputationTools::intersectMeshWithOctree(), PdmsTools::PdmsObjects::GenericItem::isOrientationValid(), CommandSubsample::process(), cloudViewer::ModelViewerWidget::SelectObject(), PdmsTools::PdmsObjects::Dish::surface(), qAnimationDlg::updateSmoothTrajectoryDurations(), and DistanceMapGenerationDlg::updateZoom().
|
inline |
Test a (squared) floating point number against our epsilon (a very small number).
| x | The number to test |
Definition at line 52 of file CVMath.h.
References ZERO_SQUARED_TOLERANCE_D.
Referenced by cloudViewer::Grid3D< Type >::intersectWith().
| int cloudViewer::indexOf | ( | T * | arr, |
| int | n, | ||
| const T & | what | ||
| ) |
Definition at line 160 of file StaticVector.h.
Referenced by cloudViewer::StaticVector< T >::indexOfSorted(), and cloudViewer::StaticVector< T >::push_back_distinct().
| T cloudViewer::InterpolateNumber | ( | T | start, |
| T | end, | ||
| double | interpolationFraction | ||
| ) |
Definition at line 46 of file ViewInterpolate.cpp.
Referenced by cloudViewer::ViewInterpolate::interpolate().
| CLOUDVIEWER_HOST_DEVICE bool cloudViewer::IsClose | ( | const scalar_t & | x, |
| const T & | y, | ||
| const double | rtol = 1e-4 |
||
| ) |
Definition at line 49 of file GeometryMacros.h.
|
inline |
Test a floating point number against our epsilon (a very small number).
| x | The number to test |
Definition at line 30 of file CVMath.h.
References ZERO_TOLERANCE_D.
|
inline |
Test a floating point number against our epsilon (a very small number).
| x | The number to test |
Definition at line 23 of file CVMath.h.
References ZERO_TOLERANCE_F.
Referenced by ccPointPairRegistrationDlg::addAlignedPoint(), ccPointPairRegistrationDlg::addReferencePoint(), ccScalarFieldArithmeticsDlg::Apply(), cloudViewer::DistanceComputationTools::computeCloud2PlaneDistanceRMS(), cloudViewer::DistanceComputationTools::computeCloud2PlaneEquation(), cloudViewer::DistanceComputationTools::ComputeCloud2PlaneMaxDistance(), cloudViewer::DistanceComputationTools::ComputeCloud2PlaneRobustMax(), cloudViewer::Neighbourhood::computeLeastSquareBestFittingPlane(), ccCropTool::Crop(), define_CCMath(), cloudViewer::WeibullDistribution::FindGRoot(), ccGLMatrixTpl< T >::FromToRotation(), ccRasterizeTool::generateImage(), GetConeProfile(), qAnimationDlg::onAutoStepsDurationToggled(), qAnimationDlg::onTotalTimeChanged(), CommandCrossSection::process(), cloudViewer::ICPRegistrationTools::Register(), cloudViewer::RegistrationTools::RegistrationProcedure(), cloudViewer::MeshSamplingTools::samplePointsOnMesh(), PdmsTools::PdmsObjects::Dish::surface(), and cloudViewer::Neighbourhood::triangulateOnPlane().
|
inline |
Test a (squared) floating point number against our epsilon (a very small number).
| x | The (squared) number to test |
Definition at line 62 of file CVMath.h.
References ZERO_SQUARED_TOLERANCE_D.
| StaticVector<T>* cloudViewer::loadArrayFromFile | ( | const std::string & | fileName, |
| bool | printfWarning = false |
||
| ) |
Definition at line 468 of file StaticVector.h.
References CVLog::Error(), NULL, CVLog::PrintDebug(), and cloudViewer::StaticVector< T >::resize().
| bool cloudViewer::loadArrayFromFile | ( | StaticVector< T > & | out, |
| const std::string & | fileName, | ||
| bool | printfWarning = false |
||
| ) |
Definition at line 555 of file StaticVector.h.
| void cloudViewer::loadArrayFromFileIntoArray | ( | StaticVector< T > * | a, |
| const std::string & | fileName, | ||
| bool | printfWarning = false |
||
| ) |
Definition at line 628 of file StaticVector.h.
References CVLog::Error(), CVLog::PrintDebug(), and cloudViewer::StaticVector< T >::size().
| StaticVector<StaticVector<T>*>* cloudViewer::loadArrayOfArraysFromFile | ( | const std::string & | fileName | ) |
Definition at line 221 of file StaticVector.h.
References CVLog::Error(), NULL, CVLog::PrintDebug(), cloudViewer::StaticVector< T >::reserve(), cloudViewer::StaticVector< T >::resize(), and cloudViewer::StaticVector< T >::resize_with().
| void cloudViewer::loadArrayOfArraysFromFile | ( | StaticVector< StaticVector< T >> & | out_aa, |
| const std::string & | fileName | ||
| ) |
Definition at line 268 of file StaticVector.h.
References CVLog::Error(), CVLog::PrintDebug(), and cloudViewer::StaticVector< T >::resize().
| cloudViewer::PYBIND11_MODULE | ( | pybind | , |
| m | |||
| ) |
Definition at line 27 of file cloudViewer_pybind.cpp.
References cloudViewer::utility::Logger::GetInstance(), cloudViewer::core::MemoryManagerStatistic::GetInstance(), cloudViewer::camera::pybind_camera(), cloudViewer::core::pybind_core(), cloudViewer::data::pybind_data(), cloudViewer::geometry::pybind_geometry(), cloudViewer::io::pybind_io(), cloudViewer::ml::pybind_ml(), cloudViewer::pipelines::pybind_pipelines(), cloudViewer::reconstruction::pybind_reconstruction(), cloudViewer::t::pybind_t(), cloudViewer::utility::pybind_utility(), cloudViewer::visualization::pybind_visualization(), cloudViewer::core::MemoryManagerStatistic::Reset(), and cloudViewer::utility::Logger::SetPrintFunction().
|
inline |
|
inline |
|
inline |
Convert radians to degrees.
| radians | Radians to convert |
Definition at line 71 of file CVMath.h.
References M_PI.
Referenced by DistanceMapGenerationDlg::angularUnitChanged(), ConvertAngleFromRad(), define_CCMath(), MatrixDisplayDlg::fillDialogWith(), ccPropertiesTreeDelegate::fillWithCameraSensor(), ccPropertiesTreeDelegate::fillWithGBLSensor(), ccCamSensorProjectionDlg::initWithCamSensor(), ccGBLSensorProjectionDlg::initWithGBLSensor(), IcmFilter::LoadCalibratedImages(), StereogramWidget::mousePressEvent(), qHoughNormalsDialog::setParameters(), TransformInfo::setTransformation(), PdmsTools::PdmsObjects::SCylinder::write(), PdmsTools::PdmsObjects::CTorus::write(), and PdmsTools::PdmsObjects::RTorus::write().
| void cloudViewer::saveArrayOfArraysToFile | ( | const std::string | fileName, |
| StaticVector< StaticVector< T >> & | aa | ||
| ) |
Definition at line 198 of file StaticVector.h.
References cloudViewer::StaticVector< T >::empty(), CVLog::PrintDebug(), and cloudViewer::StaticVector< T >::size().
| void cloudViewer::saveArrayOfArraysToFile | ( | std::string | fileName, |
| StaticVector< StaticVector< T > * > * | aa | ||
| ) |
Definition at line 175 of file StaticVector.h.
References NULL, CVLog::PrintDebug(), and cloudViewer::StaticVector< T >::size().
| void cloudViewer::saveArrayToFile | ( | const std::string & | fileName, |
| const StaticVector< T > & | a, | ||
| bool | docompress = true |
||
| ) |
Definition at line 312 of file StaticVector.h.
| void cloudViewer::saveArrayToFile | ( | const std::string & | fileName, |
| const StaticVector< T > * | a, | ||
| bool | docompress = true |
||
| ) |
Definition at line 319 of file StaticVector.h.
References cloudViewer::utility::filesystem::DirectoryExists(), CVLog::Error(), cloudViewer::utility::filesystem::GetFileParentDirectory(), cloudViewer::utility::filesystem::MakeDirectoryHierarchy(), CVLog::PrintDebug(), cloudViewer::StaticVector< T >::size(), and CVLog::Warning().
| int cloudViewer::sizeOfStaticVector | ( | const StaticVector< T > & | a | ) |
Definition at line 154 of file StaticVector.h.
References cloudViewer::StaticVector< T >::empty(), and cloudViewer::StaticVector< T >::size().
| int cloudViewer::sizeOfStaticVector | ( | const StaticVector< T > * | a | ) |
Definition at line 148 of file StaticVector.h.
References cloudViewer::StaticVector< T >::size().
| CLOUDVIEWER_HOST_DEVICE scalar_t cloudViewer::Square | ( | const scalar_t & | x | ) |
Definition at line 56 of file GeometryMacros.h.
|
static |
Relative error for Error Function computation.
You can adjust it to trade off between accuracy and speed but don't ask for more than 15 figures (assuming usual 52 bit mantissa in a double). Example: 1E-12 <--> calculate 12 significant figures
Definition at line 21 of file ErrorFunction.h.
Referenced by define_ErrorFunction(), and cloudViewer::ErrorFunction::erfc().
| const int cloudViewer::c_FastMarchingNeighbourPosShift[] |
Grid neighboring cells positions.
Definition at line 29 of file FastMarching.h.
Referenced by cloudViewer::FastMarching::computeT(), define_FastMarching(), and cloudViewer::FastMarching::initOther().