MRPT  1.9.9
Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 123456]
 C CRangeScanEdgeRegistrationDecider
 C_PROCESS_MEMORY_COUNTERS
 CA
 Cmrpt::math::detail::AccessorIterator< A, T >Template class for matrix accessor's iterators
 CAggregatorFunctor
 Cstd::allocator< T >STL class
 Cmrpt::typemeta::internal::append< T >
 Cmrpt::typemeta::internal::append< make_sequence< I - 1 > >
 Cmrpt::typemeta::internal::append< sequence< I... > >
 Cstd::array< T >STL class
 Cnanoflann::array_or_vector_selector< DIM, T >Used to declare fixed-size arrays when DIM>0, dynamically-allocated vectors when DIM=-1
 Cnanoflann::array_or_vector_selector< DIM, Interval >
 Cnanoflann::array_or_vector_selector<-1, T >Dynamic size version
 Cmrpt::typemeta::array_string< N >
 Cmrpt::graphslam::detail::AuxErrorEval< EDGE, gst >
 Cmrpt::graphslam::detail::AuxErrorEval< CPose2D, gst >
 Cmrpt::graphslam::detail::AuxErrorEval< CPose3D, gst >
 Cmrpt::graphslam::detail::AuxErrorEval< CPose3DPDFGaussianInf, gst >
 Cmrpt::graphslam::detail::AuxErrorEval< CPosePDFGaussianInf, gst >
 CAuxWindowsTicTac
 CBar1
 CBar2
 Cmrpt::apps::BaseAppDataSourceVirtual interface for offline datasets (rawlog) or live sensors
 Cmrpt::apps::BaseAppInitializableCLIVirtual interface for applications that initialize from CLI parameters
 Cmrpt::typemeta::internal::bimap< KEY, VALUE >
 Cmrpt::containers::bimap< KEY, VALUE >A bidirectional version of std::map, declared as bimap<KEY,VALUE> and which actually contains two std::map's, one for keys and another for values
 Cmrpt::containers::bimap< mrpt::maps::CLandmark::TLandmarkID, unsigned int >
 CCAboutBoxBase
 Cmrpt::gui::CGlCanvasBase::CamaraParams
 CCAngularObservationMesh_fnctr
 Cmrpt::serialization::CArchiveVirtual base class for "archives": classes abstracting I/O streams
 Cnanoflann::CArray< T, N >A STL container (as wrapper) for arrays of constant size defined at compile time (class imported from the MRPT project) This code is an adapted version from Boost, modifed for its integration within MRPT (JLBC, Dec/2009) (Renamed array -> CArray to avoid possible potential conflicts)
 Cmrpt::graphs::CAStarAlgorithm< T >This class is intended to efficiently solve graph-search problems using heuristics to determine the best path
 Cmrpt::graphs::CAStarAlgorithm< CCoinDistribution >
 Cmrpt::math::CAtan2LookUpTableA look-up-table (LUT) of atan values for any (x,y) value in a square/rectangular grid of predefined resolution
 Cmrpt::math::CAtan2LookUpTableMultiResLike CAtan2LookUpTable but with a multiresolution grid for increasingly better accuracy in points nearer to the origin
 Cmrpt::system::CAuxPSAPI_LoaderThis is an auxiliary class for mrpt::system::getMemoryUsage() under Windows
 Cmrpt::gui::WxSubsystem::CAuxWxSubsystemShutdownerAn auxiliary global object used just to launch a final request to the wxSubsystem for shutdown:
 Cmrpt::math::CBinaryRelation< T, U, UIsObject >This class models a binary relation through the elements of any given set
 Cmrpt::img::CCanvasThis virtual class defines the interface of any object accepting drawing primitives on it
 Cmrpt::rtti::CClassRegistryA singleton with the central registry for CSerializable run-time classes: users do not use this class in any direct way
 CCCoinDistributionThis is a example of problem resolution using the CAStarAlgorithm template
 Cmrpt::config::CConfigFileBaseThis class allows loading and storing values and vectors of different types from a configuration text, which can be implemented as a ".ini" file, a memory-stored string, etc..
 Cmrpt::math::CConstMatrixColumnAccessor< MAT >A vector-like wrapper for a const Matrix for accessing the elements of a given column with a [] operator
 Cmrpt::math::CConstMatrixColumnAccessorExtended< MAT >A vector-like wrapper for a const Matrix for accessing the elements of a given column with a [] operator, with offset and custom spacing
 Cmrpt::math::CConstMatrixRowAccessor< MAT >A vector-like wrapper for a const Matrix for accessing the elements of a given row with a [] operator
 Cmrpt::math::CConstMatrixRowAccessorExtended< MAT >A vector-like wrapper for a const Matrix for accessing the elements of a given row with a [] operator, with offset and custom spacing
 Cmrpt::hwdrivers::COpenNI2Generic::CDevice
 Cmrpt::vision::CDifodoThis abstract class implements a method called "Difodo" to perform Visual odometry with range cameras
 Cmrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >The Dijkstra algorithm for finding the shortest path between a given source node in a (weighted) directed graph and all other nodes in the form of a tree
 Cmrpt::graphs::CDirectedGraph< TYPE_EDGES, EDGE_ANNOTATIONS >A directed graph with the argument of the template specifying the type of the annotations in the edges
 Cmrpt::graphs::CDirectedGraph< CPOSE, EDGE_ANNOTATIONS >
 Cmrpt::graphs::CDirectedTree< TYPE_EDGES >A special kind of graph in the form of a tree with directed edges and optional edge annotations of templatized type "TYPE_EDGES"
 Cmrpt::graphs::CDirectedTree< EDGE_TYPE >
 Cmrpt::system::CDirectoryExplorerThis class allows the enumeration of the files/directories that exist into a given path
 Cmrpt::gui::CDisplayWindow3DLockerAuxiliary class for safely claiming the 3DScene of a mrpt::gui::CDisplayWindow3D
 Cmrpt::gui::CDisplayWindowGUI_ParamsAdditional parameters to change the window behavior and OpenGL context
 Cmrpt::hwdrivers::CDUO3DCameraThis "software driver" implements the communication protocol for interfacing a DUO3D Stereo Camera
 Cmrpt::containers::CDynamicGrid< T >A 2D grid of dynamic size which stores any kind of data at each cell
 Cmrpt::containers::CDynamicGrid3D< T, coord_t >A 3D rectangular grid of dynamic size which stores any kind of data at each voxel
 Cmrpt::containers::CDynamicGrid3D< OccGridCellTraits::cellType >
 Cmrpt::containers::CDynamicGrid3D< TCELL >
 Cmrpt::containers::CDynamicGrid3D< TRandomFieldVoxel >
 Cmrpt::containers::CDynamicGrid< double >
 Cmrpt::containers::CDynamicGrid< int8_t >
 Cmrpt::containers::CDynamicGrid< mrpt::nav::CPTG_DiffDrive_CollisionGridBased::TCellForLambdaFunction >
 Cmrpt::containers::CDynamicGrid< std::vector< int32_t > >
 Cmrpt::containers::CDynamicGrid< TCollisionCell >
 Cmrpt::containers::CDynamicGrid< THeightGridmapCell >
 Cmrpt::containers::CDynamicGrid< TRandomFieldCell >
 Cmrpt::containers::CDynamicGrid< uint16_t >
 Cmrpt::containers::CDynamicGrid< uint8_t >
 Cmrpt::graphslam::detail::CEdgeCounterGeneric class for tracking the total number of edges for different tpes of edges and for storing visualization-related information for each type
 Cmrpt::opengl::CFBORenderA class for rendering 3D scenes off-screen directly into an image using OpenGL extensions (glext)
 Cmrpt::vision::CFeatureExtractionThe central class from which images can be analyzed in search of different kinds of interest points and descriptors computed for them
 Cmrpt::vision::CFeatureLinesThis class wraps different line detectors and descriptors from OpenCV
 Cmrpt::hwdrivers::CFFMPEG_InputStreamA generic class which process a video file or other kind of input stream (http, rtsp) and allows the extraction of images frame by frame
 Cmrpt::system::CFileSystemWatcherThis class subscribes to notifications of file system changes, thus it can be used to efficiently stay informed about changes in a directory tree
 Cmrpt::vision::CGenericFeatureTrackerA virtual interface for all feature trackers, implementing the part of feature tracking that is common to any specific tracker implementation
 Cmrpt::system::CGenericMemoryPool< DATA_PARAMS, POOLABLE_DATA >A generic system for versatile memory pooling
 Cmrpt::hwdrivers::CGenericSensorA generic interface for a wide-variety of sensors designed to be used in the application RawLogGrabber
 Cmrpt::gui::CGlCanvasBaseThis base class implements a working with opengl::Camera and a OpenGL canvas, and it's used in gui::CWxGLCanvasBase and gui::CQtGlCanvasBase
 Cmrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >Finds the min-normalized-cut of a weighted undirected graph
 CCGraphSlamHandler< GRAPH_T >Manage variables and methods related to applications executing graphSLAM using the mrpt-graphslam API
 Cmrpt::opengl::internal::Font::Char
 Cmrpt::maps::CHeightGridMap2D_BaseVirtual base class for Digital Elevation Model (DEM) maps
 Cmrpt::math::CHistogramThis class provides an easy way of computing histograms for unidimensional real valued variables
 Cmrpt::math::CSparseMatrix::CholeskyDecompAuxiliary class to hold the results of a Cholesky factorization of a sparse matrix
 Cmrpt::containers::ci_lessA case-insensitive comparator class for use within STL containers, etc
 Cmrpt::hwdrivers::CImageGrabber_dc1394A class for grabing images from a IEEE1394 (Firewire) camera using the libdc1394-2 library
 Cmrpt::hwdrivers::CImageGrabber_FlyCapture2A wrapper for Point Gray Research (PGR) FlyCapture2 API for capturing images from Firewire, USB3 or GigaE cameras and stereo cameras
 Cmrpt::hwdrivers::CImageGrabber_OpenCVA class for grabing images from a "OpenCV"-compatible camera, or from an AVI video file
 Cmrpt::vision::CImagePyramidHolds and builds a pyramid of images: starting with an image at full resolution (octave=1), it builds a number of half-resolution images: octave=2 at 1/2 , octave=3 at 1/2^2, octave=N at 1/2^(N-1)
 Cmrpt::containers::circular_buffer< T >A circular buffer of fixed size (defined at construction-time), implemented with a std::vector as the underlying storage
 Cmrpt::containers::circular_buffer< uint8_t >
 Cmrpt::hwdrivers::CJoystickAccess to joysticks and gamepads (read buttons and position), and request number of joysticks in the system
 Cmrpt::rtti::CLASS_ID_impl< T >
 Cmrpt::rtti::CLASS_ID_impl< std::monostate >
 Cmrpt::nav::ClearanceDiagramClearance information for one particular PTG and one set of obstacles
 Cmrpt::rtti::CListOfClassesA list (actually based on a std::set) of MRPT classes, capable of keeping any class registered by the mechanism of CObject classes
 Cmrpt::config::CLoadableOptionsThis is a virtual base class for sets of options than can be loaded from and/or saved to configuration plain-text files
 Cmrpt::ClockClock that is compatible with MRPT TTimeStamp representation
 Cmrpt::hmtslam::CLSLAMAlgorithmBaseVirtual base for local SLAM methods, used in mrpt::slam::CHMTSLAM
 Cmrpt::img::CMappedImageThis class encapsulates a MRPT Image and allows the sampling of individual pixels with sub-pixel accuracy and with a change of coordinates (eg, meters)
 Cmrpt::math::CMatrixColumnAccessor< MAT >A vector-like wrapper for a Matrix for accessing the elements of a given column with a [] operator
 Cmrpt::math::CMatrixColumnAccessorExtended< MAT >A vector-like wrapper for a Matrix for accessing the elements of a given column with a [] operator, with offset and custom spacing
 Cmrpt::math::CMatrixRowAccessor< MAT >A vector-like wrapper for a Matrix for accessing the elements of a given row with a [] operator
 Cmrpt::math::CMatrixRowAccessorExtended< MAT >A vector-like wrapper for a Matrix for accessing the elements of a given row with a [] operator, with offset and custom spacing
 Cmrpt::serialization::CMessageA class that contain generic messages, that can be sent and received from a "CClientTCPSocket" object
 Cmrpt::math::CMonteCarlo< T, NUM, OTHER >Montecarlo simulation for experiments in 1D
 Cmrpt::obs::CObservationGasSensors::CMOSmodelDeclares a class within "CObservationGasSensors" that represents a set of gas concentration readings from the modelation of a MOS gas sensor readings
 Cmrpt::hwdrivers::CMyntEyeCameraWrapper on MYNT-EYE-D cameras
 Cmrpt::hwdrivers::CNTRIPClientA client for NTRIP (HTTP) sources of differential GPS corrections from internet servers, or Global navigation satellite system (GNSS) internet radio
 Cmrpt::rtti::CObjectVirtual base to provide a compiler-independent RTTI system
 Cmrpt::detectors::CObjectDetection
 Cmrpt::system::CObservableInherit from this class for those objects capable of being observed by a CObserver class
 Cmrpt::obs::CObservation2DRangeScanWithUncertaintyA 2D range scan plus an uncertainty model for each range
 CCObservation3DRangeScan_Points_MemPoolData
 CCObservation3DRangeScan_Points_MemPoolParams
 CCObservation3DRangeScan_Ranges_MemPoolData
 CCObservation3DRangeScan_Ranges_MemPoolParams
 Cmrpt::system::CObserverInherit from this class to get notified about events from any CObservable object after subscribing to it
 Cmrpt::opengl::COctreePointRenderer< Derived >Template class that implements the data structure and algorithms for Octree-based efficient rendering
 Cmrpt::opengl::COctreePointRenderer< CPointCloud >
 Cmrpt::opengl::COctreePointRenderer< CPointCloudColoured >
 Cmrpt::maps::CRandomFieldGridMap2D::ConnectivityDescriptorBase class for user-supplied objects capable of describing cells connectivity, used to build prior factors of the MRF graph
 Cmrpt::maps::CRandomFieldGridMap3D::ConnectivityDescriptorBase class for user-supplied objects capable of describing voxels connectivity, used to build prior factors of the MRF graph
 Cmrpt::obs::CRawlog::const_iteratorA normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence
 Cconstraint_no_pdf_t
 Cmrpt::containers::ContainerReadOnlyProxyAccessor< STLCONTAINER >A generic proxy accessor template that only allows read-only access to the original binded STL container object
 Cmrpt::math::ContainerType< CONTAINER >ContainerType<T>::element_t exposes the value of any STL or Eigen container
 Cmrpt::math::ContainerType< Eigen::EigenBase< Derived > >Specialization for Eigen containers
 Cmrpt::math::ContainerType< mrpt::math::MatrixVectorBase< Scalar, Derived > >Specialization for MRPT containers
 Cmrpt::obs::gnss::Message_NMEA_GGA::content_t
 Cmrpt::obs::gnss::Message_NMEA_GLL::content_t
 Cmrpt::obs::gnss::Message_NMEA_RMC::content_t
 Cmrpt::obs::gnss::Message_NMEA_VTG::content_t
 Cmrpt::obs::gnss::Message_NMEA_GSA::content_t
 Cmrpt::obs::gnss::Message_NMEA_ZDA::content_t
 Cmrpt::opengl::COpenGLBufferA wrapper for an OpenGL buffer object
 Cmrpt::opengl::COpenGLVertexArrayObjectA wrapper for an OpenGL vertex array object (VAO)
 Cmrpt::hwdrivers::COpenNI2GenericAn abstract class for accessing OpenNI2 compatible sensors
 Cmrpt::copiable_NULL_ptr_basic< T >A wrapper class for pointers that, if copied with the "=" operator, should be set to nullptr in the copy
 Cmrpt::containers::internal::CopyCloner< T >
 Cmrpt::rtti::internal::CopyCtor< is_copy_ctrtible >
 Cmrpt::rtti::internal::CopyCtor< false >
 Cmrpt::rtti::internal::CopyCtor< true >
 Cmrpt::containers::internal::CopyStatic< T >
 Cmrpt::system::COutputLoggerVersatile class for consistent logging and management of output messages
 Cmrpt::system::COutputLoggerStreamWrapperFor use in MRPT_LOG_DEBUG_STREAM(), etc
 Cmrpt::bayes::CParticleFilterCapableThis virtual class defines the interface that any particles based PDF class must implement in order to be executed by a mrpt::bayes::CParticleFilter
 Cmrpt::bayes::CParticleFilterData< T, STORAGE >This template class declares the array of particles and its internal data, managing some memory-related issues and providing an easy implementation of virtual methods required for implementing a CParticleFilterCapable
 Cmrpt::bayes::CParticleFilterData< CLSLAMParticleData >
 Cmrpt::bayes::CParticleFilterData< CParticleVehicleData >
 Cmrpt::bayes::CParticleFilterData< CRBPFParticleData >
 Cmrpt::bayes::CParticleFilterData< mrpt::math::TPoint3Df >
 Cmrpt::bayes::CParticleFilterData< mrpt::math::TPose2D, mrpt::bayes::particle_storage_mode::VALUE >
 Cmrpt::bayes::CParticleFilterData< mrpt::math::TPose3D, mrpt::bayes::particle_storage_mode::VALUE >
 CCParticleVehicleData
 Cmrpt::io::CPipeA pipe, portable across different OS
 Cmrpt::vision::pnp::CPnPThis class is used for Pose estimation from a known landmark using a monocular camera
 Cmrpt::maps::CPointCloudFilterBaseVirtual base class for all point-cloud filtering algorithm
 Cmrpt::poses::CPose2DGridTemplate< T >This is a template class for storing a 3D (2D+heading) grid containing any kind of data
 Cmrpt::poses::CPose2DGridTemplate< double >
 Cmrpt::poses::CPose3DGridTemplate< T >This is a template class for storing a 6-dimensional grid, with components corresponding to Euler angle parameterization of SE(3) poses
 Cmrpt::poses::CPose3DGridTemplate< double >
 Cmrpt::poses::CPoseInterpolatorBase< DIM >Base class for SE(2)/SE(3) interpolators
 Cmrpt::poses::CPoseInterpolatorBase< 2 >
 Cmrpt::poses::CPoseInterpolatorBase< 3 >
 Cmrpt::poses::CPoseRandomSamplerAn efficient generator of random samples drawn from a given 2D (CPosePDF) or 3D (CPose3DPDF) pose probability density function (pdf)
 Cmrpt::math::CProbabilityDensityFunction< TDATA, STATE_LEN >A generic template for probability density distributions (PDFs)
 Cmrpt::math::CProbabilityDensityFunction< CPoint2D, 2 >
 Cmrpt::math::CProbabilityDensityFunction< CPoint3D, 3 >
 Cmrpt::math::CProbabilityDensityFunction< CPose2D, 3 >
 Cmrpt::math::CProbabilityDensityFunction< CPose3D, 6 >
 Cmrpt::math::CProbabilityDensityFunction< CPose3DQuat, 7 >
 Cmrpt::bayes::CProbabilityParticle< T, STORAGE >A template class for holding a the data and the weight of a particle
 Cmrpt::bayes::CProbabilityParticleBase
 Cmrpt::hwdrivers::CPtuBaseThis class implements initialization and communication methods to control a generic Pan and Tilt Unit, working in radians
 Cmrpt::cpu::internal::CPU_analyzerAuxiliary class
 Cmrpt::random::CRandomGeneratorA thred-safe pseudo random number generator, based on an internal MT19937 randomness generator
 Cmrpt::graphslam::deciders::CRangeScanOps< GRAPH_T >Class for keeping together all the RangeScanner-related functions
 Cmrpt::system::CRateTimerA class for calling sleep() in a loop, such that the amount of sleep time will be computed to make the loop run at the desired rate (in Hz)
 Cmrpt::bayes::CRejectionSamplingCapable< TStateSpace, STORAGE >A base class for implementing rejection sampling in a generic state space
 Cmrpt::bayes::CRejectionSamplingCapable< CPose2D >
 Cmrpt::bayes::CRejectionSamplingCapable< mrpt::poses::CPose2D >
 CCRenderizableShaderTexturedTriangles_MemPoolData
 Cmrpt::poses::CRobot2DPoseEstimatorA simple filter to estimate and extrapolate the robot 2D (x,y,phi) pose from asynchronous odometry and localization/SLAM data
 Cmrpt::hwdrivers::CRovioA class to interface a Rovio robot (manufactured by WowWee)
 Cmrpt::expr::CRuntimeCompiledExpressionA wrapper of exprtk runtime expression compiler: it takes a string representing an expression (from a simple mathematical formula to a complete program), compiles it and evaluates its result as many times as required
 Cmrpt::serialization::CSchemeArchiveBaseVirtual base class for "schematic archives" (JSON, XML,...)
 Cmrpt::serialization::CSchemeArchiveBase_implPure virtual class carrying the implementation of CSchemeArchiveBase as per the PIMPL idiom
 Cmrpt::config::simpleini::CSimpleIniTempl< SI_CHAR, SI_STRLESS, SI_CONVERTER >Simple INI file reader
 Cmrpt::obs::CSinCosLookUpTableFor2DScansA smart look-up-table (LUT) of sin/cos values for 2D laser scans
 Cmrpt::math::CSparseMatrixA sparse matrix structure, wrapping T
 Cmrpt::math::CSparseMatrixTemplate< T >A sparse matrix container (with cells of any type), with iterators
 Cmrpt::math::CMonteCarlo< T, NUM, OTHER >::CStatisticalAnalyzer
 Cmrpt::hwdrivers::CStereoGrabber_Bumblebee_libdc1394Grabs from a "Bumblebee" or "Bumblebee2" stereo camera using raw access to the libdc1394 library
 Cmrpt::hwdrivers::CStereoGrabber_SVSA class for grabing stereo images from a STOC camera of Videre Design NOTE:
 Cmrpt::vision::CStereoRectifyMapUse this class to rectify stereo images if the same distortion maps are reused over and over again
 Cmrpt::io::CStreamThis base class is used to provide a unified interface to files,memory buffers,..Please see the derived classes
 Cmrpt::io::CTextFileLinesParserA class for parsing text files, returning each non-empty and non-comment line, along its line number
 Cmrpt::opengl::CTextMessageCapableKeeps a list of text messages which can be rendered to OpenGL contexts by graphic classes
 Cmrpt::containers::CThreadSafeQueue< T >A thread-safe template queue for object passing between threads; for a template argument of T, the objects being passed in the queue are "T*"
 Cmrpt::containers::CThreadSafeQueue< mrpt::serialization::CMessage >
 Cmrpt::system::CTicTacA high-performance stopwatch, with typical resolution of nanoseconds
 Cmrpt::system::CTimeLoggerEntryA safe way to call enter() and leave() of a mrpt::system::CTimeLogger upon construction and destruction of this auxiliary object, making sure that leave() will be called upon exceptions, etc
 Cmrpt::system::CTimeLoggerSaveAtDtorA helper class to save CSV stats upon self destruction, for example, at the end of a program run
 Cmrpt::hmtslam::CTopLCDetectorBaseThe virtual base class for Topological Loop-closure Detectors; used in HMT-SLAM
 Cmrpt::vision::CUndistortMapUse this class to undistort monocular images if the same distortion map is used over and over again
 CCvCBCorner
 CCvCBQuad
 CCvContourEx
 Cmrpt::kinematics::CVehicleSimulVirtualBaseThis class can be used to simulate the kinematics and dynamics of a differential driven planar mobile robot, including odometry errors and dynamics limitations
 Cmrpt::vision::CVideoFileWriterAn output stream which takes a sequence of images and writes a video file in any of a given of compatible formats
 Cmrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >Base class for C*Visualizer classes
 Cmrpt::graphs::detail::CVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS >
 CEigen::CwiseBinaryOp< BinaryOp, LhsType, RhsType >
 Cmrpt::containers::deepcopy_poly_ptr< T >Wrapper to a std::shared_ptr<>, adding deep-copy semantics to copy ctor and copy operator, suitable for polymorphic classes with a clone() method
 Cmrpt::containers::deepcopy_poly_ptr< mrpt::maps::CMetricMap::Ptr >
 Cmrpt::containers::deepcopy_poly_ptr< std::shared_ptr >
 Cmrpt::opengl::DefaultShaderID
 Cstd::deque< T >STL class
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ai_tAnalog inputs
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ao_tAnalog outputs
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_ang_encoder_tCounter: uses an angular encoder to measure angular position
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_count_edges_tCounter: period of a digital signal
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_lin_encoder_tCounter: uses a linear encoder to measure linear position
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_period_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_pulse_width_tCounter: measure the width of a digital pulse
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_co_pulses_tOutput counter: digital pulses output
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_di_tDigital inputs (di)
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_do_tDigital outs (do)
 Cmrpt::vision::pnp::dls
 Cmrpt::containers::internal::dynamic_grid_txt_saver
 CEDGE_ANNOTATIONS
 Cmrpt::graphs::detail::edge_annotations_emptyAn empty structure
 CEdgeAdders< GRAPH, EDGES_ARE_PDF >Generic struct template Auxiliary class to add a new edge to the graph
 CEdgeAdders< GRAPH, false >Specific templates based on the above EdgeAdders template Non-PDF version:
 CEdgeAdders< GRAPH, true >
 CEigen::EigenBase< Derived >
 Cmrpt::enable_if_t<(sizeof(T) > 0)> >
 Cenable_shared_from_this
 Cmrpt::config::simpleini::CSimpleIniTempl< SI_CHAR, SI_STRLESS, SI_CONVERTER >::EntryKey entry
 Cmrpt::vision::pnp::epnp
 Cmrpt::poses::Lie::Euclidean< N >Traits for Euclidean R^N space
 Cmrpt::poses::Lie::EuclideanBase< N >
 Cmrpt::poses::Lie::EuclideanBase< 2 >
 Cmrpt::poses::Lie::EuclideanBase< 3 >
 Cmrpt::nav::CHolonomicFullEval::EvalOutput
 CExampleDemoGraphSLAM< my_graph_t >
 Cstd::exceptionSTL class
 Cmrpt::typemeta::detail::explode< rem, digits >
 Cmrpt::typemeta::detail::explode< num >
 Cexprtk::expression< T >
 Cexprtk::expression< double >
 Cmrpt::expr::CRuntimeCompiledExpression::ExprVerbose
 Cmrpt::graphs::ScalarFactorGraph::FactorBase
 Cmrpt::math::FAddPoint< T, N >Auxiliary functor class to compute polygon's center
 CFAddUntracedLines
 Cfalse_type
 CFCreatePolygon
 CFCreatePolygonFromFace< T >
 CFit3DPlane
 Cmrpt::opengl::internal::Font
 CFontData
 Cmrpt::opengl::internal::FontData
 CFoo< INTER_SPACE >
 Cmrpt::maps::CPointCloudFilterByDistance::FrameInfo
 Cmrpt::poses::FrameTransformerInterface< DIM >Virtual base class for interfaces to a ROS tf2-like service capable of "publishing" and "looking-up" relative poses between two "coordinate frames"
 CFSetColor
 Cmrpt::opengl::CAngularObservationMesh::FTrace1D< T >Internal functor class to trace a ray
 Cmrpt::opengl::CAngularObservationMesh::FTrace2D< T >Internal functor class to trace a set of rays
 Cfunction
 CFUnprojectPolygon2D
 Cmrpt::random::Generator_MT19937Portable MT19937 random generator, C++11 UniformRandomBitGenerator compliant
 Cmrpt::containers::internal::generic_copier_ptr< T, Copier >
 Cmrpt::containers::internal::generic_copier_ptr< T >
 CGLCanvas
 Cmrpt::obs::gnss::gnss_messagePure virtual base for all message types
 Cmrpt::obs::gnss::gnss_message_ptrA smart pointer to a GNSS message
 Cmrpt::graphs::detail::graph_ops< graph_t >Helper struct with static template functions
 Cmrpt::graphslam::graphslam_traits< GRAPH_T >Auxiliary traits template for use among graph-slam problems to make life easier with these complicated, long data type names
 CGraphSlamLevMarqTest< my_graph_t >
 Cstd::hash< LUT_info >
 Cmrpt::ignored_copy_ptr< T >A wrapper class for pointers whose copy operations from other objects of the same type are ignored, that is, doing "a=b;" has no effect neiter on "a" or "b"
 Cmrpt::ignored_copy_ptr< mrpt::maps::COctoMapBase >
 Cmrpt::config::CConfigFile::Impl
 Cmrpt::config::CConfigFileMemory::Impl
 Cmrpt::expr::CRuntimeCompiledExpression::Impl
 Cmrpt::hwdrivers::CFFMPEG_InputStream::Impl
 Cmrpt::hwdrivers::CImageGrabber_OpenCV::Impl
 Cmrpt::hwdrivers::CMyntEyeCamera::Impl
 Cmrpt::img::CImage::Impl
 Cmrpt::io::CFileGZInputStream::Impl
 Cmrpt::io::CFileGZOutputStream::Impl
 Cmrpt::maps::mrpt::maps::COctoMapBase::Impl< OCTREE, OCTREE_NODE >
 Cnanoflann::IndexDist_SorterOperator "<" for std::sort()
 CEigen::InnerStride< Value >
 Cmrpt::int_select_by_bytecount< num_bytes >Usage: int_select_by_bytecount<N>::type var; allows defining var as a signed integer with, at least, N bytes
 Cmrpt::int_select_by_bytecount< 1 >
 Cmrpt::int_select_by_bytecount< 2 >
 Cmrpt::int_select_by_bytecount< 3 >
 Cmrpt::int_select_by_bytecount< 4 >
 Cmrpt::int_select_by_bytecount< 8 >
 Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Interval
 Cmrpt::rtti::IS_CLASS_impl< T >
 Cmrpt::is_defined< T, Enable >Checks if type is defined (fails for forward declarations)
 Cmrpt::obs::CRawlog::iteratorA normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence
 Citerator
 Cmrpt::containers::vector_with_small_size_optimization< VAL, small_size, alignment >::iteratorImpl< TYPE, POINTER, REFERENCE >
 Cmrpt::vision::JacData< FrameDof, PointDof, ObsDim >
 CJHUFF_TBL
 Cjpeg_common_struct
 Cjpeg_component_info
 Cjpeg_compress_struct
 Cjpeg_decompress_struct
 Cjpeg_destination_mgr
 Cjpeg_error_mgr
 Cjpeg_marker_struct
 Cjpeg_memory_mgr
 Cjpeg_progress_mgr
 Cjpeg_scan_info
 Cjpeg_source_mgr
 CJQUANT_TBL
 Cmrpt::math::KDTreeCapable< Derived, num_t, metric_t >A generic adaptor class for providing Nearest Neighbor (NN) lookup via the nanoflann library
 Cmrpt::math::KDTreeCapable< CFeatureList >
 Cmrpt::math::KDTreeCapable< CFeatureListKDTree< FEAT > >
 Cmrpt::math::KDTreeCapable< CPointsMap >
 Cnanoflann::KDTreeEigenMatrixAdaptor< MatrixType, DIM, Distance >An L2-metric KD-tree adaptor for working with data directly stored in an Eigen Matrix, without duplicating the data storage
 Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >Kd-tree index
 Cnanoflann::KDTreeSingleIndexAdaptorParamsParameters (see README.md)
 Ckfslam_traits< IMPL >
 Ckfslam_traits< CRangeBearingKFSLAM >
 Ckfslam_traits< CRangeBearingKFSLAM2D >
 CKmTree
 Cnanoflann::KNNResultSet< DistanceType, IndexType, CountType >
 Cnanoflann::L1_Adaptor< T, DataSource, _DistanceType >Manhattan distance functor (generic version, optimized for high-dimensionality data sets)
 Cnanoflann::L2_Adaptor< T, DataSource, _DistanceType >Squared Euclidean distance functor (generic version, optimized for high-dimensionality data sets)
 Cnanoflann::L2_Simple_Adaptor< T, DataSource, _DistanceType >Squared Euclidean (L2) distance functor (suitable for low-dimensionality datasets, like 2D or 3D point clouds) Corresponding distance traits: nanoflann::metric_L2_Simple
 Cmrpt::maps::LAS_HeaderInfoExtra information gathered from the LAS file header
 Cmrpt::maps::LAS_LoadParamsOptional settings for loadLASFile()
 Cmrpt::maps::LAS_WriteParamsOptional settings for saveLASFile()
 Cmrpt::obs::CObservationVelodyneScan::laser_return_t
 Cmrpt::vision::pnp::lhm
 Cstd::list< T >STL class
 Cmrpt::vision::lm_stat_t
 Cmrpt::maps::detail::loadFromRangeImpl< Derived >
 Cmrpt::LockHelper< T >Auxiliary helper structure for mrpt::lockHelper()
 Cmrpt::maps::detail::logoddscell_traits< TCELL >
 Cmrpt::maps::detail::logoddscell_traits< cell_t >
 Cmrpt::maps::detail::logoddscell_traits< int16_t >
 Cmrpt::maps::detail::logoddscell_traits< int8_t >
 Cmrpt::maps::detail::logoddscell_traits< OccGridCellTraits::cellType >
 Cmrpt::math::LowPassFilter_IIR11-order low-pass IIR filter
 Cmrpt::slam::detail::TPoseBin2D::lt_operatorLess-than ordering of bins for usage in STL containers
 Cmrpt::slam::detail::TPathBin2D::lt_operatorLess-than ordering of bins for usage in STL containers
 Cmrpt::slam::detail::TPoseBin3D::lt_operatorLess-than ordering of bins for usage in STL containers
 CLUT_info
 Cmrpt::typemeta::internal::make_sequence_< 0 >
 Cstd::map< K, T >STL class
 CEigen::Map< PlainObjectType, MapOptions, StrideType >
 Cmrpt::containers::map_as_vector< KEY, VALUE, VECTOR_T >A STL-like container which looks and behaves (almost exactly) like a std::map<> but is implemented as a linear std::vector<> indexed by KEY
 Cmrpt::containers::map_as_vector< size_t, size_t >
 Cmrpt::slam::map_keyframe_tMap keyframe, comprising raw observations and they as a metric map
 Cmrpt::containers::map_traits_map_as_vectorTraits for using a mrpt::containers::map_as_vector<> (dense, fastest representation)
 Cmrpt::containers::map_traits_stdmapTraits for using a std::map<> (sparse representation)
 CMapAuxPFCleanup
 CMapCanComputeLikelihood
 CMapExecutor
 Cmrpt::ros1bridge::MapHdlMethods to convert between ROS msgs and MRPT objects for map datatypes
 CMapIsEmpty
 CMatchingVertex
 Cmrpt::math::detail::MatOrVecResizer< R, C >
 Cmrpt::math::detail::MatOrVecResizer< 1, 1 >
 Cmrpt::math::detail::MatOrVecResizer< 1, C >
 Cmrpt::math::detail::MatOrVecResizer< R, 1 >
 CEigen::Matrix< _Scalar, _Rows, _Cols, _Options, _MaxRows, _MaxCols >
 CEigen::Matrix< double, 4, 1 >
 CEigen::Matrix< double, 4, 30 >
 CEigen::Matrix< NUM, Eigen::Dynamic, 1 >
 CEigen::Matrix< Scalar, NROWS, NCOLS >
 CEigen::MatrixBase< Derived >
 Cmrpt::math::MatrixBlockSparseCols< Scalar, NROWS, NCOLS, INFO, HAS_REMAP, INDEX_REMAP_MAP_IMPL >A templated column-indexed efficient storage of block-sparse Jacobian or Hessian matrices, together with other arbitrary information
 Cmrpt::math::MatrixVectorBase< Scalar, Derived >Base CRTP class for all MRPT vectors and matrices
 Cmrpt::math::MatrixVectorBase< T, CMatrixDynamic< T > >
 Cmrpt::math::MatrixVectorBase< T, CMatrixFixed< T, ROWS, COLS > >
 Cmrpt::math::MatrixVectorBase< T, CVectorDynamic< T > >
 Cmrpt::math::detail::MatrixWrapper< U, B >This template is a trick to switch the type of a variable using a boolean variable in the template
 Cmrpt::math::detail::MatrixWrapper< U, false >
 Cmrpt::math::detail::MatrixWrapper< U, true >
 Cmrpt::math::detail::MatrixWrapper< U, UIsObject >
 CMD5
 Cnanoflann::metric_L1Metaprogramming helper traits class for the L1 (Manhattan) metric
 Cnanoflann::metric_L2Metaprogramming helper traits class for the L2 (Euclidean) metric
 Cnanoflann::metric_L2_SimpleMetaprogramming helper traits class for the L2_simple (Euclidean) metric
 Cmrpt::math::ModelSearchModel search implementations: RANSAC and genetic algorithm
 CMonotonicToRealtimeEpoch
 Cmrpt_destination_mgr
 Cmrpt::system::mrptEventThe basic event type for the observer-observable pattern in MRPT
 Cmrpt::containers::MT_bufferThis class is a bulk sequence of bytes with MultiThread (MT)-safe read and write operations
 Cmy_source_mgr
 CMyNS::MyBarClass
 CMyNS::MyBarClass2
 CMyFooClass[example typename]
 Cmrpt::nav::CAbstractHolonomicReactiveMethod::NavInputInput parameters for CAbstractHolonomicReactiveMethod::navigate()
 Cmrpt::nav::CAbstractHolonomicReactiveMethod::NavOutputOutput for CAbstractHolonomicReactiveMethod::navigate()
 Cmrpt::containers::ci_less::nocase_compare
 CKmTree::Node
 Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Node
 CNODE_ANNOTATIONS
 CNODE_TYPE_DATA
 Cmrpt::non_copiable_ptr_basic< T >A wrapper class for pointers that can NOT be copied with "=" operator, raising an exception at runtime if a copy is attempted
 Cmrpt::non_copiable_ptr_basic< void >
 Cmrpt::hwdrivers::CNTRIPClient::NTRIPArgsThe arguments for connecting to a NTRIP stream, used in CNTRIPClient::open
 Cmrpt::obs::gnss::nv_oem6_header_tNovatel OEM6 regular header structure
 Cmrpt::obs::gnss::nv_oem6_short_header_tNovatel OEM6 short header structure
 Cmrpt::serialization::metaprogramming::ObjectReadFromStreamAn object for reading objects from a stream, intended for being used in STL algorithms
 Cmrpt::serialization::metaprogramming::ObjectReadFromStreamToPtrs< ptr_t >
 Cmrpt::serialization::metaprogramming::ObjectWriteToStreamAn object for writing objects to a stream, intended for being used in STL algorithms
 Cmrpt::graphslam::graphslam_traits< GRAPH_T >::observation_info_tAuxiliary struct used in graph-slam implementation: It holds the relevant information for each of the constraints being taking into account
 Cmrpt::maps::OccGridCellTraitsThe type of the map cells
 Cmrpt::config::simpleini::CSimpleIniTempl< SI_CHAR, SI_STRLESS, SI_CONVERTER >::OutputWriterInterface definition for the OutputWriter object to pass to Save() in order to output the INI file data
 Cmrpt::vision::pnp::p3p
 Cmrpt::config::simpleini::MRPT_IniFileParser::ParseContext
 Cmrpt::obs::VelodyneCalibration::PerLaserCalib
 Cpf2gauss_t< PDF >
 Cpf2gauss_t< CMonteCarloLocalization3D >
 Cpf2gauss_t< mrpt::slam::CMonteCarloLocalization2D >
 CPIThreadParam
 Cmrpt::nav::PlannerSimple2DSearches for collision-free path in 2D occupancy grids for holonomic circular robots
 Cmrpt::nav::PlannerTPS_VirtualBaseVirtual base class for TP-Space-based path planners
 Cmrpt::opengl::PLY_ExporterA virtual base class that implements the capability of exporting 3D point clouds and faces to a file in the Stanford PLY format
 Cmrpt::opengl::PLY_ImporterA virtual base class that implements the capability of importing 3D point clouds and faces from a file in the Stanford PLY format
 CPlyElement
 CPlyFile
 CPlyProperty
 Cmrpt::opengl::internal::Point
 Cmrpt::mrpt::opengl::PointCloudAdapter< POINTCLOUD >An adapter to different kinds of point cloud object
 Cmrpt::opengl::PointCloudAdapter< POINTCLOUD >An adapter to different kinds of point cloud object
 Cmrpt::opengl::PointCloudAdapter< mrpt::maps::CColouredPointsMap >Specialization mrpt::opengl::PointCloudAdapter<mrpt::maps::CColouredPointsMap> mrpt_adapters_grp
 Cmrpt::opengl::PointCloudAdapter< mrpt::maps::CPointsMap >Specialization mrpt::opengl::PointCloudAdapter<mrpt::maps::CPointsMap>
 Cmrpt::opengl::PointCloudAdapter< mrpt::maps::CPointsMapXYZI >Specialization mrpt::opengl::PointCloudAdapter<mrpt::maps::CPointsMapXYZI> mrpt_adapters_grp
 Cmrpt::opengl::PointCloudAdapter< mrpt::maps::CSimplePointsMap >Specialization mrpt::opengl::PointCloudAdapter<mrpt::maps::CSimplePointsMap>
 Cmrpt::opengl::PointCloudAdapter< mrpt::maps::CWeightedPointsMap >Specialization mrpt::opengl::PointCloudAdapter<mrpt::maps::CWeightedPointsMap> mrpt_adapters_grp
 Cmrpt::opengl::PointCloudAdapter< mrpt::obs::CObservation3DRangeScan >Specialization mrpt::opengl::PointCloudAdapter<CObservation3DRangeScan>
 Cmrpt::opengl::PointCloudAdapter< mrpt::opengl::CPointCloud >Specialization mrpt::opengl::PointCloudAdapter<mrpt::opengl::CPointCloud>
 Cmrpt::opengl::PointCloudAdapter< mrpt::opengl::CPointCloudColoured >Specialization mrpt::opengl::PointCloudAdapter<mrpt::opengl::CPointCloudColoured> mrpt_adapters_grp
 Cmrpt::opengl::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZ > >Specialization mrpt::opengl::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZ> > for an XYZ point cloud (without RGB)
 Cmrpt::opengl::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGB > >Specialization mrpt::opengl::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZRGB> > for an XYZ point cloud with RGB
 Cmrpt::opengl::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGBA > >Specialization mrpt::opengl::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZRGBA> > for an XYZ point cloud with RGB
 Cmrpt::obs::CObservationVelodyneScan::PointCloudStorageWrapperDerive from this class to generate pointclouds into custom containers
 Cmrpt::maps::detail::pointmap_traits< Derived >
 Cmrpt::maps::detail::pointmap_traits< CColouredPointsMap >
 Cmrpt::maps::detail::pointmap_traits< CPointsMapXYZI >
 Cmrpt::maps::detail::pointmap_traits< CSimplePointsMap >
 Cmrpt::maps::detail::pointmap_traits< CWeightedPointsMap >
 Cnanoflann::PooledAllocator
 Cmrpt::poses::detail::pose_point_impl< DERIVEDCLASS, IS3D >
 Cmrpt::poses::detail::pose_point_impl< DERIVEDCLASS, 0 >
 Cmrpt::poses::detail::pose_point_impl< DERIVEDCLASS, 1 >
 Cmrpt::poses::detail::pose_point_impl< DERIVEDCLASS, mrpt::poses::detail::T3DTypeHelper< DERIVEDCLASS >::is_3D_val >
 Cmrpt::nav::PoseDistanceMetric< node_t >Generic base for metrics
 Cmrpt::nav::PoseDistanceMetric< TNodeSE2 >Pose metric for SE(2)
 Cmrpt::nav::PoseDistanceMetric< TNodeSE2_TP >Pose metric for SE(2) limited to a given PTG manifold
 Cmrpt::vision::pnp::posit
 CPOSIT
 Cmrpt::vision::pnp::ppnp
 CEigen::Product< _Lhs, _Rhs, Option >
 Cmrpt::opengl::ProgramA resource handling helper for OpenGL Shader "programs"
 Cmrpt::math::internal::ProvideStaticResize< Derived >Provided for STL and matrices/vectors compatibility
 Cmrpt::math::internal::ProvideStaticResize< TPoint2D_< T > >
 Cmrpt::math::internal::ProvideStaticResize< TPoint3D_< T > >
 Cmrpt::math::internal::ProvideStaticResize< TPose2D >
 Cmrpt::math::internal::ProvideStaticResize< TPose3D >
 Cmrpt::math::internal::ProvideStaticResize< TPose3DQuat >
 Cmrpt::math::internal::ProvideStaticResize< TTwist2D >
 Cmrpt::math::internal::ProvideStaticResize< TTwist3D >
 Cmrpt::nav::CAbstractPTGBasedReactive::PTGTarget
 Cmrpt::ptr_cast< CAST_TO >Converts a polymorphic smart pointer Base::Ptr to Derived::Ptr, in a way compatible with MRPT >=1.5.4 and MRPT 2.x series
 CQDialog
 Cmrpt::rtti::queue_register_functions_t
 Cnanoflann::RadiusResultSet< DistanceType, IndexType >A result-set class used when performing a radius based search
 Cmrpt::opengl::COpenGLVertexArrayObject::RAII_Impl
 Cmrpt::opengl::COpenGLBuffer::RAII_Impl
 Cmrpt::obs::CObservationVelodyneScan::raw_block_tRaw Velodyne data block
 Cmrpt::opengl::CAngularObservationMesh::TDoubleRange::rdUnion type with the actual data
 Cmrpt::aligned_allocator_cpp11< T, AligmentBytes >::rebind< U >
 Cmrpt::opengl::CRenderizable::RenderContextContext for calls to render()
 CRenderElements
 Cmrpt::opengl::RenderQueueElementEach element in the queue to be rendered for each keyframe
 Cmrpt::math::detail::ReverseAccessorIterator< A, T >Template class for matrix accessor's iterators
 CrgbRecord
 Cmrpt::math::RobustKernel< KERNEL_TYPE, T >
 Cmrpt::math::RobustKernel< rkLeastSquares, T >No robust kernel, use standard least squares: rho(r) = r^2
 Cmrpt::math::RobustKernel< rkPseudoHuber, T >Pseudo-huber robust kernel: rho(r) = 2 * delta^2 * ( -1+sqrt( 1+ r^2/delta^2 ) )
 Cmrpt::vision::pnp::rpnp
 Cmrpt::nav::RRTAlgorithmParams
 Cmrpt::nav::RRTEndCriteria
 CruntimeClassId
 Cmrpt::safe_ptr_basic< T >A wrapper class for pointers that can be safely copied with "=" operator without problems
 Cmrpt::safe_ptr_basic< mrpt::hmtslam::CHierarchicalMHMap >
 Cmrpt::safe_ptr_basic< mrpt::hmtslam::CHMTSLAM >
 Cmrpt::safe_ptr_basic< mrpt::opengl::COpenGLScene >
 CScreen
 Cmrpt::poses::Lie::SE< n >Traits for SE(n), rigid-body transformations in R^n space
 Cmrpt::tfest::internal::se2_l2_impl_return_t< T >
 Cmrpt::poses::Lie::SE< 2 >Traits for SE(2), rigid-body transformations in R^2 space
 Cmrpt::poses::Lie::SE< 3 >Traits for SE(3), rigid-body transformations in R^3 space
 Cmrpt::poses::SE_average< DOF >Computes weighted and un-weighted averages of SE(2) or SE(3) poses
 Cmrpt::poses::SE_average< 2 >Computes weighted and un-weighted averages of SE(2) poses
 Cmrpt::poses::SE_average< 3 >Computes weighted and un-weighted averages of SE(3) poses
 Cnanoflann::SearchParamsSearch options for KDTreeSingleIndexAdaptor::findNeighbors()
 CSegmentVector
 CEigen::SelfAdjointEigenSolver< _MatrixType >
 Cmrpt::typemeta::internal::sequence< I >
 Cstd::set< K >STL class
 Cmrpt::opengl::ShaderA resource handling helper for OpenGL "Shader" compiled code fragment
 Cstd::shared_ptr< T >
 Cstd::shared_ptr< CDisplayWindow >
 Cstd::shared_ptr< CDisplayWindow3D >
 Cstd::shared_ptr< CHMHMapNode >
 Cstd::shared_ptr< CHolonomicLogFileRecord >
 Cstd::shared_ptr< CMetricMap >
 Cstd::shared_ptr< CMultiObjectiveMotionOptimizerBase >
 Cstd::shared_ptr< CObservation >
 Cstd::shared_ptr< ConnectivityDescriptor >
 Cstd::shared_ptr< CParameterizedTrajectoryGenerator >
 Cstd::shared_ptr< CPointCloudFilterBase >
 Cstd::shared_ptr< CPointsMap >
 Cstd::shared_ptr< CPose3DPDF >
 Cstd::shared_ptr< CPosePDF >
 Cstd::shared_ptr< CSerializable >
 Cstd::shared_ptr< CvCBCorner >
 Cstd::shared_ptr< CvCBQuad >
 Cstd::shared_ptr< CVehicleVelCmd >
 Cstd::shared_ptr< mrpt::comms::CSerialPort >
 Cstd::shared_ptr< mrpt::hmtslam::CHMHMapArc >
 Cstd::shared_ptr< mrpt::img ::CImage >
 Cstd::shared_ptr< mrpt::io::CStream >
 Cstd::shared_ptr< mrpt::maps ::CLandmarksMap >
 Cstd::shared_ptr< mrpt::maps ::CMultiMetricMap >
 Cstd::shared_ptr< mrpt::maps ::COccupancyGridMap2D >
 Cstd::shared_ptr< mrpt::maps ::COctoMap >
 Cstd::shared_ptr< mrpt::maps ::CSimplePointsMap >
 Cstd::shared_ptr< mrpt::obs ::CActionCollection >
 Cstd::shared_ptr< mrpt::obs ::CObservation2DRangeScan >
 Cstd::shared_ptr< mrpt::obs ::CObservation3DRangeScan >
 Cstd::shared_ptr< mrpt::obs ::CObservationImage >
 Cstd::shared_ptr< mrpt::obs ::CObservationIMU >
 Cstd::shared_ptr< mrpt::obs ::CObservationVelodyneScan >
 Cstd::shared_ptr< mrpt::obs ::CSensoryFrame >
 Cstd::shared_ptr< mrpt::opengl ::COpenGLScene >
 Cstd::shared_ptr< mrpt::opengl ::CSetOfLines >
 Cstd::shared_ptr< mrpt::opengl ::CText >
 Cstd::shared_ptr< mrpt::opengl ::CTexturedPlane >
 Cstd::shared_ptr< mrpt::opengl::CAssimpModel::TImplAssimp >
 Cstd::shared_ptr< mrpt::opengl::COpenGLBuffer::RAII_Impl >
 Cstd::shared_ptr< mrpt::opengl::COpenGLVertexArrayObject::RAII_Impl >
 Cstd::shared_ptr< mrpt::opengl::CText >
 Cstd::shared_ptr< mrpt::slam::CMetricMapBuilderRBPF >
 Cstd::shared_ptr< std::istream >
 Cstd::shared_ptr< std::mutex >
 Cstd::shared_ptr< T2ListsOfSegments >
 Cstd::shared_ptr< TCommonRegion >
 Cstd::shared_ptr< TPixelLabelInfoBase >
 Cstd::shared_ptr< TPoint2D >
 Cstd::shared_ptr< TSegment2D >
 Cmrpt::config::simpleini::SI_ConvertA< SI_CHAR >Null conversion class for MBCS/UTF-8 to char (or equivalent)
 Cmrpt::config::simpleini::SI_ConvertA< char >
 CSI_CONVERTER
 Cmrpt::config::simpleini::SI_GenericCase< SI_CHAR >Generic case-sensitive less than comparison
 Cmrpt::config::simpleini::SI_GenericNoCase< SI_CHAR >Generic ASCII case-insensitive less than comparison
 Cmrpt::poses::Lie::SO< n >Traits for SO(n), rotations in R^n space
 Cmrpt::poses::Lie::SO< 2 >Traits for SO(2), rotations in R^2 space
 Cmrpt::poses::Lie::SO< 3 >Traits for SO(3), rotations in R^3 space
 Cmrpt::poses::SO_average< DOF >Computes weighted and un-weighted averages of SO(2) or SO(3) orientations
 Cmrpt::poses::SO_average< 2 >Computes weighted and un-weighted averages of SO(2) orientations
 Cmrpt::poses::SO_average< 3 >Computes weighted and un-weighted averages of SO(3) orientations
 Csort_pred
 Cstreambuf
 CEigen::Stride< Outter, Inner >
 Cmrpt::typemeta::string_literal< N >
 Cmrpt::comms::SubscriberNodelet-like Pub/Sub communications (in #include <mrpt/comms/nodelets.h>)
 Cmrpt::obs::T2DScanPropertiesAuxiliary struct that holds all the relevant geometry information about a 2D scan
 CT2ListsOfSegments
 Cmrpt::obs::T3DPointsProjectionParamsUsed in CObservation3DRangeScan::unprojectInto()
 Cmrpt::obs::T3DPointsTo2DScanParamsUsed in CObservation3DRangeScan::convertTo2DScan()
 Cmrpt::poses::detail::T3DTypeHelper< POSEORPOINT >
 Cmrpt::poses::detail::T3DTypeHelper< CPoint2D >
 Cmrpt::poses::detail::T3DTypeHelper< CPoint3D >
 Cmrpt::poses::detail::T3DTypeHelper< CPose2D >
 Cmrpt::poses::detail::T3DTypeHelper< CPose3D >
 Cmrpt::poses::detail::T3DTypeHelper< CPose3DQuat >
 Cmrpt::vision::CFeatureExtraction::TOptions::TAKAZEOptionsAKAZEOptions Options
 Cmrpt::nav::CAbstractNavigator::TargetInfoIndividual target info in CAbstractNavigator::TNavigationParamsBase and derived classes
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescriptionEach of the tasks to create in CNationalInstrumentsDAQ::initialize()
 Cmrpt::slam::TAuxDataRecursiveJCBB
 CTAuxLoadFunctor
 CTAuxRangeMeasInfoAuxiliary for optimal sampling in RO-SLAM
 Cmrpt::math::detail::TAuxResizer< MAT, TypeSizeAtCompileTime >Internal resize which compiles to nothing on fixed-size matrices
 Cmrpt::math::detail::TAuxResizer< MAT, -1 >
 Cmrpt::vision::CFeatureExtraction::TOptions::TBCDOptionsBCD Options
 Cmrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromTBI::TBI_info
 Cmrpt::vision::CFeatureExtraction::TOptions::TBLDOptionsBLDOptions Descriptor Options
 Cmrpt::system::CTimeLogger::TCallDataData of all the calls:
 Cmrpt::system::TCallStackBackTraceSee: getCallStackBackTrace()
 Cmrpt::system::TCallStackEntryUsed in getCallStackBackTrace()
 Cmrpt::system::CTimeLogger::TCallStatsData of each call section: # of calls, minimum, maximum, average and overall execution time (in seconds)
 Cmrpt::hwdrivers::CImageGrabber_dc1394::TCameraInfoUsed in enumerateCameras
 Cmrpt::nav::TCandidateMovementPTGStores a candidate movement in TP-Space-based navigation
 Cmrpt::hwdrivers::TCaptureCVOptionsOptions used when creating an OpenCV capture object Some options apply to IEEE1394 cameras only
 Cmrpt::hwdrivers::TCaptureOptions_bumblebeeOptions used when creating a bumblebee camera capture object
 Cmrpt::hwdrivers::TCaptureOptions_dc1394Options used when creating an dc1394 capture object All but the frame size, framerate, and color_coding can be changed dynamically by CImageGrabber_dc1394::changeCaptureOptions
 Cmrpt::hwdrivers::TCaptureOptions_DUO3DOptions used when creating a camera capture object of type CImageGrabber_FlyCapture2
 Cmrpt::hwdrivers::TCaptureOptions_FlyCapture2Options used when creating a camera capture object of type CImageGrabber_FlyCapture2
 Cmrpt::hwdrivers::TCaptureOptions_SVSOptions used when creating a STOC Videre Design camera capture object
 Cmrpt::nav::CPTG_DiffDrive_CollisionGridBased::TCellForLambdaFunctionSpecifies the min/max values for "k" and "n", respectively
 Cmrpt::img::TColorA RGB color - 8bit
 Cmrpt::img::TColorfAn RGBA color - floats in the range [0,1]
 Cmrpt::img::TColorManagerManage R, G, B color triads and ask class instance of the next unique RGB combination
 CTCommonRegion
 Cmrpt::obs::gnss::Message_NV_OEM6_VERSION::TComponentVersion
 Cmrpt::obs::gnss::Message_NV_OEM6_RANGECMP::TCompressedRangeLog
 Cmrpt::topography::TCoordsA coordinate that is stored as a simple "decimal" angle in degrees, but can be retrieved/set in the form of DEGREES + arc-MINUTES + arc-SECONDS
 Cmrpt::nav::TCPointTrajectory points in C-Space for non-holonomic robots
 Cmrpt::maps::COccupancyGridMap2D::TCriticalPointsListThe structure used to store the set of Voronoi diagram critical points
 Cmrpt::maps::CLandmarksMap::TCustomSequenceLandmarksThe list of landmarks: the wrapper class is just for maintaining the KD-Tree representation
 Cmrpt::slam::TDataAssociationResultsThe results from mrpt::slam::data_association
 Cmrpt::slam::CRangeBearingKFSLAM::TDataAssocInfoInformation for data-association:
 Cmrpt::slam::CRangeBearingKFSLAM2D::TDataAssocInfoInformation for data-association:
 Cmrpt::obs::CObservationGasSensors::CMOSmodel::TdataMapThe content of each m_lastObservations in the estimation when using the option : MOS_MODEl (useMOSmodel =1)
 Cmrpt::slam::CRejectionSamplingRangeOnlyLocalization::TDataPerBeaconData for each beacon observation with a correspondence with the map
 Cmrpt::topography::TDatum10ParamsParameters for a topographic transfomation
 Cmrpt::topography::TDatum1DTransfParameters for a topographic transfomation
 Cmrpt::topography::TDatum7ParamsParameters for a topographic transfomation
 Cmrpt::topography::TDatum7Params_TOPCON
 Cmrpt::topography::TDatumHelmert2DParameters for a topographic transfomation
 Cmrpt::topography::TDatumHelmert2D_TOPCON
 Cmrpt::topography::TDatumHelmert3DParameters for a topographic transfomation
 Cmrpt::topography::TDatumHelmert3D_TOPCONParameters for a topographic transfomation
 Cmrpt::topography::TDatumTransfInterpolationParameters for a topographic transfomation
 Cmrpt::vision::CFeature::TDescriptorsAll the possible descriptors this feature may have
 Cmrpt::slam::CMetricMapBuilderICP::TDistTraveled distances from last map update / ICP-based localization
 CTDistance
 Cmrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::TDistanceAuxiliary struct for topological distances from root node
 Cmrpt::detectors::CDetectorDoorCrossing::TDoorCrossingOutParamsA structure used as output in this method
 Cmrpt::opengl::CAngularObservationMesh::TDoubleRangeRange specification type, with several uses
 CTDUOParams
 Cmrpt::graphs::CDirectedTree< TYPE_EDGES >::TEdgeInfo
 Cmrpt::topography::TEllipsoid
 Cmrpt::hwdrivers::CRovio::TEncoders
 Cmrpt::maps::COccupancyGridMap2D::TEntropyInfoUsed for returning entropy related information
 Cmrpt::math::MatrixBlockSparseCols< Scalar, NROWS, NCOLS, INFO, HAS_REMAP, INDEX_REMAP_MAP_IMPL >::TEntry
 Cmrpt::typemeta::TEnumType< ENUMTYPE >A helper class that can convert an enum value into its textual representation, and viceversa
 Cmrpt::typemeta::TEnumTypeFiller< ENUMTYPE >Only specializations of this class are defined for each enum type of interest
 Cmrpt::nav::CAbstractNavigator::TErrorReason
 CTest
 Cmrpt::obs::CObservation2DRangeScanWithUncertainty::TEvalParams
 Cmrpt::maps::CPointCloudFilterBase::TExtraFilterParams
 Cmrpt::vision::CGenericFeatureTracker::TExtraOutputInfo
 Cmrpt::poses::FrameTransformer< DIM >::TF_TreeEdge
 CTFace
 Cmrpt::bayes::CParticleFilterCapable::TFastDrawAuxVarsAuxiliary vectors, see CParticleFilterCapable::prepareFastDrawSample for more information
 Cmrpt::vision::CFeatureExtraction::TOptions::TFASTOptionsFAST Options
 Cmrpt::vision::TFeatureObservationOne feature observation entry, used within sequences with TSequenceFeatureObservations
 Cmrpt::system::CDirectoryExplorer::TFileInfoThis represents the information about each file
 Cmrpt::system::CFileSystemWatcher::TFileSystemChangeEach of the changes detected by utils::CFileSystemWatcher
 Cmrpt::opengl::TFontParamsA description of a bitmapped or vectorized text font
 CTForce
 Cmrpt::io::internal::TFreeFnDataForZMQ
 Cmrpt::comms::TFTDIDeviceA list of FTDI devices and their descriptors
 CTFunctorLaserSimulData
 Cmrpt::maps::CLandmarksMap::TFuseOptionsWith this struct options are provided to the fusion process
 CTGap
 Cmrpt::nav::CHolonomicND::TGapThe structure used to store a detected gap in obstacles
 Cmrpt::maps::CGasConcentrationGridMap2D::TGaussianCell
 Cmrpt::poses::CPointPDFSOG::TGaussianModeThe struct for each mode:
 Cmrpt::poses::CPose3DPDFSOG::TGaussianModeThe struct for each mode:
 Cmrpt::poses::CPosePDFSOG::TGaussianModeThe struct for each mode:
 Cmrpt::maps::CGasConcentrationGridMap2D::TGaussianWindTable
 Cmrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TGenerateHypotsPoolAdParamsStruct for passing additional parameters to the generateHypotsPool call
 Cmrpt::obs::CObservationVelodyneScan::TGeneratePointCloudParameters
 Cmrpt::obs::CObservationVelodyneScan::TGeneratePointCloudSE3ResultsResults for generatePointCloudAlongSE3Trajectory()
 Cmrpt::topography::TGeodeticCoordsA set of geodetic coordinates: latitude, longitude and height, defined over a given geoid (typically, WGS84)
 Cmrpt::graphslam::deciders::CLoopCloserERD< GRAPH_T >::TGetICPEdgeAdParamsStruct for passing additional parameters to the getICPEdge call
 Cmrpt::maps::CLandmarksMap::TLikelihoodOptions::TGPSOriginThis struct store de GPS longitude, latitude (in degrees ) and altitude (in meters) for the first GPS observation compose with de sensor position on the robot
 Cmrpt::graphs::TGraphvizExportParamsUsed in mrpt::graphs export functions to .dot files
 Cmrpt::opengl::COctoMapVoxels::TGridCubeThe info of each grid block
 Cmrpt::vision::CFeatureExtraction::TOptions::THarrisOptionsHarris Options
 Cmrpt::maps::THeightGridmapCellThe contents of each cell in a CHeightGridMap2D map
 Cmrpt::hmtslam::CLocalMetricHypothesis::ThreadLocks
 Cmrpt::graphs::detail::THypothesis< GRAPH_T >An edge hypothesis between two nodeIDs
 Cmrpt::vision::TImageCalibDataData associated to each image in the calibration process mrpt::vision::checkerBoardCameraCalibration (All the information can be left empty and will be filled up in the calibration method)
 Cmrpt::vision::TImageROIA structure for defining a ROI within an image
 Cmrpt::vision::TImageStereoCalibDataData associated to each stereo image in the calibration process mrpt::vision::checkerBoardCameraCalibration (All the information can be left empty and will be filled up in the calibration method)
 Cmrpt::vision::TImageStereoCallbackDataParams of the optional callback provided by the user
 Cmrpt::opengl::CAssimpModel::TImplAssimpA container for automatic deletion of assimp scene when the last reference of the smart_ptr's is destroyed
 Cmrpt::nav::CAbstractPTGBasedReactive::TInfoPerPTG
 Cmrpt::nav::CLogFileRecord::TInfoPerPTGThe structure used to store all relevant information about each transformation into TP-Space
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TInfoPerTask
 Cmrpt::opengl::COctoMapVoxels::TInfoPerVoxelSet
 Cmrpt::maps::CRandomFieldGridMap2D::TInsertionOptionsCommonParameters common to any derived class
 CTInsertionOptionsCommon
 Cmrpt::maps::CLandmarksMap::TInsertionResultsThis struct stores extra results from invoking insertObservation
 CTInterpQuery
 Cmrpt::math::KDTreeCapable< Derived, num_t, metric_t >::TKDTreeDataHolder< _DIM >Internal structure with the KD-tree representation (mainly used to avoid copying pointers with the = operator)
 Cmrpt::math::KDTreeCapable< Derived, num_t, metric_t >::TKDTreeDataHolder< 2 >
 Cmrpt::math::KDTreeCapable< Derived, num_t, metric_t >::TKDTreeDataHolder< 3 >
 Cmrpt::math::KDTreeCapable< Derived, num_t, metric_t >::TKDTreeSearchParams
 Cmrpt::vision::TKeyPoint_templ< PIXEL_COORD_TYPE >Simple structure for image key points
 Cmrpt::vision::TKeyPoint_templ< mrpt::img::TPixelCoordf >
 Cmrpt::vision::TKeyPointList_templ< FEATURE >A list of image features using the structure TKeyPoint for each feature Users normally will use directly: TKeyPointList, TKeyPointfList
 Cmrpt::vision::TKeyPointList_templ< TKeyPoint >
 Cmrpt::vision::TKeyPointTraits< FEATURE >
 Cmrpt::vision::TKeyPointTraits< TKeyPoint >
 Cmrpt::vision::TKeyPointTraits< TKeyPointf >
 Cmrpt::kinematics::TKinematicLinkAn individual kinematic chain element (one link) which builds up a CKinematicChain
 Cmrpt::vision::CFeatureExtraction::TOptions::TKLTOptionsKLT Options
 Cmrpt::maps::CPointsMap::TLaserRange2DInsertContextHelper struct used for internal_loadFromRangeScan2D_prepareOneRange()
 Cmrpt::maps::CPointsMap::TLaserRange3DInsertContextHelper struct used for internal_loadFromRangeScan3D_prepareOneRange()
 Cmrpt::maps::COccupancyGridMap2D::TLaserSimulUncertaintyParamsInput params for laserScanSimulatorWithUncertainty()
 Cmrpt::maps::COccupancyGridMap2D::TLaserSimulUncertaintyResultOutput params for laserScanSimulatorWithUncertainty()
 Cmrpt::vision::CFeatureExtraction::TOptions::TLATCHOptionsLATCHOptions Descriptor
 Cmrpt::obs::detail::TLevMarData
 Cmrpt::opengl::TLightParametersLighting parameters, mostly for triangle shaders
 Cmrpt::maps::COccupancyGridMap2D::TLikelihoodOutputSome members of this struct will contain intermediate or output data after calling "computeObservationLikelihood" for some likelihood functions
 Cmrpt::math::TLine2D2D line without bounds, represented by its equation $Ax+By+C=0$
 Cmrpt::math::TLine3D3D line, represented by a base point and a director vector
 Cmrpt::opengl::CTextMessageCapable::TListTextMessages
 CTLocalPointLocal stucture used in the next method (must be here for usage within STL stuff)
 Cmrpt::vision::CFeatureExtraction::TOptions::TLogPolarImagesOptionsLogPolarImagesOptions Options
 Cmrpt::vision::CFeatureExtraction::TOptions::TLSDOptionsLSDOptions Options
 CTMass
 Cmrpt::maps::TMatchingExtraResultsAdditional results from the determination of matchings between point clouds, etc., apart from the pairings themselves
 Cmrpt::tfest::TMatchingPairA structure for holding correspondences between two sets of points or points-like entities in 2D or 3D
 Cmrpt::maps::TMatchingParamsParameters for the determination of matchings between point clouds, etc
 Cmrpt::maps::TMatchingRatioParamsParameters for CMetricMap::compute3DMatchingRatio()
 Cmrpt::obs::CObservation6DFeatures::TMeasurementEach one of the measurements
 Cmrpt::obs::CObservationBeaconRanges::TMeasurementEach one of the measurements
 Cmrpt::detectors::CFaceDetection::TMeasurement
 Cmrpt::obs::CObservationRange::TMeasurement
 Cmrpt::obs::CObservationBearingRange::TMeasurementEach one of the measurements:
 Cmrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromAAMessage definition:
 Cmrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromTBIMessage definition:
 Cmrpt::hmtslam::CHMTSLAM::TMessageLSLAMtoTBIMessage definition:
 Cmrpt::slam::TMetricMapAlignmentResultUsed as base class for other result structures of each particular algorithm in CMetricMapsAlignmentAlgorithm derived classes
 Cmrpt::maps::internal::TMetricMapTypesRegistryClass factory & registry for map classes
 Cmrpt::hwdrivers::CVelodyneScanner::TModelPropertiesHard-wired properties of LIDARs depending on the model
 Cmrpt::hwdrivers::CVelodyneScanner::TModelPropertiesFactoryAccess to default sets of parameters for Velodyne LIDARs
 Cmrpt::slam::TMonteCarloLocalizationParamsThe struct for passing extra simulation parameters to the prediction stage when running a particle filter
 Cmrpt::obs::CActionRobotMovement3D::TMotionModelOptionsThe parameter to be passed to "computeFromOdometry"
 Cmrpt::obs::CActionRobotMovement2D::TMotionModelOptionsThe parameter to be passed to "computeFromOdometry"
 Cmrpt::hwdrivers::CNTRIPClient::TMountPointA descriptor of one stream in an NTRIP Caster - See CNTRIPClient::retrieveListOfMountpoints
 Cmrpt::nav::TMoveEdgeSE2_TPAn edge for the move tree used for planning in SE2 and TP-space
 Cmrpt::graphs::detail::TMRSlamEdgeAnnotationsStruct to be used as the EDGE_ANNOTATIONS template argument in CNetworkOfPoses class instances for use in multiple-robot SLAM applications
 Cmrpt::system::COutputLogger::TMsgStruct responsible of holding information relevant to the message (in std::string form) issued by the user
 Cmrpt::vision::TMultiResMatchingOutputStruct containing the output after matching multi-resolution SIFT-like descriptors
 Cmrpt::nav::CParameterizedTrajectoryGenerator::TNavDynamicStateDynamic state that may affect the PTG path parameterization
 Cmrpt::nav::CAbstractNavigator::TNavigationParamsBaseBase for all high-level navigation commands
 Cmrpt::opengl::COctreePointRenderer< Derived >::TNodeThe structure for each octree spatial node
 Cmrpt::graphs::detail::TNodeAnnotationsAbstract class from which NodeAnnotations related classes can be implemented
 Cmrpt::graphslam::detail::TNodeProps< GRAPH_T >
 Cmrpt::nav::TNodeSE2
 Cmrpt::nav::TNodeSE2_TP
 Cmrpt::typemeta::detail::to_chars< digits >
 Cmrpt::typemeta::detail::to_chars< digits... >
 Cmrpt::math::TObject2DStandard type for storing any lightweight 2D type
 Cmrpt::math::TObject2D::tobject2d_data_tUnion type storing pointers to every allowed type
 Cmrpt::math::TObject3DStandard object for storing any 3D lightweight object
 Cmrpt::math::TObject3D::tobject3d_data_tUnion containing pointer to actual data
 CTObs
 Cmrpt::obs::CObservationGasSensors::TObservationENoseThe structure for each e-nose
 CTOldCellTypeInVersion1
 Cmrpt::detectors::CCascadeClassifierDetection::TOptions
 Cmrpt::slam::CMetricMapBuilder::TOptionsOptions for the algorithm
 Cmrpt::hwdrivers::CRovio::TOptions
 Cmrpt::detectors::CDetectorDoorCrossing::TOptionsIn this structure parameters can be changed to customize the behaviour of this algorithm
 Cmrpt::detectors::CFaceDetection::TOptions
 Cmrpt::poses::CRobot2DPoseEstimator::TOptions
 Cmrpt::obs::CActionRobotMovement3D::TMotionModelOptions::TOptions_6DOFModel
 Cmrpt::obs::CActionRobotMovement2D::TMotionModelOptions::TOptions_GaussianModelOptions for the gaussian model, which generates a CPosePDFGaussian object in poseChange using a closed-form linear Gaussian model
 Cmrpt::obs::CActionRobotMovement2D::TMotionModelOptions::TOptions_ThrunModelOptions for the Thrun's model, which generates a CPosePDFParticles object in poseChange using a MonteCarlo simulation
 Cmrpt::vision::CFeatureExtraction::TOptions::TORBOptionsORB Options
 Cmrpt::slam::CGridMapAligner::TReturnInfo::TPairPlusDistance
 Cmrpt::system::TParameters< T >For usage when passing a dynamic number of (numeric) arguments to a function, by name
 Cmrpt::system::TParameters< double >
 CSE_traits_tests< POSE_TYPE >::TParams
 CPose3DTests::TParams_func_jacob_Aexpe_D
 CSE_traits_tests< POSE_TYPE >::TParamsMat< MAT_LEN >
 CTParsersRegistry
 Cmrpt::bayes::CParticleFilter::TParticleFilterStatsStatistics for being returned from the "execute" method
 Cmrpt::hmtslam::CLSLAM_RBPF_2DLASER::TPathBinAuxiliary structure
 Cmrpt::slam::detail::TPathBin2DAuxiliary structure
 Cmrpt::topography::TPathFromRTKInfoUsed to return optional information from mrpt::topography::path_from_rtk_gps
 Cmrpt::img::TPixelCoordA pair (x,y) of pixel coordinates (integer resolution)
 Cmrpt::img::TPixelCoordfA pair (x,y) of pixel coordinates (subpixel resolution)
 Cmrpt::obs::TPixelLabelInfoBaseVirtual interface to all pixel-label semantic information structs
 Cmrpt::math::TPlane3D Plane, represented by its equation $Ax+By+Cz+D=0$
 Cmrpt::nav::TPlannerInputTempl< node_pose_t, world_limits_t >
 Cmrpt::nav::TPlannerInputTempl< node_pose_t, node_pose_t >
 Cmrpt::nav::TPlannerResultTempl< tree_t >
 Cmrpt::nav::TPlannerResultTempl< TMoveTreeSE2_TP >
 Cmrpt::math::TPoint2D_data< T >
 Cmrpt::math::TPoint3D_data< T >Trivially copiable underlying data for TPoint3D 1-byte memory packed, no padding]
 Cmrpt::obs::CObservationVelodyneScan::TPointCloudSee point_cloud and scan_packets
 Cmrpt::maps::CHeightGridMap2D_Base::TPointInsertParamsExtra params for insertIndividualPoint()
 Cmrpt::math::TPointXYZfIu8XYZ point (float) + Intensity(u8)
 Cmrpt::math::TPointXYZfRGBAu8XYZ point (float) + RGBA(u8)
 Cmrpt::math::TPointXYZfRGBu8XYZ point (float) + RGB(u8)
 Cmrpt::math::TPointXYZIu8XYZ point (double) + Intensity(u8)
 Cmrpt::math::TPointXYZRGBAfXYZ point (float) + RGBA(float) [1-byte memory packed, no padding]
 Cmrpt::math::TPointXYZRGBu8XYZ point (double) + RGB(u8)
 Cmrpt::vision::CFeatureExtraction::TOptions::TPolarImagesOptionsPolarImagesOptions options
 Cmrpt::math::TPolygonWithPlaneSlightly heavyweight type to speed-up calculations with polygons in 3D
 Cmrpt::opengl::CPolyhedron::TPolyhedronEdgeStruct used to store a polyhedron edge
 Cmrpt::opengl::CPolyhedron::TPolyhedronFaceStruct used to store a polyhedron face
 Cmrpt::slam::detail::TPoseBin2DAuxiliary structure used in KLD-sampling in particle filters
 Cmrpt::slam::detail::TPoseBin3DAuxiliary structure used in KLD-sampling in particle filters
 Cmrpt::hmtslam::TPoseInfoInformation kept for each robot pose used in CRobotPosesGraph
 Cmrpt::math::TPoseOrPointBase type of all TPoseXX and TPointXX classes in mrpt::math
 Cmrpt::graphs::detail::TPosePDFHelper< POSE_PDF >
 Cmrpt::graphs::detail::TPosePDFHelper< CPose2D >
 Cmrpt::graphs::detail::TPosePDFHelper< CPose3D >
 Cmrpt::tfest::TPotentialMatchFor each individual-compatibility (IC) test, the indices of the candidate match between elements in both reference frames
 Cmrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::TPreviousAuxiliary struct for backward paths
 CTPrevious
 Cmrpt::hmtslam::TPropertyValueIDTripletInternal triplet for each property in utils::CMHPropertiesValuesList
 Cmrpt::hmtslam::CPropertiesValuesList::TPropertyValuePair
 Cmrpt::nav::CReactiveNavigationSystem3D::TPTGmultilevelA set of PTGs of the same type, one per "height level"
 Cnanoflann::metric_L2::traits< T, DataSource >
 Cnanoflann::metric_L2_Simple::traits< T, DataSource >
 Cnanoflann::metric_L1::traits< T, DataSource >
 Cmrpt::maps::TRandomFieldCellThe contents of each cell in a CRandomFieldGridMap2D map
 Cmrpt::maps::TRandomFieldVoxelThe contents of each voxel in a CRandomFieldGridMap3D map
 Cmrpt::obs::TRangeImageFilterMainly for internal use within CObservation3DRangeScan::unprojectInto()
 Cmrpt::obs::TRangeImageFilterParamsUsed in CObservation3DRangeScan::unprojectInto()
 Cmrpt::graphslam::apps::TRegistrationDeciderOrOptimizerPropsProperties struct for both the Registration Decider and Optimizer classes
 Cmrpt::vision::TRelativeFeaturePosOne relative feature observation entry, used with some relative bundle-adjustment functions
 Cmrpt::maps::COctoMapBase< octree_t, octree_node_t >::TRenderingOptionsOptions for the conversion of a mrpt::maps::COctoMap into a mrpt::opengl::COctoMapVoxels
 Cmrpt::maps::COccupancyGridMap3D::TRenderingOptionsOptions for the conversion of a mrpt::maps::COccupancyGridMap3D into a mrpt::opengl::COctoMapVoxels
 Cmrpt::opengl::TRenderMatricesRendering state related to the projection and model-view matrices
 Cmrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptionsOptions for renderMoveTree()
 Cmrpt::opengl::COctreePointRenderer< Derived >::TRenderQueueElement
 Cmrpt::gui::WxSubsystem::TRequestToWxMainThreadThe data structure for each inter-thread request:
 Cmrpt::vision::TResidJacobElementData associated to each observation in the Lev-Marq
 Cmrpt::nav::CMultiObjectiveMotionOptimizerBase::TResultInfo
 Cmrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::TResultInfo
 Cmrpt::graphslam::TResultInfoSpaLevMarqOutput information for mrpt::graphslam::optimize_graph_spa_levmarq()
 Cmrpt::gui::detail::TReturnAskUserOpenCamera
 Cmrpt::graphslam::CGraphSlamEngine< GRAPH_T >::TRGBDInfoFileParamsStruct responsible for keeping the parameters of the .info file in RGBD related datasets
 Cmrpt::hmtslam::CLocalMetricHypothesis::TRobotPosesPartitioningUsed by AA thread
 Cmrpt::nav::CAbstractNavigator::TRobotPoseVel
 Cmrpt::nav::TRobotShapeA 3D robot shape stored as a "sliced" stack of 2D polygons, used for CReactiveNavigationSystem3D Depending on each PTG, only the 2D polygon or the circular radius will be taken into account
 Cmrpt::vision::TROIA structure for storing a 3D ROI
 Cmrpt::hwdrivers::CRovio::TRovioState
 Ctrue_type
 Cmrpt::rtti::TRuntimeClassIdA structure that holds runtime class type information
 Cmrpt::containers::ts_map_entry< KEY, VALUE >
 Cmrpt::tfest::TSE2RobustParamsParameters for se2_l2_robust()
 Cmrpt::tfest::TSE2RobustResultOutput placeholder for se2_l2_robust()
 Cmrpt::tfest::TSE3RobustParamsParameters for se3_l2_robust()
 Cmrpt::tfest::TSE3RobustResultOutput placeholder for se3_l2_robust()
 Cmrpt::math::TSegment2D2D segment, consisting of two points
 Cmrpt::math::TSegment3D3D segment, consisting of two points
 CTSegmentWithLine
 Cmrpt::hwdrivers::TSensorClassIdA structure for runtime ID class type information in the context of hwdrivers::CGenericSensor
 Cmrpt::hwdrivers::CHokuyoURG::TSensorInfoUsed in CHokuyoURG::displayVersionInfo
 Cmrpt::nav::CAbstractPTGBasedReactive::TSentVelCmd
 Cmrpt::vision::detail::TSIFTDesc2KDTree_Adaptor< distance_t, element_t >
 Cmrpt::vision::detail::TSIFTDesc2KDTree_Adaptor< distance_t >
 Cmrpt::vision::TSIFTDescriptorsKDTreeIndex< distance_t, metric_t >A kd-tree builder for sets of features with SIFT descriptors
 Cmrpt::vision::CFeatureExtraction::TOptions::TSIFTOptionsSIFT Options
 Cmrpt::obs::CSinCosLookUpTableFor2DScans::TSinCosValuesA pair of vectors with the cos and sin values
 Cmrpt::obs::CObservationSkeleton::TSkeletonJointA generic joint for the skeleton observation
 Cmrpt::math::ModelSearch::TSpecies< TModelFit >
 Cmrpt::vision::CFeatureExtraction::TOptions::TSpinImagesOptionsSpinImages Options
 Cmrpt::slam::CMetricMapBuilderRBPF::TStatsThis structure will hold stats after each execution of processActionObservation
 Cmrpt::vision::TStereoCalibParamsInput parameters for mrpt::vision::checkerBoardStereoCalibration
 Cmrpt::vision::TStereoCalibResultsOutput results for mrpt::vision::checkerBoardStereoCalibration
 Cmrpt::obs::TStereoImageFeatures
 Cmrpt::vision::detail::TSURFDesc2KDTree_Adaptor< distance_t, element_t >
 Cmrpt::vision::detail::TSURFDesc2KDTree_Adaptor< distance_t >
 Cmrpt::vision::TSURFDescriptorsKDTreeIndex< distance_t, metric_t >A kd-tree builder for sets of features with SURF descriptors
 Cmrpt::vision::CFeatureExtraction::TOptions::TSURFOptionsSURF Options
 Cmrpt::obs::CObservationRFID::TTagReadingEach of the individual readings of a RFID tag
 CTTempIntersection
 Cmrpt::detectors::CFaceDetection::TTestsOptions
 CTThreadParam
 Cmrpt::apps::ICP_SLAM_App_Live::TThreadParams
 Cmrpt::system::TTimePartsThe parts of a date/time (it's like the standard 'tm' but with fractions of seconds)
 Cmrpt::opengl::TTriangleA triangle (float coordinates) with RGBA colors (u8) and UV (texture coordinates) for each vertex
 Cmrpt::opengl::CMesh::TTriangleVertexIndices
 Cmrpt::typemeta::TTypeName< T >A template to obtain the type of its argument as a string at compile time
 Cmrpt::typemeta::TTypeName< mrpt::math::CMatrixDynamic< T > >
 Cmrpt::typemeta::TTypeName< mrpt::math::CMatrixFixed< T, N, M > >
 Cmrpt::typemeta::TTypeName< mrpt::math::CVectorDynamic< T > >
 Cmrpt::typemeta::TTypeName< mrpt::math::CVectorFixed< T, N > >
 Cmrpt::typemeta::TTypeName< mrpt::math::CVectorFixedDouble< N > >
 Cmrpt::typemeta::TTypeName< mrpt::math::CVectorFixedFloat< N > >
 Cmrpt::typemeta::TTypeName< std::chrono::time_point< T > >
 Cmrpt::typemeta::TTypeName< std::pair< T1, T2 > >
 Cmrpt::typemeta::TTypeName< std::shared_ptr< T > >Specialization for shared_ptr<T>
 Cmrpt::maps::COccupancyGridMap2D::TUpdateCellsInfoChangeOnlyAn internal structure for storing data related to counting the new information apported by some observation
 Cmrpt::graphslam::apps::TUserOptionsChecker< GRAPH_t >Class containing the declarations of supplementary methods that can be used in application-related code
 Cmrpt::graphslam::apps::TUserOptionsChecker< GRAPH_T >
 Cmrpt::nav::CNavigatorManualSequence::TVelCmd
 Cmrpt::kinematics::CVehicleVelCmd::TVelCmdParamsParameters that may be used by cmdVel_limits() in any derived classes
 Cmrpt::obs::CObservationVelodyneScan::TVelodynePositionPacketPayload of one POSITION packet
 Cmrpt::obs::CObservationVelodyneScan::TVelodyneRawPacketOne unit of data from the scanner (the payload of one UDP DATA packet)
 Cmrpt::kinematics::CVehicleSimul_Holo::TVelRampCmd
 CTVertex
 Cmrpt::opengl::COctoMapVoxels::TVoxelThe info of each of the voxels
 Cmrpt::nav::TWaypointA single waypoint within TWaypointSequence
 Cmrpt::nav::TWaypointSequenceThe struct for requesting navigation requests for a sequence of waypoints
 Cmrpt::nav::TWaypointsRenderingParamsUsed in getAsOpenglVisualization()
 Cmrpt::nav::TWaypointStatusSequenceThe struct for querying the status of waypoints navigation
 Cmrpt::gui::WxSubsystem::TWxMainThreadData
 CTYPE_EDGES
 Cmrpt::uint_select_by_bytecount< num_bytes >Usage: uint_select_by_bytecount<N>::type var; allows defining var as a unsigned integer with, at least, N bytes
 Cmrpt::uint_select_by_bytecount< 1 >
 Cmrpt::uint_select_by_bytecount< 2 >
 Cmrpt::uint_select_by_bytecount< 3 >
 Cmrpt::uint_select_by_bytecount< 4 >
 Cmrpt::uint_select_by_bytecount< 8 >
 Cmrpt::obs::CObservation3DRangeScan::unproject_LUT_tLook-up-table struct for unprojectInto()
 Cmrpt::containers::UnspecializedBool
 Cmrpt::vision::pnp::upnp
 Cmrpt::obs::gnss::UTC_timeUTC (Coordinated Universal Time) time-stamp structure for GPS messages
 Cstd::vector< T >STL class
 Cmrpt::containers::vector_with_small_size_optimization< VAL, small_size, alignment >Container that transparently and dynamically switches between a std::array and std::vector
 Cmrpt::containers::vector_with_small_size_optimization< bitmask_t, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 Cmrpt::containers::vector_with_small_size_optimization< double, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 Cmrpt::containers::vector_with_small_size_optimization< KFTYPE, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 Cmrpt::containers::vector_with_small_size_optimization< kftype, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 Cmrpt::containers::vector_with_small_size_optimization< mrpt::math::TPoint3D_data< double >, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 Cmrpt::containers::vector_with_small_size_optimization< NUMTYPE, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 Cmrpt::containers::vector_with_small_size_optimization< T, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 Cmrpt::containers::vector_with_small_size_optimization< uint16_t, small_size, MRPT_MAX_STATIC_ALIGN_BYTES >
 CEigen::VectorBlock< VectorType, Size >
 Cmrpt::obs::VelodyneCalibrationVelodyne calibration data, for usage in mrpt::obs::CObservationVelodyneScan
 Cmrpt::opengl::TTriangle::Vertex
 Cmrpt::graphs::CDirectedTree< TYPE_EDGES >::VisitorVirtual base class for user-defined visitors
 Cmrpt::system::WorkerThreadsPoolA simple thread pool
 CwxApp
 CwxDialog
 CwxFrame
 CwxPanel
 Cmrpt::gui::WxSubsystemThis class implements the GUI thread required for the wxWidgets-based GUI
 CXPMColorMapData



Page generated by Doxygen 1.8.14 for MRPT 1.9.9 Git: c7a3bec24 Sun Mar 29 18:33:13 2020 +0200 at dom mar 29 18:50:38 CEST 2020