C mrpt::math::detail::AccessorIterator< A, T > Template class for matrix accessor's iterators
C Eigen::aligned_allocator< T >
C mrpt::aligned_containers< TYPE1, TYPE2 > Helper types for STL containers with Eigen memory allocators
C mrpt::aligned_containers< CPose2D >
C mrpt::aligned_containers< KFArray_OBS >
C mrpt::aligned_containers< mrpt::math::CMatrixFixedNumeric >
C mrpt::aligned_containers< mrpt::obs::CObservation6DFeatures::TMeasurement >
C mrpt::aligned_containers< mrpt::opengl::COctreePointRenderer::TNode >
C mrpt::aligned_containers< mrpt::poses::CPose2D >
C mrpt::aligned_containers< mrpt::poses::CPose3D >
C mrpt::aligned_containers< mrpt::system::TTimeStamp, CPose3D >
C mrpt::aligned_containers< mrpt::system::TTimeStamp, mrpt::math::CMatrixFixedNumeric >
C mrpt::aligned_containers< std::pair< KEY, VALUE > >
C mrpt::aligned_containers< std::pair< size_t, size_t > >
C mrpt::aligned_containers< std::string, mrpt::slam::CMetricMapBuilderICP::TDist >
C mrpt::aligned_containers< TGaussianMode >
C mrpt::aligned_containers< THypothesisID, mrpt::hmtslam::CLocalMetricHypothesis >
C mrpt::aligned_containers< TPairNodeIDs, edge_t >
C mrpt::aligned_containers< TPoseID, mrpt::poses::CPose3D >
► C TCLAP::Arg A virtual base class that defines the essential data for all arguments
► C TCLAP::MultiArg< T > An argument that allows multiple values of type T to be specified
C TCLAP::UnlabeledMultiArg< T > Just like a MultiArg , except that the arguments are unlabeled
► C TCLAP::SwitchArg A simple switch argument
C TCLAP::MultiSwitchArg< DUMMY > A multiple switch argument
► C TCLAP::ValueArg< T > The basic labeled argument that parses a value
C TCLAP::UnlabeledValueArg< T > The basic unlabeled argument that parses a value
C nanoflann::array_or_vector_selector< DIM, T > Used to declare fixed-size arrays when DIM>0, dynamically-allocated vectors when DIM=-1
C nanoflann::array_or_vector_selector< -1, Interval >
C nanoflann::array_or_vector_selector<-1, T > Dynamic size version
C mrpt::graphslam::detail::AuxErrorEval< EDGE, gst >
C mrpt::graphslam::detail::AuxErrorEval< CPose2D, gst >
C mrpt::graphslam::detail::AuxErrorEval< CPose3D, gst >
C mrpt::graphslam::detail::AuxErrorEval< CPose3DPDFGaussianInf, gst >
C mrpt::graphslam::detail::AuxErrorEval< CPosePDFGaussianInf, gst >
C mrpt::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
C mrpt::utils::bimap< mrpt::maps::CLandmark::TLandmarkID, unsigned int >
► C std::binary_function
C mrpt::utils::ci_less A case-insensitive comparator struct for usage within STL containers, eg: map<string,string,ci_less>
C mrpt::utils::ci_less::nocase_compare
C mrpt::vision::KeypointResponseSorter< FEATURE_LIST > A helper struct to sort keypoints by their response: It can be used with these types:
C mrpt::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
C mrpt::system::BlockedRange
C nanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::BranchStruct< T, DistanceType > This record represents a branch point when finding neighbors in the tree
► C mrpt::nav::CAbstractHolonomicReactiveMethod A base class for holonomic reactive navigation methods
C mrpt::nav::CHolonomicND An implementation of the holonomic reactive navigation method "Nearness-Diagram"
C mrpt::nav::CHolonomicVFF A holonomic reactive navigation method, based on Virtual Force Fields (VFF)
C mrpt::vision::CCamModel::CameraTempVariables< T >
C mrpt::math::CArray< T, N > A STL container (as wrapper) for arrays of constant size defined at compile time - Users will most likely prefer to use CArrayPOD and its derived classes instead
C nanoflann::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)
► C mrpt::math::CArray< size_t, 2 >
C mrpt::math::CMatrixTemplateSize Auxiliary class used in CMatrixTemplate :size() , CMatrixTemplate::resize() , CMatrixFixedNumeric::size(), CMatrixFixedNumeric::resize(), to mimic the behavior of STL-containers
C mrpt::math::CArray< T, 0 >
C mrpt::graphs::CAStarAlgorithm< T > This class is intended to efficiently solve graph-search problems using heuristics to determine the best path
C mrpt::synch::CAtomicCounter This class acts exactly as an int (or long) variable, but with atomic increment and decrement operators
C mrpt::math::CBinaryRelation< T, U, UIsObject > This class models a binary relation through the elements of any given set
► C mrpt::utils::CCanvas This virtual class defines the interface of any object accepting drawing primitives on it
C mrpt::utils::CEnhancedMetaFile This class represents a Windows Enhanced Meta File (EMF) for generating and saving graphics
C mrpt::utils::CImage A class for storing images as grayscale or RGB bitmaps
► C mrpt::utils::CConfigFileBase This 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... This is a virtual class, use only as a pointer to an implementation of one of the derived classes
C mrpt::utils::CConfigFile This class allows loading and storing values and vectors of different types from ".ini" files easily
C mrpt::utils::CConfigFileMemory This class implements a config file-like interface over a memory-stored string list
C mrpt::utils::CConfigFilePrefixer A wrapper for other CConfigFileBase-based objects that prefixes a given token to every key and/or section
C mrpt::math::CConstMatrixColumnAccessor< MAT > A vector-like wrapper for a const Matrix for accessing the elements of a given column with a [] operator
C mrpt::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
C mrpt::math::CConstMatrixRowAccessor< MAT > A vector-like wrapper for a const Matrix for accessing the elements of a given row with a [] operator
C mrpt::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
C mrpt::synch::CCriticalSection This class provides simple critical sections functionality
C mrpt::synch::CCriticalSectionLocker A class acquiring a CCriticalSection at its constructor, and releasing it at destructor
► C mrpt::utils::CDebugOutputCapable This base class provides a common printf-like method to send debug information to std::cout, with the purpose of allowing its redirection to other streams if desired
C mrpt::bayes::CKalmanFilterCapable< 7, 3, 3, 7 >
► C mrpt::bayes::CKalmanFilterCapable< 3, 2, 2, 3 >
C mrpt::slam::CRangeBearingKFSLAM2D An implementation of EKF-based SLAM with range-bearing sensors, odometry, and a 2D (+heading) robot pose, and 2D landmarks
► C mrpt::bayes::CKalmanFilterCapable< VEH_SIZE, OBS_SIZE, FEAT_SIZE, ACT_SIZE, KFTYPE > Virtual base for Kalman Filter (EKF,IEKF,UKF) implementations
C mrpt::slam::CRangeBearingKFSLAM An implementation of EKF-based SLAM with range-bearing sensors, odometry, a full 6D robot pose, and 3D landmarks
C mrpt::bayes::CParticleFilter This class acts as a common interface to the different interfaces (see CParticleFilter::TParticleFilterAlgorithm ) any bayes::CParticleFilterCapable class can implement: it is the invoker of particle filter algorithms
C mrpt::detectors::CDetectorDoorCrossing
C mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t > Algorithms for finding the min-normalized-cut of a weighted undirected graph
C mrpt::hmtslam::CHMTSLAM An implementation of Hybrid Metric Topological SLAM (HMT-SLAM)
► C mrpt::hmtslam::CHierarchicalMapMHPartition Represents a set of nodes and arcs, posibly only a part of the whole hierarchical, multi-hypothesis map
C mrpt::hmtslam::CHierarchicalMHMap The most high level class for storing hybrid, multi-hypothesis maps in a graph-based model
► C mrpt::hwdrivers::C2DRangeFinderAbstract This is the base, abstract class for "software drivers" interfaces to 2D scanners (laser range finders)
C mrpt::hwdrivers::CHokuyoURG This software driver implements the protocol SCIP-2.0 for interfacing HOKUYO URG, UTM and UXM laser scanners (USB or Ethernet) Refer to the example code HOKUYO_laser_test and to example rawlog-grabber config files
C mrpt::hwdrivers::CLMS100Eth This "software driver" implements the communication protocol for interfacing a SICK LMS100 laser scanners through an ethernet controller
C mrpt::hwdrivers::CRoboPeakLidar Interfaces a Robo Peak LIDAR laser scanner
C mrpt::hwdrivers::CSickLaserSerial This "software driver" implements the communication protocol for interfacing a SICK LMS 2XX laser scanners through a standard RS232 serial port (or a USB2SERIAL converter)
C mrpt::hwdrivers::CSickLaserUSB This "software driver" implements the communication protocol for interfacing a SICK LMS2XX laser scanners through a custom USB RS-422 interface board
C mrpt::hwdrivers::CBoardIR A parser of NMEA commands, for connecting to a GPS by a serial port
C mrpt::hwdrivers::CCANBusReader This "software driver" implements the communication protocol for interfacing a SICK LMS 2XX laser scanners through a standard RS232 serial port (or a USB2SERIAL converter)
C mrpt::hwdrivers::CCameraSensor The central class for camera grabbers in MRPT, implementing the "generic sensor" interface
C mrpt::hwdrivers::CGPSInterface A class capable of reading GPS/GNSS/GNSS+IMU receiver data, from a serial port or from any input stream, and parsing the ASCII/binary stream into indivual messages stored in mrpt::obs::CObservationGPS objects
C mrpt::hwdrivers::CNationalInstrumentsDAQ An interface to read from data acquisition boards compatible with National Instruments "DAQmx Base" or "DAQmx"
C mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors : An interface for the phidget Interface kit board (1018)
C mrpt::hwdrivers::CRoboticHeadInterface This "software driver" implements the communication protocol for interfacing a Robotic Head Board through a custom USB RS-422 interface board
C mrpt::hwdrivers::CTuMicos This class implements initialization and comunication methods to control a Tilt Unit model DT-80, working in radians
C mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM > An implementation of the Levenberg-Marquardt algorithm for least-square minimization
C mrpt::math::RANSAC_Template< NUMTYPE > A generic RANSAC implementation with models as matrices
► C mrpt::nav::CAbstractReactiveNavigationSystem This is the base class for any reactive navigation system
► C mrpt::nav::CAbstractPTGBasedReactive Base class for reactive navigator systems based on TP-Space, with an arbitrary holonomic reactive method running on it and any number of PTGs for transforming the navigation space
C mrpt::nav::CReactiveNavigationSystem See base class CAbstractPTGBasedReactive for a description and instructions of use
C mrpt::nav::CReactiveNavigationSystem3D See base class CAbstractPTGBasedReactive for a description and instructions of use
C mrpt::slam::CIncrementalMapPartitioner This class can be used to make partitions on a map/graph build from observations taken at some poses/nodes
► C mrpt::slam::CMetricMapBuilder This virtual class is the base for SLAM implementations
C mrpt::slam::CMetricMapBuilderICP A class for very simple 2D SLAM based on ICP
C mrpt::slam::CMetricMapBuilderRBPF This class implements a Rao-Blackwelized Particle Filter (RBPF) approach to map building (SLAM)
► C mrpt::slam::CMetricMapsAlignmentAlgorithm A base class for any algorithm able of maps alignment
C mrpt::slam::CGridMapAligner A class for aligning two multi-metric maps (with an occupancy grid maps and a points map, at least) based on features extraction and matching
C mrpt::slam::CICP Several implementations of ICP (Iterative closest point) algorithms for aligning two point maps or a point map wrt a grid map
C mrpt::utils::CServerTCPSocket A TCP socket that can be wait for client connections to enter
C mrpt::utils::CTimeLogger A versatile "profiler" that logs the time spent within each pair of calls to enter(X)-leave(X), among other stats
C mrpt::vision::CDifodo This abstract class implements a method called "Difodo" to perform Visual odometry with range cameras
C mrpt::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
► C mrpt::graphs::CDirectedGraph< TYPE_EDGES, EDGE_ANNOTATIONS > A directed graph with the argument of the template specifying the type of the annotations in the edges
C mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS > A directed graph of pose constraints, with edges being the relative pose between pairs of nodes indentified by their numeric IDs (of type mrpt::utils::TNodeID )
C mrpt::graphs::CDirectedGraph< CPOSE, mrpt::graphs::detail::edge_annotations_empty >
► C mrpt::graphs::CDirectedTree< TYPE_EDGES > < Make available this typedef in this namespace too
C mrpt::nav::TMoveTree< TNodeSE2_TP, TMoveEdgeSE2_TP >
► C mrpt::graphs::CDirectedTree< EDGE_TYPE >
C mrpt::nav::TMoveTree< NODE_TYPE_DATA, EDGE_TYPE, MAPS_IMPLEMENTATION > This class contains motions and motions tree structures for the hybrid navigation algorithm
C mrpt::graphs::CDirectedTree< TMoveEdgeSE2_TP >
C mrpt::system::CDirectoryExplorer This class allows the enumeration of the files/directories that exist into a given path
C mrpt::utils::CDynamicGrid< T > A 2D grid of dynamic size which stores any kind of data at each cell
C mrpt::utils::CDynamicGrid< double >
► C mrpt::utils::CDynamicGrid< int8_t >
C mrpt::maps::CReflectivityGridMap2D A 2D grid map representing the reflectivity of the environment (for example, measured with an IR proximity sensor)
C mrpt::utils::CDynamicGrid< mrpt::nav::CParameterizedTrajectoryGenerator::TCellForLambdaFunction >
► C mrpt::utils::CDynamicGrid< TCollisionCell >
C mrpt::nav::CParameterizedTrajectoryGenerator::CColisionGrid An internal class for storing the collision grid
► C mrpt::utils::CDynamicGrid< THeightGridmapCell >
C mrpt::maps::CHeightGridMap2D Digital Elevation Model (DEM), a mesh or grid representation of a surface which keeps the estimated height for each (x,y) location
► C mrpt::utils::CDynamicGrid< TRandomFieldCell >
► C mrpt::maps::CRandomFieldGridMap2D CRandomFieldGridMap2D represents a 2D grid map where each cell is associated one real-valued property which is estimated by this map, either as a simple value or as a probility distribution (for each cell)
C mrpt::maps::CGasConcentrationGridMap2D CGasConcentrationGridMap2D represents a PDF of gas concentrations over a 2D area
C mrpt::maps::CHeightGridMap2D_MRF CHeightGridMap2D_MRF represents a PDF of gas concentrations over a 2D area
C mrpt::maps::CWirelessPowerGridMap2D CWirelessPowerGridMap2D represents a PDF of wifi concentrations over a 2D area
C mrpt::utils::CDynamicGrid< uint16_t >
C mrpt::utils::CDynamicGrid< uint8_t >
C mrpt::utils::CDynamicGrid< vector_int >
C mrpt::vision::CFeatureExtraction The central class from which images can be analyzed in search of different kinds of interest points and descriptors computed for them
C mrpt::hwdrivers::CFFMPEG_InputStream A generic class which process a video file or other kind of input stream (http, rtsp) and allows the extraction of images frame by frame
C mrpt::system::CFileSystemWatcher This class subscribes to notifications of file system changes, thus it can be used to efficiently stay informed about changes in a directory tree
► C mrpt::vision::CGenericFeatureTracker A virtual interface for all feature trackers, implementing the part of feature tracking that is common to any specific tracker implementation
C mrpt::vision::CFeatureTracker_KL Track a set of features from old_img -> new_img using sparse optimal flow (classic KL method)
C mrpt::system::CGenericMemoryPool< DATA_PARAMS, POOLABLE_DATA > A generic system for versatile memory pooling
► C mrpt::maps::CHeightGridMap2D_Base Virtual base class for Digital Elevation Model (DEM) maps
C mrpt::maps::CHeightGridMap2D Digital Elevation Model (DEM), a mesh or grid representation of a surface which keeps the estimated height for each (x,y) location
C mrpt::maps::CHeightGridMap2D_MRF CHeightGridMap2D_MRF represents a PDF of gas concentrations over a 2D area
C mrpt::math::CHistogram This class provides an easy way of computing histograms for unidimensional real valued variables
C mrpt::hwdrivers::CImageGrabber_dc1394 A class for grabing images from a IEEE1394 (Firewire) camera using the libdc1394-2 library
C mrpt::hwdrivers::CImageGrabber_OpenCV A class for grabing images from a "OpenCV"-compatible camera, or from an AVI video file
C mrpt::vision::CImagePyramid Holds 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)
C mrpt::utils::circular_buffer< T > A circular buffer of fixed size (defined at construction-time), implemented with a std::vector as the underlying storage
C mrpt::utils::circular_buffer< uint8_t >
C mrpt::hwdrivers::CJoystick Access to joysticks and gamepads (read buttons and position), and request number of joysticks in the system
C mrpt::utils::CLASSINIT Auxiliary structure used for CObject-based RTTI
C mrpt::hwdrivers::CGenericSensor::CLASSINIT_GENERIC_SENSOR Auxiliary structure used for CSerializable runtime class ID support
C mrpt::opengl::CLight Each of the possible lights of a 3D scene
C mrpt::utils::CListOfClasses A list (actually based on a std::set) of MRPT classes, capable of keeping any class registered by the mechanism of CSerializable classes
► C mrpt::utils::CLoadableOptions This is a virtual base class for sets of options than can be loaded from and/or saved to configuration plain-text files
C mrpt::bayes::CParticleFilter::TParticleFilterOptions The configuration of a particle filter
C mrpt::bayes::TKF_options Generic options for the Kalman Filter algorithm in itself
C mrpt::hmtslam::CHMTSLAM::TOptions A variety of options and configuration params (private, use loadOptions)
C mrpt::hmtslam::CTopLCDetector_FabMap::TOptions Options for a TLC-detector of type FabMap, used from CHMTSLAM
C mrpt::hmtslam::CTopLCDetector_GridMatching::TOptions Options for a TLC-detector of type gridmap-matching, used from CHMTSLAM
C mrpt::maps::CBeaconMap::TInsertionOptions This struct contains data for choosing the method by which new beacons are inserted in the map
C mrpt::maps::CBeaconMap::TLikelihoodOptions With this struct options are provided to the likelihood computations
C mrpt::maps::CColouredPointsMap::TColourOptions The definition of parameters for generating colors from laser scans
C mrpt::maps::CGasConcentrationGridMap2D::TInsertionOptions Parameters related with inserting observations into the map:
C mrpt::maps::CHeightGridMap2D::TInsertionOptions Parameters related with inserting observations into the map
C mrpt::maps::CHeightGridMap2D_MRF::TInsertionOptions Parameters related with inserting observations into the map
C mrpt::maps::CLandmarksMap::TInsertionOptions With this struct options are provided to the observation insertion process
C mrpt::maps::CLandmarksMap::TLikelihoodOptions With this struct options are provided to the likelihood computations
C mrpt::maps::CMultiMetricMapPDF::TPredictionParams The struct for passing extra simulation parameters to the prediction/update stage when running a particle filter
C mrpt::maps::COccupancyGridMap2D::TInsertionOptions With this struct options are provided to the observation insertion process
C mrpt::maps::COccupancyGridMap2D::TLikelihoodOptions With this struct options are provided to the observation likelihood computation process
C mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TInsertionOptions With this struct options are provided to the observation insertion process
C mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TLikelihoodOptions Options used when evaluating "computeObservationLikelihood"
C mrpt::maps::CPointsMap::TInsertionOptions With this struct options are provided to the observation insertion process
C mrpt::maps::CPointsMap::TLikelihoodOptions Options used when evaluating "computeObservationLikelihood" in the derived classes
C mrpt::maps::CReflectivityGridMap2D::TInsertionOptions Parameters related with inserting observations into the map
C mrpt::maps::CWirelessPowerGridMap2D::TInsertionOptions Parameters related with inserting observations into the map:
C mrpt::maps::TMapGenericParams Common params to all maps derived from mrpt::maps::CMetricMap
► C mrpt::maps::TMetricMapInitializer Virtual base for specifying the kind and parameters of one map (normally, to be inserted into mrpt::maps::CMultiMetricMap ) See mrpt::maps::TSetOfMetricMapInitializers::loadFromConfigFile()
as an easy way of initialize this object, or construct with the factory methods <metric_map_class>::MapDefinition()
and TMetricMapInitializer::factory()
► C mrpt::maps::CBeaconMap::TMapDefinitionBase
C mrpt::maps::CBeaconMap::TMapDefinition
► C mrpt::maps::CColouredOctoMap::TMapDefinitionBase
C mrpt::maps::CColouredOctoMap::TMapDefinition
► C mrpt::maps::CColouredPointsMap::TMapDefinitionBase
C mrpt::maps::CColouredPointsMap::TMapDefinition
► C mrpt::maps::CGasConcentrationGridMap2D::TMapDefinitionBase
C mrpt::maps::CGasConcentrationGridMap2D::TMapDefinition
► C mrpt::maps::CHeightGridMap2D::TMapDefinitionBase
C mrpt::maps::CHeightGridMap2D::TMapDefinition
► C mrpt::maps::CHeightGridMap2D_MRF::TMapDefinitionBase
C mrpt::maps::CHeightGridMap2D_MRF::TMapDefinition
► C mrpt::maps::CLandmarksMap::TMapDefinitionBase
C mrpt::maps::CLandmarksMap::TMapDefinition
► C mrpt::maps::COccupancyGridMap2D::TMapDefinitionBase
C mrpt::maps::COccupancyGridMap2D::TMapDefinition
► C mrpt::maps::COctoMap::TMapDefinitionBase
C mrpt::maps::COctoMap::TMapDefinition
► C mrpt::maps::CReflectivityGridMap2D::TMapDefinitionBase
C mrpt::maps::CReflectivityGridMap2D::TMapDefinition
► C mrpt::maps::CSimplePointsMap::TMapDefinitionBase
C mrpt::maps::CSimplePointsMap::TMapDefinition
► C mrpt::maps::CWeightedPointsMap::TMapDefinitionBase
C mrpt::maps::CWeightedPointsMap::TMapDefinition
► C mrpt::maps::CWirelessPowerGridMap2D::TMapDefinitionBase
C mrpt::maps::CWirelessPowerGridMap2D::TMapDefinition
C mrpt::maps::TSetOfMetricMapInitializers A set of TMetricMapInitializer structures, passed to the constructor CMultiMetricMap::CMultiMetricMap See the comments for TSetOfMetricMapInitializers::loadFromConfigFile , and "CMultiMetricMap::setListOfMaps" for effectively creating the list of desired maps
C mrpt::nav::CHolonomicND::TOptions Algorithm options
C mrpt::nav::CHolonomicVFF::TOptions Algorithm options
C mrpt::slam::CGridMapAligner::TConfigParams The ICP algorithm configuration data
C mrpt::slam::CICP::TConfigParams The ICP algorithm configuration data
C mrpt::slam::CIncrementalMapPartitioner::TOptions Configuration of the algorithm:
C mrpt::slam::CMetricMapBuilderICP::TConfigParams Algorithm configuration params
C mrpt::slam::CMetricMapBuilderRBPF::TConstructionOptions Options for building a CMetricMapBuilderRBPF object, passed to the constructor
C mrpt::slam::CRangeBearingKFSLAM2D::TOptions The options for the algorithm
C mrpt::slam::CRangeBearingKFSLAM::TOptions The options for the algorithm
C mrpt::slam::TKLDParams Option set for KLD algorithm
C mrpt::vision::CCamModel This class represent a pinhole camera model for Monocular SLAM and implements some associated Jacobians
C mrpt::vision::CFeatureExtraction::TOptions The set of parameters for all the detectors & descriptor algorithms
C mrpt::vision::TMatchingOptions A structure containing options for the matching
C mrpt::vision::TMultiResDescMatchOptions Struct containing the options when matching multi-resolution SIFT-like descriptors
C mrpt::vision::TMultiResDescOptions Struct containing the options when computing the multi-resolution SIFT-like descriptors
C mrpt::vision::TStereoSystemParams Parameters associated to a stereo system
C stlplus::clone_copy< T >
► C mrpt::hmtslam::CLSLAMAlgorithmBase Virtual base for local SLAM methods, used in mrpt::slam::CHMTSLAM
C mrpt::hmtslam::CLSLAM_RBPF_2DLASER Implements a 2D local SLAM method based on a RBPF over an occupancy grid map
C mrpt::utils::CMappedImage This class encapsulates a MRPT Image and allows the sampling of individual pixels with sub-pixel accuracy and with a change of coordinates (eg, meters)
C mrpt::math::CMatrixColumnAccessor< MAT > A vector-like wrapper for a Matrix for accessing the elements of a given column with a [] operator
C mrpt::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
C mrpt::math::CMatrixRowAccessor< MAT > A vector-like wrapper for a Matrix for accessing the elements of a given row with a [] operator
C mrpt::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
C mrpt::math::CMatrixTemplate< T > This template class provides the basic functionality for a general 2D any-size, resizable container of numerical or non-numerical elements
► C mrpt::math::CMatrixTemplate< bool >
► C mrpt::math::CMatrixBool Declares a matrix of booleans (non serializable)
C mrpt::math::CMatrixB This class is a "CSerializable" wrapper for "CMatrixBool"
C mrpt::math::CMatrixTemplate< mrpt::math::TPoint3D >
► C mrpt::math::CMatrixTemplate< T * >
C mrpt::math::CMatrixTemplateObjects< T > This template class extends the class "CMatrixTemplate" for storing "objects" at each matrix entry
► C TCLAP::CmdLineInterface The base class that manages the command line definition and passes along the parsing to the appropriate Arg classes
C TCLAP::CmdLine The base class that manages the command line definition and passes along the parsing to the appropriate Arg classes
► C TCLAP::CmdLineOutput The interface that any output object must implement
C TCLAP::DocBookOutput A class that generates DocBook output for usage() method for the given CmdLine and its Args
C TCLAP::StdOutput A class that isolates any output from the CmdLine object so that it may be easily modified
C mrpt::utils::CMessage A class that contain generic messages, that can be sent and received from a "CClientTCPSocket" object
C mrpt::math::CMonteCarlo< T, NUM, OTHER > Montecarlo simulation for experiments in 1D
C mrpt::obs::CObservationGasSensors::CMOSmodel Declares a class within "CObservationGasSensors" that represents a set of gas concentration readings from the modelation of a MOS gas sensor readings
C mrpt::hwdrivers::CNTRIPClient A client for NTRIP (HTTP) sources of differential GPS corrections from internet servers, or Global navigation satellite system (GNSS) internet radio
► C mrpt::utils::CObject The virtual base class of all MRPT classes with a unified RTTI system
► C mrpt::gui::CBaseGUIWindow The base class for GUI window classes
C mrpt::gui::CDisplayWindow This class creates a window as a graphical user interface (GUI) for displaying images to the user
C mrpt::gui::CDisplayWindow3D A graphical user interface (GUI) for efficiently rendering 3D scenes in real-time
C mrpt::gui::CDisplayWindowPlots Create a GUI window and display plots with MATLAB-like interfaces and commands
► C mrpt::detectors::CObjectDetection
C mrpt::detectors::CCascadeClassifierDetection
C mrpt::detectors::CFaceDetection Specific class for face detection
► C mrpt::utils::CObservable Inherit from this class for those objects capable of being observed by a CObserver class
C mrpt::gui::CBaseGUIWindow The base class for GUI window classes
► C mrpt::maps::CMetricMap Declares a virtual base class for all metric maps storage classes
► C mrpt::maps::COctoMapBase< octomap::ColorOcTree, octomap::ColorOcTreeNode >
C mrpt::maps::CColouredOctoMap A three-dimensional probabilistic occupancy grid, implemented as an octo-tree with the "octomap" C++ library
► C mrpt::maps::COctoMapBase< octomap::OcTree, octomap::OcTreeNode >
C mrpt::maps::COctoMap A three-dimensional probabilistic occupancy grid, implemented as an octo-tree with the "octomap" C++ library
C mrpt::maps::CBeaconMap A class for storing a map of 3D probabilistic beacons, using a Montecarlo, Gaussian, or Sum of Gaussians (SOG) representation (for range-only SLAM)
C mrpt::maps::CHeightGridMap2D Digital Elevation Model (DEM), a mesh or grid representation of a surface which keeps the estimated height for each (x,y) location
C mrpt::maps::CLandmarksMap A class for storing a map of 3D probabilistic landmarks
C mrpt::maps::CMultiMetricMap This class stores any customizable set of metric maps
C mrpt::maps::COccupancyGridMap2D A class for storing an occupancy grid map
C mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE > A three-dimensional probabilistic occupancy grid, implemented as an octo-tree with the "octomap" C++ library
► C mrpt::maps::CPointsMap A cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors
C mrpt::maps::CColouredPointsMap A map of 2D/3D points with individual colours (RGB)
C mrpt::maps::CSimplePointsMap A cloud of points in 2D or 3D, which can be built from a sequence of laser scans
C mrpt::maps::CWeightedPointsMap A cloud of points in 2D or 3D, which can be built from a sequence of laser scans
C mrpt::maps::CRandomFieldGridMap2D CRandomFieldGridMap2D represents a 2D grid map where each cell is associated one real-valued property which is estimated by this map, either as a simple value or as a probility distribution (for each cell)
C mrpt::maps::CReflectivityGridMap2D A 2D grid map representing the reflectivity of the environment (for example, measured with an IR proximity sensor)
C mrpt::opengl::COpenGLViewport A viewport within a COpenGLScene , containing a set of OpenGL objects to render
C mrpt::obs::CObservation2DRangeScanWithUncertainty A 2D range scan plus an uncertainty model for each range
► C mrpt::utils::CObserver Inherit from this class to get notified about events from any CObservable object after subscribing to it
C mrpt::slam::COccupancyGridMapFeatureExtractor A class for detecting features from occupancy grid maps
C mrpt::opengl::COctreePointRenderer< Derived > Template class that implements the data structure and algorithms for Octree-based efficient rendering
► C mrpt::opengl::COctreePointRenderer< CPointCloud >
C mrpt::opengl::CPointCloud A cloud of points, all with the same color or each depending on its value along a particular coordinate axis
► C mrpt::opengl::COctreePointRenderer< CPointCloudColoured >
C mrpt::opengl::CPointCloudColoured A cloud of points, each one with an individual colour (R,G,B)
C mrpt::pbmap::config_heuristics A class used to define the heuristic parameters and thresholds used to match sets of planes
C mrpt::pbmap::ConsistencyTest
C mrpt::obs::CRawlog::const_iterator A normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence
► C TCLAP::Constraint< T > The interface that defines the interaction between the Arg and Constraint
C TCLAP::ValuesConstraint< T > A Constraint that constrains the Arg to only those values specified in the constraint
► C constraint_no_pdf_t
C mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::global_pose_t The type of each global pose in nodes: an extension of the constraint_no_pdf_t pose with any optional user-defined data
C stlplus::constructor_copy< T >
C mrpt::math::ContainerType< CONTAINER > ContainerType<T>::element_t exposes the value of any STL or Eigen container
C mrpt::math::ContainerType< Eigen::EigenBase< Derived > > Specialization for Eigen containers
C mrpt::obs::gnss::Message_NMEA_GGA::content_t
C mrpt::obs::gnss::Message_NMEA_GLL::content_t
C mrpt::obs::gnss::Message_NMEA_RMC::content_t
C mrpt::obs::gnss::Message_NMEA_VTG::content_t
C mrpt::obs::gnss::Message_NMEA_ZDA::content_t
► C mrpt::hwdrivers::COpenNI2Generic An abstract class for accessing OpenNI2 compatible sensors
C mrpt::hwdrivers::COpenNI2Sensor A class for grabing "range images", intensity images (either RGB or IR) and other information from an OpenNI2 sensor
C mrpt::hwdrivers::COpenNI2_RGBD360 A class for grabing RGBD images from several OpenNI2 sensors
► C mrpt::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
C mrpt::utils::copiable_NULL_ptr< T > A wrapper class for pointers that, if copied with the "=" operator, should be set to NULL in the new copy
► C mrpt::nav::CParameterizedTrajectoryGenerator This is the base class for any user-defined PTG
C mrpt::nav::CPTG1 A PTG for circular paths ("C" type PTG in papers)
C mrpt::nav::CPTG2 The "alpha-PTG", as named in PTG papers
C mrpt::nav::CPTG3 A PTG for optimal paths of type "C|C,S" (as named in PTG papers)
C mrpt::nav::CPTG4 A PTG for optimal paths of type "C|C" , as named in PTG papers
C mrpt::nav::CPTG5 A PTG for optimal paths of type "CS", as named in PTG papers
C mrpt::nav::CPTG6 A variation of the alpha-PTG (with fixed parameters, for now)
C mrpt::nav::CPTG7 Trajectories with a fixed linear speed (V_MAX) and a first turning part followed by a straight segment
C mrpt::nav::CPTG_Dummy A dummy PTG, used mainly to call loadTrajectories() without knowing the exact derived PTG class and still be able to analyze the trajectories
► C mrpt::bayes::CParticleFilterCapable This virtual class defines the interface that any particles based PDF class must implement in order to be executed by a mrpt::bayes::CParticleFilter
► C mrpt::bayes::CParticleFilterDataImpl< CLocalMetricHypothesis, mrpt::bayes::CParticleFilterData< CLSLAMParticleData >::CParticleList >
C mrpt::hmtslam::CLocalMetricHypothesis This class is used in HMT-SLAM to represent each of the Local Metric Hypotheses (LMHs)
► C mrpt::bayes::CParticleFilterDataImpl< CMultiMetricMapPDF, mrpt::bayes::CParticleFilterData< CRBPFParticleData >::CParticleList >
C mrpt::maps::CMultiMetricMapPDF Declares a class that represents a Rao-Blackwellized set of particles for solving the SLAM problem (This class is the base of RBPF-SLAM applications)
► C mrpt::bayes::CParticleFilterDataImpl< CPointPDFParticles, mrpt::bayes::CParticleFilterData< TSimple3DPoint >::CParticleList >
C mrpt::poses::CPointPDFParticles A probability distribution of a 2D/3D point, represented as a set of random samples (particles)
► C mrpt::bayes::CParticleFilterDataImpl< CPose3DPDFParticles, mrpt::bayes::CParticleFilterData< CPose3D >::CParticleList >
► C mrpt::poses::CPose3DPDFParticles Declares a class that represents a Probability Density function (PDF) of a 3D pose
C mrpt::slam::CMonteCarloLocalization3D Declares a class that represents a Probability Density Function (PDF) over a 3D pose (x,y,phi,yaw,pitch,roll), using a set of weighted samples
► C mrpt::bayes::CParticleFilterDataImpl< CPosePDFParticles, mrpt::bayes::CParticleFilterData< CPose2D >::CParticleList >
► C mrpt::poses::CPosePDFParticles Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples
C mrpt::slam::CMonteCarloLocalization2D Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples
C mrpt::bayes::CParticleFilterDataImpl< Derived, particle_list_t > A curiously recurring template pattern (CRTP) approach to providing the basic functionality of any CParticleFilterData<> class
C mrpt::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
► C mrpt::bayes::CParticleFilterData< CLSLAMParticleData >
C mrpt::hmtslam::CLocalMetricHypothesis This class is used in HMT-SLAM to represent each of the Local Metric Hypotheses (LMHs)
► C mrpt::bayes::CParticleFilterData< CPose2D >
C mrpt::poses::CPosePDFParticles Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples
► C mrpt::bayes::CParticleFilterData< CPose3D >
C mrpt::poses::CPose3DPDFParticles Declares a class that represents a Probability Density function (PDF) of a 3D pose
► C mrpt::bayes::CParticleFilterData< CRBPFParticleData >
C mrpt::maps::CMultiMetricMapPDF Declares a class that represents a Rao-Blackwellized set of particles for solving the SLAM problem (This class is the base of RBPF-SLAM applications)
► C mrpt::bayes::CParticleFilterData< TSimple3DPoint >
C mrpt::poses::CPointPDFParticles A probability distribution of a 2D/3D point, represented as a set of random samples (particles)
C mrpt::synch::CPipe A pipe, portable across different OS
C mrpt::poses::CPose2DGridTemplate< T > This is a template class for storing a 3D (2D+heading) grid containing any kind of data
► C mrpt::poses::CPose2DGridTemplate< double >
C mrpt::poses::CPosePDFGrid Declares a class that represents a Probability Distribution function (PDF) of a 2D pose (x,y,phi)
C mrpt::poses::CPoseRandomSampler An efficient generator of random samples drawn from a given 2D (CPosePDF ) or 3D (CPose3DPDF ) pose probability density function (pdf)
C mrpt::utils::CProbabilityDensityFunction< TDATA, STATE_LEN > A generic template for probability density distributions (PDFs)
► C mrpt::utils::CProbabilityDensityFunction< CPoint2D, 2 >
► C mrpt::poses::CPoint2DPDF Declares a class that represents a Probability Distribution function (PDF) of a 2D point (x,y)
C mrpt::poses::CPoint2DPDFGaussian A gaussian distribution for 2D points
► C mrpt::utils::CProbabilityDensityFunction< CPoint3D, 3 >
► C mrpt::poses::CPointPDF Declares a class that represents a Probability Distribution function (PDF) of a 3D point (x,y,z)
C mrpt::maps::CBeacon The class for storing individual "beacon landmarks" under a variety of 3D position PDF distributions
C mrpt::poses::CPointPDFGaussian A gaussian distribution for 3D points
C mrpt::poses::CPointPDFParticles A probability distribution of a 2D/3D point, represented as a set of random samples (particles)
C mrpt::poses::CPointPDFSOG Declares a class that represents a Probability Density function (PDF) of a 3D point
► C mrpt::utils::CProbabilityDensityFunction< CPose2D, 3 >
► C mrpt::poses::CPosePDF Declares a class that represents a probability density function (pdf) of a 2D pose (x,y,phi)
C mrpt::poses::CPosePDFGaussian Declares a class that represents a Probability Density function (PDF) of a 2D pose
C mrpt::poses::CPosePDFGaussianInf A Probability Density function (PDF) of a 2D pose as a Gaussian with a mean and the inverse of the covariance
C mrpt::poses::CPosePDFGrid Declares a class that represents a Probability Distribution function (PDF) of a 2D pose (x,y,phi)
C mrpt::poses::CPosePDFParticles Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples
C mrpt::poses::CPosePDFSOG Declares a class that represents a Probability Density function (PDF) of a 2D pose
► C mrpt::utils::CProbabilityDensityFunction< CPose3D, 6 >
► C mrpt::poses::CPose3DPDF Declares a class that represents a Probability Density Function (PDF) of a 3D pose (6D actually)
C mrpt::poses::CPose3DPDFGaussian Declares a class that represents a Probability Density function (PDF) of a 3D pose
C mrpt::poses::CPose3DPDFGaussianInf Declares a class that represents a Probability Density function (PDF) of a 3D pose as a Gaussian described by its mean and its inverse covariance matrix
C mrpt::poses::CPose3DPDFParticles Declares a class that represents a Probability Density function (PDF) of a 3D pose
C mrpt::poses::CPose3DPDFSOG Declares a class that represents a Probability Density function (PDF) of a 3D(6D) pose
► C mrpt::utils::CProbabilityDensityFunction< CPose3DQuat, 7 >
► C mrpt::poses::CPose3DQuatPDF Declares a class that represents a Probability Density Function (PDF) of a 3D pose (6D actually), by means of a 7-vector with a translation [x y z] and a quaternion [qr qx qy qz]
C mrpt::poses::CPose3DQuatPDFGaussian Declares a class that represents a Probability Density function (PDF) of a 3D pose using a quaternion
C mrpt::poses::CPose3DQuatPDFGaussianInf Declares a class that represents a Probability Density function (PDF) of a 3D pose using a quaternion
C mrpt::bayes::CProbabilityParticle< T > A template class for holding a the data and the weight of a particle
C mrpt::utils::CProfilerProxy
► C mrpt::hwdrivers::CPtuBase This class implements initialization and comunication methods to control a generic Pan and Tilt Unit, working in radians
C mrpt::hwdrivers::CPtuDPerception This class implements initialization and comunication methods to control a Pan and Tilt Unit model PTU-46-17.5, working in radians
C mrpt::hwdrivers::CTuMicos This class implements initialization and comunication methods to control a Tilt Unit model DT-80, working in radians
C mrpt::random::CRandomGenerator A thred-safe pseudo random number generator, based on an internal MT19937 randomness generator
C mrpt::nav::CReactiveInterfaceImplementation The pure virtual class that a user of CAbstractReactiveNavigationSystem-derived classes must implement in order to allow the navigator sense the world and send motion commands to the robot
C mrpt::bayes::CRejectionSamplingCapable< TStateSpace > A base class for implementing rejection sampling in a generic state space
► C mrpt::bayes::CRejectionSamplingCapable< mrpt::poses::CPose2D >
C mrpt::slam::CRejectionSamplingRangeOnlyLocalization An implementation of rejection sampling for generating 2D robot pose from range-only measurements within a landmarks (beacons) map
C mrpt::poses::CRobot2DPoseEstimator A simple filter to estimate and extrapolate the robot 2D (x,y,phi) pose from asynchronous odometry and localization data
C mrpt::utils::CRobotSimulator This class can be used to simulate the kinematics and dynamics of a differential driven planar mobile robot, including odometry errors and dynamics limitations
C mrpt::hwdrivers::CRovio A class to interface a Rovio robot (manufactured by WowWee)
C mrpt::synch::CSemaphore A semaphore for inter-thread synchronization
► C mrpt::utils::CSerializable
► C mrpt::detectors::CDetectableObject Base class that contains common atributes and functions of detectable objects
► C mrpt::detectors::CDetectable2D
C mrpt::detectors::CDetectable3D
C mrpt::hmtslam::CHMHMapArc A class for representing an arc between two nodes in a hierarchical, multi-hypothesis map
C mrpt::hmtslam::CHMHMapNode A class for representing a node in a hierarchical, multi-hypothesis map
C mrpt::hmtslam::CHMTSLAM An implementation of Hybrid Metric Topological SLAM (HMT-SLAM)
C mrpt::hmtslam::CHierarchicalMHMap The most high level class for storing hybrid, multi-hypothesis maps in a graph-based model
C mrpt::hmtslam::CLSLAMParticleData Auxiliary class used in mrpt::slam::CLocalMetricHypothesis for HMT-SLAM; this class keeps the data relative to each local metric particle ("a robot metric path hypothesis" and its associated metric map)
C mrpt::hmtslam::CLocalMetricHypothesis This class is used in HMT-SLAM to represent each of the Local Metric Hypotheses (LMHs)
C mrpt::hmtslam::CRobotPosesGraph Auxiliary class used in mrpt::slam::CLocalMetricHypothesis for HMT-SLAM; this class stores a set of robot poses and its sensory frames and pose PDF, for being stored in a HMT-map as a serializable object in annotation NODE_ANNOTATION_POSES_GRAPH
C mrpt::hmtslam::THypothesisIDSet A set of hypothesis IDs, used for arcs and nodes in multi-hypothesis hybrid maps
C mrpt::kinematics::CKinematicChain A open-loop kinematic chain model, suitable to robotic manipulators
C mrpt::maps::CLandmark The class for storing "landmarks" (visual or laser-scan-extracted features,...)
C mrpt::maps::CMetricMap Declares a virtual base class for all metric maps storage classes
C mrpt::maps::CMultiMetricMapPDF Declares a class that represents a Rao-Blackwellized set of particles for solving the SLAM problem (This class is the base of RBPF-SLAM applications)
C mrpt::maps::CRBPFParticleData Auxiliary class used in mrpt::maps::CMultiMetricMapPDF
C mrpt::maps::CSimpleMap This class stores a sequence of <Probabilistic Pose,SensoryFrame> pairs, thus a "metric map" can be totally determined with this information
C mrpt::maps::TMapGenericParams Common params to all maps derived from mrpt::maps::CMetricMap
C mrpt::math::CMatrix This class is a "CSerializable" wrapper for "CMatrixFloat"
C mrpt::math::CMatrixB This class is a "CSerializable" wrapper for "CMatrixBool"
C mrpt::math::CMatrixD This class is a "CSerializable" wrapper for "CMatrixTemplateNumeric<double>"
C mrpt::math::CPolygon A wrapper of a TPolygon2D class, implementing CSerializable
C mrpt::math::CSplineInterpolator1D A (persistent) sequence of (x,y) coordinates, allowing queries of intermediate points through spline interpolation, where possible
► C mrpt::nav::CHolonomicLogFileRecord A base class for log records for different holonomic navigation methods
C mrpt::nav::CLogFileRecord_ND A class for storing extra information about the execution of CHolonomicND navigation
C mrpt::nav::CLogFileRecord_VFF A class for storing extra information about the execution of CHolonomicVFF navigation
C mrpt::nav::CLogFileRecord A class for storing, saving and loading a reactive navigation log record for the CReactiveNavigationSystem class
► C mrpt::obs::CAction Declares a class for storing a robot action
C mrpt::obs::CActionRobotMovement2D Represents a probabilistic 2D movement of the robot mobile base
C mrpt::obs::CActionRobotMovement3D Represents a probabilistic 3D (6D) movement
C mrpt::obs::CActionCollection Declares a class for storing a collection of robot actions
► C mrpt::obs::CObservation Declares a class that represents any robot's observation
C mrpt::obs::CObservation2DRangeScan A "CObservation"-derived class that represents a 2D range scan measurement (typically from a laser scanner)
C mrpt::obs::CObservation3DRangeScan Declares a class derived from "CObservation" that encapsules a 3D range scan measurement, as from a time-of-flight range camera or any other RGBD sensor
C mrpt::obs::CObservation6DFeatures An observation of one or more "features" or "objects", possibly identified with a unique ID, whose relative SE(3) pose is observed with respect to the sensor
C mrpt::obs::CObservationBatteryState This represents a measurement of the batteries on the robot
C mrpt::obs::CObservationBeaconRanges Declares a class derived from "CObservation" that represents one (or more) range measurements to labeled beacons
C mrpt::obs::CObservationBearingRange This observation represents a number of range-bearing value pairs, each one for a detected landmark, which optionally can have identification IDs
C mrpt::obs::CObservationCANBusJ1939 This class stores a message from a CAN BUS with the protocol J1939
C mrpt::obs::CObservationComment This "observation" is actually a placeholder for a text block with comments or additional parameters attached to a given rawlog file
C mrpt::obs::CObservationGPS This class stores messages from GNSS or GNSS+IMU devices, from consumer-grade inexpensive GPS receivers to Novatel/Topcon/... advanced RTK solutions
C mrpt::obs::CObservationGasSensors Declares a class derived from "CObservation" that represents a set of readings from gas sensors
C mrpt::obs::CObservationIMU This class stores measurements from an Inertial Measurement Unit (IMU) (attitude estimation, raw gyroscope and accelerometer values), altimeters or magnetometers
C mrpt::obs::CObservationImage Declares a class derived from "CObservation" that encapsules an image from a camera, whose relative pose to robot is also stored
C mrpt::obs::CObservationOdometry An observation of the current (cumulative) odometry for a wheeled robot
C mrpt::obs::CObservationRFID This represents one or more RFID tags observed by a receiver
C mrpt::obs::CObservationRGBD360 Declares a class derived from "CObservation" that encapsules an omnidirectional RGBD measurement from a set of RGBD sensors
C mrpt::obs::CObservationRange Declares a class derived from "CObservation" that encapsules a single range measurement, and associated parameters
C mrpt::obs::CObservationRawDAQ Store raw data from a Data Acquisition (DAQ) device, such that input or output analog and digital channels, counters from encoders, etc
C mrpt::obs::CObservationReflectivity Declares a class derived from "CObservation" that encapsules a single short-range reflectivity measurement
C mrpt::obs::CObservationSkeleton This class stores a skeleton as tracked by OPENNI2 & NITE2 libraries from PrimeSense sensors
C mrpt::obs::CObservationStereoImages Observation class for either a pair of left+right or left+disparity images from a stereo camera
C mrpt::obs::CObservationStereoImagesFeatures Declares a class derived from "CObservation" that encapsules a pair of cameras and a set of matched image features extracted from them
C mrpt::obs::CObservationVelodyneScan A CObservation
-derived class for RAW DATA (and optionally, point cloud) of scans from 3D Velodyne LIDAR scanners
C mrpt::obs::CObservationVisualLandmarks Declares a class derived from "CObservation" that stores a Landmarks Map as seen from a stereo camera at a given instant of time
C mrpt::obs::CObservationWindSensor Declares a class derived from "CObservation" that represents the wind measurements taken on the robot by an anemometer
C mrpt::obs::CObservationWirelessPower This represents a measurement of the wireless strength perceived by the robot
C mrpt::obs::CRawlog This class stores a rawlog (robotic datasets) in one of two possible formats:
C mrpt::obs::CSensoryFrame Declares a class for storing a "sensory frame", a set of "observations" taken by the robot approximately at the same time as one "snapshot" of the environment
C mrpt::opengl::COpenGLScene This class allows the user to create, load, save, and render 3D scenes using OpenGL primitives
C mrpt::opengl::COpenGLViewport A viewport within a COpenGLScene , containing a set of OpenGL objects to render
► C mrpt::opengl::CRenderizable The base class of 3D objects that can be directly rendered through OpenGL
C mrpt::opengl::CCamera A camera: if added to a scene, the viewpoint defined by this camera will be used instead of the camera parameters set in COpenGLViewport::m_camera
C mrpt::opengl::CPointCloud A cloud of points, all with the same color or each depending on its value along a particular coordinate axis
C mrpt::opengl::CPointCloudColoured A cloud of points, each one with an individual colour (R,G,B)
► C mrpt::opengl::CRenderizableDisplayList A renderizable object suitable for rendering with OpenGL's display lists
► C mrpt::opengl::CGeneralizedEllipsoidTemplate< 2 >
C mrpt::opengl::CEllipsoidInverseDepth2D An especial "ellipsoid" in 3D computed as the uncertainty iso-surfaces of a (inv_range,yaw) variable
C mrpt::opengl::CEllipsoidRangeBearing2D An especial "ellipsoid" in 2D computed as the uncertainty iso-surfaces of a (range,bearing) variable
► C mrpt::opengl::CGeneralizedEllipsoidTemplate< 3 >
C mrpt::opengl::CEllipsoidInverseDepth3D An especial "ellipsoid" in 3D computed as the uncertainty iso-surfaces of a (inv_range,yaw,pitch) variable
C mrpt::opengl::C3DSScene This element keeps a set of objects imported from a 3DStudio file (.3ds)
C mrpt::opengl::CAngularObservationMesh A mesh built from a set of 2D laser scan observations
C mrpt::opengl::CArrow A 3D arrow
C mrpt::opengl::CAssimpModel This class can load & render 3D models in a number of different formats (requires the library assimp)
C mrpt::opengl::CAxis Draw a 3D world axis, with coordinate marks at some regular interval
C mrpt::opengl::CBox A solid or wireframe box in 3D, defined by 6 rectangular faces parallel to the planes X, Y and Z (note that the object can be translated and rotated afterwards as any other CRenderizable object using the "object pose" in the base class)
C mrpt::opengl::CCylinder A cylinder or cone whose base lies in the XY plane
C mrpt::opengl::CDisk A planar disk in the XY plane
C mrpt::opengl::CEllipsoid A 2D ellipse or 3D ellipsoid, depending on the size of the m_cov matrix (2x2 or 3x3)
C mrpt::opengl::CFrustum A solid or wireframe frustum in 3D (a rectangular truncated pyramid), with arbitrary (possibly assymetric) field-of-view angles
C mrpt::opengl::CGeneralizedCylinder This object represents any figure obtained by extruding any profile along a given axis
C mrpt::opengl::CGeneralizedEllipsoidTemplate< DIM > A class that generalizes the concept of an ellipsoid to arbitrary parameterizations of uncertainty shapes in either 2D or 3D
C mrpt::opengl::CGridPlaneXY A grid of lines over the XY plane
C mrpt::opengl::CGridPlaneXZ A grid of lines over the XZ plane
C mrpt::opengl::CMesh A planar (XY) grid where each cell has an associated height and, optionally, a texture map
C mrpt::opengl::CMesh3D A 3D mesh composed of Triangles and/or Quads
C mrpt::opengl::CMeshFast A planar (XY) grid where each cell has an associated height and, optionally, a texture map
C mrpt::opengl::COctoMapVoxels A flexible renderer of voxels, typically from a 3D octo map (see mrpt::maps::COctoMap )
C mrpt::opengl::COpenGLStandardObject Objects of this class represent a generic openGL object without specific geometric properties
C mrpt::opengl::CPlanarLaserScan This object renders a 2D laser scan by means of three elements: the points, the line along end-points and the 2D scanned surface
C mrpt::opengl::CPolyhedron This class represents arbitrary polyhedra
C mrpt::opengl::CSetOfLines A set of independent lines (or segments), one line with its own start and end positions (X,Y,Z)
C mrpt::opengl::CSetOfTriangles A set of colored triangles
C mrpt::opengl::CSimpleLine A line segment
C mrpt::opengl::CSphere A solid or wire-frame sphere
C mrpt::opengl::CText3D A 3D text (rendered with OpenGL primitives), with selectable font face and drawing style
► C mrpt::opengl::CTexturedObject A base class for all OpenGL objects with loadable textures
C mrpt::opengl::CSetOfTexturedTriangles A set of textured triangles
C mrpt::opengl::CTexturedPlane A 2D plane in the XY plane with a texture image
C mrpt::opengl::CVectorField2D A 2D vector field representation, consisting of points and arrows drawn on a plane (invisible grid)
C mrpt::opengl::CVectorField3D A 3D vector field representation, consisting of points and arrows drawn at any spatial position
C mrpt::opengl::CSetOfObjects A set of object, which are referenced to the coordinates framework established in this object
C mrpt::opengl::CText A 2D text (bitmap rendering): it always "faces the observer" despite it's at some 3D location
C mrpt::pbmap::PbMap A class used to store a Plane-based Map (PbMap )
C mrpt::pbmap::Plane A class used to store a planar feature (Plane for short)
C mrpt::poses::CPoint2D A class used to store a 2D point
C mrpt::poses::CPoint2DPDF Declares a class that represents a Probability Distribution function (PDF) of a 2D point (x,y)
C mrpt::poses::CPoint3D A class used to store a 3D point
C mrpt::poses::CPointPDF Declares a class that represents a Probability Distribution function (PDF) of a 3D point (x,y,z)
C mrpt::poses::CPose2D A class used to store a 2D pose
C mrpt::poses::CPose3D A class used to store a 3D pose (a 3D translation + a rotation in 3D)
C mrpt::poses::CPose3DInterpolator This class stores a time-stamped trajectory in SE(3) (CPose3D poses)
C mrpt::poses::CPose3DPDF Declares a class that represents a Probability Density Function (PDF) of a 3D pose (6D actually)
C mrpt::poses::CPose3DQuat A class used to store a 3D pose as a translation (x,y,z) and a quaternion (qr,qx,qy,qz)
C mrpt::poses::CPose3DQuatPDF Declares a class that represents a Probability Density Function (PDF) of a 3D pose (6D actually), by means of a 7-vector with a translation [x y z] and a quaternion [qr qx qy qz]
C mrpt::poses::CPose3DRotVec A 3D pose, with a 3D translation and a rotation in 3D parameterized in rotation-vector form (equivalent to axis-angle)
C mrpt::poses::CPosePDF Declares a class that represents a probability density function (pdf) of a 2D pose (x,y,phi)
C mrpt::poses::CPoses2DSequence This class stores a sequence of relative, incremental 2D poses
C mrpt::poses::CPoses3DSequence This class stores a sequence of relative, incremental 3D poses
C mrpt::poses::TSimple3DPoint Data within each particle
C mrpt::slam::CIncrementalMapPartitioner This class can be used to make partitions on a map/graph build from observations taken at some poses/nodes
C mrpt::utils::CImage A class for storing images as grayscale or RGB bitmaps
C mrpt::utils::CMHPropertiesValuesList An arbitrary list of "annotations", or named attributes, each being an instance of any CSerializable object (Multi-hypotheses version)
C mrpt::utils::CMemoryChunk A memory buffer (implements CStream ) which can be itself serialized
C mrpt::utils::CPropertiesValuesList An arbitrary list of "annotations", or named attributes, each being an instance of any CSerializable object
C mrpt::utils::CSimpleDatabase This class impements a very simple database system
C mrpt::utils::CSimpleDatabaseTable This class implements the tables of databases
► C mrpt::utils::CStringList A class for storing a list of text lines
C mrpt::utils::CLog A decorator of CStringList special for keeping logs
C mrpt::utils::CTypeSelector This class represents a std::string derived class which is also CSerializable
C mrpt::utils::TCamera Structure to hold the parameters of a pinhole camera model
C mrpt::utils::TStereoCamera Structure to hold the parameters of a pinhole stereo camera model
C mrpt::vision::CFeature A generic 2D feature from an image, extracted with CFeatureExtraction Each feature may have one or more descriptors (see descriptors ), in addition to an image patch
C mrpt::obs::CSinCosLookUpTableFor2DScans A smart look-up-table (LUT) of sin/cos values for 2D laser scans
C mrpt::math::CSparseMatrix A sparse matrix structure, wrapping T
► C mrpt::math::CSparseMatrixTemplate< T > A sparse matrix container (with cells of any type), with iterators
C mrpt::math::CSparseSymmetricalMatrix< T > A sparse matrix container for square symmetrical content around the main diagonal
C mrpt::utils::CStartUpClassesRegister A helper class that automatically register at start up a custom function to register all the CObject-derived classes in a given MRPT library or user application
C mrpt::math::CMonteCarlo< T, NUM, OTHER >::CStatisticalAnalyzer
C mrpt::vision::CStereoRectifyMap Use this class to rectify stereo images if the same distortion maps are reused over and over again
► C mrpt::utils::CStream This base class is used to provide a unified interface to files,memory buffers,..Please see the derived classes
► C mrpt::hwdrivers::CInterfaceFTDI A definition of a CStream actually representing a USB connection to a FTDI chip
C mrpt::hwdrivers::CBoardDLMS An interface to a custom board which interfaces two SICK laser scanners
C mrpt::hwdrivers::CBoardSonars This "software driver" implements the communication protocol for interfacing a Ultrasonic range finder SRF10 through a custom USB board
C mrpt::hwdrivers::CServoeNeck A USB-interface for a custom "robotic neck" designed at MAPIR lab
C mrpt::hwdrivers::CSerialPort A communications serial port built as an implementation of a utils::CStream
► C mrpt::synch::CPipeBaseEndPoint Common interface of read & write pipe end-points
C mrpt::synch::CPipeReadEndPoint The read end-point in a pipe created with mrpt::synch::CPipe
C mrpt::synch::CPipeWriteEndPoint The write end-point in a pipe created with mrpt::synch::CPipe
C mrpt::utils::CClientTCPSocket A TCP socket that can be connected to a TCP server, implementing MRPT's CStream interface for passing objects as well as generic read/write methods
C mrpt::utils::CFileGZInputStream Transparently opens a compressed "gz" file and reads uncompressed data from it
C mrpt::utils::CFileInputStream This CStream derived class allow using a file as a read-only, binary stream
C mrpt::utils::CFileOutputStream This CStream derived class allow using a file as a write-only, binary stream
C mrpt::utils::CFileStream This CStream derived class allow using a file as a read/write binary stream, creating it if the file didn't exist
► C mrpt::utils::CMemoryStream This CStream derived class allow using a memory buffer as a CStream
C mrpt::utils::CMemoryChunk A memory buffer (implements CStream ) which can be itself serialized
C mrpt::utils::CStdOutStream This CStdOutStream derived class allow printing to standard out, normally the console text output
C mrpt::utils::CTextFileLinesParser A class for parsing text files, returning each non-empty and non-comment line, along its line number
► C mrpt::opengl::CTextMessageCapable Keeps a list of text messages which can be rendered to OpenGL contexts by graphic classes
C mrpt::opengl::CFBORender A class for rendering 3D scenes off-screen directly into an image using OpenGL extensions (glext)
C mrpt::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*"
C mrpt::synch::CThreadSafeVariable< T > A template for created thread-safe variables with an internal critical section controlled each read or write
C mrpt::utils::CTimeLoggerEntry A 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
► C mrpt::hmtslam::CTopLCDetectorBase The virtual base class for Topological Loop-closure Detectors; used in HMT-SLAM
C mrpt::hmtslam::CTopLCDetector_FabMap
C mrpt::hmtslam::CTopLCDetector_GridMatching
► C mrpt::utils::CUncopiable The base class of classes that cannot be copied: compile-time errors will be issued on any copy operation
C mrpt::hwdrivers::CDUO3DCamera This "software driver" implements the communication protocol for interfacing a DUO3D Stereo Camera
► C mrpt::hwdrivers::CGenericSensor A generic interface for a wide-variety of sensors designed to be used in the application RawLogGrabber
C mrpt::hwdrivers::C2DRangeFinderAbstract This is the base, abstract class for "software drivers" interfaces to 2D scanners (laser range finders)
C mrpt::hwdrivers::CActivMediaRobotBase This software driver implements the communications (and some rudimentary control) for ActivMedia robotic bases (Pioneer DX/AT, PeopleBot, etc)
C mrpt::hwdrivers::CBoardDLMS An interface to a custom board which interfaces two SICK laser scanners
C mrpt::hwdrivers::CBoardENoses A class for interfacing an e-Noses via a FTDI USB link
C mrpt::hwdrivers::CBoardIR A parser of NMEA commands, for connecting to a GPS by a serial port
C mrpt::hwdrivers::CBoardSonars This "software driver" implements the communication protocol for interfacing a Ultrasonic range finder SRF10 through a custom USB board
C mrpt::hwdrivers::CCANBusReader This "software driver" implements the communication protocol for interfacing a SICK LMS 2XX laser scanners through a standard RS232 serial port (or a USB2SERIAL converter)
C mrpt::hwdrivers::CCameraSensor The central class for camera grabbers in MRPT, implementing the "generic sensor" interface
C mrpt::hwdrivers::CEnoseModular A class for interfacing an e-NoseModular via a FTDI USB link
C mrpt::hwdrivers::CGPSInterface A class capable of reading GPS/GNSS/GNSS+IMU receiver data, from a serial port or from any input stream, and parsing the ASCII/binary stream into indivual messages stored in mrpt::obs::CObservationGPS objects
C mrpt::hwdrivers::CGPS_NTRIP A combination of GPS receiver + NTRIP receiver capable of submitting GGA frames to enable RTCM 3.0
C mrpt::hwdrivers::CGillAnemometer This class implements a driver for the Gill Windsonic Option 1 Anemometer The sensor is accessed via a standard serial port
C mrpt::hwdrivers::CGyroKVHDSP3000 A class for interfacing KVH DSP 3000 gyroscope with an assynchronous serial communication (product SN : 02-1222-01)
C mrpt::hwdrivers::CIMUIntersense A class for interfacing Intersense Inertial Measuring Units (IMUs)
C mrpt::hwdrivers::CIMUXSens A class for interfacing XSens 3rd generation Inertial Measuring Units (IMUs), the "XSens MTi" model
C mrpt::hwdrivers::CIMUXSens_MT4 A class for interfacing XSens 4th generation Inertial Measuring Units (IMUs): MTi 10-series, MTi 100-series
C mrpt::hwdrivers::CIbeoLuxETH This "software driver" implements the communication protocol for interfacing a Ibeo Lux laser scanners through an ethernet controller
C mrpt::hwdrivers::CImpinjRFID This class implements an interface to an Impinj RFID reader
C mrpt::hwdrivers::CKinect A class for grabing "range images", intensity images (either RGB or IR) and other information from an Xbox Kinect sensor
C mrpt::hwdrivers::CNTRIPEmitter This "virtual driver" encapsulates a NTRIP client (see CNTRIPClient ) but adds the functionality of dumping the received datastream to a given serial port
C mrpt::hwdrivers::CNationalInstrumentsDAQ An interface to read from data acquisition boards compatible with National Instruments "DAQmx Base" or "DAQmx"
C mrpt::hwdrivers::COpenNI2Sensor A class for grabing "range images", intensity images (either RGB or IR) and other information from an OpenNI2 sensor
C mrpt::hwdrivers::COpenNI2_RGBD360 A class for grabing RGBD images from several OpenNI2 sensors
C mrpt::hwdrivers::CPhidgetInterfaceKitProximitySensors : An interface for the phidget Interface kit board (1018)
C mrpt::hwdrivers::CPtuHokuyo
C mrpt::hwdrivers::CRaePID This class implements a driver for the RAE Systems gas PhotoIonization Detector (PID) (Tested on a MiniRAE Lite) The sensor is accessed via a standard (or USB) serial port
C mrpt::hwdrivers::CSkeletonTracker A class for grabbing mrpt::obs::CObservationSkeleton from a PrimeSense camera
C mrpt::hwdrivers::CSwissRanger3DCamera A class for grabing "range images" from a MESA imaging SwissRanger 3D cameras (SR-2, SR-3000, SR-4k)
C mrpt::hwdrivers::CVelodyneScanner A C++ interface to Velodyne laser scanners (HDL-64, HDL-32, VLP-16), working on Windows and Linux
C mrpt::hwdrivers::CWirelessPower This class implements a wireless power probe
C mrpt::hwdrivers::CImageGrabber_FlyCapture2 A wrapper for Point Gray Research (PGR) FlyCapture2 API for capturing images from Firewire, USB3 or GigaE cameras and stereo cameras
C mrpt::hwdrivers::CStereoGrabber_Bumblebee_libdc1394 Grabs from a "Bumblebee" or "Bumblebee2" stereo camera using raw access to the libdc1394 library
C mrpt::hwdrivers::CStereoGrabber_SVS A class for grabing stereo images from a STOC camera of Videre Design NOTE:
C mrpt::math::CSparseMatrix::CholeskyDecomp Auxiliary class to hold the results of a Cholesky factorization of a sparse matrix
C mrpt::synch::CPipeBaseEndPoint Common interface of read & write pipe end-points
C mrpt::utils::CFileGZInputStream Transparently opens a compressed "gz" file and reads uncompressed data from it
C mrpt::utils::CFileInputStream This CStream derived class allow using a file as a read-only, binary stream
C mrpt::utils::CFileOutputStream This CStream derived class allow using a file as a write-only, binary stream
C mrpt::utils::CFileStream This CStream derived class allow using a file as a read/write binary stream, creating it if the file didn't exist
C mrpt::utils::CTicTac This class implements a high-performance stopwatch
C mrpt::vision::CUndistortMap Use this class to undistort monocular images if the same distortion map is used over and over again
C mrpt::vision::CVideoFileWriter An output stream which takes a sequence of images and writes a video file in any of a given of compatible formats
► C std::deque< T > STL class
C mrpt::vision::CMatchedFeatureList A list of features
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ai_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ao_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_ang_encoder_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_count_edges_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_lin_encoder_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_period_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_ci_pulse_width_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_co_pulses_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_di_t
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription::desc_do_t
C mrpt::utils::internal::dynamic_grid_txt_saver
► C EDGE_ANNOTATIONS
C mrpt::graphs::CDirectedGraph< TYPE_EDGES, EDGE_ANNOTATIONS >::edge_t The type of each global pose in nodes: an extension of the TYPE_EDGES pose with any optional user-defined data
C mrpt::graphs::detail::edge_annotations_empty An empty structure
C Eigen::EigenBase< Derived >
► C std::exception STL class
► C TCLAP::ArgException A simple class that defines and argument exception
C TCLAP::ArgParseException Thrown from within the child Arg classes when it fails to properly parse the argument it has been passed
C TCLAP::CmdLineParseException Thrown from CmdLine when the arguments on the command line are not properly specified, e.g
C TCLAP::SpecificationException Thrown from Arg and CmdLine when an Arg is improperly specified, e.g
► C std::logic_error STL class
► C mrpt::utils::CMRPTException The base for MRPT-especific exceptions
C mrpt::math::CExceptionNotDefPos Used in mrpt::math::CSparseMatrix
C mrpt::utils::CExceptionEOF Used in mrpt::utils::CStream
C mrpt::utils::CExceptionExternalImageNotFound Used in mrpt::utils::CImage
C stlplus::end_dereference
C stlplus::illegal_copy
C stlplus::null_dereference
C stlplus::wrong_object
► C std::runtime_error STL class
C TCLAP::ActionDoneException (Added by JLBC for MRPT): An exception that indicates to CmdLine::parse that help,version,... have been invoked so it should return false for the main program to exit
C mrpt::pbmap::frameRGBDandPose
C mrpt::opengl::CAngularObservationMesh::FTrace1D< T > Internal functor class to trace a ray
C mrpt::opengl::CAngularObservationMesh::FTrace2D< T > Internal functor class to trace a set of rays
C mrpt::math::detail::getVicinity< MatrixType, T, ReturnType, D > This huge template encapsulates a function to get the vicinity of an element, with maximum genericity
► C mrpt::obs::gnss::gnss_message Pure virtual base for all message types
C mrpt::obs::gnss::Message_NMEA_GGA NMEA datum: GGA
C mrpt::obs::gnss::Message_NMEA_GLL NMEA datum: GLL
C mrpt::obs::gnss::Message_NMEA_RMC NMEA datum: RMC
C mrpt::obs::gnss::Message_NMEA_VTG NMEA datum: VTG
C mrpt::obs::gnss::Message_NMEA_ZDA NMEA datum: ZDA
C mrpt::obs::gnss::Message_NV_OEM6_GENERIC_FRAME Novatel generic frame (to store frames without a parser at the present time)
C mrpt::obs::gnss::Message_NV_OEM6_GENERIC_SHORT_FRAME Novatel generic short-header frame (to store frames without a parser at the present time)
C mrpt::obs::gnss::Message_NV_OEM6_RANGECMP Novatel frame: NV_OEM6_RANGECMP
C mrpt::obs::gnss::Message_NV_OEM6_VERSION Novatel frame: NV_OEM6_VERSION
C mrpt::obs::gnss::Message_TOPCON_PZS GPS datum for TopCon's mmGPS devices: PZS
C mrpt::obs::gnss::Message_TOPCON_SATS TopCon mmGPS devices: SATS, a generic structure for statistics about tracked satelites and their positions
C mrpt::obs::gnss::gnss_message_ptr A smart pointer to a GNSS message
C mrpt::graphs::detail::graph_ops< graph_t > Helper struct with static template functions
C mrpt::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
C mrpt::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"
C mrpt::utils::ignored_copy_ptr< mrpt::maps::COctoMapBase >
C imaxdiv_t
C nanoflann::IndexDist_Sorter Operator "<" for std::sort()
C mrpt::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
C mrpt::utils::int_select_by_bytecount< 1 >
C mrpt::utils::int_select_by_bytecount< 2 >
C mrpt::utils::int_select_by_bytecount< 3 >
C mrpt::utils::int_select_by_bytecount< 4 >
C mrpt::utils::int_select_by_bytecount< 8 >
C mrpt::obs::CObservationGPS::internal_msg_test_proxy< MSG_TYPE > Proxy class for type-based testing existence of data inside CObservationGPS::messages
C mrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::NMEA_GGA >
C mrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::NMEA_RMC >
C mrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::TOPCON_PZS >
C mrpt::obs::CObservationGPS::internal_msg_test_proxy< gnss::TOPCON_SATS >
C nanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Interval
C mrpt::obs::CRawlog::iterator A normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence
► C std::iterator
C mrpt::poses::CPose3DQuat::const_iterator
C mrpt::poses::CPose3DQuat::iterator
C mrpt::math::KDTreeCapable< Derived, num_t, metric_t > A generic adaptor class for providing Nearest Neighbor (NN) lookup via the nanoflann
library
► C mrpt::math::KDTreeCapable< CFeatureList >
C mrpt::vision::CFeatureList A list of visual features, to be used as output by detectors, as input/output by trackers, etc
► C mrpt::math::KDTreeCapable< CFeatureListKDTree< FEAT > >
C mrpt::vision::CFeatureListKDTree< FEAT > Helper class: KD-tree search class for vector<KeyPoint>: Call mark_as_outdated() to force rebuilding the kd-tree after modifying the linked feature list
► C mrpt::math::KDTreeCapable< CPointsMap >
C mrpt::maps::CPointsMap A cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors
C nanoflann::KDTreeEigenMatrixAdaptor< MatrixType, DIM, Distance, IndexType > An L2-metric KD-tree adaptor for working with data directly stored in an Eigen Matrix, without duplicating the data storage
C nanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType > Kd-tree index
C nanoflann::KDTreeSingleIndexAdaptorParams Parameters (see http://code.google.com/p/nanoflann/ for help choosing the parameters)
C nanoflann::KNNResultSet< DistanceType, IndexType, CountType >
C nanoflann::L1_Adaptor< T, DataSource, _DistanceType > Manhattan distance functor (generic version, optimized for high-dimensionality data sets)
C nanoflann::L2_Adaptor< T, DataSource, _DistanceType > Squared Euclidean distance functor (generic version, optimized for high-dimensionality data sets)
C nanoflann::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
C mrpt::maps::CPointsMap::LAS_HeaderInfo Extra information gathered from the LAS file header
C mrpt::maps::CPointsMap::LAS_LoadParams Optional settings for loadLASFile()
C mrpt::maps::CPointsMap::LAS_WriteParams Optional settings for saveLASFile()
C mrpt::obs::CObservationVelodyneScan::laser_return_t
► C std::list< T > STL class
► C mrpt::utils::list_searchable< mrpt::hmtslam::CHMHMapArcPtr >
C mrpt::hmtslam::TArcList A class for storing a sequence of arcs (a path)
C mrpt::utils::list_searchable< CHMHMapNode::TNodeID >
C mrpt::utils::list_searchable< T > This class implements a STL container with features of both, a std::set and a std::list
C mrpt::maps::detail::loadFromRangeImpl< Derived >
► C mrpt::maps::detail::logoddscell_traits< TCELL >
► C mrpt::maps::CLogOddsGridMap2D< int16_t >
C mrpt::maps::COccupancyGridMap2D A class for storing an occupancy grid map
► C mrpt::maps::CLogOddsGridMap2D< int8_t >
C mrpt::maps::CReflectivityGridMap2D A 2D grid map representing the reflectivity of the environment (for example, measured with an IR proximity sensor)
C mrpt::maps::CLogOddsGridMapLUT< cellType >
C mrpt::maps::CLogOddsGridMapLUT< cell_t >
C mrpt::maps::CLogOddsGridMap2D< TCELL > A generic provider of log-odds grid-map maintainance functions
C mrpt::maps::CLogOddsGridMapLUT< TCELL > One static instance of this struct should exist in any class implementing CLogOddsGridMap2D to hold the Look-up-tables (LUTs) for log-odss Bayesian update
C mrpt::maps::detail::logoddscell_traits< cell_t >
C mrpt::maps::detail::logoddscell_traits< cellType >
C mrpt::maps::detail::logoddscell_traits< int16_t >
C mrpt::maps::detail::logoddscell_traits< int16_t >
C mrpt::maps::detail::logoddscell_traits< int8_t >
C mrpt::maps::detail::logoddscell_traits< int8_t >
C mrpt::slam::detail::TPathBin2D::lt_operator Less-than ordering of bins for usage in STL containers
C mrpt::slam::detail::TPoseBin2D::lt_operator Less-than ordering of bins for usage in STL containers
C mrpt::slam::detail::TPoseBin3D::lt_operator Less-than ordering of bins for usage in STL containers
► C std::map< K, T > STL class
C mrpt::hmtslam::CRobotPosesGraph Auxiliary class used in mrpt::slam::CLocalMetricHypothesis for HMT-SLAM; this class stores a set of robot poses and its sensory frames and pose PDF, for being stored in a HMT-map as a serializable object in annotation NODE_ANNOTATION_POSES_GRAPH
C mrpt::utils::TParameters< T > For usage when passing a dynamic number of (numeric) arguments to a function, by name
C mrpt::utils::map_traits_stdmap::map< KEY, VALUE, _LessPred, _Alloc >
► C mrpt::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
C mrpt::utils::map_traits_map_as_vector::map< KEY, VALUE, _LessPred, _Alloc >
C mrpt::utils::map_as_vector< size_t, size_t >
C mrpt::utils::map_traits_map_as_vector Traits for using a mrpt::utils::map_as_vector<> (dense, fastest representation)
C mrpt::utils::map_traits_stdmap Traits for using a std::map<> (sparse representation)
C internal_mrpt::MatOrVecResizer< R, C >
C internal_mrpt::MatOrVecResizer< 1, 1 >
C internal_mrpt::MatOrVecResizer< 1, C >
C internal_mrpt::MatOrVecResizer< R, 1 >
► C Eigen::Matrix
► C mrpt::math::CArrayNumeric< double, N >
C mrpt::math::CArrayDouble< 2 >
C mrpt::math::CArrayDouble< 3 >
C mrpt::math::CArrayDouble< 5 >
C mrpt::math::CArrayDouble< N > A partial specialization of CArrayNumeric for double numbers
► C mrpt::math::CArrayNumeric< float, N >
C mrpt::math::CArrayFloat< N > A partial specialization of CArrayNumeric for float numbers
► C mrpt::math::CArrayNumeric< int, N >
C mrpt::math::CArrayInt< N > A partial specialization of CArrayNumeric for int numbers
► C mrpt::math::CArrayNumeric< unsigned int, N >
C mrpt::math::CArrayUInt< N > A partial specialization of CArrayNumeric for unsigned int numbers
► C mrpt::math::CArrayNumeric< T, 4 >
C mrpt::math::CQuaternion< T > A quaternion, which can represent a 3D rotation as pair , with a real part "r" and a 3D vector , or alternatively, q = r + ix + jy + kz
C mrpt::math::CMatrixFixedNumeric< double, DIM, DIM >
C mrpt::math::CMatrixFixedNumeric< double, DIM, 1 >
► C mrpt::math::CMatrixTemplateNumeric< double >
C mrpt::math::CMatrixD This class is a "CSerializable" wrapper for "CMatrixTemplateNumeric<double>"
C mrpt::math::CMatrixTemplateNumeric< kftype >
C mrpt::math::CArrayNumeric< T, N > CArrayNumeric is an array for numeric types supporting several mathematical operations (actually, just a wrapper on Eigen::Matrix<T,N,1>)
C mrpt::math::CMatrixFixedNumeric< T, NROWS, NCOLS > A numeric matrix of compile-time fixed size
► C mrpt::math::CMatrixTemplateNumeric< T > A matrix of dynamic size
C mrpt::math::CMatrix This class is a "CSerializable" wrapper for "CMatrixFloat"
C mrpt::math::dynamic_vector< T > Column vector, like Eigen::MatrixX*, but automatically initialized to zeros since construction
C mrpt::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
C mrpt::math::detail::MatrixWrapper< U, B > This template is a trick to switch the type of a variable using a boolean variable in the template
C mrpt::math::detail::MatrixWrapper< U, false >
C mrpt::math::detail::MatrixWrapper< U, true >
C mrpt::utils::metaprogramming::MemberFunctionWrapper< T, V > This template encapsulates a member function without arguments and a single object into a function
C mrpt::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*
C nanoflann::metric_L1 Metaprogramming helper traits class for the L1 (Manhattan) metric
C nanoflann::metric_L2 Metaprogramming helper traits class for the L2 (Euclidean) metric
C nanoflann::metric_L2_Simple Metaprogramming helper traits class for the L2_simple (Euclidean) metric
C mrpt::math::ModelSearch Model search implementations: RANSAC and genetic algorithm
► C mrpt::utils::mrptEvent The basic event type for the observer-observable pattern in MRPT
C mrpt::gui::mrptEvent3DWindowGrabImageFile An event sent by a CDisplayWindow3D window when an image is saved after enabling this feature with CDisplayWindow3D::grabImagesStart()
C mrpt::gui::mrptEventMouseDown An event sent by a window upon a mouse click, giving the (x,y) pixel coordinates
C mrpt::gui::mrptEventWindowChar An event sent by a window upon a char pressed by the user
C mrpt::gui::mrptEventWindowClosed An event sent by a window upon when it's about to be closed, either manually by the user or programatically
C mrpt::gui::mrptEventWindowResize An event sent by a window upon resize
C mrpt::maps::mrptEventMetricMapClear Event emitted by a metric up upon call of clear()
C mrpt::maps::mrptEventMetricMapInsert Event emitted by a metric up upon a succesful call to insertObservation()
C mrpt::opengl::mrptEventGLPostRender An event sent by an mrpt::opengl::COpenGLViewport after calling the scene OpenGL drawing primitives and before doing a glSwapBuffers
C mrpt::opengl::mrptEventGLPreRender An event sent by an mrpt::opengl::COpenGLViewport just after clearing the viewport and setting the GL_PROJECTION matrix, and before calling the scene OpenGL drawing primitives
C mrpt::utils::mrptEventOnDestroy An event sent by any CObservable object (automatically) just before being destroyed and telling its observers to unsubscribe
C mrpt::synch::MT_buffer This class is a bulk sequence of bytes with MultiThread (MT)-safe read and write operations
C mrpt::hwdrivers::CPtuHokuyo::my_pos
C stlplus::no_copy< T >
C nanoflann::KDTreeSingleIndexAdaptor< Distance, DatasetAdaptor, DIM, IndexType >::Node
► C NODE_ANNOTATIONS
C mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::global_pose_t The type of each global pose in nodes: an extension of the constraint_no_pdf_t pose with any optional user-defined data
C mrpt::graphs::detail::node_annotations_empty An empty structure
► C NODE_TYPE_DATA
C mrpt::nav::TMoveTree< NODE_TYPE_DATA, EDGE_TYPE, MAPS_IMPLEMENTATION >::NODE_TYPE
► C mrpt::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
C mrpt::utils::non_copiable_ptr< mrpt::maps::CMultiMetricMap >
C mrpt::utils::non_copiable_ptr< T > A wrapper class for pointers that can NOT be copied with "=" operator, raising an exception at runtime if a copy is attempted
C mrpt::utils::non_copiable_ptr_basic< mrpt::maps::CMultiMetricMap >
C mrpt::utils::non_copiable_ptr_basic< void >
C mrpt::utils::metaprogramming::NonConstBind1st< Op > Equivalent of std::bind1st for functions with non-const arguments
C mrpt::utils::metaprogramming::NonConstBind2nd< Op > Equivalent of std::bind2nd for functions with non-const arguments
C mrpt::hwdrivers::CNTRIPClient::NTRIPArgs The arguments for connecting to a NTRIP stream, used in CNTRIPClient::open
C mrpt::obs::gnss::nv_oem6_header_t Novatel OEM6 regular header structure
C mrpt::obs::gnss::nv_oem6_short_header_t Novatel OEM6 short header structure
C mrpt::utils::metaprogramming::ObjectClear An object for clearing an object (invokes its method "->clear()") given a pointer or smart-pointer, intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectClear2 An object for clearing an object (invokes its method ".clear()") given a pointer or smart-pointer, intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectClearSecond An object for clearing an object->second (invokes its method "clear()") given a pointer or smart-pointer, intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectClearUnique An object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectConvert< TARGET_TYPE > An object for transforming between types/classes, intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectDelete An object for deleting pointers (intended for STL algorithms)
C mrpt::utils::metaprogramming::ObjectMakeUnique An object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectPairMakeUnique An object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectReadFromStream An object for reading objects from a stream, intended for being used in STL algorithms
C mrpt::utils::metaprogramming::ObjectWriteToStream An object for writing objects to a stream, intended for being used in STL algorithms
C mrpt::graphslam::graphslam_traits< GRAPH_T >::observation_info_t Auxiliary struct used in graph-slam implementation: It holds the relevant information for each of the constraints being taking into account
C TCLAP::OptionalUnlabeledTracker< DUMMY >
C mrpt::pbmap::PbMapLocaliser
C mrpt::pbmap::PbMapMaker
C mrpt::obs::VelodyneCalibration::PerLaserCalib
C mrpt::slam::PF_implementation< PARTICLE_TYPE, MYSELF > A set of common data shared by PF implementations for both SLAM and localization
► C mrpt::slam::PF_implementation< CRBPFParticleData, CMultiMetricMapPDF >
C mrpt::maps::CMultiMetricMapPDF Declares a class that represents a Rao-Blackwellized set of particles for solving the SLAM problem (This class is the base of RBPF-SLAM applications)
► C mrpt::slam::PF_implementation< mrpt::poses::CPose2D, CMonteCarloLocalization2D >
C mrpt::slam::CMonteCarloLocalization2D Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples
► C mrpt::slam::PF_implementation< mrpt::poses::CPose3D, CMonteCarloLocalization3D >
C mrpt::slam::CMonteCarloLocalization3D Declares a class that represents a Probability Density Function (PDF) over a 3D pose (x,y,phi,yaw,pitch,roll), using a set of weighted samples
C mrpt::pbmap::PlaneInferredInfo A class used to infer some semantic meaning to the planes of a PbMap
C mrpt::nav::PlannerRRT_SE2_TPS TP Space-based RRT path planning for SE(2) (planar) robots
C mrpt::nav::PlannerSimple2D Searches for collision-free path in 2D occupancy grids for holonomic circular robots
► C mrpt::utils::PLY_Exporter A virtual base class that implements the capability of exporting 3D point clouds and faces to a file in the Stanford PLY format
C mrpt::maps::CPointsMap A cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors
C mrpt::opengl::CPointCloud A cloud of points, all with the same color or each depending on its value along a particular coordinate axis
C mrpt::opengl::CPointCloudColoured A cloud of points, each one with an individual colour (R,G,B)
► C mrpt::utils::PLY_Importer A virtual base class that implements the capability of importing 3D point clouds and faces from a file in the Stanford PLY format
C mrpt::maps::CPointsMap A cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors
C mrpt::opengl::CPointCloud A cloud of points, all with the same color or each depending on its value along a particular coordinate axis
C mrpt::opengl::CPointCloudColoured A cloud of points, each one with an individual colour (R,G,B)
C mrpt::utils::PointCloudAdapter< POINTCLOUD > An adapter to different kinds of point cloud object
C mrpt::utils::PointCloudAdapter< mrpt::maps::CColouredPointsMap > Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CColouredPointsMap>
C mrpt::utils::PointCloudAdapter< mrpt::opengl::CPointCloudColoured > Specialization mrpt::utils::PointCloudAdapter<mrpt::opengl::CPointCloudColoured>
C mrpt::utils::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGB > > Specialization mrpt::utils::PointCloudAdapter <pcl::PointCloud<pcl::PointXYZRGB> > for an XYZ point cloud with RGB
C mrpt::utils::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGBA > > Specialization mrpt::utils::PointCloudAdapter <pcl::PointCloud<pcl::PointXYZRGBA> > for an XYZ point cloud with RGB
C 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
► C mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::maps::CPointsMap, float >
C mrpt::utils::PointCloudAdapter< mrpt::maps::CPointsMap > Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CPointsMap>
► C mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::maps::CSimplePointsMap, float >
C mrpt::utils::PointCloudAdapter< mrpt::maps::CSimplePointsMap > Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CSimplePointsMap>
► C mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::maps::CWeightedPointsMap, float >
C mrpt::utils::PointCloudAdapter< mrpt::maps::CWeightedPointsMap > Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CWeightedPointsMap>
► C mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::obs::CObservation3DRangeScan, float >
C mrpt::utils::PointCloudAdapter< mrpt::obs::CObservation3DRangeScan > Specialization mrpt::utils::PointCloudAdapter<CObservation3DRangeScan>
► C mrpt::utils::detail::PointCloudAdapterHelperNoRGB< mrpt::opengl::CPointCloud, float >
C mrpt::utils::PointCloudAdapter< mrpt::opengl::CPointCloud > Specialization mrpt::utils::PointCloudAdapter<mrpt::opengl::CPointCloud>
► C mrpt::utils::detail::PointCloudAdapterHelperNoRGB< pcl::PointCloud< pcl::PointXYZ >, float >
C mrpt::utils::PointCloudAdapter< pcl::PointCloud< pcl::PointXYZ > > Specialization mrpt::utils::PointCloudAdapter <pcl::PointCloud<pcl::PointXYZ> > for an XYZ point cloud (without RGB)
C mrpt::maps::detail::pointmap_traits< Derived >
C nanoflann::PooledAllocator
► C mrpt::poses::detail::pose_point_impl< DERIVEDCLASS, IS3D >
C mrpt::poses::CPoseOrPoint< CPoint2D >
C mrpt::poses::CPoseOrPoint< CPoint3D >
C mrpt::poses::CPoseOrPoint< CPose2D >
C mrpt::poses::CPoseOrPoint< CPose3D >
C mrpt::poses::CPoseOrPoint< CPose3DQuat >
C mrpt::poses::CPoseOrPoint< CPose3DRotVec >
C mrpt::poses::detail::pose_point_impl< CPoint2D, mrpt::poses::detail::T3DTypeHelper< CPoint2D >::is_3D_val >
C mrpt::poses::detail::pose_point_impl< CPoint3D, mrpt::poses::detail::T3DTypeHelper< CPoint3D >::is_3D_val >
C mrpt::poses::detail::pose_point_impl< CPose2D, mrpt::poses::detail::T3DTypeHelper< CPose2D >::is_3D_val >
C mrpt::poses::detail::pose_point_impl< CPose3D, mrpt::poses::detail::T3DTypeHelper< CPose3D >::is_3D_val >
C mrpt::poses::detail::pose_point_impl< CPose3DQuat, mrpt::poses::detail::T3DTypeHelper< CPose3DQuat >::is_3D_val >
C mrpt::poses::detail::pose_point_impl< CPose3DRotVec, mrpt::poses::detail::T3DTypeHelper< CPose3DRotVec >::is_3D_val >
C mrpt::poses::detail::pose_point_impl< DERIVEDCLASS, 0 >
C mrpt::poses::detail::pose_point_impl< DERIVEDCLASS, 1 >
► C mrpt::poses::detail::pose_point_impl< DERIVEDCLASS, mrpt::poses::detail::T3DTypeHelper< DERIVEDCLASS >::is_3D_val >
► C mrpt::poses::CPoseOrPoint< DERIVEDCLASS > The base template class for 2D & 3D points and poses
► C mrpt::poses::CPoint< CPoint2D >
C mrpt::poses::CPoint2D A class used to store a 2D point
► C mrpt::poses::CPoint< CPoint3D >
C mrpt::poses::CPoint3D A class used to store a 3D point
► C mrpt::poses::CPose< CPose2D >
C mrpt::poses::CPose2D A class used to store a 2D pose
► C mrpt::poses::CPose< CPose3D >
C mrpt::poses::CPose3D A class used to store a 3D pose (a 3D translation + a rotation in 3D)
► C mrpt::poses::CPose< CPose3DQuat >
C mrpt::poses::CPose3DQuat A class used to store a 3D pose as a translation (x,y,z) and a quaternion (qr,qx,qy,qz)
► C mrpt::poses::CPose< CPose3DRotVec >
C mrpt::poses::CPose3DRotVec A 3D pose, with a 3D translation and a rotation in 3D parameterized in rotation-vector form (equivalent to axis-angle)
C mrpt::poses::CPoint< DERIVEDCLASS > A base class for representing a point in 2D or 3D
C mrpt::poses::CPose< DERIVEDCLASS > A base class for representing a pose in 2D or 3D
C mrpt::nav::PoseDistanceMetric< NODE_TYPE > Generic base for metrics
C mrpt::nav::PoseDistanceMetric< TNodeSE2 > Pose metric for SE(2)
C mrpt::nav::PoseDistanceMetric< TNodeSE2_TP > Pose metric for SE(2) limited to a given PTG manifold
C mrpt::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_cast
ed to SELECTED_CLASS_PTR
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CColouredOctoMapPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CGasConcentrationGridMap2DPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CHeightGridMap2D_MRFPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CHeightGridMap2DPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::COccupancyGridMap2DPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::COctoMapPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CReflectivityGridMap2DPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CSimplePointsMapPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxyFilterContainerByClass< mrpt::maps::CWirelessPowerGridMap2DPtr, TListMaps >
C mrpt::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)
C mrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CBeaconMapPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CColouredPointsMapPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CLandmarksMapPtr, TListMaps >
C mrpt::maps::CMultiMetricMap::ProxySelectorContainerByClass< mrpt::maps::CWeightedPointsMapPtr, TListMaps >
C nanoflann::RadiusResultSet< DistanceType, IndexType > A result-set class used when performing a radius based search
C mrpt::obs::CObservationVelodyneScan::raw_block_t Raw Velodyne data block
C mrpt::opengl::CAngularObservationMesh::TDoubleRange::rd Union type with the actual data
C mrpt::math::detail::ReverseAccessorIterator< A, T > Template class for matrix accessor's iterators
C mrpt::math::RobustKernel< KERNEL_TYPE, T >
C mrpt::math::RobustKernel< rkLeastSquares, T > No robust kernel, use standard least squares: rho(r) = r^2
C mrpt::math::RobustKernel< rkPseudoHuber, T > Pseudo-huber robust kernel: rho(r) = 2 * delta^2 * ( -1+sqrt( 1+ r^2/delta^2 ) )
► C mrpt::utils::safe_ptr_basic< T > A wrapper class for pointers that can be safely copied with "=" operator without problems
C mrpt::utils::safe_ptr< mrpt::hmtslam::CHierarchicalMHMap >
C mrpt::utils::safe_ptr< mrpt::hmtslam::CHMTSLAM >
C mrpt::utils::safe_ptr< mrpt::opengl::COpenGLScene >
C mrpt::utils::safe_ptr< T > A wrapper class for pointers that can be safely copied with "=" operator without problems
C mrpt::utils::safe_ptr_basic< mrpt::hmtslam::CHierarchicalMHMap >
C mrpt::utils::safe_ptr_basic< mrpt::hmtslam::CHMTSLAM >
C mrpt::utils::safe_ptr_basic< mrpt::opengl::COpenGLScene >
C mrpt::poses::SE_average< 2 > Computes weighted and un-weighted averages of SE(2) poses
C mrpt::poses::SE_average< 3 > Computes weighted and un-weighted averages of SE(3) poses
C mrpt::poses::SE_traits< 2 > Specialization of SE for 2D poses
C mrpt::poses::SE_traits< 3 > Specialization of SE for 3D poses
C nanoflann::SearchParams Search options for KDTreeSingleIndexAdaptor::findNeighbors()
C mrpt::pbmap::Segment
C mrpt::pbmap::SemanticClustering
► C std::set< K > STL class
C mrpt::hmtslam::THypothesisIDSet A set of hypothesis IDs, used for arcs and nodes in multi-hypothesis hybrid maps
► C stlplus::smart_ptr_base< T, C, COUNTER >
► C stlplus::smart_ptr< std::vector< char > >
C mrpt::utils::CReferencedMemBlock Represents a memory block (via "void*") that can be shared between several objects through copy operator (=)
C stlplus::smart_ptr< CDevice >
C stlplus::smart_ptr< CParameterizedTrajectoryGenerator >
C stlplus::smart_ptr< TPixelLabelInfoBase >
C stlplus::smart_ptr< mrpt::opengl::C3DSScene::TImpl3DS >
C stlplus::smart_ptr< mrpt::opengl::CAssimpModel::TImplAssimp >
► C stlplus::smart_ptr_clone< CObject >
C mrpt::utils::CObjectPtr A smart pointer to a CObject object
C stlplus::smart_ptr< T, COUNTER >
C stlplus::smart_ptr_clone< T, COUNTER >
C stlplus::smart_ptr_nocopy< T, COUNTER >
C stlplus::smart_ptr_base< CDevice, constructor_copy< CDevice >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< CObject, clone_copy< CObject >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< CParameterizedTrajectoryGenerator, constructor_copy< CParameterizedTrajectoryGenerator >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< mrpt::opengl::C3DSScene::TImpl3DS, constructor_copy< mrpt::opengl::C3DSScene::TImpl3DS >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< mrpt::opengl::CAssimpModel::TImplAssimp, constructor_copy< mrpt::opengl::CAssimpModel::TImplAssimp >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< std::vector< char >, constructor_copy< std::vector< char > >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< T, clone_copy< T >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< T, constructor_copy< T >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< T, no_copy< T >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_base< TPixelLabelInfoBase, constructor_copy< TPixelLabelInfoBase >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< T, COUNTER >
C stlplus::smart_ptr_holder< CDevice, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< CObject, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< CParameterizedTrajectoryGenerator, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< mrpt::opengl::C3DSScene::TImpl3DS, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< mrpt::opengl::CAssimpModel::TImplAssimp, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< std::vector< char >, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< T, mrpt::synch::CAtomicCounter >
C stlplus::smart_ptr_holder< TPixelLabelInfoBase, mrpt::synch::CAtomicCounter >
C mrpt::poses::SO_average< 2 > Computes weighted and un-weighted averages of SO(2) orientations
C mrpt::poses::SO_average< 3 > Computes weighted and un-weighted averages of SO(3) orientations
C mrpt::system::Split
► C std::streambuf
C mrpt::utils::CConsoleRedirector By creating an object of this class, all the output to std::cout (and std::cerr) will be redirected to a text file, and optionally also shown on the console
C mrpt::pbmap::Subgraph
C mrpt::pbmap::SubgraphMatcher
C mrpt::obs::T2DScanProperties Auxiliary struct that holds all the relevant geometry information about a 2D scan
C mrpt::poses::detail::T3DTypeHelper< POSEORPOINT >
C mrpt::poses::detail::T3DTypeHelper< CPoint2D >
C mrpt::poses::detail::T3DTypeHelper< CPoint3D >
C mrpt::poses::detail::T3DTypeHelper< CPose2D >
C mrpt::poses::detail::T3DTypeHelper< CPose3D >
C mrpt::poses::detail::T3DTypeHelper< CPose3DQuat >
C mrpt::poses::detail::T3DTypeHelper< CPose3DRotVec >
C mrpt::nav::PlannerRRT_SE2_TPS::TAlgorithmParams
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TaskDescription Each of the tasks to create in CNationalInstrumentsDAQ::initialize()
C mrpt::math::detail::TAuxResizer< MAT, TypeSizeAtCompileTime > Internal resize which compiles to nothing on fixed-size matrices
C mrpt::math::detail::TAuxResizer< MAT,-1 >
C mrpt::vision::CFeatureExtraction::TOptions::TBCDOptions BCD Options
C mrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromTBI::TBI_info
C mrpt::obs::CObservation3DRangeScan::TCached3DProjTables Look-up-table struct for project3DPointsFromDepthImageInto()
C mrpt::utils::CTimeLogger::TCallData Data of all the calls:
C mrpt::utils::CTimeLogger::TCallStats Data of each call section: # of calls, minimum, maximum, average and overall execution time (in seconds)
C mrpt::hwdrivers::CImageGrabber_dc1394::TCameraInfo Used in enumerateCameras
C mrpt::hwdrivers::TCaptureCVOptions Options used when creating an OpenCV capture object Some options apply to IEEE1394 cameras only
C mrpt::hwdrivers::TCaptureOptions_bumblebee Options used when creating a bumblebee camera capture object
C mrpt::hwdrivers::TCaptureOptions_dc1394 Options used when creating an dc1394 capture object All but the frame size, framerate, and color_coding can be changed dynamically by CImageGrabber_dc1394::changeCaptureOptions
C mrpt::hwdrivers::TCaptureOptions_DUO3D Options used when creating a camera capture object of type CImageGrabber_FlyCapture2
C mrpt::hwdrivers::TCaptureOptions_FlyCapture2 Options used when creating a camera capture object of type CImageGrabber_FlyCapture2
C mrpt::hwdrivers::TCaptureOptions_SVS Options used when creating a STOC Videre Design camera capture object
C mrpt::nav::CParameterizedTrajectoryGenerator::TCellForLambdaFunction Specifies the min/max values for "k" and "n", respectively
C mrpt::utils::TColor A RGB color - 8bit
C mrpt::utils::TColorf A RGB color - floats in the range [0,1]
C mrpt::obs::gnss::Message_NV_OEM6_VERSION::TComponentVersion
C mrpt::obs::gnss::Message_NV_OEM6_RANGECMP::TCompressedRangeLog
C mrpt::topography::TCoords A 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
C mrpt::nav::TCPoint Trajectory points in C-Space
C mrpt::maps::COccupancyGridMap2D::TCriticalPointsList The structure used to store the set of Voronoi diagram critical points
C mrpt::maps::CLandmarksMap::TCustomSequenceLandmarks The list of landmarks: the wrapper class is just for maintaining the KD-Tree representation
C mrpt::slam::TDataAssociationResults The results from mrpt::slam::data_association
C mrpt::slam::CRangeBearingKFSLAM2D::TDataAssocInfo Information for data-association:
C mrpt::slam::CRangeBearingKFSLAM::TDataAssocInfo Information for data-association:
C mrpt::obs::CObservationGasSensors::CMOSmodel::TdataMap The content of each m_lastObservations in the estimation when using the option : MOS_MODEl (useMOSmodel =1)
C mrpt::slam::CRejectionSamplingRangeOnlyLocalization::TDataPerBeacon Data for each beacon observation with a correspondence with the map
C mrpt::topography::TDatum10Params Parameters for a topographic transfomation
C mrpt::topography::TDatum1DTransf Parameters for a topographic transfomation
C mrpt::topography::TDatum7Params Parameters for a topographic transfomation
C mrpt::topography::TDatum7Params_TOPCON
C mrpt::topography::TDatumHelmert2D Parameters for a topographic transfomation
C mrpt::topography::TDatumHelmert2D_TOPCON
C mrpt::topography::TDatumHelmert3D Parameters for a topographic transfomation
C mrpt::topography::TDatumHelmert3D_TOPCON Parameters for a topographic transfomation
C mrpt::topography::TDatumTransfInterpolation Parameters for a topographic transfomation
C mrpt::vision::CFeature::TDescriptors All the possible descriptors this feature may have
C mrpt::slam::CMetricMapBuilderICP::TDist Traveled distances from last map update / ICP-based localization
C mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::TDistance Auxiliary struct for topological distances from root node
C mrpt::detectors::CDetectorDoorCrossing::TDoorCrossingOutParams A structure used as output in this method
C mrpt::opengl::CAngularObservationMesh::TDoubleRange Range specification type, with several uses
C mrpt::graphs::CDirectedTree< TYPE_EDGES >::TEdgeInfo
C mrpt::topography::TEllipsoid
C mrpt::hwdrivers::CRovio::TEncoders
C mrpt::nav::PlannerRRT_SE2_TPS::TEndCriteria
C mrpt::maps::COccupancyGridMap2D::TEntropyInfo Used for returning entropy related information
C mrpt::math::MatrixBlockSparseCols< Scalar, NROWS, NCOLS, INFO, HAS_REMAP, INDEX_REMAP_MAP_IMPL >::TEntry
C mrpt::utils::TEnumType< ENUMTYPE > A helper class that can convert an enum value into its textual representation, and viceversa
C mrpt::utils::TEnumTypeFiller< ENUMTYPE > Only specializations of this class are defined for each enum type of interest
C mrpt::utils::TEnumTypeFiller< bayes::TKFMethod >
C mrpt::utils::TEnumTypeFiller< hwdrivers::CGPSInterface::PARSERS >
C mrpt::utils::TEnumTypeFiller< hwdrivers::CKinect::TVideoChannel >
C mrpt::utils::TEnumTypeFiller< hwdrivers::CVelodyneScanner::model_t >
C mrpt::utils::TEnumTypeFiller< maps::CHeightGridMap2D::TMapRepresentation >
C mrpt::utils::TEnumTypeFiller< maps::CRandomFieldGridMap2D::TMapRepresentation >
C mrpt::utils::TEnumTypeFiller< mrpt::obs::CObservation3DRangeScan::TIntensityChannelID >
C mrpt::utils::TEnumTypeFiller< nav::CHolonomicND::TSituations >
C mrpt::utils::TEnumTypeFiller< nav::THolonomicMethod >
C mrpt::utils::TEnumTypeFiller< poses::CPose3DInterpolator::TInterpolatorMethod >
C mrpt::utils::TEnumTypeFiller< slam::CGridMapAligner::TAlignerMethod >
C mrpt::utils::TEnumTypeFiller< slam::TDataAssociationMethod >
C mrpt::utils::TEnumTypeFiller< slam::TDataAssociationMetric >
C mrpt::utils::TEnumTypeFiller< slam::TICPAlgorithm >
C mrpt::utils::TEnumTypeFiller< slam::TICPCovarianceMethod >
C mrpt::obs::CObservation2DRangeScanWithUncertainty::TEvalParams
C mrpt::vision::CGenericFeatureTracker::TExtraOutputInfo
C mrpt::bayes::CParticleFilterCapable::TFastDrawAuxVars Auxiliary vectors, see CParticleFilterCapable::prepareFastDrawSample for more information
C mrpt::vision::CFeatureExtraction::TOptions::TFASTOptions FAST and FASTER Options
C mrpt::vision::TFeatureObservation One feature observation entry, used within sequences with TSequenceFeatureObservations
C mrpt::system::CDirectoryExplorer::TFileInfo This represents the information about each file
C mrpt::system::CFileSystemWatcher::TFileSystemChange Each of the changes detected by utils::CFileSystemWatcher
► C mrpt::opengl::TFontParams A description of a bitmapped or vectorized text font
C mrpt::opengl::T2DTextData An auxiliary struct for holding a list of text messages in some mrpt::opengl & mrpt::gui classes The font can be either a bitmapped or a vectorized font
C mrpt::hwdrivers::TFTDIDevice A list of FTDI devices and their descriptors
C mrpt::maps::CLandmarksMap::TFuseOptions With this struct options are provided to the fusion process
C mrpt::nav::CHolonomicND::TGap The structure used to store a detected gap in obstacles
C mrpt::maps::CGasConcentrationGridMap2D::TGaussianCell
C mrpt::poses::CPointPDFSOG::TGaussianMode The struct for each mode:
C mrpt::poses::CPose3DPDFSOG::TGaussianMode The struct for each mode:
C mrpt::poses::CPosePDFSOG::TGaussianMode The struct for each mode:
C mrpt::maps::CGasConcentrationGridMap2D::TGaussianWindTable
C mrpt::obs::CObservationVelodyneScan::TGeneratePointCloudParameters
C mrpt::obs::CObservationVelodyneScan::TGeneratePointCloudSE3Results Results for generatePointCloudAlongSE3Trajectory()
C mrpt::topography::TGeodeticCoords A set of geodetic coordinates: latitude, longitude and height, defined over a given geoid (typically, WGS84)
C mrpt::maps::CLandmarksMap::TLikelihoodOptions::TGPSOrigin This 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
C mrpt::graphs::TGraphvizExportParams Used in mrpt::graphs export functions to .dot files
C mrpt::opengl::COctoMapVoxels::TGridCube The info of each grid block
C mrpt::vision::CFeatureExtraction::TOptions::THarrisOptions Harris Options
C mrpt::maps::THeightGridmapCell The contents of each cell in a CHeightGridMap2D map
C mrpt::nav::CAbstractPTGBasedReactive::THolonomicMovement The structure used for storing a movement generated by a holonomic-method
C mrpt::system::detail::ThreadCreateFunctor< T >
C mrpt::system::detail::ThreadCreateFunctor< void * >
C mrpt::system::detail::ThreadCreateFunctorNoParams
C mrpt::system::detail::ThreadCreateObjectFunctor< CLASS, PARAM >
C mrpt::system::detail::ThreadCreateObjectFunctorNoParams< CLASS >
C mrpt::hwdrivers::ThreadParams
C mrpt::vision::TImageCalibData Data 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)
C mrpt::vision::TImageROI A structure for defining a ROI within an image
C mrpt::vision::TImageStereoCalibData Data 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)
C mrpt::vision::TImageStereoCallbackData Params of the optional callback provided by the user
C mrpt::opengl::C3DSScene::TImpl3DS A container for automatic deletion of lib3ds's scene when the last reference of the smart_ptr's is destroyed
C mrpt::opengl::CAssimpModel::TImplAssimp A container for automatic deletion of lib3ds's scene when the last reference of the smart_ptr's is destroyed
C mrpt::nav::CAbstractPTGBasedReactive::TInfoPerPTG
C mrpt::nav::CLogFileRecord::TInfoPerPTG The structure used to store all relevant information about each transformation into TP-Space
C mrpt::hwdrivers::CNationalInstrumentsDAQ::TInfoPerTask
C mrpt::opengl::CAssimpModel::TInfoPerTexture
C mrpt::opengl::COctoMapVoxels::TInfoPerVoxelSet
► C mrpt::maps::CRandomFieldGridMap2D::TInsertionOptionsCommon Parameters common to any derived class
C mrpt::maps::CGasConcentrationGridMap2D::TInsertionOptions Parameters related with inserting observations into the map:
C mrpt::maps::CHeightGridMap2D_MRF::TInsertionOptions Parameters related with inserting observations into the map
C mrpt::maps::CWirelessPowerGridMap2D::TInsertionOptions Parameters related with inserting observations into the map:
C mrpt::maps::CLandmarksMap::TInsertionResults This struct stores extra results from invoking insertObservation
C mrpt::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)
C mrpt::math::KDTreeCapable< Derived, num_t, metric_t >::TKDTreeDataHolder< 2 >
C mrpt::math::KDTreeCapable< Derived, num_t, metric_t >::TKDTreeDataHolder< 3 >
C mrpt::math::KDTreeCapable< Derived, num_t, metric_t >::TKDTreeSearchParams
C mrpt::kinematics::TKinematicLink An individual kinematic chain element (one link) which builds up a CKinematicChain
C mrpt::vision::CFeatureExtraction::TOptions::TKLTOptions KLT Options
C mrpt::maps::CPointsMap::TLaserRange2DInsertContext Helper struct used for internal_loadFromRangeScan2D_prepareOneRange()
C mrpt::maps::CPointsMap::TLaserRange3DInsertContext Helper struct used for internal_loadFromRangeScan3D_prepareOneRange()
C mrpt::maps::COccupancyGridMap2D::TLaserSimulUncertaintyParams Input params for laserScanSimulatorWithUncertainty()
C mrpt::maps::COccupancyGridMap2D::TLaserSimulUncertaintyResult Output params for laserScanSimulatorWithUncertainty()
C mrpt::opengl::COpenGLViewport::TLastProjectiveMatrixInfo
C mrpt::maps::COccupancyGridMap2D::TLikelihoodOutput Some members of this struct will contain intermediate or output data after calling "computeObservationLikelihood" for some likelihood functions
C mrpt::math::TLine2D 2D line without bounds, represented by its equation
C mrpt::math::TLine3D 3D line, represented by a base point and a director vector
C mrpt::vision::CFeatureExtraction::TOptions::TLogPolarImagesOptions LogPolarImagesOptions Options
C mrpt::maps::TMatchingExtraResults Additional results from the determination of matchings between point clouds, etc., apart from the pairings themselves
C mrpt::utils::TMatchingPair A structure for holding correspondences between two sets of points or points-like entities in 2D or 3D
C mrpt::maps::TMatchingParams Parameters for the determination of matchings between point clouds, etc
C mrpt::maps::TMatchingRatioParams Parameters for CMetricMap::compute3DMatchingRatio()
C mrpt::detectors::CFaceDetection::TMeasurement
C mrpt::obs::CObservation6DFeatures::TMeasurement Each one of the measurements
C mrpt::obs::CObservationBeaconRanges::TMeasurement Each one of the measurements:
C mrpt::obs::CObservationBearingRange::TMeasurement Each one of the measurements:
C mrpt::obs::CObservationRange::TMeasurement
C mrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromAA Message definition:
C mrpt::hmtslam::CHMTSLAM::TMessageLSLAMfromTBI Message definition:
C mrpt::hmtslam::CHMTSLAM::TMessageLSLAMtoTBI Message definition:
C mrpt::maps::internal::TMetricMapTypesRegistry Class factory & registry for map classes
C mrpt::hwdrivers::CVelodyneScanner::TModelProperties Hard-wired properties of LIDARs depending on the model
C mrpt::hwdrivers::CVelodyneScanner::TModelPropertiesFactory Access to default sets of parameters for Velodyne LIDARs
C mrpt::slam::TMonteCarloLocalizationParams The struct for passing extra simulation parameters to the prediction stage when running a particle filter
C mrpt::obs::CActionRobotMovement2D::TMotionModelOptions The parameter to be passed to "computeFromOdometry"
C mrpt::hwdrivers::CNTRIPClient::TMountPoint A descriptor of one stream in an NTRIP Caster - See CNTRIPClient::retrieveListOfMountpoints
C mrpt::nav::TMoveEdgeSE2_TP An edge for the move tree used for planning in SE2 and TP-space
C mrpt::random::CRandomGenerator::TMT19937_data Data used internally by the MT19937 PRNG algorithm
C mrpt::vision::TMultiResMatchingOutput Struct containing the output after matching multi-resolution SIFT-like descriptors
► C mrpt::nav::CAbstractReactiveNavigationSystem::TNavigationParams The struct for configuring navigation requests
C mrpt::nav::CAbstractPTGBasedReactive::TNavigationParamsPTG The struct for configuring navigation requests to CAbstractPTGBasedReactive and derived classes
C mrpt::opengl::COctreePointRenderer< Derived >::TNode The structure for each octree spatial node
C mrpt::nav::TNodeSE2
C mrpt::nav::TNodeSE2_TP
C mrpt::math::TObject2D Standard type for storing any lightweight 2D type
C mrpt::math::TObject2D::tobject2d_data_t Union type storing pointers to every allowed type
C mrpt::math::TObject3D Standard object for storing any 3D lightweight object
C mrpt::math::TObject3D::tobject3d_data_t Union containing pointer to actual data
C mrpt::obs::CObservationGasSensors::TObservationENose The structure for each e-nose
C mrpt::maps::CRandomFieldGridMap2D::TobservationGMRF
C mrpt::detectors::CCascadeClassifierDetection::TOptions
C mrpt::detectors::CDetectorDoorCrossing::TOptions In this structure parameters can be changed to customize the behaviour of this algorithm
C mrpt::detectors::CFaceDetection::TOptions
C mrpt::hwdrivers::CRovio::TOptions
C mrpt::poses::CRobot2DPoseEstimator::TOptions
C mrpt::slam::CMetricMapBuilder::TOptions Options for the algorithm
C mrpt::obs::CActionRobotMovement2D::TMotionModelOptions::TOptions_GaussianModel Options 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/
C mrpt::obs::CActionRobotMovement2D::TMotionModelOptions::TOptions_ThrunModel Options 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/
C mrpt::vision::CFeatureExtraction::TOptions::TORBOptions ORB Options
C mrpt::slam::CGridMapAligner::TReturnInfo::TPairPlusDistance
C mrpt::bayes::CParticleFilter::TParticleFilterStats Statistics for being returned from the "execute" method
C mrpt::hmtslam::CLSLAM_RBPF_2DLASER::TPathBin Auxiliary structure
C mrpt::slam::detail::TPathBin2D Auxiliary structure
C mrpt::topography::TPathFromRTKInfo Used to return optional information from mrpt::topography::path_from_rtk_gps
C mrpt::utils::TPixelCoord A pair (x,y) of pixel coordinates (integer resolution)
C mrpt::utils::TPixelCoordf A pair (x,y) of pixel coordinates (subpixel resolution)
► C mrpt::obs::CObservation3DRangeScan::TPixelLabelInfoBase Virtual interface to all pixel-label information structs
C mrpt::obs::CObservation3DRangeScan::TPixelLabelInfo< BYTES_REQUIRED_ >
C mrpt::math::TPlane 3D Plane, represented by its equation
C mrpt::nav::PlannerRRT_SE2_TPS::TPlannerInput
C mrpt::nav::PlannerRRT_SE2_TPS::TPlannerResult
C mrpt::math::TPoint2D Lightweight 2D point
C mrpt::math::TPoint3D Lightweight 3D point
C mrpt::math::TPoint3Df Lightweight 3D point (float version)
C mrpt::obs::CObservationVelodyneScan::TPointCloud See point_cloud and scan_packets
C mrpt::opengl::CPointCloudColoured::TPointColour
C mrpt::maps::CHeightGridMap2D_Base::TPointInsertParams Extra params for insertIndividualPoint()
C mrpt::math::TPointXYZfIu8 XYZ point (float) + Intensity(u8)
C mrpt::math::TPointXYZfRGBu8 XYZ point (float) + RGB(u8)
C mrpt::math::TPointXYZIu8 XYZ point (double) + Intensity(u8)
C mrpt::math::TPointXYZRGBu8 XYZ point (double) + RGB(u8)
C mrpt::vision::CFeatureExtraction::TOptions::TPolarImagesOptions PolarImagesOptions Options
C mrpt::math::TPolygonWithPlane Slightly heavyweight type to speed-up calculations with polygons in 3D
C mrpt::opengl::CPolyhedron::TPolyhedronEdge Struct used to store a polyhedron edge
C mrpt::opengl::CPolyhedron::TPolyhedronFace Struct used to store a polyhedron face
C mrpt::math::TPose2D Lightweight 2D pose
C mrpt::math::TPose3D Lightweight 3D pose (three spatial coordinates, plus three angular coordinates)
C mrpt::math::TPose3DQuat Lightweight 3D pose (three spatial coordinates, plus a quaternion )
C mrpt::slam::detail::TPoseBin2D Auxiliary structure used in KLD-sampling in particle filters
C mrpt::slam::detail::TPoseBin3D Auxiliary structure used in KLD-sampling in particle filters
C mrpt::hmtslam::TPoseInfo Information kept for each robot pose used in CRobotPosesGraph
C mrpt::graphs::detail::TPosePDFHelper< POSE_PDF >
C mrpt::graphs::detail::TPosePDFHelper< CPose2D >
C mrpt::graphs::detail::TPosePDFHelper< CPose3D >
C mrpt::tfest::TPotentialMatch For each individual-compatibility (IC) test, the indices of the candidate match between elements in both reference frames
C mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::TPrevious Auxiliary struct for backward paths
C mrpt::utils::TPropertyValueIDTriplet Internal triplet for each property in utils::CMHPropertiesValuesList
C mrpt::utils::CPropertiesValuesList::TPropertyValuePair
C mrpt::nav::CReactiveNavigationSystem3D::TPTGmultilevel A set of PTGs of the same type, one per "height level"
C mrpt::opengl::CGeneralizedCylinder::TQuadrilateral Auxiliary struct holding any quadrilateral, represented by foour points
C nanoflann::metric_L1::traits< T, DataSource >
C nanoflann::metric_L2::traits< T, DataSource >
C nanoflann::metric_L2_Simple::traits< T, DataSource >
C mrpt::maps::TRandomFieldCell The contents of each cell in a CRandomFieldGridMap2D map
C mrpt::vision::TRelativeFeaturePos One relative feature observation entry, used with some relative bundle-adjustment functions
C mrpt::opengl::gl_utils::TRenderInfo Information about the rendering process being issued
C mrpt::maps::COctoMapBase< OCTREE, OCTREE_NODE >::TRenderingOptions Options for the conversion of a mrpt::maps::COctoMap into a mrpt::opengl::COctoMapVoxels
C mrpt::nav::PlannerRRT_SE2_TPS::TRenderPlannedPathOptions Options for renderMoveTree()
C mrpt::opengl::COctreePointRenderer< Derived >::TRenderQueueElement
C mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::TResultInfo
C mrpt::graphslam::TResultInfoSpaLevMarq Output information for mrpt::graphslam::optimize_graph_spa_levmarq()
C mrpt::slam::CGridMapAligner::TReturnInfo The ICP algorithm return information
C mrpt::slam::CICP::TReturnInfo The ICP algorithm return information
C mrpt::hwdrivers::CActivMediaRobotBase::TRobotDescription A structure describing the robot
C mrpt::hmtslam::CLocalMetricHypothesis::TRobotPosesPartitioning Used by AA thread
C mrpt::nav::TRobotShape A 3D robot shape stored as a "sliced" stack of 2D polygons, used for CReactiveNavigationSystem3D
C mrpt::vision::TROI A structure for storing a 3D ROI
C mrpt::hwdrivers::CRovio::TRovioState
C mrpt::utils::TRuntimeClassId A structure that holds runtime class type information
C mrpt::tfest::TSE2RobustParams Parameters for se2_l2_robust()
C mrpt::tfest::TSE2RobustResult Output placeholder for se2_l2_robust()
C mrpt::tfest::TSE3RobustParams Parameters for se3_l2_robust()
C mrpt::tfest::TSE3RobustResult Output placeholder for se3_l2_robust()
C mrpt::math::TSegment2D 2D segment, consisting of two points
C mrpt::math::TSegment3D 3D segment, consisting of two points
C mrpt::hwdrivers::TSensorClassId A structure for runtime ID class type information in the context of hwdrivers::CGenericSensor
C mrpt::hwdrivers::CHokuyoURG::TSensorInfo Used in CHokuyoURG::displayVersionInfo
C mrpt::vision::detail::TSIFTDesc2KDTree_Adaptor< distance_t, element_t >
C mrpt::vision::detail::TSIFTDesc2KDTree_Adaptor< distance_t >
C mrpt::vision::TSIFTDescriptorsKDTreeIndex< distance_t, metric_t > A kd-tree builder for sets of features with SIFT descriptors
C mrpt::vision::CFeatureExtraction::TOptions::TSIFTOptions SIFT Options
C mrpt::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
C mrpt::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
C mrpt::vision::TSimpleFeatureList_templ< TSimpleFeature >
C mrpt::vision::TSimpleFeatureTraits< FEATURE >
C mrpt::vision::TSimpleFeatureTraits< TSimpleFeature >
C mrpt::vision::TSimpleFeatureTraits< TSimpleFeaturef >
C mrpt::obs::CSinCosLookUpTableFor2DScans::TSinCosValues A pair of vectors with the cos and sin values
C mrpt::obs::CObservationSkeleton::TSkeletonJoint A generic joint for the skeleton observation
C mrpt::math::ModelSearch::TSpecies< TModelFit >
C mrpt::vision::CFeatureExtraction::TOptions::TSpinImagesOptions
C mrpt::slam::CMetricMapBuilderRBPF::TStats This structure will hold stats after each execution of processActionObservation
C mrpt::vision::TStereoCalibParams Input parameters for mrpt::vision::checkerBoardStereoCalibration
C mrpt::vision::TStereoCalibResults Output results for mrpt::vision::checkerBoardStereoCalibration
C mrpt::obs::TStereoImageFeatures
C mrpt::vision::detail::TSURFDesc2KDTree_Adaptor< distance_t, element_t >
C mrpt::vision::detail::TSURFDesc2KDTree_Adaptor< distance_t >
C mrpt::vision::TSURFDescriptorsKDTreeIndex< distance_t, metric_t > A kd-tree builder for sets of features with SURF descriptors
C mrpt::vision::CFeatureExtraction::TOptions::TSURFOptions
C mrpt::obs::CObservationRFID::TTagReading Each of the individual readings of a RFID tag
C mrpt::detectors::CFaceDetection::TTestsOptions
C mrpt::system::TThreadHandle This structure contains the information needed to interface the threads API on each platform:
C mrpt::system::TTimeParts The parts of a date/time (it's like the standard 'tm' but with fractions of seconds)
C mrpt::opengl::CSetOfTexturedTriangles::TTriangle Triangle
C mrpt::opengl::CSetOfTriangles::TTriangle Triangle definition
C mrpt::opengl::CMesh::TTriangleVertexIndices
C mrpt::utils::TTypeName< T > A template to obtain the type of its argument as a string at compile time
C mrpt::utils::TTypeName< mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS > >
C mrpt::utils::TTypeName< mrpt::math::CArrayDouble< N > >
C mrpt::utils::TTypeName< mrpt::math::CArrayFloat< N > >
C mrpt::utils::TTypeName< mrpt::math::CArrayNumeric< T, N > >
C mrpt::utils::TTypeName< mrpt::math::CMatrixFixedNumeric< T, N, M > >
C mrpt::utils::TTypeName< mrpt::math::CMatrixTemplateNumeric< T > >
C mrpt::utils::TTypeName< mrpt::opengl::CLight >
C mrpt::utils::TTypeName< std::pair< T1, T2 > >
C mrpt::maps::COccupancyGridMap2D::TUpdateCellsInfoChangeOnly An internal structure for storing data related to counting the new information apported by some observation
C mrpt::obs::CObservationVelodyneScan::TVelodynePositionPacket Payload of one POSITION packet
C mrpt::obs::CObservationVelodyneScan::TVelodyneRawPacket One unit of data from the scanner (the payload of one UDP DATA packet)
C mrpt::opengl::CSetOfTexturedTriangles::TVertex Triangle vertex
C mrpt::opengl::COctoMapVoxels::TVoxel The info of each of the voxels
► C TYPE_EDGES
C mrpt::graphs::CDirectedGraph< TYPE_EDGES, EDGE_ANNOTATIONS >::edge_t The type of each global pose in nodes: an extension of the TYPE_EDGES pose with any optional user-defined data
C mrpt::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
C mrpt::utils::uint_select_by_bytecount< 1 >
C mrpt::utils::uint_select_by_bytecount< 2 >
C mrpt::utils::uint_select_by_bytecount< 3 >
C mrpt::utils::uint_select_by_bytecount< 4 >
C mrpt::utils::uint_select_by_bytecount< 8 >
C mrpt::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
C mrpt::obs::gnss::UTC_time UTC (Coordinated Universal Time) time-stamp structure for GPS messages
C TCLAP::MULTI_ARG_HELPER::ValueExtractor< T > This class is used to extract a value from an argument
C TCLAP::VALUE_ARG_HELPER::ValueExtractor< T > This class is used to extract a value from an argument
C TCLAP::MULTI_ARG_HELPER::ValueExtractor< std::string > Specialization for string
C TCLAP::VALUE_ARG_HELPER::ValueExtractor< std::string > Specialization for string
► C std::vector< T > STL class
► C mrpt::math::TPolygon2D 2D polygon, inheriting from std::vector<TPoint2D>
C mrpt::math::CPolygon A wrapper of a TPolygon2D class, implementing CSerializable
C mrpt::math::TPolygon3D 3D polygon, inheriting from std::vector<TPoint3D>
C mrpt::utils::TMatchingPairList A list of TMatchingPair
C mrpt::vision::TSequenceFeatureObservations A complete sequence of observations of features from different camera frames (poses)
C mrpt::obs::VelodyneCalibration Velodyne calibration data, for usage in mrpt::obs::CObservationVelodyneScan
C mrpt::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
C mrpt::math::detail::VicinityTraits< CMatrixFixedNumeric< T, D, D > > Vicinity traits class specialization for fixed size matrices
C mrpt::math::detail::VicinityTraits< CMatrixTemplateNumeric< T > > Vicinity traits class specialization for fixed size matrices
C mrpt::graphs::CDirectedTree< TYPE_EDGES >::Visitor Virtual base class for user-defined visitors
► C TCLAP::Visitor A base class that defines the interface for visitors
C TCLAP::HelpVisitor A Visitor object that calls the usage method of the given CmdLineOutput object for the specified CmdLine object
C TCLAP::IgnoreRestVisitor A Vistor that tells the CmdLine to begin ignoring arguments after this one is parsed
C TCLAP::VersionVisitor A Vistor that will call the version method of the given CmdLineOutput for the specified CmdLine object and then exit
► C wxObject
► C mpLayer Plot layer, abstract base class
C mpBitmapLayer This virtual class represents objects that can be moved to an arbitrary 2D location+rotation
C mpFX Abstract base class providing plot and labeling functionality for functions F:X->Y
► C mpFXY Abstract base class providing plot and labeling functionality for a locus plot F:N->X,Y
C mpFXYVector A class providing graphs functionality for a 2D plot (either continuous or a set of points), from vectors of data
C mpFY Abstract base class providing plot and labeling functionality for functions F:Y->X
► C mpInfoLayer Base class to create small rectangular info boxes mpInfoLayer is the base class to create a small rectangular info box in transparent overlay over plot layers
C mpInfoCoords Implements an overlay box which shows the mouse coordinates in plot units
C mpInfoLegend Implements the legend to be added to the plot This layer allows you to add a legend to describe the plots in the window
► C mpMovableObject This virtual class represents objects that can be moved to an arbitrary 2D location+rotation
C mpCovarianceEllipse A 2D ellipse, described by a 2x2 covariance matrix
C mpPolygon An arbitrary polygon, descendant of mpMovableObject
C mpProfile Abstract base class providing plot and labeling functionality for functions F:Y->X
C mpScaleX Plot layer implementing a x-scale ruler
C mpScaleY Plot layer implementing a y-scale ruler
C mpText Plot layer implementing a text string
► C wxPrintout
C mpPrintout Printout class used by mpWindow to draw in the objects to be printed
C mrpt::gui::WxSubsystem This class implements the GUI thread required for the wxWidgets-based GUI
► C wxWindow
C mpWindow Canvas for plotting mpLayer implementations
C TCLAP::XorHandler This class handles lists of Arg 's that are to be XOR'd on the command line