| Clvr2::BVHTree< BaseVecT >::AABB | |
| Clvr2::AABB< T > | A struct to calculate the Axis Aligned Bounding Box and Average Point of a Point Cloud |
| ►CAbstractStage | |
| CFusionStage | |
| CGridStage | |
| CMeshStage | |
| COptimizeStage | |
| Clvr2::FeatureBase< Features >::add_feature< F > | |
| Clvr2::Hdf5IO< Features >::add_feature< F > | |
| Clvr2::FeatureBase< Features >::add_features< F, Fs > | |
| Clvr2::Hdf5IO< Features >::add_features< F, Fs > | |
| Clvr2::FeatureBase< Features >::add_features< F > | |
| Clvr2::Hdf5IO< Features >::add_features< F > | |
| Clvr2::FeatureBase< Features >::add_features_with_deps< F, Fs > | |
| Clvr2::Hdf5IO< Features >::add_features_with_deps< F, Fs > | |
| Clvr2::FeatureBase< Features >::add_features_with_deps< F > | |
| Clvr2::Hdf5IO< Features >::add_features_with_deps< F > | |
| Ckfusion::device::Aff3f | |
| ►CAllocator | |
| CChunkAllocator | |
| CPackedChunkAllocator | |
| CSequentialAllocator | |
| CHighFive::AnnotateTraits< Derivate > | |
| ►CHighFive::AnnotateTraits< DataSet > | |
| CHighFive::DataSet | |
| ►CHighFive::AnnotateTraits< File > | |
| CHighFive::File | File class |
| ►CHighFive::AnnotateTraits< Group > | |
| CHighFive::Group | |
| CArithmeticBitModel | |
| CArithmeticModel | |
| CHighFive::details::array_dims< T > | |
| CHighFive::details::array_dims< std::array< T, N > > | |
| CHighFive::details::array_dims< std::vector< T > > | |
| CHighFive::details::array_dims< T * > | |
| CHighFive::details::array_dims< T[N]> | |
| Clvr2::ArrayIO< FeatureBase > | |
| Clvr2::hdf5features::ArrayIO< Derived > | |
| ►CArrayIO ... | |
| Clvr2::Hdf5IO< lvr2::hdf5features::ArrayIO ... > | |
| ►Clvr2::hdf5features::ArrayIO< Hdf5IO< lvr2::hdf5features::ArrayIO ... > > | |
| Clvr2::Hdf5IO< lvr2::hdf5features::ArrayIO, lvr2::hdf5features::ChannelIO, lvr2::hdf5features::VariantChannelIO, lvr2::hdf5features::MeshIO > | |
| Clvr2::ArrayIO< lvr2::FeatureBase > | |
| Clvr2::ArrayIO< lvr2::lvr2::FeatureBase > | |
| Clvr2::ArrayIO< lvr2::lvr2::lvr2::FeatureBase > | |
| Clvr2::AsciiRenderer | |
| ►Clvr2::AttributeMap< HandleT, ValueT > | Interface for attribute maps |
| Clvr2::HashMap< HandleT, ValueT > | |
| Clvr2::ListMap< HandleT, ValueT > | A simple implementation of AttributeMap for a small number of values |
| Clvr2::VectorMap< HandleT, ValueT > | A map with constant lookup overhead using small-ish integer-keys |
| ►Clvr2::AttributeMap< HandleT, lvr2::ClusterHandle > | |
| Clvr2::VectorMap< HandleT, lvr2::ClusterHandle > | |
| ►Clvr2::AttributeMap< lvr2::FaceHandle, lvr2::ClusterHandle > | |
| Clvr2::VectorMap< lvr2::FaceHandle, lvr2::ClusterHandle > | |
| ►Clvr2::AttributeMap< lvr2::FaceHandle, std::pair< float, float > > | |
| Clvr2::HashMap< lvr2::FaceHandle, std::pair< float, float > > | |
| ►Clvr2::AttributeMap< lvr2::Material, ValueT > | |
| Clvr2::VectorMap< lvr2::Material > | |
| Clvr2::AttributeMap< lvr2::Normal< typename BaseVecT::CoordType > > | |
| ►Clvr2::AttributeMap< lvr2::VertexHandle, double > | |
| Clvr2::HashMap< lvr2::VertexHandle, double > | |
| ►Clvr2::AttributeMapHandleIterator< HandleT > | Iterator over keys of an attribute map |
| Clvr2::HashMapIterator< HandleT, ValueT > | |
| Clvr2::ListMapIterator< HandleT, ValueT > | |
| Clvr2::VectorMapIterator< HandleT, ValueT > | |
| Clvr2::AttributeMapHandleIteratorPtr< HandleT > | Simple convinience wrapper for unique_ptr<AttributeMapHandleIterator> |
| Clvr2::intelem::Barycentrics | Barycentric coordinates of the intersection point |
| Clvr2::BaseHandle< IdxT > | Interface for all kinds of handles. Handles are basically a key to refer to something |
| ►Clvr2::BaseHandle< Index > | |
| Clvr2::ClusterHandle | Handle to access Cluster of the ClusterBiMap |
| Clvr2::EdgeHandle | Handle to access edges of the mesh |
| Clvr2::FaceHandle | Handle to access faces of the mesh |
| Clvr2::HalfEdgeHandle | Handle to access half edges of the HEM |
| Clvr2::TextureHandle | Handle to access textures of the mesh |
| Clvr2::VertexHandle | Handle to access vertices of the mesh |
| ►Clvr2::BaseIO | Interface specification for low-level io. All read elements are stored in linear arrays |
| Clvr2::AsciiIO | A import / export class for point cloud data in plain text formats. Currently the file extensions .xyz, .txt, .3d and .pts are supported |
| Clvr2::BoctreeIO | IO-Class to import compressed octrees from slam6d |
| Clvr2::DatIO | IO class for binary laser scans |
| Clvr2::DrcIO | |
| Clvr2::LasIO | Interface class to read laser scan data in .las-Format |
| Clvr2::ObjIO | A basic implementation of the obj file format |
| Clvr2::PCDIO | A import / export class for point cloud data in the PointCloudLibrary file format |
| Clvr2::PLYIO | A class for input and output to ply files |
| Clvr2::RxpIO | Reads .rxp files |
| Clvr2::STLIO | |
| Clvr2::UosIO | An input class for laser scans in UOS 3d format |
| ►Clvr2::BaseMesh< BaseVecT > | Interface for triangle-meshes with adjacency information |
| Clvr2::HalfEdgeMesh< BaseVecT > | Half-edge data structure implementing the BaseMesh interface |
| ►Clvr2::BaseOption | |
| Cdmc_reconstruction::Options | |
| Cgs_reconstruction::Options | |
| Ckaboom::Options | A class to parse the program options for the reconstruction executable |
| CLargeScaleOptions::Options | A class to parse the program options for the reconstruction executable |
| Cmeshreduce::Options | A class to parse the program options for the reconstruction executable |
| Creconstruct::Options | A class to parse the program options for the reconstruction executable |
| Cviewer::Options | |
| Clvr2::BaseOptionalHandle< IdxT, NonOptionalT > | Base class for optional handles (handles that can be "null" or "None") |
| ►Clvr2::BaseOptionalHandle< Index, ClusterHandle > | |
| Clvr2::OptionalClusterHandle | Semantically equivalent to boost::optional<ClusterHandle> |
| ►Clvr2::BaseOptionalHandle< Index, EdgeHandle > | |
| Clvr2::OptionalEdgeHandle | Semantically equivalent to boost::optional<EdgeHandle> |
| ►Clvr2::BaseOptionalHandle< Index, FaceHandle > | |
| Clvr2::OptionalFaceHandle | Semantically equivalent to boost::optional<FaceHandle> |
| ►Clvr2::BaseOptionalHandle< Index, HalfEdgeHandle > | |
| Clvr2::OptionalHalfEdgeHandle | Semantically equivalent to boost::optional<HalfEdgeHandle> |
| ►Clvr2::BaseOptionalHandle< Index, VertexHandle > | |
| Clvr2::OptionalVertexHandle | Semantically equivalent to boost::optional<VertexHandle> |
| Clvr2::BaseVector< CoordT > | A generic, weakly-typed vector |
| Clvr2::BaseVector< CoordType > | |
| Clvr2::BaseVector< float > | |
| Clvr2::BaseVector< std::size_t > | |
| ►Clvr2::BaseVector< T > | |
| Clvr2::ColorVertex< T, ColorT > | A color vertex |
| Clvr2::BigGrid< BaseVecT > | |
| Clvr2::BigGridKdTree< BaseVecT > | |
| Clvr2::BigVolumen< BaseVecT > | |
| Clvr2::BitField< W, H > | |
| ►Clvr2::BitField< 2, 4 > | |
| Clvr2::BrailleChar | |
| Cbitoct | |
| Cbitunion< T > | |
| Ckfusion::device::Block | |
| CBlockingQueue | |
| CBlockMemoryHandler | |
| Clvr2::BOct | |
| Clvr2::BoundingBox< BaseVecT > | A dynamic bounding box class |
| Clvr2::BoundingBox< BaseVector< float > > | |
| Clvr2::BoundingBox< lvr2::BaseVector< float > > | |
| Clvr2::BoundingRectangle< CoordType > | A representation of a bounding rectangle |
| Clvr2::BoxTraits< BoxT > | |
| Clvr2::BoxTraits< BilinearFastBox< BaseVecT > > | |
| Clvr2::BoxTraits< SharpBox< BaseVecT > > | |
| Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::BranchStruct< T, DistanceType > | |
| ►Clvr2::BVHTree< BaseVecT >::BVHNode | |
| Clvr2::BVHTree< BaseVecT >::BVHInner | |
| Clvr2::BVHTree< BaseVecT >::BVHLeaf | |
| Clvr2::BVHTree< BaseVecT > | Implementation of an Bounding Volume Hierarchy Tree used for ray casting |
| Clvr2::BVHTree< lvr2::BaseVector< float > > | |
| ►CByteStreamIn | |
| ►CByteStreamInFile | |
| CByteStreamInFileBE | |
| CByteStreamInFileLE | |
| ►CByteStreamInIstream | |
| CByteStreamInIstreamBE | |
| CByteStreamInIstreamLE | |
| ►CByteStreamOut | |
| ►CByteStreamOutFile | |
| CByteStreamOutFileBE | |
| CByteStreamOutFileLE | |
| CByteStreamOutNil | |
| ►CByteStreamOutOstream | |
| CByteStreamOutOstreamBE | |
| CByteStreamOutOstreamLE | |
| Clvr2::C_Octree< BaseVecT, BoxT, T_CellData > | |
| Clvr2::C_Octree< BaseVecT, BoxT, lvr2::my_dummy > | |
| CHighFive::Caching | |
| Clvr2::Cell | |
| Clvr2::CellHandle | |
| Clvr2::CellInfo | |
| Clvr2::Channel< T > | |
| Clvr2::Channel< float > | |
| Clvr2::ChannelIO< FeatureBase > | |
| Clvr2::ChannelIO< lvr2::ConstructType > | |
| Clvr2::ChannelIO< lvr2::lvr2::FeatureBase > | |
| ►CChecker | |
| CCheckerHeightBottom | |
| CCheckerHeightTop | |
| CCheckerRangeMax | |
| CCheckerRangeMin | |
| CCheckerFactory< T > | Factory integrating the create-function and adding it to the lookup map in an easy template |
| ►Clvr2::ChunkHashGrid | |
| Clvr2::ChunkManager | |
| CHighFive::Chunking | |
| Clvr2::ChunkingPipeline< BaseVecT > | |
| Clvr2::ChunkIO< FeatureBase > | |
| Clvr2::hdf5features::ChunkIO< Derived > | |
| Clvr2::ChunkLeaf | |
| CChunkMemoryHandler | |
| Clvr2::ClSOR | |
| Clvr2::ClSurface | |
| Clvr2::CLRaycaster< IntT >::ClTriangleIntersectionResult | |
| Clvr2::Cluster< HandleT > | Represents a group of handles, which are somehow connected |
| Clvr2::ClusterBiMap< HandleT > | A map of clusters, which also saves a back-reference from handle to cluster |
| Clvr2::ClusterBiMap< lvr2::FaceHandle > | |
| Clvr2::ClusterBiMapIterator< HandleT > | Iterator over cluster handles in this cluster map |
| Clvr2::ClusterPainter | Algorithm which generates the same color for all vertices, which are in the same cluster |
| Clvr2::ClusterTexCoordMapping | Mapping of clusters to texture coordinates for a single vertex |
| Clvr2::CLUtil | Util class for CL that maps error codes to human readable strings |
| Clvr2::color< ColorT > | |
| Clvr2::color< bool > | |
| Clvr2::color< size_t > | |
| Clvr2::ColorMap | |
| Clvr2::Colors | |
| Clvr2::Util::ColorVecCompare | A comparison object for Vector<VecUChar> |
| Clvr2::CompareDistancePair< T > | |
| Ckfusion::device::ComputeIcpHelper | |
| Clvr2::VariantChannelMap< T >::const_iterator< U > | |
| Clvr2::ConstructType | |
| Clvr2::hdf5features::ConstructType | |
| CContentGenerate< T > | |
| CContentGenerate< char > | |
| CContentGenerate< std::string > | |
| CYAML::convert< Eigen::Matrix< Scalar_, A_, B_, C_, D_, E_ > > | |
| CYAML::convert< lvr2::HyperspectralCamera > | |
| CYAML::convert< lvr2::HyperspectralPanoramaChannel > | |
| CYAML::convert< lvr2::LSROptions > | |
| CYAML::convert< lvr2::Scan > | |
| CYAML::convert< lvr2::ScanCamera > | |
| CYAML::convert< lvr2::ScanImage > | |
| CYAML::convert< lvr2::ScanPosition > | |
| CYAML::convert< lvr2::ScanProject > | |
| CYAML::convert< lvr2::SLAMOptions > | |
| Clvr2::coord< CoordT > | |
| Clvr2::CoordinateTransform< T > | Stores information to transform a 3D point into a different coordinate system. It is assumed, that the coordinate called x is refered to as coordinate 0, y is 1 and z is 2 |
| Clvr2::CoordinateTransform< float > | |
| Clvr2::CudaSurface | |
| Ckfusion::cuda::CyclicalBuffer | CyclicalBuffer implements a cyclical TSDF buffer. The class offers a simple interface, by handling shifts and maintaining the world autonomously |
| CHighFive::details::data_converter< Scalar, Enable > | |
| CHighFive::details::data_converter< CArray, typename std::enable_if<(is_c_array< CArray >::value)>::type > | |
| CHighFive::details::data_converter< std::array< T, S >, typename std::enable_if<(std::is_same< T, typename type_of_array< T >::type >::value)>::type > | |
| CHighFive::details::data_converter< std::string, void > | |
| CHighFive::details::data_converter< std::vector< std::string >, void > | |
| CHighFive::details::data_converter< std::vector< T >, typename std::enable_if<(is_container< T >::value)>::type > | |
| CHighFive::details::data_converter< std::vector< T >, typename std::enable_if<(std::is_same< T, typename type_of_array< T >::type >::value)>::type > | |
| ►CDataPointer | |
| CSingleArray< T > | |
| CSingleObject< T > | |
| CTripleArray< T > | |
| CHighFive::Deflate | |
| Clvr2::ModelToImage::DepthPixel | Pixelcoordinates with depth value |
| Clvr2::Description | |
| ►Ckfusion::cuda::DeviceMemory | DeviceMemory class |
| Ckfusion::cuda::DeviceArray< kfusion::Point > | |
| Ckfusion::cuda::DeviceArray< Point > | |
| Ckfusion::cuda::DeviceArray< T > | DeviceArray class |
| ►Ckfusion::cuda::DeviceMemory2D | DeviceMemory2D class |
| Ckfusion::cuda::DeviceArray2D< float > | |
| Ckfusion::cuda::DeviceArray2D< Normal > | |
| Ckfusion::cuda::DeviceArray2D< Point > | |
| Ckfusion::cuda::DeviceArray2D< unsigned short > | |
| Ckfusion::cuda::DeviceArray2D< T > | DeviceArray2D class |
| ►Ckfusion::cuda::DevPtr< T > | |
| ►Ckfusion::cuda::PtrStep< T > | |
| Ckfusion::cuda::PtrStepSz< T > | |
| Ckfusion::cuda::PtrSz< T > | |
| ►Ckfusion::cuda::DevPtr< Normal > | |
| Ckfusion::cuda::PtrStep< Normal > | |
| ►Ckfusion::cuda::DevPtr< Point > | |
| Ckfusion::cuda::PtrStep< Point > | |
| ►Ckfusion::cuda::DevPtr< ushort > | |
| Ckfusion::cuda::PtrStep< ushort > | |
| Clvr2::ModelToImage::DI | Image with single depth information |
| Clvr2::DirectoryIO | |
| Clvr2::intelem::Distance | Intersection distance(float) |
| ►Clvr2::DMCPointHandle< BaseVecT > | |
| Clvr2::DMCVecPointHandle< BaseVecT > | |
| Cpsimpl::PolylineSimplification< DIM, InputIterator, OutputIterator >::DPHelper | Douglas-Peucker approximation helper class |
| Clvr2::DualLeaf< BaseVecT, BoxT > | |
| Cdunion< T > | |
| Clvr2::DynamicKDTree< BaseVecT > | |
| Clvr2::EdgeCollapseRemovedFace | |
| Clvr2::EdgeCollapseResult | |
| Clvr2::EdgeIteratorProxy< BaseVecT > | |
| Clvr2::EdgeSplitResult | |
| Ckfusion::device::Eigen33 | |
| Clvr2::EigenSVDPointAlign< T, PointT > | |
| Clvr2::ElementProxy< T > | |
| Clvr2::ElementProxyPtr< T > | This class emulates a Pointer behaviour for an ElementProxy if its & operator is used. The arithmetic is based on the width of an ElementProxy. It was necessary for the Octree. USE WITH CARE |
| CHighFive::ElementSet | |
| Ckfusion::device::Emulation | |
| ►Cenable_shared_from_this | |
| Clvr2::ChunkBuilder | |
| ►CEntropyDecoder | |
| CArithmeticDecoder | |
| ►CEntropyEncoder | |
| CArithmeticEncoder | |
| Ckfusion::cuda::TsdfVolume::Entry | |
| ►Cexception | |
| ►CHighFive::Exception | Basic HighFive Exception class |
| CHighFive::AttributeException | Exception specific to HighFive Attribute interface |
| CHighFive::DataSetException | Exception specific to HighFive DataSet interface |
| CHighFive::DataSpaceException | Exception specific to HighFive DataSpace interface |
| CHighFive::DataTypeException | Exception specific to HighFive DataType interface |
| CHighFive::FileException | Exception specific to HighFive File interface |
| CHighFive::GroupException | Exception specific to HighFive Group interface |
| CHighFive::ObjectException | Exception specific to HighFive Object interface |
| CHighFive::PropertyException | Exception specific to HighFive Property interface |
| Clvr2::LineReader::readException | |
| Clvr2::PanicException | An exception denoting an internal bug |
| Clvr2::VertexLoopException | |
| Clvr2::intelem::Face | Intersection face as uint id |
| Clvr2::FaceIteratorProxy< BaseVecT > | |
| ►Cfalse_type | |
| Clvr2::FeatureBase< Features >::has_type< T, std::tuple<> > | |
| Clvr2::Hdf5IO< Features >::has_type< T, std::tuple<> > | |
| Clvr2::Intersection< Tp >::has_type< T, std::tuple<> > | |
| ►Clvr2::FastBox< BaseVecT > | A volume representation used by the standard Marching Cubes implementation |
| Clvr2::BilinearFastBox< BaseVecT > | |
| Clvr2::SharpBox< BaseVecT > | Used for extended marching cubes Reconstruction |
| Clvr2::TetraederBox< BaseVecT > | Used for Marching Tetreader Reconstruction. Dives a regular box into 5 Tetraeders for mesh generation |
| ►Clvr2::FastReconstructionBase< BaseVecT > | |
| Clvr2::DMCReconstruction< BaseVecT, BoxT > | A surface reconstruction object that implements the standard marching cubes algorithm using a octree and a thread pool for parallel computation |
| Clvr2::FastReconstruction< BaseVecT, BoxT > | A surface reconstruction object that implements the standard marching cubes algorithm using a hashed grid structure for parallel computation |
| Clvr2::FeatureConstruct | Helper class how to construct a IO feature with its dependencies |
| Clvr2::FeatureConstruct< ChunkIO, FeatureBase > | |
| Clvr2::FeatureConstruct< HyperspectralCameraIO, FeatureBase > | FeatureConstruct Specialization for ScanCameraIO |
| Clvr2::FeatureConstruct< PointCloudIO, FeatureBase > | |
| Clvr2::FeatureConstruct< ScanCameraIO, FeatureBase > | FeatureConstruct Specialization for hdf5features::ScanCameraIO |
| Clvr2::FeatureConstruct< ScanImageIO, FeatureBase > | FeatureConstruct Specialization for hdf5features::ScanImageIO |
| Clvr2::FeatureConstruct< ScanIO, FeatureBase > | FeatureConstruct Specialization for ScanIO |
| Clvr2::FeatureConstruct< ScanPositionIO, FeatureBase > | |
| Clvr2::FeatureConstruct< ScanProjectIO, FeatureBase > | |
| ►CFeatures | |
| Clvr2::FeatureBase< Features > | Manager Class for all FeatureBase components located in hdf5 directory |
| Clvr2::Hdf5IO< Features > | Manager Class for all Hdf5IO components located in hdf5 directory |
| Clvr2::fileAttribut | |
| ►Clvr2::FileKernel | |
| Clvr2::DirectoryKernel | |
| Clvr2::HDF5Kernel | |
| Ckfusion::device::float12 | |
| Ckfusion::device::float8 | |
| Ckfusion::cuda::Frame | |
| ►CFreenectDevice | |
| Clvr2::KinectGrabber | |
| Clvr2::GeoTIFFIO | Class providing and encapsulating GDAL GeoTIFF I/O functions |
| Clvr2::GlTexture | |
| Ckfusion::device::gmem | |
| Clvr2::GraphSLAM | Wrapper class for running GraphSLAM on Scans |
| ►Clvr2::GridBase | |
| ►Clvr2::HashGrid< BaseVecT, BoxT > | |
| Clvr2::PointsetGrid< BaseVecT, BoxT > | |
| Clvr2::GridIO | |
| ►Clvr2::GroupedChannelIO | Interface class for io classes that support annotation channels organized in different groups |
| Clvr2::hdf5features::ChannelIO< ConstructType > | |
| ►Clvr2::AttributeMeshIOBase | |
| Clvr2::hdf5features::MeshIO< Derived > | Hdf5IO Feature for handling MeshBuffer related IO |
| Clvr2::hdf5features::ChannelIO< Derived > | |
| Clvr2::GrowingCellStructure< BaseVecT, NormalT > | |
| Clvr2::HalfEdge | |
| Clvr2::HalfEdgeFace | Represents a face in the HEM data structure |
| Clvr2::HalfEdgeVertex< BaseVecT > | Represents a vertex in the HEM data structure |
| Clvr2::Intersection< Tp >::has_elem< F > | |
| Clvr2::FeatureBase< Features >::has_feature< F > | |
| Clvr2::Hdf5IO< Features >::has_feature< F > | |
| Clvr2::FeatureBase< Features >::has_type< T, Tuple > | |
| Clvr2::Hdf5IO< Features >::has_type< T, Tuple > | |
| Clvr2::Intersection< Tp >::has_type< T, Tuple > | |
| ►Clvr2::FeatureBase< Features >::has_type< T, std::tuple< Ts... > > | |
| Clvr2::FeatureBase< Features >::has_type< T, std::tuple< U, Ts... > > | |
| ►Clvr2::Hdf5IO< Features >::has_type< T, std::tuple< Ts... > > | |
| Clvr2::Hdf5IO< Features >::has_type< T, std::tuple< U, Ts... > > | |
| ►Clvr2::Intersection< Tp >::has_type< T, std::tuple< Ts... > > | |
| Clvr2::Intersection< Tp >::has_type< T, std::tuple< U, Ts... > > | |
| Cstd::hash< lvr2::ClusterHandle > | |
| Cstd::hash< lvr2::EdgeHandle > | |
| Cstd::hash< lvr2::FaceHandle > | |
| Cstd::hash< lvr2::HalfEdgeHandle > | |
| Cstd::hash< lvr2::TextureHandle > | |
| Cstd::hash< lvr2::VertexHandle > | |
| Clvr2::Hdf5Construct | Helper class how to construct a IO feature with its dependencies |
| Clvr2::Hdf5Construct< hdf5features::ChunkIO, Derived > | |
| Clvr2::Hdf5Construct< hdf5features::HyperspectralCameraIO, Derived > | Hdf5Construct Specialization for hdf5features::ScanCameraIO |
| Clvr2::Hdf5Construct< hdf5features::MeshIO, Derived > | Hdf5Construct Specialization for hdf5features::MeshIO |
| Clvr2::Hdf5Construct< hdf5features::PointCloudIO, Derived > | |
| Clvr2::Hdf5Construct< hdf5features::ScanCameraIO, Derived > | Hdf5Construct Specialization for hdf5features::ScanCameraIO |
| Clvr2::Hdf5Construct< hdf5features::ScanImageIO, Derived > | Hdf5Construct Specialization for hdf5features::ScanImageIO |
| Clvr2::Hdf5Construct< hdf5features::ScanIO, Derived > | Hdf5Construct Specialization for hdf5features::ScanIO |
| Clvr2::Hdf5Construct< hdf5features::ScanPositionIO, Derived > | |
| Clvr2::Hdf5Construct< hdf5features::ScanProjectIO, Derived > | |
| Clvr2::Hdf5Construct< hdf5features::VariantChannelIO, BaseIO > | |
| Clvr2::Hdf5Construct< VariantChannelIO, BaseIO > | |
| CHighFive::HDF5ErrMapper | |
| Clvr2::HDF5IO | |
| ►Clvr2::HDF5MetaDescriptionBase | |
| Clvr2::HDF5MetaDescriptionV2 | |
| CHighFive::details::HighFiveIterateData | |
| Clvr2::HyperspectralCalibration_ | |
| Clvr2::HyperspectralCamera | |
| Clvr2::HyperspectralCameraIO< FeatureBase > | |
| Clvr2::hdf5features::HyperspectralCameraIO< Derived > | |
| Clvr2::HyperspectralCameraIO< lvr2::FeatureBase > | |
| Clvr2::HyperspectralCameraIO< lvr2::lvr2::FeatureBase > | |
| Clvr2::HyperspectralCameraModel | |
| Clvr2::HyperspectralPanorama | |
| Clvr2::HyperspectralPanoramaChannel | |
| Clvr2::ICPPointAlign | A class to align two Scans with ICP |
| Clvr2::idxVal< T > | |
| Clvr2::ImageIO< FeatureBase > | |
| Clvr2::hdf5features::ImageIO< Derived > | |
| Clvr2::ImageIO< lvr2::FeatureBase > | |
| Clvr2::ImageIO< lvr2::lvr2::FeatureBase > | |
| Clvr2::ImageIO< lvr2::lvr2::lvr2::FeatureBase > | |
| Clvr2::ImageIO< lvr2::lvr2::lvr2::lvr2::FeatureBase > | |
| Ckfusion::ImgPose | |
| Ckfusion::OpenNISource::Impl | |
| Clvr2::VariantChannel< T >::index_of_type< U > | Access type index with type |
| Clvr2::VariantChannelMap< T >::index_of_type< U > | Access type index by type |
| Cnanoflann::IndexDist_Sorter | |
| CInitializer | Start-of-the-program initializer for the sequence map |
| CIntegerCompressor | |
| Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Interval | |
| Ckfusion::Intr | |
| Clvr2::IOType< FeatureBase, T > | |
| Clvr2::hdf5features::IOType< Derived, T > | |
| Clvr2::hdf5features::IOType< Derived, MeshBufferPtr > | |
| Clvr2::hdf5features::IOType< Derived, PointBufferPtr > | |
| Clvr2::IOType< FeatureBase, MeshBufferPtr > | |
| Clvr2::IOType< FeatureBase, PointBufferPtr > | |
| CHighFive::details::is_c_array< typename > | |
| CHighFive::details::is_c_array< T * > | |
| CHighFive::details::is_c_array< T[N]> | |
| CHighFive::details::is_container< typename > | |
| CHighFive::details::is_container< std::vector< T > > | |
| Clvr2::NodeData< BaseVecT >::Iterator | |
| Clvr2::VariantChannelMap< T >::iterator< U > | |
| ►Clvr2::KDTree | Kd-Tree Implementation for nearest Neighbor searches |
| Clvr2::KDLeaf | |
| Clvr2::KDNode | |
| Cnanoflann::KDTreeEigenMatrixAdaptor< MatrixType, DIM, Distance, IndexType > | |
| Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType > | |
| Cnanoflann::KDTreeSingleIndexAdaptorParams | |
| Cpsimpl::PolylineSimplification< DIM, InputIterator, OutputIterator >::DPHelper::KeyInfo | Defines the key of a polyline |
| Clvr2::KinectIO | |
| Ckfusion::KinFu | |
| CKinFuApp | |
| Ckfusion::KinFuParams | |
| Cnanoflann::KNNResultSet< DistanceType, IndexType, CountType > | |
| Cnanoflann::L1_Adaptor< T, DataSource, _DistanceType > | |
| Cnanoflann::L2_Adaptor< T, DataSource, _DistanceType > | |
| Cnanoflann::L2_Simple_Adaptor< T, DataSource, _DistanceType > | |
| Clvr2::LargeScaleReconstruction< BaseVecT > | |
| CLASattribute | |
| ►CLASattributer | |
| CLASheader | |
| CLASbin | |
| ►CLAScriterion | |
| CLAScriterionClipCircle | |
| CLAScriterionClipRawXAbove | |
| CLAScriterionClipRawXBelow | |
| CLAScriterionClipRawXY | |
| CLAScriterionClipRawYAbove | |
| CLAScriterionClipRawYBelow | |
| CLAScriterionClipRawZ | |
| CLAScriterionClipRawZAbove | |
| CLAScriterionClipRawZBelow | |
| CLAScriterionClipTile | |
| CLAScriterionClipXAbove | |
| CLAScriterionClipXBelow | |
| CLAScriterionClipXY | |
| CLAScriterionClipYAbove | |
| CLAScriterionClipYBelow | |
| CLAScriterionClipZ | |
| CLAScriterionClipZAbove | |
| CLAScriterionClipZBelow | |
| CLAScriterionDropFirstReturn | |
| CLAScriterionDropGpsTimeAbove | |
| CLAScriterionDropGpsTimeBelow | |
| CLAScriterionDropGpsTimeBetween | |
| CLAScriterionDropIntensityAbove | |
| CLAScriterionDropIntensityBelow | |
| CLAScriterionDropIntensityBetween | |
| CLAScriterionDropLastReturn | |
| CLAScriterionDropMiddleReturn | |
| CLAScriterionDropPointSourceAbove | |
| CLAScriterionDropPointSourceBelow | |
| CLAScriterionDropPointSourceBetween | |
| CLAScriterionDropScanAngleAbove | |
| CLAScriterionDropScanAngleBelow | |
| CLAScriterionDropScanAngleBetween | |
| CLAScriterionDropScanDirection | |
| CLAScriterionDropSpecificNumberOfReturns | |
| CLAScriterionEdgeOfFlightLineOnly | |
| CLAScriterionKeepClassifications | |
| CLAScriterionKeepEveryNth | |
| CLAScriterionKeepFirstReturn | |
| CLAScriterionKeepGpsTime | |
| CLAScriterionKeepIntensity | |
| CLAScriterionKeepLastReturn | |
| CLAScriterionKeepMiddleReturn | |
| CLAScriterionKeepPointSource | |
| CLAScriterionKeepPointSourceBetween | |
| CLAScriterionKeepRandomFraction | |
| CLAScriterionKeepReturns | |
| CLAScriterionKeepScanAngle | |
| CLAScriterionKeepSpecificNumberOfReturns | |
| CLAScriterionKeepWavepackets | |
| CLAScriterionScanDirectionChangeOnly | |
| CLAScriterionThinWithGrid | |
| CLASfilter | |
| CLAShistogram | |
| CLASindex | |
| CLASinterval | |
| ►CLASintervalCell | |
| CLASintervalStartCell | |
| CLASinventory | |
| CLASitem | |
| CLASoccupancyGrid | |
| ►CLASoperation | |
| CLASoperationChangeClassificationFromTo | |
| CLASoperationChangeNumberOfReturnsFromTo | |
| CLASoperationChangePointSourceFromTo | |
| CLASoperationChangeReturnNumberFromTo | |
| CLASoperationClampRawZ | |
| CLASoperationClampZ | |
| CLASoperationClampZmax | |
| CLASoperationClampZmin | |
| CLASoperationFlipWaveformDirection | |
| CLASoperationRepairZeroReturns | |
| CLASoperationRotateXY | |
| CLASoperationScaleIntensity | |
| CLASoperationScaleRGBdown | |
| CLASoperationScaleRGBup | |
| CLASoperationScaleScanAngle | |
| CLASoperationScaleX | |
| CLASoperationScaleXYZ | |
| CLASoperationScaleY | |
| CLASoperationScaleZ | |
| CLASoperationSwitchXY | |
| CLASoperationSwitchXZ | |
| CLASoperationSwitchYZ | |
| CLASoperationTranslateGpsTime | |
| CLASoperationTranslateIntensity | |
| CLASoperationTranslateRawX | |
| CLASoperationTranslateRawXYZ | |
| CLASoperationTranslateRawY | |
| CLASoperationTranslateRawZ | |
| CLASoperationTranslateScanAngle | |
| CLASoperationTranslateThenScaleIntensity | |
| CLASoperationTranslateThenScaleScanAngle | |
| CLASoperationTranslateThenScaleX | |
| CLASoperationTranslateThenScaleY | |
| CLASoperationTranslateThenScaleZ | |
| CLASoperationTranslateX | |
| CLASoperationTranslateXYZ | |
| CLASoperationTranslateY | |
| CLASoperationTranslateZ | |
| CLASpoint | |
| CLASpoint10 | |
| ►CLASquantizer | |
| CLASheader | |
| ►CLASreader | |
| ►CLASreaderBIN | |
| ►CLASreaderBINreoffset | |
| CLASreaderBINrescalereoffset | |
| ►CLASreaderBINrescale | |
| CLASreaderBINrescalereoffset | |
| ►CLASreaderLAS | |
| ►CLASreaderLASreoffset | |
| CLASreaderLASrescalereoffset | |
| ►CLASreaderLASrescale | |
| CLASreaderLASrescalereoffset | |
| CLASreaderMerged | |
| ►CLASreaderQFIT | |
| ►CLASreaderQFITreoffset | |
| CLASreaderQFITrescalereoffset | |
| ►CLASreaderQFITrescale | |
| CLASreaderQFITrescalereoffset | |
| ►CLASreaderSHP | |
| ►CLASreaderSHPreoffset | |
| CLASreaderSHPrescalereoffset | |
| ►CLASreaderSHPrescale | |
| CLASreaderSHPrescalereoffset | |
| ►CLASreaderTXT | |
| ►CLASreaderTXTreoffset | |
| CLASreaderTXTrescalereoffset | |
| ►CLASreaderTXTrescale | |
| CLASreaderTXTrescalereoffset | |
| ►CLASreadItem | |
| ►CLASreadItemCompressed | |
| CLASreadItemCompressed_BYTE_v1 | |
| CLASreadItemCompressed_BYTE_v2 | |
| CLASreadItemCompressed_GPSTIME11_v1 | |
| CLASreadItemCompressed_GPSTIME11_v2 | |
| CLASreadItemCompressed_POINT10_v1 | |
| CLASreadItemCompressed_POINT10_v2 | |
| CLASreadItemCompressed_RGB12_v1 | |
| CLASreadItemCompressed_RGB12_v2 | |
| CLASreadItemCompressed_WAVEPACKET13_v1 | |
| ►CLASreadItemRaw | |
| CLASreadItemRaw_BYTE | |
| CLASreadItemRaw_GPSTIME11_BE | |
| CLASreadItemRaw_GPSTIME11_LE | |
| CLASreadItemRaw_POINT10_BE | |
| CLASreadItemRaw_POINT10_LE | |
| CLASreadItemRaw_POINT14_LE | |
| CLASreadItemRaw_RGB12_BE | |
| CLASreadItemRaw_RGB12_LE | |
| CLASreadItemRaw_RGBNIR14_BE | |
| CLASreadItemRaw_RGBNIR14_LE | |
| CLASreadItemRaw_WAVEPACKET13_BE | |
| CLASreadItemRaw_WAVEPACKET13_LE | |
| CLASreadOpener | |
| CLASreadPoint | |
| ►CLASspatial | |
| CLASquadtree | |
| CLASspatialReadWrite | |
| CLASsummary | |
| CLAStempReadPoint10 | |
| CLAStempReadPoint14 | |
| CLAStempWritePoint10 | |
| CLAStempWritePoint14 | |
| CLAStransform | |
| CLASunzipper | |
| CLASvlr | |
| CLASvlr_classification | |
| CLASvlr_geo_keys | |
| CLASvlr_key_entry | |
| CLASvlr_lastiling | |
| CLASvlr_wave_packet_descr | |
| CLASwaveform13reader | |
| CLASwaveform13writer | |
| CLASwaveformDescription | |
| CLASwavepacket | |
| CLASwavepacket13 | |
| ►CLASwriteItem | |
| ►CLASwriteItemCompressed | |
| CLASwriteItemCompressed_BYTE_v1 | |
| CLASwriteItemCompressed_BYTE_v2 | |
| CLASwriteItemCompressed_GPSTIME11_v1 | |
| CLASwriteItemCompressed_GPSTIME11_v2 | |
| CLASwriteItemCompressed_POINT10_v1 | |
| CLASwriteItemCompressed_POINT10_v2 | |
| CLASwriteItemCompressed_RGB12_v1 | |
| CLASwriteItemCompressed_RGB12_v2 | |
| CLASwriteItemCompressed_WAVEPACKET13_v1 | |
| ►CLASwriteItemRaw | |
| CLASwriteItemRaw_BYTE | |
| CLASwriteItemRaw_GPSTIME11_BE | |
| CLASwriteItemRaw_GPSTIME11_LE | |
| CLASwriteItemRaw_POINT10_BE | |
| CLASwriteItemRaw_POINT10_LE | |
| CLASwriteItemRaw_POINT14_LE | |
| CLASwriteItemRaw_RGB12_BE | |
| CLASwriteItemRaw_RGB12_LE | |
| CLASwriteItemRaw_RGBNIR14_BE | |
| CLASwriteItemRaw_RGBNIR14_LE | |
| CLASwriteItemRaw_WAVEPACKET13_BE | |
| CLASwriteItemRaw_WAVEPACKET13_LE | |
| CLASwriteOpener | |
| CLASwritePoint | |
| ►CLASwriter | |
| CLASwriterBIN | |
| CLASwriterLAS | |
| CLASwriterQFIT | |
| CLASwriterTXT | |
| CLASzip | |
| CLASzipper | |
| Clvr2::LBKdTree | Implements a left-balanced array-based index kd-tree. Left-Balanced: minimum memory Array-Based: Good for GPU - Usage |
| Clvr2::LBPointArray< T > | |
| Clvr2::LBPointArray< float > | |
| Clvr2::LBPointArray< unsigned char > | |
| Clvr2::Leaf | |
| Cstd::less< lvr2::VertexHandle > | |
| Clvr2::Line< BaseVecT > | A Line |
| CLinearPipeline< WorkTypeA, WorkTypeB > | |
| CLinearPipeline< pair< kfusion::TSDFSlice, bool >, MeshPtr > | |
| Clvr2::LineReader | |
| Clvr2::LocalApproximation< BaseVecT > | An interface class for local approximation operations (e.g. in a Marching Cubes box) |
| Clvr2::Location | |
| Clvr2::LSROptions | |
| Clvr2::LVRBoundingBoxBridge | |
| Clvr2::LVRMeshBufferBridge | |
| Clvr2::LVRModelBridge | Main class for conversion of LVR model instances to vtk actors. This class parses the internal model structures to vtk representations that can be added to a vtkRenderer instance |
| Ckfusion::LVRPipeline | |
| Clvr2::LVRPointBufferBridge | |
| Clvr2::LVRTreeWidgetHelper | |
| Clvr2::LVRVtkArrow | A wrapper class to generate arrow actors for vtk based on VTK's oriented arrow example |
| ►CMainWindow | |
| Clvr2::LVRMainWindow | |
| CMainWindow | |
| Ckfusion::device::Mat3f | |
| Clvr2::Material | A material that stores information about color and texture of a cluster |
| Clvr2::MaterialGroup | |
| Clvr2::Materializer< BaseVecT > | Class for calculating materials for each cluster of a given mesh |
| Clvr2::MaterializerResult | Result struct for the materializer |
| Clvr2::Matrix4< BaseVecT > | A 4x4 matrix class implementation for use with the provided vertex types |
| Clvr2::Matrix4< BaseVector< float > > | |
| Clvr2::Matrix4< lvr2::BaseVector< float > > | |
| Clvr2::MatrixIO< FeatureBase > | |
| Clvr2::hdf5features::MatrixIO< Derived > | |
| Clvr2::MatrixIO< lvr2::FeatureBase > | |
| Clvr2::MatrixIO< lvr2::lvr2::FeatureBase > | |
| Clvr2::MatrixIO< lvr2::lvr2::lvr2::FeatureBase > | |
| Clvr2::MatrixIO< lvr2::lvr2::lvr2::lvr2::FeatureBase > | |
| Clvr2::Meap< KeyT, ValueT > | A map combined with a binary heap |
| Clvr2::MeapPair< KeyT, ValueT > | Element in a meap, consisting of a key and a value |
| Clvr2::intelem::Mesh | Receive the intersected Mesh. TODO |
| ►Clvr2::MeshGenerator< BaseVecT > | Interface class for mesh based reconstruction algorithms |
| ►Clvr2::PointsetMeshGenerator< BaseVecT > | Interface class for surface reconstruction algorithms that generate triangle meshes from point set surfaces |
| Clvr2::DMCReconstruction< BaseVecT, BoxT > | A surface reconstruction object that implements the standard marching cubes algorithm using a octree and a thread pool for parallel computation |
| ►Clvr2::MeshGeometryIO | |
| Clvr2::AttributeMeshIOBase | |
| ►Clvr2::MeshHandleIterator< HandleT > | An iterator for handles in the BaseMesh |
| Clvr2::HemFevIterator< HandleT, ElemT > | Implementation of the MeshHandleIterator for the HalfEdgeMesh |
| ►Clvr2::MeshHandleIterator< EdgeHandle > | |
| Clvr2::HemEdgeIterator< BaseVecT > | |
| Clvr2::MeshHandleIteratorPtr< HandleT > | A wrapper for the MeshHandleIterator to save beloved future programmers from dereferencing too much <3 |
| Clvr2::MeshOctree< BaseVecT > | |
| Cnanoflann::metric_L1 | |
| Cnanoflann::metric_L2 | |
| Cnanoflann::metric_L2_Simple | |
| Ckfusion::device::Eigen33::MiniMat< Rows > | |
| Clvr2::Model | |
| Clvr2::ModelFactory | Factory class extract point cloud and mesh information from supported file formats. The instantiated MeshLoader and PointLoader instances are persistent, i.e. they will not be freed in the destructor of this class to prevent side effects |
| Clvr2::ModelToImage | Methods to re-project 3D laser scans to image planes |
| CMpiFixture | |
| Clvr2::my_dummy | |
| CNNParams | |
| Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Node | |
| Clvr2::Node< BaseVecT > | |
| Clvr2::NodeData< BaseVecT > | |
| CHighFive::NodeTraits< Derivate > | |
| ►CHighFive::NodeTraits< File > | |
| CHighFive::File | File class |
| ►CHighFive::NodeTraits< Group > | |
| CHighFive::Group | |
| Clvr2::Normal< CoordType > | A vector guaranteed to be normalized (length = 1) |
| Clvr2::intelem::Normal | Raycaster should compute the normal of the intersected face flipped towards the ray |
| Clvr2::Normal< float > | |
| Clvr2::Normal< typename BaseVecT::CoordType > | |
| Clvr2::Normal< typename Vec::CoordType > | |
| Ckfusion::device::numeric_limits< T > | |
| Ckfusion::device::numeric_limits< float > | |
| Ckfusion::device::numeric_limits< unsigned short > | |
| ►CHighFive::Object | |
| CHighFive::Attribute | |
| CHighFive::DataSet | |
| CHighFive::DataSpace | |
| ►CHighFive::DataType | HDF5 Data Type |
| CHighFive::AtomicType< T > | Create an HDF5 DataType from a C++ type |
| CHighFive::File | File class |
| CHighFive::Group | |
| Clvr2::OctreeReduction | |
| Clvr2::OpenMPConfig | |
| Ckfusion::OpenNISource | |
| Chdf5meshtool::Options | A class to parse the program options for the reconstruction executable |
| COptions | |
| Chdf5togeotiff::Options | A class to parse the program options for the extraction of radiometric data from a HDF5 dataset |
| Cslam2hdf5::Options | A class to parse the program options for the reconstruction executable |
| Ctransform::Options | A class to parse the program options for the reconstruction executable |
| Cchunking_server::Options | A class to parse the program options for the chunking server executable |
| Cascii_viewer::Options | A class to parse the program options for the reconstruction executable |
| Cascii_convert::Options | A class to parse the program options for the reconstruction executable |
| Cchunking::Options | A class to parse the program options for the chunking executable |
| Ccuda_normals::Options | A class to parse the program options for the reconstruction executable |
| Cslam6dmerger::Options | A class to parse the program options for the reconstruction executable |
| Cscanproject_parser::Options | A class to parse the program options for the reconstruction executable |
| Chdf5tool2::Options | A class to parse the program options for the reconstruction executable |
| Cply_merger::Options | A class to parse the program options for the reconstruction executable |
| Ckfusion::Options | A class to parse the program options for the reconstruction executable |
| Chdf5tool::Options | A class to parse the program options for the reconstruction executable |
| Ccl_normals::Options | A class to parse the program options for the reconstruction executable |
| Cimage_normals::Options | A class to parse the program options for the reconstruction executable |
| Clvr2::PacmanProgressBar | |
| Ckfusion::device::ComputeIcpHelper::PageLockHelper | |
| Clvr2::ModelToImage::PanoPoint | |
| Clvr2::PanoramaNormals | Computes normals for a given panorama |
| Clvr2::PinholeModel< T > | |
| Clvr2::PinholeModel< double > | |
| Ckfusion::PixelRGB | |
| Clvr2::Plane< BaseVecT > | A plane |
| Clvr2::ModelToImage::PLI | Image with list of projected points at each pixel |
| Ckfusion::device::plus | |
| Clvr2::PlutoMapImage | |
| Clvr2::PlutoMapIO | |
| Clvr2::PlutoMapMaterial | |
| CPoint | Representation of a point in 3D space |
| Clvr2::intelem::Point | Intersection point (x,y,z) |
| Ckfusion::Point | |
| Clvr2::PointCloudAttribute | |
| Clvr2::hdf5features::PointCloudIO< Derived > | Hdf5IO Feature for handling PointBuffer related IO |
| Clvr2::PointCloudIO< FeatureBase > | Hdf5IO Feature for handling PointBuffer related IO |
| CPointerArray< T > | |
| CPointFilter | |
| Clvr2::PointOctree< BaseVecT > | |
| CPointSave | |
| ►Clvr2::PointsetSurface< BaseVecT > | An interface class to wrap all functionality that is needed to generate a surface approximation from point cloud data |
| Clvr2::AdaptiveKSearchSurface< BaseVecT > | A point cloud manager class that uses the STANN nearest neighbor search library to handle the data. This class calculates robust surface normals for the given point set as described in the SSRR2010 paper |
| CPointType | |
| Cpsimpl::PolylineSimplification< DIM, InputIterator, OutputIterator > | Provides various simplification algorithms for n-dimensional simple polylines |
| Cnanoflann::PooledAllocator | |
| Clvr2::Pose | |
| Clvr2::PPMIO | An implementation of the PPM file format |
| CDataPointer::PrivateImplementation | Subclass for storing further members and attaching an overloadable dtor |
| Clvr2::ProgressBar | |
| Clvr2::ProgressCounter | A progress counter class |
| ►Clvr2::Projection | |
| Clvr2::AzimuthalProjection | |
| Clvr2::ConicProjection | |
| Clvr2::CylindricalProjection | |
| Clvr2::EquirectangularProjection | |
| Clvr2::MercatorProjection | |
| Clvr2::PanniniProjection | |
| Clvr2::RectilinearProjection | |
| Clvr2::StereographicProjection | |
| Ckfusion::cuda::ProjectiveICP | |
| Ckfusion::device::Projector | |
| ►CHighFive::Properties | Generic HDF5 property List |
| CHighFive::DataSetAccessProps | |
| CHighFive::DataSetCreateProps | |
| ►CHighFive::FileDriver | File driver base concept |
| CHighFive::MPIOFileDriver | MPIIO Driver for Parallel HDF5 |
| CPtPair | Representing point pairs |
| ►CQDialog | |
| Clvr2::LVRBackgroundDialog | |
| Clvr2::LVRHistogram | |
| Clvr2::LVRPointInfo | |
| ►CQGraphicsView | |
| Clvr2::LVRGraphicsView | |
| ►CQListWidgetItem | |
| Clvr2::LVRRecordedFrameItem | |
| ►CQMainWindow | |
| Clvr2::LVRMainWindow | |
| CMainWindow | |
| ►CQObject | |
| Clvr2::LVRAnimationDialog | |
| Clvr2::LVRChunkedMeshBridge | |
| Clvr2::LVRCorrespondanceDialog | |
| Clvr2::LVREstimateNormalsDialog | |
| Clvr2::LVRLabelDialog | |
| Clvr2::LVRMLSProjectionDialog | |
| Clvr2::LVRPickingInteractor | |
| Clvr2::LVRPlanarOptimizationDialog | |
| Clvr2::LVRReconstructViaExtendedMarchingCubesDialog | |
| Clvr2::LVRReconstructViaMarchingCubesDialog | |
| Clvr2::LVRRemoveArtifactsDialog | |
| Clvr2::LVRRemoveOutliersDialog | |
| Clvr2::LVRRenameDialog | |
| Clvr2::LVRTransformationDialog | |
| CLVRLabelInteractorStyle | |
| ►CQThread | |
| CMeshUpdateThread | |
| ►CQTreeWidgetItem | |
| Clvr2::LVRBoundingBoxItem | |
| Clvr2::LVRCamDataItem | |
| Clvr2::LVRCvImageItem | |
| ►Clvr2::LVRMeshItem | |
| Clvr2::LVRTextureMeshItem | |
| Clvr2::LVRModelItem | |
| Clvr2::LVRPickItem | |
| Clvr2::LVRPointCloudItem | |
| Clvr2::LVRPoseItem | |
| Clvr2::LVRScanDataItem | |
| Clvr2::Quaternion< BaseVecT > | |
| Clvr2::QueryPoint< BaseVecT > | A query Vector for marching cubes reconstructions. It represents a Vector in space together with a 'distance' value that is used by the marching cubes algorithm |
| Cctpl::detail::Queue< T > | |
| Cctpl::detail::Queue< std::function< void(int id)> * > | |
| ►CQWidget | |
| Clvr2::LVRPlotter | |
| CQVTKOpenGLWidget | QWidget for displaying a vtkRenderWindow in a Qt Application |
| Cnanoflann::RadiusResultSet< DistanceType, IndexType > | |
| Clvr2::BVHRaycaster< IntT >::Ray | Data type to store information about a ray |
| ►Clvr2::RaycasterBase< IntT > | RaycasterBase interface |
| ►Clvr2::BVHRaycaster< IntT > | BVHRaycaster: CPU version of BVH Raycasting: WIP |
| Clvr2::CLRaycaster< IntT > | CLRaycaster: GPU OpenCL version of BVH Raycasting |
| Clvr2::EmbreeRaycaster< IntT > | |
| CRegistrationPipeline | |
| ►Clvr2::Renderable | |
| Clvr2::Arrow | |
| Clvr2::CoordinateAxes | |
| Clvr2::Grid | |
| Clvr2::GroundPlane | |
| Clvr2::InteractivePointCloud | |
| Clvr2::MeshCluster | |
| Clvr2::MultiPointCloud | |
| Clvr2::PointCloud | |
| Clvr2::PointCorrespondences | |
| ►Clvr2::StaticMesh | |
| Clvr2::TexturedMesh | |
| Ckfusion::device::Reprojector | |
| Ckfusion::RGB | |
| Clvr2::RGBMaterial | |
| Clvr2::RieglProject | |
| Ckfusion::SampledScopeTime | |
| Clvr2::Scan | |
| Clvr2::ScanCamera | |
| Clvr2::ScanCameraIO< FeatureBase > | |
| Clvr2::hdf5features::ScanCameraIO< Derived > | |
| Clvr2::ScanCameraIO< lvr2::FeatureBase > | |
| Clvr2::ScanCameraIO< lvr2::lvr2::FeatureBase > | |
| Clvr2::ScanDataManager | |
| Clvr2::ScanDirectoryParser | |
| Clvr2::ScanImage | |
| Clvr2::hdf5features::ScanImageIO< Derived > | |
| Clvr2::ScanImageIO< FeatureBase > | |
| Clvr2::ScanImageIO< lvr2::FeatureBase > | |
| Clvr2::ScanImageIO< lvr2::lvr2::FeatureBase > | |
| Clvr2::ScanImageIO< lvr2::lvr2::lvr2::FeatureBase > | |
| Clvr2::ScanInfo | |
| Clvr2::hdf5features::ScanIO< Derived > | |
| ►CScanIO | IO of a 3D scan |
| CScanIO_oct | 3D scan loader for from binary octree files |
| Clvr2::ScanIO< FeatureBase > | |
| Clvr2::ScanIO< lvr2::FeatureBase > | |
| Clvr2::ScanIO< lvr2::lvr2::FeatureBase > | |
| Clvr2::ScanPosition | |
| Clvr2::hdf5features::ScanPositionIO< Derived > | |
| Clvr2::ScanPositionIO< FeatureBase > | |
| Clvr2::ScanPositionIO< lvr2::FeatureBase > | |
| Clvr2::ScanProject | |
| Clvr2::ScanProjectEditMark | |
| Clvr2::hdf5features::ScanProjectIO< Derived > | Hdf5IO Feature for handling ScanProject related IO |
| Clvr2::ScanProjectIO< FeatureBase > | Hdf5IO Feature for handling ScanProject related IO |
| ►Clvr2::ScanProjectSchema | |
| ►Clvr2::DirectorySchema | Marker interface for directory schemas |
| Clvr2::ScanProjectSchemaHyperlib | |
| Clvr2::ScanProjectSchemaSLAM | |
| Clvr2::HDF5Schema | Marker interface for HDF5 schemas |
| Cpsimpl::util::scoped_array< T > | A smart pointer for holding a dynamically allocated array |
| Ckfusion::ScopeTime | |
| Cnanoflann::SearchParams | |
| ►Clvr2::SearchTree< BaseVecT > | Abstract interface for storing and searching through a set of points. Query functions for nearest neighbour searches are defined |
| Clvr2::SearchTreeFlann< BaseVecT > | SearchClass for point data |
| CSearchTreeCacheItem | The general Cache Item |
| CHighFive::Shuffle | |
| CHighFive::SilenceHDF5 | Utility class to disable HDF5 stack printing inside a scope |
| Clvr2::SimpleFinalizer< BaseVecT > | |
| Clvr2::SLAMAlign | A class to run SLAM on Scans |
| Clvr2::SLAMOptions | A struct to configure SLAMAlign |
| ►Clvr2::SLAMScanWrapper | A Wrapper around Scan to allow for SLAM usage |
| Clvr2::Metascan | Represents several Scans as part of a single Scan |
| CHighFive::SliceTraits< Derivate > | |
| ►CHighFive::SliceTraits< DataSet > | |
| CHighFive::DataSet | |
| ►CHighFive::SliceTraits< Selection > | |
| CHighFive::Selection | Selection: represent a view on a slice/part of a dataset |
| Clvr2::sort_indices | |
| Clvr2::StableVector< HandleT, ElemT > | A vector which guarantees stable indices and features O(1) deletion |
| Clvr2::StableVector< HandleT, lvr2::ClusterHandle > | |
| Clvr2::StableVector< HandleT, ValueT > | |
| Clvr2::StableVector< lvr2::ClusterHandle, lvr2::Cluster< HandleT > > | |
| Clvr2::StableVector< lvr2::ClusterHandle, lvr2::Cluster< lvr2::FaceHandle > > | |
| Clvr2::StableVector< lvr2::FaceHandle, lvr2::ClusterHandle > | |
| Clvr2::StableVector< lvr2::FaceHandle, lvr2::HalfEdgeFace > | |
| Clvr2::StableVector< lvr2::HalfEdgeHandle, lvr2::HalfEdge > | |
| Clvr2::StableVector< lvr2::Material, ValueT > | |
| Clvr2::StableVector< lvr2::TextureHandle, lvr2::Texture > | |
| Clvr2::StableVector< lvr2::VertexHandle, lvr2::HalfEdgeVertex > | |
| Clvr2::StableVectorIterator< HandleT, ElemT > | Iterator over handles in this vector, which skips deleted elements |
| Clvr2::StableVectorIterator< HandleT, ValueT > | |
| Clvr2::StableVectorIterator< lvr2::ClusterHandle, lvr2::Cluster< HandleT > > | |
| Clvr2::StableVectorIterator< lvr2::HalfEdgeHandle, lvr2::HalfEdge > | |
| ►Cstatic_visitor | |
| Clvr2::ChunkGeomtryChannelVisitor | Visitor that returns the channel that holds geometic information (like vertices-channel for meshes) |
| Clvr2::manipulators::RandomSample | |
| Clvr2::manipulators::Slice | |
| Clvr2::manipulators::SliceShallow | |
| Clvr2::VariantChannel< T >::CloneVisitor | |
| Clvr2::VariantChannel< T >::DataPtrVisitor< U > | |
| Clvr2::VariantChannel< T >::NumElementsVisitor | |
| Clvr2::VariantChannel< T >::WidthVisitor | |
| Cpsimpl::math::Statistics | POD structure for storing several statistical values |
| ►Cstreambuf | |
| Clvr2::Timestamp::NullBuffer | |
| Ckfusion::cuda::ProjectiveICP::StreamHelper | ProjectiveICP::StreamHelper |
| CStreamingMedian5 | |
| Cpsimpl::PolylineSimplification< DIM, InputIterator, OutputIterator >::DPHelper::SubPoly | Defines a sub polyline |
| Cpsimpl::PolylineSimplification< DIM, InputIterator, OutputIterator >::DPHelper::SubPolyAlt | Defines a sub polyline including its key |
| Ct_ply_ | |
| Ct_ply_argument_ | |
| Ct_ply_element_ | |
| Ct_ply_idriver_ | |
| Ct_ply_odriver_ | |
| Ct_ply_property_ | |
| Clvr2::Tesselator< BaseVecT > | |
| Clvr2::TexCoords | Texture coordinates |
| Clvr2::Texture | This class represents a texture |
| Ckfusion::cuda::TextureBinder | |
| Clvr2::TextureFactory | |
| Clvr2::TextureFinalizer< BaseVecT > | |
| ►Clvr2::Texturizer< BaseVecT > | Class that performs texture-related tasks |
| Clvr2::ImageTexturizer< BaseVecT > | A texturizer that uses images instead of pointcloud colors for creating the textures for meshes |
| CThird | |
| Cctpl::thread_pool | |
| Clvr2::Timestamp | A helper class for automated time stamping. Timing is started as soon as an object of this class is created. To time some parts of a program, just create a new object and use the provided output operator to display the elapsed time |
| Cnanoflann::metric_L2::traits< T, DataSource > | |
| Cnanoflann::metric_L1::traits< T, DataSource > | |
| Cnanoflann::metric_L2_Simple::traits< T, DataSource > | |
| ►Clvr2::TransformableBase< T > | Interface for transformable objects |
| Clvr2::LVRCamDataItem | |
| Clvr2::LVRScanDataItem | |
| ►CTree | The tree structure |
| ►CSearchTree | The search tree structure |
| CBOctTree< T > | Octree |
| CCachedSearchTree | The search tree structure |
| Clvr2::BVHTree< BaseVecT >::Triangle | |
| Clvr2::BVHRaycaster< IntT >::TriangleIntersectionResult | A struct to return the calculation results of a triangle intersection |
| ►Ctrue_type | |
| Clvr2::FeatureBase< Features >::has_type< T, std::tuple< T, Ts... > > | |
| Clvr2::Hdf5IO< Features >::has_type< T, std::tuple< T, Ts... > > | |
| Clvr2::Intersection< Tp >::has_type< T, std::tuple< T, Ts... > > | |
| Ckfusion::tsdf_buffer | Structure to handle buffer addresses |
| Ckfusion::TSDFSlice | |
| Ckfusion::cuda::TsdfVolume | |
| Ckfusion::device::TsdfVolume | |
| CTSheader | |
| CTSpoint | |
| CTSrow | |
| Clvr2::TumbleTree | |
| Clvr2::VariantChannel< T >::TupleIndex< T1, Tuple > | |
| Clvr2::VariantChannel< T >::TupleIndex< T1, std::tuple< T1, Types... > > | |
| Clvr2::VariantChannel< T >::TupleIndex< T1, std::tuple< U, Types... > > | |
| CHighFive::details::type_of_array< T > | |
| CHighFive::details::type_of_array< std::array< T, N > > | |
| CHighFive::details::type_of_array< std::vector< T > > | |
| CHighFive::details::type_of_array< T * > | |
| CHighFive::details::type_of_array< T[N]> | |
| CU32I32F32 | |
| CU64I64F64 | |
| ►Cunordered_map | |
| ►Clvr2::VariantChannelMap< T > | |
| ►Clvr2::BaseBuffer | ChannelManager class Store and access AttributeChannels. It expands the MultiChannelMap with downwoards compitibility functions of the old ChannelManager |
| Clvr2::MeshBuffer | The MeshBuffer Mesh representation for I/O modules |
| Clvr2::PointBuffer | A class to handle point information with an arbitrarily large number of attribute channels. The added channels should always have the same length as the point array to keep the mapping between geometry (channel 'points') and the associated layers like RGB colors or point normals consistent |
| Clvr2::Util | A class that contains utility functions/types |
| ►Cvariant | |
| Clvr2::VariantChannel< T > | |
| Clvr2::VariantChannelIO< FeatureBase > | Hdf5IO Feature for handling VariantChannel related IO |
| Clvr2::hdf5features::VariantChannelIO< Derived > | Hdf5IO Feature for handling VariantChannel related IO |
| Clvr2::VariantChannelIO< lvr2::FeatureBase > | |
| Clvr2::VertexIteratorProxy< BaseVecT > | |
| Clvr2::VertexSplitResult | |
| Clvr2::VirtualGrid< BaseVecT > | |
| Clvr2::BigVolumen< BaseVecT >::VolumeCellInfo | |
| ►CvtkCuller | |
| Clvr2::ChunkedMeshCuller | |
| ►CvtkInteractorStyleTrackballCamera | |
| ►CLVRInteractorStylePolygonPick | Like TrackBallCamera, but this can pick props underneath a rubber band selection rectangle |
| Clvr2::LVRPickingInteractor | |
| CLVRLabelInteractorStyle | |
| CLVRInteractorStylePolygonPick::vtkInternal | |
| Ckfusion::device::Warp | |
| ►CTp | |
| Clvr2::Intersection< Tp > | CRTP Container for User defined intersection elements |