Main MRPT website > C++ reference for MRPT 1.5.3
Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 123456]
 Cmrpt::math::detail::AccessorIterator< A, T >Template class for matrix accessor's iterators
 CEigen::aligned_allocator< T >
 Cmrpt::aligned_containers< TYPE1, TYPE2 >Helper types for STL containers with Eigen memory allocators
 Cmrpt::aligned_containers< CPose2D >
 Cmrpt::aligned_containers< KFArray_OBS >
 Cmrpt::aligned_containers< mrpt::math::CMatrixFixedNumeric >
 Cmrpt::aligned_containers< mrpt::nav::CLogFileRecord::TInfoPerPTG >
 Cmrpt::aligned_containers< mrpt::obs::CObservation6DFeatures::TMeasurement >
 Cmrpt::aligned_containers< mrpt::opengl::COctreePointRenderer::TNode >
 Cmrpt::aligned_containers< mrpt::poses::CPose2D >
 Cmrpt::aligned_containers< mrpt::poses::CPose3D >
 Cmrpt::aligned_containers< mrpt::system::TTimeStamp, mrpt::maps::CPointCloudFilterByDistance::FrameInfo >
 Cmrpt::aligned_containers< mrpt::system::TTimeStamp, mrpt::math::CMatrixFixedNumeric >
 Cmrpt::aligned_containers< std::pair< KEY, VALUE > >
 Cmrpt::aligned_containers< std::pair< size_t, size_t > >
 Cmrpt::aligned_containers< std::string, mrpt::slam::CMetricMapBuilderICP::TDist >
 Cmrpt::aligned_containers< std::string, TF_TreeEdge >
 Cmrpt::aligned_containers< TGaussianMode >
 Cmrpt::aligned_containers< THypothesisID, mrpt::hmtslam::CLocalMetricHypothesis >
 Cmrpt::aligned_containers< TPairNodeIDs, edge_t >
 Cmrpt::aligned_containers< TPoseID, mrpt::poses::CPose3D >
 CTCLAP::ArgA virtual base class that defines the essential data for all arguments
 CSophus::details::ArgToStream< T >
 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
 Cexprtk::details::asn_addassignment
 Cexprtk::details::asn_assignment
 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 >
 Cexprtk::details::base_operation_t
 Cmrpt::utils::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::utils::bimap< mrpt::maps::CLandmark::TLandmarkID, unsigned int >
 Cbinary_function
 Cmrpt::utils::metaprogramming::BinaryMemberFunctionWrapper< T, U1, U2, V >This template encapsulates a binary member function and a single object into a function expecting the two parameters of the member function
 Cmrpt::system::BlockedRange
 Cexprtk::details::break_exception< T >
 Cexprtk::details::build_string
 Cmrpt::synch::CAbstractMutex
 Cmrpt::vision::CCamModel::CameraTempVariables< T >
 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::utils::CArray< T, N >A STL container (as wrapper) for arrays of constant size defined at compile time
 Cmrpt::utils::CArray< size_t, 2 >
 Cmrpt::utils::CArray< T, 0 >
 Cmrpt::graphs::CAStarAlgorithm< T >This class is intended to efficiently solve graph-search problems using heuristics to determine the best path
 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::synch::CAtomicCounterThis class acts exactly as an int (or long) variable, but with atomic increment and decrement operators
 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::utils::CCanvasThis virtual class defines the interface of any object accepting drawing primitives on it
 Cmrpt::utils::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::synch::CCriticalSectionLockerA class acquiring a CCriticalSection at its constructor, and releasing it at destructor
 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 >< Make available this typedef in this namespace too
 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::utils::CDynamicGrid< T >A 2D grid of dynamic size which stores any kind of data at each cell
 Cmrpt::utils::CDynamicGrid3D< T >A 3D rectangular grid of dynamic size which stores any kind of data at each voxel
 Cmrpt::utils::CDynamicGrid3D< TRandomFieldVoxel >
 Cmrpt::utils::CDynamicGrid< double >
 Cmrpt::utils::CDynamicGrid< int8_t >
 Cmrpt::utils::CDynamicGrid< mrpt::nav::CPTG_DiffDrive_CollisionGridBased::TCellForLambdaFunction >
 Cmrpt::utils::CDynamicGrid< TCollisionCell >
 Cmrpt::utils::CDynamicGrid< THeightGridmapCell >
 Cmrpt::utils::CDynamicGrid< TRandomFieldCell >
 Cmrpt::utils::CDynamicGrid< uint16_t >
 Cmrpt::utils::CDynamicGrid< uint8_t >
 Cmrpt::utils::CDynamicGrid< vector_int >
 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::vision::CFeatureExtractionThe central class from which images can be analyzed in search of different kinds of interest points and descriptors computed for them
 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
 CCGraphSlamHandler< GRAPH_T >Manage variables and methods related to applications executing graphSLAM using the mrpt-graphslam API
 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::hwdrivers::CImageGrabber_dc1394A class for grabing images from a IEEE1394 (Firewire) camera using the libdc1394-2 library
 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::utils::circular_buffer< T >A circular buffer of fixed size (defined at construction-time), implemented with a std::vector as the underlying storage
 Cmrpt::utils::circular_buffer< uint8_t >
 Cexprtk::details::cis_match
 Cmrpt::hwdrivers::CJoystickAccess to joysticks and gamepads (read buttons and position), and request number of joysticks in the system
 Cmrpt::utils::CLASSINITAuxiliary structure used for CObject-based RTTI
 Cmrpt::hwdrivers::CGenericSensor::CLASSINIT_GENERIC_SENSORAuxiliary structure used for CSerializable runtime class ID support
 Cexprtk::details::cleanup_branches
 Cmrpt::nav::ClearanceDiagramClearance information for one particular PTG and one set of obstacles
 Cmrpt::opengl::CLightEach of the possible lights of a 3D scene
 Cmrpt::utils::CListOfClassesA list (actually based on a std::set) of MRPT classes, capable of keeping any class registered by the mechanism of CSerializable classes
 Cmrpt::utils::CLoadableOptionsThis is a virtual base class for sets of options than can be loaded from and/or saved to configuration plain-text files
 Cstlplus::clone_copy< T >
 Cmrpt::hmtslam::CLSLAMAlgorithmBaseVirtual base for local SLAM methods, used in mrpt::slam::CHMTSLAM
 Cmrpt::utils::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::math::CMatrixTemplate< T >This template class provides the basic functionality for a general 2D any-size, resizable container of numerical or non-numerical elements
 Cmrpt::math::CMatrixTemplate< bool >
 Cmrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >
 Cmrpt::math::CMatrixTemplate< T *>
 CTCLAP::CmdLineInterfaceThe base class that manages the command line definition and passes along the parsing to the appropriate Arg classes
 CTCLAP::CmdLineOutputThe interface that any output object must implement
 Cmrpt::utils::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::CNTRIPClientA client for NTRIP (HTTP) sources of differential GPS corrections from internet servers, or Global navigation satellite system (GNSS) internet radio
 Cmrpt::utils::CObjectThe virtual base class of all MRPT classes with a unified RTTI system
 Cmrpt::detectors::CObjectDetection
 Cmrpt::utils::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
 Cmrpt::utils::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 >
 Cexprtk::details::numeric::details::complex_type_tag
 Cmrpt::pbmap::config_heuristicsA class used to define the heuristic parameters and thresholds used to match sets of planes
 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::pbmap::ConsistencyTest
 Cmrpt::obs::CRawlog::const_iteratorA normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence
 CSophus::Constants< Scalar >
 CSophus::Constants< float >
 CTCLAP::Constraint< T >The interface that defines the interaction between the Arg and Constraint
 Cconstraint_no_pdf_t
 Cexprtk::details::construct_branch_pair< T, D, B >
 Cexprtk::details::construct_branch_pair< T, D, true >
 Cstlplus::constructor_copy< T >
 Cmrpt::utils::ContainerReadOnlyProxyAccessor< STLCONTAINER >A generic proxy accessor template that only allows read-only access to the original binded STL container object
 Cmrpt::utils::ContainerReadOnlyProxyAccessor< std::vector< char > >
 Cmrpt::utils::ContainerReadOnlyProxyAccessor< std::vector< float > >
 Cmrpt::utils::ContainerReadOnlyProxyAccessor< std::vector< int32_t > >
 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::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_ZDA::content_t
 Cexprtk::details::continue_exception
 Cexprtk::symbol_table< T >::control_block
 Cexprtk::expression< T >::control_block
 Cexprtk::details::vec_data_store< T >::control_block
 Cmrpt::hwdrivers::COpenNI2GenericAn abstract class for accessing OpenNI2 compatible sensors
 Cmrpt::utils::copiable_NULL_ptr_basic< T >A wrapper class for pointers that, if copied with the "=" operator, should be set to NULL in the copy
 Cmrpt::utils::internal::CopyCloner< T >
 Cmrpt::utils::internal::CopyStatic< T >
 CCOutputLogger
 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 >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< CPose2D >
 Cmrpt::bayes::CParticleFilterData< CPose3D >
 Cmrpt::bayes::CParticleFilterData< CRBPFParticleData >
 Cmrpt::bayes::CParticleFilterData< TSimple3DPoint >
 Cmrpt::synch::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::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::utils::CProbabilityDensityFunction< TDATA, STATE_LEN >A generic template for probability density distributions (PDFs)
 Cmrpt::utils::CProbabilityDensityFunction< CPoint2D, 2 >
 Cmrpt::utils::CProbabilityDensityFunction< CPoint3D, 3 >
 Cmrpt::utils::CProbabilityDensityFunction< CPose2D, 3 >
 Cmrpt::utils::CProbabilityDensityFunction< CPose3D, 6 >
 Cmrpt::utils::CProbabilityDensityFunction< CPose3DQuat, 7 >
 Cmrpt::bayes::CProbabilityParticle< T >A template class for holding a the data and the weight of a particle
 Cmrpt::mrpt::utils::CProfilerProxy
 Cmrpt::utils::CProfilerProxy
 Cmrpt::hwdrivers::CPtuBaseThis class implements initialization and comunication methods to control a generic Pan and Tilt Unit, working in radians
 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::utils::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::utils::CReferencedMemBlockRepresents a memory block (via "void*") that can be shared between several objects through copy operator (=)
 Cmrpt::bayes::CRejectionSamplingCapable< TStateSpace >A base class for implementing rejection sampling in a generic state space
 Cmrpt::bayes::CRejectionSamplingCapable< mrpt::poses::CPose2D >
 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::math::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
 Ccs_dmperm_results
 Cexprtk::details::cs_match
 Ccs_numeric
 Ccs_sparse
 Ccs_symbolic
 Cmrpt::synch::CSemaphoreA semaphore for inter-thread synchronization
 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::vision::CStereoRectifyMapUse this class to rectify stereo images if the same distortion maps are reused over and over again
 Cmrpt::utils::CStreamThis base class is used to provide a unified interface to files,memory buffers,..Please see the derived classes
 Cmrpt::utils::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::utils::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::synch::CThreadSafeVariable< T >A template for created thread-safe variables with an internal critical section controlled each read or write
 Cmrpt::utils::CTimeLoggerEntryA safe way to call enter() and leave() of a mrpt::utils::CTimeLogger upon construction and destruction of this auxiliary object, making sure that leave() will be called upon exceptions, etc
 Cmrpt::hmtslam::CTopLCDetectorBaseThe virtual base class for Topological Loop-closure Detectors; used in HMT-SLAM
 Cmrpt::utils::CUncopiableThe base class of classes that cannot be copied: compile-time errors will be issued on any copy operation
 Cmrpt::vision::CUndistortMapUse this class to undistort monocular images if the same distortion map is used over and over again
 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 >
 Cexprtk::expression< T >::control_block::data_pack
 Cexprtk::parser< T >::dependent_entity_collector
 Cstd::deque< T >STL class
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ai_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ao_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_ang_encoder_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_count_edges_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_lin_encoder_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_period_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_pulse_width_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_co_pulses_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_di_t
 Cmrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_do_t
 Cexprtk::details::loop_unroll::details
 Cmrpt::utils::internal::dynamic_grid_txt_saver
 CEDGE_ANNOTATIONS
 Cmrpt::graphs::detail::edge_annotations_emptyAn empty structure
 CEigen::EigenBase< Derived >
 Cexprtk::details::numeric::details::epsilon_type< float >
 Cexprtk::details::numeric::details::epsilon_type< long double >
 Cmrpt::nav::CHolonomicFullEval::EvalOutput
 Cexprtk::details::function_N_node< T, IFunction, N >::evaluate_branches< T_, BranchCount >
 Cexprtk::details::function_N_node< T, IFunction, N >::evaluate_branches< T_, 1 >
 Cexprtk::details::function_N_node< T, IFunction, N >::evaluate_branches< T_, 2 >
 Cexprtk::details::function_N_node< T, IFunction, N >::evaluate_branches< T_, 3 >
 Cexprtk::details::function_N_node< T, IFunction, N >::evaluate_branches< T_, 4 >
 Cexprtk::details::function_N_node< T, IFunction, N >::evaluate_branches< T_, 5 >
 Cstd::exceptionSTL class
 Cexprtk::expression< T >
 Cexprtk::parser< T >::expression_generator< Type >
 Cexprtk::parser< T >::expression_generator< T >
 Cexprtk::expression_helper< T >
 Cexprtk::details::expression_node< T >
 Cmrpt::graphs::ScalarFactorGraph::FactorBase
 Cexprtk::details::numeric::fast_exp< T, N >
 Cexprtk::details::numeric::fast_exp< T, 0 >
 Cexprtk::details::numeric::fast_exp< T, 1 >
 Cexprtk::details::numeric::fast_exp< T, 10 >
 Cexprtk::details::numeric::fast_exp< T, 2 >
 Cexprtk::details::numeric::fast_exp< T, 3 >
 Cexprtk::details::numeric::fast_exp< T, 4 >
 Cexprtk::details::numeric::fast_exp< T, 5 >
 Cexprtk::details::numeric::fast_exp< T, 6 >
 Cexprtk::details::numeric::fast_exp< T, 7 >
 Cexprtk::details::numeric::fast_exp< T, 8 >
 Cexprtk::details::numeric::fast_exp< T, 9 >
 Cexprtk::rtl::io::file::details::file_descriptor
 Cmrpt::maps::CPointCloudFilterByDistance::FrameInfo
 Cmrpt::pbmap::frameRGBDandPose
 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"
 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
 Cexprtk::function_compositor< T >::function
 Cexprtk::function_compositor< T >
 Cexprtk::function_traits
 Cexprtk::details::functor_t< T >
 Cexprtk::lexer::generator
 Cmrpt::utils::internal::generic_copier_ptr< T, Copier >
 Cmrpt::utils::internal::generic_copier_ptr< T, internal::CopyCloner< T > >
 Cmrpt::utils::internal::generic_copier_ptr< T, internal::CopyStatic< T > >
 Cmrpt::math::detail::getVicinity< MatrixType, T, ReturnType, D >This huge template encapsulates a function to get the vicinity of an element, with maximum genericity
 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
 Cexprtk::lexer::helper::helper_assembly
 Cexprtk::lexer::helper_interface
 Cmrpt::utils::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::utils::ignored_copy_ptr< mrpt::maps::COctoMapBase >
 Cexprtk::details::ilesscompare
 Cimaxdiv_t
 Cnanoflann::IndexDist_SorterOperator "<" for std::sort()
 Cmrpt::utils::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::utils::int_select_by_bytecount< 1 >
 Cmrpt::utils::int_select_by_bytecount< 2 >
 Cmrpt::utils::int_select_by_bytecount< 3 >
 Cmrpt::utils::int_select_by_bytecount< 4 >
 Cmrpt::utils::int_select_by_bytecount< 8 >
 Cexprtk::details::numeric::details::int_type_tag
 Cmrpt::obs::CObservationGPS::internal_msg_test_proxy< MSG_TYPE >Proxy class for type-based testing existence of data inside CObservationGPS::messages
 Cmrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::NMEA_GGA >
 Cmrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::NMEA_RMC >
 Cmrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::TOPCON_PZS >
 Cmrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::TOPCON_SATS >
 Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Interval
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, ParamCount >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 1 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 10 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 11 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 12 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 13 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 14 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 15 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 16 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 17 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 18 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 19 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 2 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 20 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 3 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 4 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 5 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 6 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 7 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 8 >
 Cexprtk::details::function_N_node< T, IFunction, N >::invoke< T_, 9 >
 Cexprtk::details::is_const< T >
 Cexprtk::details::is_const< const T >
 Cexprtk::details::is_const_ref< T >
 Cexprtk::details::is_const_ref< const T & >
 Cexprtk::details::is_ref< T >
 Cexprtk::details::is_ref< const T & >
 Cexprtk::details::is_ref< T & >
 CSophus::details::IsStreamable< T >
 Citerator
 Cmrpt::obs::CRawlog::iteratorA normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence
 Cexprtk::details::ivariable< T >
 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)
 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
 Cexprtk::rtl::vecops::helper::load_vector_range< T >
 Cmrpt::maps::detail::loadFromRangeImpl< Derived >
 Cmrpt::maps::detail::logoddscell_traits< TCELL >
 Cmrpt::maps::detail::logoddscell_traits< cell_t >
 Cmrpt::maps::detail::logoddscell_traits< cellType >
 Cmrpt::maps::detail::logoddscell_traits< int16_t >
 Cmrpt::maps::detail::logoddscell_traits< int8_t >
 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
 Cstd::map< K, T >STL class
 Cmrpt::utils::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::utils::map_as_vector< KEY, VALUE >
 Cmrpt::utils::map_as_vector< size_t, size_t >
 Cmrpt::utils::map_traits_map_as_vectorTraits for using a mrpt::utils::map_as_vector<> (dense, fastest representation)
 Cmrpt::utils::map_traits_stdmapTraits for using a std::map<> (sparse representation)
 Cinternal_mrpt::MatOrVecResizer< R, C >
 Cinternal_mrpt::MatOrVecResizer< 1, 1 >
 Cinternal_mrpt::MatOrVecResizer< 1, C >
 Cinternal_mrpt::MatOrVecResizer< R, 1 >
 CMatrix
 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::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 >
 Cmrpt::utils::metaprogramming::MemberFunctionWrapper< T, V >This template encapsulates a member function without arguments and a single object into a function
 Cmrpt::utils::metaprogramming::MemoryBypasserIterator< T, U >This class bypasses pointer access in iterators to pointers, thus allowing the use of algorithms that expect an object of class T with containers of T*
 CSophus::details::Metric< Scalar >
 CSophus::details::Metric< Matrix< Scalar, M, N > >
 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
 Cexprtk::details::T0oT1oT2process< T >::mode0
 Cexprtk::details::T0oT1oT20T3process< T >::mode0
 Cexprtk::details::T0oT1oT2process< T >::mode1
 Cexprtk::details::T0oT1oT20T3process< T >::mode1
 Cexprtk::details::T0oT1oT20T3process< T >::mode2
 Cexprtk::details::T0oT1oT20T3process< T >::mode3
 Cexprtk::details::T0oT1oT20T3process< T >::mode4
 Cmrpt::math::ModelSearchModel search implementations: RANSAC and genetic algorithm
 Cmrpt::utils::mrptEventThe basic event type for the observer-observable pattern in MRPT
 Cmrpt::synch::MT_bufferThis class is a bulk sequence of bytes with MultiThread (MT)-safe read and write operations
 Cmrpt::nav::CAbstractHolonomicReactiveMethod::NavInputInput parameters for CAbstractHolonomicReactiveMethod::navigate()
 Cmrpt::nav::CAbstractHolonomicReactiveMethod::NavOutputOutput for CAbstractHolonomicReactiveMethod::navigate()
 Cstlplus::no_copy< T >
 Cnanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Node
 Cexprtk::details::node_allocator
 CNODE_ANNOTATIONS
 CNODE_TYPE_DATA
 Cexprtk::details::nodetype_T0oT1< T, T0, T1 >
 Cexprtk::details::nodetype_T0oT1oT2
 Cexprtk::details::nodetype_T0oT1oT2oT3
 Cmrpt::utils::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::utils::non_copiable_ptr_basic< void >
 Cmrpt::utils::metaprogramming::NonConstBind1st< Op >Equivalent of std::bind1st for functions with non-const arguments
 Cmrpt::utils::metaprogramming::NonConstBind2nd< Op >Equivalent of std::bind2nd for functions with non-const arguments
 Cmrpt::hwdrivers::CNTRIPClient::NTRIPArgsThe arguments for connecting to a NTRIP stream, used in CNTRIPClient::open
 Cexprtk::details::null_igenfunc< T >
 CSophus::nullopt_t
 Cexprtk::details::numeric::details::number_type< T >
 Cexprtk::details::numeric::numeric_info< Type >
 Cexprtk::details::numeric::numeric_info< double >
 Cexprtk::details::numeric::numeric_info< float >
 Cexprtk::details::numeric::numeric_info< int >
 Cexprtk::details::numeric::numeric_info< long double >
 Cmrpt::obs::gnss::nv_oem6_header_tNovatel OEM6 regular header structure
 Cmrpt::obs::gnss::nv_oem6_short_header_tNovatel OEM6 short header structure
 Cmrpt::utils::metaprogramming::ObjectClearAn object for clearing an object (invokes its method "->clear()") given a pointer or smart-pointer, intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectClear2An object for clearing an object (invokes its method ".clear()") given a pointer or smart-pointer, intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectClearSecondAn object for clearing an object->second (invokes its method "clear()") given a pointer or smart-pointer, intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectClearUnique< T >An object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectConvert< TARGET_TYPE >An object for transforming between types/classes, intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectDeleteAn object for deleting pointers (intended for STL algorithms)
 Cmrpt::utils::metaprogramming::ObjectMakeUniqueAn object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectPairMakeUniqueAn object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectReadFromStreamAn object for reading objects from a stream, intended for being used in STL algorithms
 Cmrpt::utils::metaprogramming::ObjectReadFromStreamToPtrs< ptr_t >
 Cmrpt::utils::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
 Copr_base
 CSophus::optional< T >
 CTCLAP::OptionalUnlabeledTracker< DUMMY >
 Cmrpt::vision::pnp::p3p
 Cexprtk::rtl::io::package< T >
 Cexprtk::rtl::io::file::package< T >
 Cexprtk::rtl::vecops::package< T >
 Cexprtk::details::param_to_str< State >
 Cexprtk::details::param_to_str< 0 >
 Cexprtk::type_store< T >::parameter_list
 Cexprtk::parser< T >::parse_special_function_impl< Type, NumberOfParameters >
 Cexprtk::lexer::parser_helper
 Cexprtk::parser< T >::parser_state
 Cmrpt::pbmap::PbMapLocaliser
 Cmrpt::pbmap::PbMapMaker
 Cmrpt::obs::VelodyneCalibration::PerLaserCalib
 Cmrpt::utils::pimpl< T >Pointer to IMPLementation auxiliary structure to make raw pointers movable, copiable and automatically deleted
 Cmrpt::pbmap::PlaneInferredInfoA class used to infer some semantic meaning to the planes of a PbMap
 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::utils::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::utils::PLY_ImporterA virtual base class that implements the capability of importing 3D point clouds and faces from a file in the Stanford PLY format
 Cmrpt::mrpt::utils::PointCloudAdapter< POINTCLOUD >An adapter to different kinds of point cloud object
 Cmrpt::utils::PointCloudAdapter< POINTCLOUD >An adapter to different kinds of point cloud object
 Cmrpt::utils::PointCloudAdapter< mrpt::maps::CColouredPointsMap >Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CColouredPointsMap>
 Cmrpt::utils::PointCloudAdapter< mrpt::opengl::CPointCloudColoured >Specialization mrpt::utils::PointCloudAdapter<mrpt::opengl::CPointCloudColoured>
 Cmrpt::utils::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGB > >Specialization mrpt::utils::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZRGB> > for an XYZ point cloud with RGB
 Cmrpt::utils::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGBA > >Specialization mrpt::utils::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZRGBA> > for an XYZ point cloud with RGB
 Cmrpt::mrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >A helper base class for those PointCloudAdapter<> which do not handle RGB data; it declares needed interface methods which fall back to XYZ-only methods
 Cmrpt::utils::detail::PointCloudAdapterHelperNoRGB< POINTMAPTYPE, coords_t >A helper base class for those PointCloudAdapter<> which do not handle RGB data; it declares needed interface methods which fall back to XYZ-only methods
 Cmrpt::mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::maps::CPointsMap, float >
 Cmrpt::mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::maps::CSimplePointsMap, float >
 Cmrpt::mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::maps::CWeightedPointsMap, float >
 Cmrpt::mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::obs::CObservation3DRangeScan, float >
 Cmrpt::mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::opengl::CPointCloud, float >
 Cmrpt::mrpt::utils::detail::PointCloudAdapterHelperNoRGB< pcl::PointCloud< pcl::PointXYZ >, float >
 Cmrpt::maps::detail::pointmap_traits< Derived >
 Cexprtk::polynomial< T, N >::poly_impl< Type, NumberOfCoefficients >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 1 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 10 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 11 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 12 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 2 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 3 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 4 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 5 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 6 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 7 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 8 >
 Cexprtk::polynomial< T, N >::poly_impl< Type, 9 >
 Cmrpt::utils::poly_ptr_ptr< T >Wrapper to a stlplus clone smart pointer to polymorphic classes, capable of handling copy operator, etc
 Cmrpt::utils::poly_ptr_ptr< CActionPtr >
 Cmrpt::utils::poly_ptr_ptr< mrpt::maps::CMetricMapPtr >
 Cmrpt::utils::poly_ptr_ptr< mrpt::poses::CPosePDFPtr >
 Cmrpt::utils::poly_ptr_ptr< mrpt::poses::CPosePDFSOGPtr >
 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
 CSophus::details::Pretty< Scalar >
 CSophus::details::Pretty< Eigen::Matrix< Scalar, M, N > >
 Cexprtk::rtl::io::details::print_impl< T >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< SELECTED_CLASS_PTR, CONTAINER >Takes a const ref of a STL non-associative container of smart pointers at construction and exposes an interface mildly similar to that of another STL container containing only those elements in the original container that can be dynamic_casted to SELECTED_CLASS_PTR
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CColouredOctoMapPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CGasConcentrationGridMap2DPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CHeightGridMap2D_MRFPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CHeightGridMap2DPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::COccupancyGridMap2DPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::COctoMapPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CReflectivityGridMap2DPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CSimplePointsMapPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CWirelessPowerGridMap2DPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< SELECTED_CLASS_PTR, CONTAINER >A proxy like ProxyFilterContainerByClass, but it directly appears as if it was a single smart pointer (empty if no matching object is found in the container)
 Cmrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CBeaconMapPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CColouredPointsMapPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CLandmarksMapPtr, TListMaps >
 Cmrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CWeightedPointsMapPtr, TListMaps >
 Cmrpt::nav::CAbstractPTGBasedReactive::PTGTarget
 Cexprtk::symbol_table< T >::type_store< Type, RawType >::ptr_match< TType, TRawType, PtrType >
 Cexprtk::symbol_table< T >::type_store< Type, RawType >::ptr_match< TType, TRawType, variable_node_t * >
 Cnanoflann::RadiusResultSet< DistanceType, IndexType >A result-set class used when performing a radius based search
 Cexprtk::details::range_data_type< T >
 Cexprtk::details::range_interface< T >
 Cexprtk::details::range_pack< T >
 Cmrpt::obs::CObservationVelodyneScan::raw_block_tRaw Velodyne data block
 Cmrpt::opengl::CAngularObservationMesh::TDoubleRange::rdUnion type with the actual data
 Cexprtk::details::numeric::details::real_type_tag
 Cexprtk::results_context< T >
 Cexprtk::details::return_exception
 Cmrpt::math::detail::ReverseAccessorIterator< A, T >Template class for matrix accessor's iterators
 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
 CSophus::RxSO3Base< Derived >
 CSophus::RxSO3Base< Map< Sophus::RxSO3< Scalar_ > const, Options > >
 CSophus::RxSO3Base< Map< Sophus::RxSO3< Scalar_ >, Options > >
 CSophus::RxSO3Base< RxSO3< Scalar, Options > >
 CSophus::RxSO3Base< RxSO3< Scalar_, Options > >
 Cmrpt::utils::safe_ptr_basic< T >A wrapper class for pointers that can be safely copied with "=" operator without problems
 Cmrpt::utils::safe_ptr_basic< mrpt::hmtslam::CHierarchicalMHMap >
 Cmrpt::utils::safe_ptr_basic< mrpt::hmtslam::CHMTSLAM >
 Cmrpt::utils::safe_ptr_basic< mrpt::opengl::COpenGLScene >
 Cexprtk::type_store< T >::scalar_view
 Cexprtk::parser< T >::scope_element
 Cexprtk::parser< T >::scope_element_manager
 Cexprtk::parser< T >::scope_handler
 Cexprtk::function_compositor< T >::scoped_bft< BaseFuncType >
 Cexprtk::parser< T >::scoped_bool_negator
 Cexprtk::parser< T >::scoped_bool_or_restorer
 Cexprtk::parser< T >::scoped_delete< Type, N >
 Cexprtk::parser< T >::scoped_deq_delete< Type >
 Cexprtk::parser< T >::scoped_vec_delete< Type >
 CSophus::SE2Base< Derived >
 CSophus::SE2Base< Map< Sophus::SE2< Scalar_ > const, Options > >
 CSophus::SE2Base< Map< Sophus::SE2< Scalar_ >, Options > >
 CSophus::SE2Base< SE2< Scalar_, Options > >
 CSophus::SE3Base< Derived >
 CSophus::SE3Base< Map< Sophus::SE3< Scalar_ > const, Options > >
 CSophus::SE3Base< Map< Sophus::SE3< Scalar_ >, Options > >
 CSophus::SE3Base< SE3< Scalar_, Options > >
 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
 Cmrpt::poses::SE_traits< 2 >Specialization of SE for 2D poses
 Cmrpt::poses::SE_traits< 3 >Specialization of SE for 3D poses
 Cnanoflann::SearchParamsSearch options for KDTreeSingleIndexAdaptor::findNeighbors()
 Cmrpt::pbmap::Segment
 Cmrpt::pbmap::SemanticClustering
 Cstd::set< K >STL class
 Cexprtk::parser< T >::settings_store
 CSophus::details::SetToZero< Scalar >
 CSophus::details::SetToZero< Matrix< Scalar, M, N > >
 Cexprtk::details::sf_base< T >
 CSophus::Sim3Base< Derived >
 CSophus::Sim3Base< Map< Sophus::Sim3< Scalar_ > const, Options > >
 CSophus::Sim3Base< Map< Sophus::Sim3< Scalar_ >, Options > >
 CSophus::Sim3Base< Sim3< Scalar_, Options > >
 Cstlplus::smart_ptr_base< T, C, COUNTER >
 Cstlplus::smart_ptr_base< CObject, clone_copy< CObject >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_base< ConnectivityDescriptor, constructor_copy< ConnectivityDescriptor >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_base< CPointCloudFilterBase, constructor_copy< CPointCloudFilterBase >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_base< mrpt::hwdrivers::COpenNI2Generic::CDevice, constructor_copy< mrpt::hwdrivers::COpenNI2Generic::CDevice >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_base< mrpt::opengl::C3DSScene::TImpl3DS, constructor_copy< mrpt::opengl::C3DSScene::TImpl3DS >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_base< mrpt::opengl::CAssimpModel::TImplAssimp, constructor_copy< mrpt::opengl::CAssimpModel::TImplAssimp >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_base< std::vector< char >, constructor_copy< std::vector< char > >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_base< T, clone_copy< T >, COUNTER >
 Cstlplus::smart_ptr_base< T, constructor_copy< T >, COUNTER >
 Cstlplus::smart_ptr_base< T, no_copy< T >, COUNTER >
 Cstlplus::smart_ptr_base< TPixelLabelInfoBase, constructor_copy< TPixelLabelInfoBase >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< T, COUNTER >
 Cstlplus::smart_ptr_holder< CObject, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< ConnectivityDescriptor, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< CPointCloudFilterBase, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< mrpt::hwdrivers::COpenNI2Generic::CDevice, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< mrpt::opengl::C3DSScene::TImpl3DS, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< mrpt::opengl::CAssimpModel::TImplAssimp, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< std::vector< char >, mrpt::synch::CAtomicCounter >
 Cstlplus::smart_ptr_holder< TPixelLabelInfoBase, mrpt::synch::CAtomicCounter >
 CSophus::SO2Base< Derived >
 CSophus::SO2Base< Map< Sophus::SO2< Scalar_ > const, Options > >
 CSophus::SO2Base< Map< Sophus::SO2< Scalar_ >, Options > >
 CSophus::SO2Base< SO2< Scalar, Options > >
 CSophus::SO2Base< SO2< Scalar_, Options > >
 CSophus::SO3Base< Derived >
 CSophus::SO3Base< Map< Sophus::SO3< Scalar_ > const, Options > >
 CSophus::SO3Base< Map< Sophus::SO3< Scalar_ >, Options > >
 CSophus::SO3Base< SO3< Scalar, Options > >
 CSophus::SO3Base< SO3< Scalar_, Options > >
 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
 Cmrpt::system::Split
 CSophus::details::SquaredNorm< Scalar >
 CSophus::details::SquaredNorm< Matrix< Scalar, N, 1 > >
 Cexprtk::symbol_table< T >::control_block::st_data
 Cexprtk::parser< T >::state_t
 Cstreambuf
 Cexprtk::details::string_base_node< T >
 Cmrpt::pbmap::Subgraph
 Cmrpt::pbmap::SubgraphMatcher
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes::switch_1
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes::switch_2
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes::switch_3
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes::switch_4
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes::switch_5
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes::switch_6
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes::switch_7
 Cexprtk::parser< T >::expression_generator< Type >::switch_nodes
 Cexprtk::symbol_table< T >
 Cexprtk::parser< T >::symtab_store
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_binary_ext_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_boc_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_bov_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_cob_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_coboc_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_cocob_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_cocov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_cocov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_cov_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covoc_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covoc_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covocov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covocov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covocov_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covocov_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covocov_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovoc_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovoc_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovoc_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovoc_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovoc_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovov_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovov_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_covovov_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_sf3ext_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_sf4ext_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vob_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_voc_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vococ_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vococ_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vococov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vococov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vococov_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vococov_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vococov_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovoc_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovoc_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovoc_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovoc_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovoc_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovov_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovov_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vocovov_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vov_expression
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovoc_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovoc_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovocov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovocov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovocov_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovocov_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovocov_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovoc_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovoc_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovoc_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovoc_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovoc_expression4
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovov_expression0
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovov_expression1
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovov_expression2
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovov_expression3
 Cexprtk::parser< T >::expression_generator< Type >::synthesize_vovovov_expression4
 Cexprtk::details::T0oT1_define< T, T0, T1 >
 Cexprtk::details::T0oT1oT20T3process< T >
 Cexprtk::details::T0oT1oT2_define< T, T0, T1, T2 >
 Cexprtk::details::T0oT1oT2oT3_define< T, T0, T1, T2, T3 >
 Cexprtk::details::T0oT1oT2process< T >
 Cmrpt::obs::T2DScanPropertiesAuxiliary struct that holds all the relevant geometry information about a 2D scan
 Cmrpt::obs::T3DPointsProjectionParamsUsed in CObservation3DRangeScan::project3DPointsFromDepthImageInto()
 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::poses::detail::T3DTypeHelper< CPose3DRotVec >
 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::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::obs::CObservation3DRangeScan::TCached3DProjTablesLook-up-table struct for project3DPointsFromDepthImageInto()
 Cmrpt::utils::CTimeLogger::TCallDataData of all the calls:
 Cmrpt::system::TCallStackBackTraceSee: getCallStackBackTrace()
 Cmrpt::system::TCallStackEntryUsed in getCallStackBackTrace()
 Cmrpt::utils::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::utils::TColorA RGB color - 8bit
 Cmrpt::utils::TColorfA RGB color - floats in the range [0,1]
 Cmrpt::utils::TColorManagerManage R, G, B color triads and ask class instance of the next unique RGB combination
 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
 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
 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::utils::TEnumType< ENUMTYPE >A helper class that can convert an enum value into its textual representation, and viceversa
 Cmrpt::utils::TEnumTypeFiller< ENUMTYPE >Only specializations of this class are defined for each enum type of interest
 Cmrpt::utils::TEnumTypeFiller< bayes::TKFMethod >
 Cmrpt::utils::TEnumTypeFiller< hwdrivers::CGPSInterface::PARSERS >
 Cmrpt::utils::TEnumTypeFiller< hwdrivers::CKinect::TVideoChannel >
 Cmrpt::utils::TEnumTypeFiller< hwdrivers::CVelodyneScanner::model_t >
 Cmrpt::utils::TEnumTypeFiller< hwdrivers::CVelodyneScanner::return_type_t >
 Cmrpt::utils::TEnumTypeFiller< maps::CHeightGridMap2D::TMapRepresentation >
 Cmrpt::utils::TEnumTypeFiller< maps::CRandomFieldGridMap2D::TMapRepresentation >
 Cmrpt::utils::TEnumTypeFiller< mrpt::nav::CAbstractNavigator::TState >
 Cmrpt::utils::TEnumTypeFiller< mrpt::obs::CObservation3DRangeScan::TIntensityChannelID >
 Cmrpt::utils::TEnumTypeFiller< mrpt::poses::TInterpolatorMethod >
 Cmrpt::utils::TEnumTypeFiller< nav::CHolonomicND::TSituations >
 Cmrpt::utils::TEnumTypeFiller< nav::THolonomicMethod >
 Cmrpt::utils::TEnumTypeFiller< slam::CGridMapAligner::TAlignerMethod >
 Cmrpt::utils::TEnumTypeFiller< slam::TDataAssociationMethod >
 Cmrpt::utils::TEnumTypeFiller< slam::TDataAssociationMetric >
 Cmrpt::utils::TEnumTypeFiller< slam::TICPAlgorithm >
 Cmrpt::utils::TEnumTypeFiller< slam::TICPCovarianceMethod >
 Cmrpt::obs::CObservation2DRangeScanWithUncertainty::TEvalParams
 Cmrpt::maps::CPointCloudFilterBase::TExtraFilterParams
 Cmrpt::vision::CGenericFeatureTracker::TExtraOutputInfo
 Cmrpt::poses::FrameTransformer< DIM >::TF_TreeEdge
 Cmrpt::bayes::CParticleFilterCapable::TFastDrawAuxVarsAuxiliary vectors, see CParticleFilterCapable::prepareFastDrawSample for more information
 Cmrpt::vision::CFeatureExtraction::TOptions::TFASTOptionsFAST and FASTER 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
 Cmrpt::utils::internal::TFreeFnDataForZMQ
 Cmrpt::hwdrivers::TFTDIDeviceA list of FTDI devices and their descriptors
 Cmrpt::maps::CLandmarksMap::TFuseOptionsWith this struct options are provided to the fusion process
 Cmrpt::nav::CHolonomicND::TGapThe structure used to store a detected gap in obstacles
 Cmrpt::maps::CGasConcentrationGridMap2D::TGaussianCell
 Cmrpt::poses::CPosePDFSOG::TGaussianModeThe struct for each mode:
 Cmrpt::poses::CPose3DPDFSOG::TGaussianModeThe struct for each mode:
 Cmrpt::poses::CPointPDFSOG::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::system::detail::ThreadCreateFunctor< T >
 Cmrpt::system::detail::ThreadCreateFunctor< void * >
 Cmrpt::system::detail::ThreadCreateFunctorNoParams
 Cmrpt::system::detail::ThreadCreateObjectFunctor< CLASS, PARAM >
 Cmrpt::system::detail::ThreadCreateObjectFunctorNoParams< CLASS >
 Cmrpt::graphs::detail::THypothesis< GRAPH_T >An edge hypothesis between two nodeIDs
 Cexprtk::symbol_table< T >::type_store< Type, RawType >::tie_array
 Cexprtk::symbol_table< T >::type_store< Type, RawType >::tie_stddeq
 Cexprtk::symbol_table< T >::type_store< Type, RawType >::tie_stdvec
 Cexprtk::symbol_table< T >::type_store< Type, RawType >::tie_vecview
 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
 Cexprtk::timer
 Cmrpt::opengl::C3DSScene::TImpl3DSA container for automatic deletion of lib3ds's scene when the last reference of the smart_ptr's is destroyed
 Cmrpt::opengl::CAssimpModel::TImplAssimpA container for automatic deletion of lib3ds's 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::CAssimpModel::TInfoPerTexture
 Cmrpt::opengl::COctoMapVoxels::TInfoPerVoxelSet
 CTInsertionOptionsCommon
 Cmrpt::maps::CRandomFieldGridMap2D::TInsertionOptionsCommonParameters common to any derived class
 Cmrpt::maps::CLandmarksMap::TInsertionResultsThis struct stores extra results from invoking insertObservation
 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::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::opengl::COpenGLViewport::TLastProjectiveMatrixInfo
 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::vision::CFeatureExtraction::TOptions::TLogPolarImagesOptionsLogPolarImagesOptions Options
 Cmrpt::maps::TMatchingExtraResultsAdditional results from the determination of matchings between point clouds, etc., apart from the pairings themselves
 Cmrpt::utils::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::CObservationBearingRange::TMeasurementEach one of the measurements:
 Cmrpt::detectors::CFaceDetection::TMeasurement
 Cmrpt::obs::CObservation6DFeatures::TMeasurementEach one of the measurements
 Cmrpt::obs::CObservationBeaconRanges::TMeasurementEach one of the measurements
 Cmrpt::obs::CObservationRange::TMeasurement
 Cmrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromAAMessage definition:
 Cmrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromTBIMessage definition:
 Cmrpt::hmtslam::CHMTSLAM::TMessageLSLAMtoTBIMessage definition:
 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::CActionRobotMovement2D::TMotionModelOptionsThe parameter to be passed to "computeFromOdometry"
 Cmrpt::obs::CActionRobotMovement3D::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::random::CRandomGenerator::TMT19937_dataData used internally by the MT19937 PRNG algorithm
 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::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
 Cmrpt::obs::CObservationGasSensors::TObservationENoseThe structure for each e-nose
 Cexprtk::lexer::token
 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::hwdrivers::CRovio::TOptions
 Cmrpt::slam::CMetricMapBuilder::TOptionsOptions for the algorithm
 Cmrpt::detectors::CCascadeClassifierDetection::TOptions
 Cmrpt::obs::CActionRobotMovement3D::TMotionModelOptions::TOptions_6DOFModel
 Cmrpt::obs::CActionRobotMovement2D::TMotionModelOptions::TOptions_GaussianModelOptions for the gaussian model, which generates a CPosePDFGaussian object in poseChange See docs in : http://www.mrpt.org/tutorials/programming/odometry-and-motion-models/probabilistic_motion_models/
 Cmrpt::obs::CActionRobotMovement2D::TMotionModelOptions::TOptions_ThrunModelOptions for the Thrun's model, which generates a CPosePDFParticles object in poseChange See docs in : http://www.mrpt.org/tutorials/programming/odometry-and-motion-models/probabilistic_motion_models/
 Cmrpt::vision::CFeatureExtraction::TOptions::TORBOptionsORB Options
 Cmrpt::slam::CGridMapAligner::TReturnInfo::TPairPlusDistance
 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::nav::CAbstractNavigator::TPendingEvent
 Cmrpt::utils::TPixelCoordA pair (x,y) of pixel coordinates (integer resolution)
 Cmrpt::utils::TPixelCoordfA pair (x,y) of pixel coordinates (subpixel resolution)
 Cmrpt::obs::CObservation3DRangeScan::TPixelLabelInfoBaseVirtual interface to all pixel-label 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::TPoint2DLightweight 2D point
 Cmrpt::math::TPoint3DLightweight 3D point
 Cmrpt::math::TPoint3DfLightweight 3D point (float version)
 Cmrpt::obs::CObservationVelodyneScan::TPointCloudSee point_cloud and scan_packets
 Cmrpt::opengl::CPointCloudColoured::TPointColour
 Cmrpt::maps::CHeightGridMap2D_Base::TPointInsertParamsExtra params for insertIndividualPoint()
 Cmrpt::math::TPointXYZfIu8XYZ point (float) + Intensity(u8)
 Cmrpt::math::TPointXYZfRGBu8XYZ point (float) + RGB(u8)
 Cmrpt::math::TPointXYZIu8XYZ point (double) + Intensity(u8)
 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::math::TPose2DLightweight 2D pose
 Cmrpt::math::TPose3DLightweight 3D pose (three spatial coordinates, plus three angular coordinates)
 Cmrpt::math::TPose3DQuatLightweight 3D pose (three spatial coordinates, plus a quaternion )
 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::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
 Cmrpt::utils::TPropertyValueIDTripletInternal triplet for each property in utils::CMHPropertiesValuesList
 Cmrpt::utils::CPropertiesValuesList::TPropertyValuePair
 Cmrpt::nav::CReactiveNavigationSystem3D::TPTGmultilevelA set of PTGs of the same type, one per "height level"
 Cmrpt::opengl::CGeneralizedCylinder::TQuadrilateralAuxiliary struct holding any quadrilateral, represented by foour points
 Cnanoflann::metric_L2::traits< T, DataSource >
 CSophus::interp_details::Traits< Group >
 Cnanoflann::metric_L2_Simple::traits< T, DataSource >
 Cnanoflann::metric_L1::traits< T, DataSource >
 Ctraits
 CSophus::interp_details::Traits< RxSO3< Scalar > >
 CSophus::interp_details::Traits< SE2< Scalar > >
 CSophus::interp_details::Traits< SE3< Scalar > >
 CSophus::interp_details::Traits< Sim3< Scalar > >
 CSophus::interp_details::Traits< SO2< Scalar > >
 CSophus::interp_details::Traits< SO3< Scalar > >
 CEigen::internal::traits< Sophus::RxSO3< Scalar_, Options > >
 CEigen::internal::traits< Sophus::SE2< Scalar_, Options > >
 CEigen::internal::traits< Sophus::SE3< Scalar_, Options > >
 CEigen::internal::traits< Sophus::Sim3< Scalar_, Options > >
 CEigen::internal::traits< Sophus::SO2< Scalar_, Options > >
 CEigen::internal::traits< Sophus::SO3< Scalar_, Options > >
 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::project3DPointsFromDepthImageInto()
 Cmrpt::obs::TRangeImageFilterParamsUsed in CObservation3DRangeScan::project3DPointsFromDepthImageInto()
 CSophus::details::Transpose< Scalar >
 CSophus::details::Transpose< Matrix< Scalar, M, N > >
 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::opengl::gl_utils::TRenderInfoInformation about the rendering process being issued
 Cmrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TRenderingOptionsOptions for the conversion of a mrpt::maps::COctoMap into a mrpt::opengl::COctoMapVoxels
 Cmrpt::nav::PlannerTPS_VirtualBase::TRenderPlannedPathOptionsOptions for renderMoveTree()
 Cmrpt::opengl::COctreePointRenderer< Derived >::TRenderQueueElement
 Cmrpt::gui::WxSubsystem::TRequestToWxMainThreadThe data structure for each inter-thread request:
 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::slam::CGridMapAligner::TReturnInfoThe ICP algorithm return information
 Cmrpt::slam::CICP::TReturnInfoThe ICP algorithm return information
 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
 Cmrpt::utils::TRuntimeClassIdA structure that holds runtime class type information
 Cmrpt::utils::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
 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::vision::TSimpleFeature_templ< PIXEL_COORD_TYPE >A simple structure for representing one image feature (without descriptor nor patch) - This is the template which allows you to select if pixels are represented as integers or floats
 Cmrpt::vision::TSimpleFeatureList_templ< FEATURE >A list of image features using the structure TSimpleFeature for each feature - capable of KD-tree computations Users normally use directly the typedef's: TSimpleFeatureList & TSimpleFeaturefList
 Cmrpt::vision::TSimpleFeatureList_templ< TSimpleFeature >
 Cmrpt::vision::TSimpleFeatureTraits< FEATURE >
 Cmrpt::vision::TSimpleFeatureTraits< TSimpleFeature >
 Cmrpt::vision::TSimpleFeatureTraits< TSimpleFeaturef >
 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::TSpinImagesOptions
 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::TSURFOptions
 Cmrpt::obs::CObservationRFID::TTagReadingEach of the individual readings of a RFID tag
 Cmrpt::detectors::CFaceDetection::TTestsOptions
 Cmrpt::system::TThreadHandleThis structure contains the information needed to interface the threads API on each platform:
 Cmrpt::system::TTimePartsThe parts of a date/time (it's like the standard 'tm' but with fractions of seconds)
 Cmrpt::opengl::CSetOfTexturedTriangles::TTriangleTriangle
 Cmrpt::opengl::CSetOfTriangles::TTriangleTriangle definition
 Cmrpt::opengl::CMesh::TTriangleVertexIndices
 Cmrpt::math::TTwist2D2D twist: 2D velocity vector (vx,vy) + planar angular velocity (omega)
 Cmrpt::math::TTwist3D3D twist: 3D velocity vector (vx,vy,vz) + angular velocity (wx,wy,wz)
 Cmrpt::utils::TTypeName< T >A template to obtain the type of its argument as a string at compile time
 Cmrpt::utils::TTypeName< mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS > >
 Cmrpt::utils::TTypeName< mrpt::math::CArrayDouble< N > >
 Cmrpt::utils::TTypeName< mrpt::math::CArrayFloat< N > >
 Cmrpt::utils::TTypeName< mrpt::math::CArrayNumeric< T, N > >
 Cmrpt::utils::TTypeName< mrpt::math::CMatrixFixedNumeric< T, N, M > >
 Cmrpt::utils::TTypeName< mrpt::math::CMatrixTemplateNumeric< T > >
 Cmrpt::utils::TTypeName< mrpt::opengl::CLight >
 Cmrpt::utils::TTypeName< std::pair< T1, T2 > >
 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
 Cmrpt::opengl::CSetOfTexturedTriangles::TVertexTriangle vertex
 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
 Cexprtk::parser_error::type
 Cexprtk::parser< T >::type_checker
 CTYPE_EDGES
 Cexprtk::symbol_table< T >::type_store< Type, RawType >
 Cexprtk::type_store< T >
 Cexprtk::symbol_table< T >::type_store< exprtk::details::vector_holder, exprtk::details::vector_holder >
 Cexprtk::symbol_table< T >::type_store< exprtk::ifunction< T >, exprtk::ifunction< T > >
 Cexprtk::symbol_table< T >::type_store< exprtk::igeneric_function< T >, exprtk::igeneric_function< T > >
 Cexprtk::symbol_table< T >::type_store< exprtk::ivararg_function< T >, exprtk::ivararg_function< T > >
 Cexprtk::symbol_table< T >::type_store< typename exprtk::details::stringvar_node< T >, std::string >
 Cexprtk::symbol_table< T >::type_store< typename exprtk::details::variable_node< T >, T >
 Cexprtk::type_store< T >::type_view< ViewType >
 Cmrpt::utils::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::utils::uint_select_by_bytecount< 1 >
 Cmrpt::utils::uint_select_by_bytecount< 2 >
 Cmrpt::utils::uint_select_by_bytecount< 3 >
 Cmrpt::utils::uint_select_by_bytecount< 4 >
 Cmrpt::utils::uint_select_by_bytecount< 8 >
 Cmrpt::utils::metaprogramming::UnaryMemberFunctionWrapper< T, U, V >This template encapsulates an unary member function and a single object into a function expecting the parameter of the member function
 Cexprtk::parser< T >::unknown_symbol_resolver
 Cexprtk::details::numeric::details::unknown_type_tag
 Cmrpt::obs::gnss::UTC_timeUTC (Coordinated Universal Time) time-stamp structure for GPS messages
 CTCLAP::MULTI_ARG_HELPER::ValueExtractor< T >This class is used to extract a value from an argument
 CTCLAP::VALUE_ARG_HELPER::ValueExtractor< T >This class is used to extract a value from an argument
 CTCLAP::VALUE_ARG_HELPER::ValueExtractor< std::string >Specialization for string
 CTCLAP::MULTI_ARG_HELPER::ValueExtractor< std::string >Specialization for string
 Cexprtk::details::vec_add_op< T >
 Cexprtk::details::vec_avg_op< T >
 Cexprtk::details::vec_data_store< T >
 Cexprtk::details::vec_max_op< T >
 Cexprtk::details::vec_min_op< T >
 Cexprtk::details::vec_mul_op< T >
 Cstd::vector< T >STL class
 Cexprtk::details::vector_holder< Type >
 Cexprtk::details::vector_holder< T >
 Cexprtk::details::vector_holder< Type >::vector_holder_base
 Cexprtk::details::vector_interface< T >
 Cexprtk::vector_view< T >
 Cmrpt::obs::VelodyneCalibrationVelodyne calibration data, for usage in mrpt::obs::CObservationVelodyneScan
 Cmrpt::math::detail::VicinityTraits< T >The purpose of this class is to model traits for containers, so that they can be used as return values for the function CMatrixTemplate::getVicinity
 Cmrpt::math::detail::VicinityTraits< CMatrixFixedNumeric< T, D, D > >Vicinity traits class specialization for fixed size matrices
 Cmrpt::math::detail::VicinityTraits< CMatrixTemplateNumeric< T > >Vicinity traits class specialization for fixed size matrices
 Cmrpt::graphs::CDirectedTree< TYPE_EDGES >::VisitorVirtual base class for user-defined visitors
 CTCLAP::VisitorA base class that defines the interface for visitors
 CwxFrame
 CwxObject
 CwxPanel
 CwxPrintout
 Cmrpt::gui::WxSubsystemThis class implements the GUI thread required for the wxWidgets-based GUI
 CwxWindow
 CTCLAP::XorHandlerThis class handles lists of Arg's that are to be XOR'd on the command line



Page generated by Doxygen 1.8.13 for MRPT 1.5.3 at Tue Aug 22 01:03:35 UTC 2017