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