▶NEigen | |
Caligned_allocator | |
CEigenBase | |
▶Ninternal_mrpt | |
CMatOrVecResizer | |
CMatOrVecResizer< 1, 1 > | |
CMatOrVecResizer< 1, C > | |
CMatOrVecResizer< R, 1 > | |
▶Nmrpt | This is the global namespace for all Mobile Robot Programming Toolkit (MRPT) libraries |
▶Nbayes | The namespace for Bayesian filtering algorithm: different particle filters and Kalman filter algorithms |
CCKalmanFilterCapable | Virtual base for Kalman Filter (EKF,IEKF,UKF) implementations |
▶CCParticleFilter | 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 |
CTParticleFilterOptions | The configuration of a particle filter |
CTParticleFilterStats | Statistics for being returned from the "execute" method |
▶CCParticleFilterCapable | This virtual class defines the interface that any particles based PDF class must implement in order to be executed by a mrpt::bayes::CParticleFilter |
CTFastDrawAuxVars | Auxiliary vectors, see CParticleFilterCapable::prepareFastDrawSample for more information |
CCParticleFilterData | 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 |
CCParticleFilterDataImpl | A curiously recurring template pattern (CRTP) approach to providing the basic functionality of any CParticleFilterData<> class |
CCProbabilityParticle | A template class for holding a the data and the weight of a particle |
CCRejectionSamplingCapable | A base class for implementing rejection sampling in a generic state space |
CTKF_options | Generic options for the Kalman Filter algorithm in itself |
▶Ncompress | Data compression/decompression algorithms |
▶Ndetectors | |
▶CCCascadeClassifierDetection | |
CTOptions | |
CCDetectable2D | |
CCDetectable3D | |
CCDetectableObject | Base class that contains common atributes and functions of detectable objects |
▶CCDetectorDoorCrossing | |
CTDoorCrossingOutParams | A structure used as output in this method |
CTOptions | In this structure parameters can be changed to customize the behaviour of this algorithm |
▶CCFaceDetection | Specific class for face detection |
CTMeasurement | |
CTOptions | |
CTTestsOptions | |
CCObjectDetection | |
▶Ngraphs | Abstract graph and tree data structures, plus generic graph algorithms |
▶Ndetail | Internal functions for MRPT |
CCMRVisualizer | Wrapper class that provides visualization of a network of poses that have been registered by many graphSLAM agents/robots |
CCMRVisualizer< CPOSE, MAPS_IMPLEMENTATION, TMRSlamNodeAnnotations, EDGE_ANNOTATIONS > | |
CCVisualizer | Base class for C*Visualizer classes |
Cedge_annotations_empty | An empty structure |
Cgraph_ops | Helper struct with static template functions |
CNotConnectedGraph | Custom exception class that passes information in case an unconnected graph is passed to a Dijkstra instance |
CTHypothesis | An edge hypothesis between two nodeIDs |
CTMRSlamEdgeAnnotations | Struct to be used as the EDGE_ANNOTATIONS template argument in CNetworkOfPoses class instances for use in multiple-robot SLAM applications |
CTMRSlamNodeAnnotations | Struct to be used as the NODE_ANNOTATIONS template argument in CNetworkOfPoses class instances for use in multiple-robot SLAM applications |
CTNodeAnnotations | Abstract class from which NodeAnnotations related classes can be implemented |
CTNodeAnnotationsEmpty | Struct to be used as the NODE_ANNOTATIONS template argument in CNetworkOfPoses class instances for use in multiple-robot SLAM applications |
CTPosePDFHelper | |
CTPosePDFHelper< CPose2D > | |
CTPosePDFHelper< CPose3D > | |
CCAStarAlgorithm | This class is intended to efficiently solve graph-search problems using heuristics to determine the best path |
▶CCDijkstra | 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 |
CTDistance | Auxiliary struct for topological distances from root node |
CTPrevious | Auxiliary struct for backward paths |
▶CCDirectedGraph | A directed graph with the argument of the template specifying the type of the annotations in the edges |
Cedge_t | The type of each global pose in nodes: an extension of the TYPE_EDGES pose with any optional user-defined data |
▶CCDirectedTree | < Make available this typedef in this namespace too |
CTEdgeInfo | |
CVisitor | Virtual base class for user-defined visitors |
CCGraphPartitioner | Algorithms for finding the min-normalized-cut of a weighted undirected graph |
▶CCNetworkOfPoses | A directed graph of pose constraints, with edges being the relative poses between pairs of nodes identified by their numeric IDs (of type mrpt::utils::TNodeID) |
Cglobal_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 |
▶CScalarFactorGraph | Sparse solver for GMRF (Gaussian Markov Random Fields) graphical models |
CBinaryFactorVirtualBase | Simple, scalar (1-dim) constraint (edge) for a GMRF |
CFactorBase | |
CUnaryFactorVirtualBase | Simple, scalar (1-dim) constraint (edge) for a GMRF |
CTGraphvizExportParams | Used in mrpt::graphs export functions to .dot files |
▶Ngraphslam | SLAM methods related to graphs of pose constraints |
▶Napps | |
CTOptimizerProps | Properties struct for the Optimizer classes |
CTRegistrationDeciderOrOptimizerProps | Properties struct for both the Registration Decider and Optimizer classes |
CTRegistrationDeciderProps | Properties struct for the Registration Decider classes |
CTUserOptionsChecker | Class containing the declarations of supplementary methods that can be used in application-related code |
▶Ndeciders | |
CCEdgeRegistrationDecider | Interface for implementing edge registration classes |
CCEmptyERD | Empty Edge Registration Decider |
CCEmptyNRD | Empty Node Registration Decider |
▶CCFixedIntervalsNRD | Fixed Intervals Odometry-based Node Registration |
CTParams | Parameters structure for managing the relevant to the decider variables in a compact manner |
▶CCICPCriteriaERD | ICP-based Edge Registration |
CTParams | |
▶CCICPCriteriaNRD | ICP-based Fixed Intervals Node Registration |
CTParams | |
▶CCLoopCloserERD | Edge Registration Decider scheme specialized in Loop Closing |
CTGenerateHypotsPoolAdParams | Struct for passing additional parameters to the generateHypotsPool call |
CTGetICPEdgeAdParams | Struct for passing additional parameters to the getICPEdge call |
CTLaserParams | Struct for storing together the parameters needed for ICP matching, laser scans visualization etc |
CTLoopClosureParams | Struct for storing together the loop-closing related parameters |
CCNodeRegistrationDecider | Interface for implementing node registration classes |
CCRangeScanEdgeRegistrationDecider | Edge Registration Decider Interface from which RangeScanner-based ERDs can inherit from |
▶CCRangeScanOps | Class for keeping together all the RangeScanner-related functions |
CTParams | |
▶Ndetail | Internal auxiliary classes |
CAuxErrorEval | |
CAuxErrorEval< CPose2D, gst > | |
CAuxErrorEval< CPose3D, gst > | |
CAuxErrorEval< CPose3DPDFGaussianInf, gst > | |
CAuxErrorEval< CPosePDFGaussianInf, gst > | |
CAuxPoseOPlus | |
CAuxPoseOPlus< CPose2D, gst > | |
CAuxPoseOPlus< CPose3D, gst > | |
CAuxPoseOPlus< CPose3DPDFGaussianInf, gst > | |
CAuxPoseOPlus< CPosePDFGaussianInf, gst > | |
CCEdgeCounter | Generic class for tracking the total number of edges for different tpes of edges and for storing visualization-related information for each type |
CTNodeProps | |
▶Noptimizers | |
CCEmptyGSO | Empty Edge Registration Decider |
CCGraphSlamOptimizer | Interface for implementing graphSLAM optimizer classes |
▶CCLevMarqGSO | Levenberg-Marquardt non-linear graph slam optimization scheme |
CGraphVisualizationParams | Struct for holding the graph visualization-related variables in a compact form |
COptimizationParams | Struct for holding the optimization-related variables in a compact form |
▶CCGraphSlamEngine | Main file for the GraphSlamEngine |
CTRGBDInfoFileParams | Struct responsible for keeping the parameters of the .info file in RGBD related datasets |
CCRegistrationDeciderOrOptimizer | Interface for implementing node/edge registration deciders or optimizer classes |
CCWindowManager | Class acts as a container for storing pointers to mrpt::gui::CDisplayWindow3D, mrpt::graphslam::CWindowObserver instances |
CCWindowObserver | Monitor events in the visualization window |
▶Cgraphslam_traits | Auxiliary traits template for use among graph-slam problems to make life easier with these complicated, long data type names |
Cobservation_info_t | Auxiliary struct used in graph-slam implementation: It holds the relevant information for each of the constraints being taking into account |
CTResultInfoSpaLevMarq | Output information for mrpt::graphslam::optimize_graph_spa_levmarq() |
CTSlidingWindow | Class to monitor the evolution of a statistical quantity |
CTUncertaintyPath | Holds the data of an information path |
▶Ngui | Classes for creating GUI windows for 2D and 3D visualization |
▶Ndetail | Auxiliary structures used internally to mrpt |
CTReturnAskUserOpenCamera | |
CC3DWindowDialog | |
CCBaseGUIWindow | The base class for GUI window classes |
CCDisplayWindow | This class creates a window as a graphical user interface (GUI) for displaying images to the user |
CCDisplayWindow3D | A graphical user interface (GUI) for efficiently rendering 3D scenes in real-time |
CCDisplayWindow3DLocker | Auxiliary class for safely claiming the 3DScene of a mrpt::gui::CDisplayWindow3D |
CCDisplayWindowPlots | Create a GUI window and display plots with MATLAB-like interfaces and commands |
CCPanelCameraSelection | A panel to select the camera input from all the formats supported by MRPT |
▶CCWindowDialog | The wx dialog for gui::CDisplayWindow |
CwxMRPTImageControl | A custom control to display the bitmap and avoid flicker |
CCWindowDialogPlots | The wx dialog for gui::CDisplayWindowPlots |
CmrptEvent3DWindowGrabImageFile | An event sent by a CDisplayWindow3D window when an image is saved after enabling this feature with CDisplayWindow3D::grabImagesStart() |
CmrptEventMouseDown | An event sent by a window upon a mouse click, giving the (x,y) pixel coordinates |
CmrptEventMouseMove | An event sent by a window when the mouse is moved over it |
CmrptEventWindowChar | An event sent by a window upon a char pressed by the user |
CmrptEventWindowClosed | An event sent by a window upon when it's about to be closed, either manually by the user or programatically |
CmrptEventWindowResize | An event sent by a window upon resize |
CwxMRPTImageControl | A custom control to display the bitmap and avoid flicker |
▶CWxSubsystem | This class implements the GUI thread required for the wxWidgets-based GUI |
CCAuxWxSubsystemShutdowner | An auxiliary global object used just to launch a final request to the wxSubsystem for shutdown: |
CCWXMainFrame | The main frame of the wxWidgets application |
CTRequestToWxMainThread | The data structure for each inter-thread request: |
CTWxMainThreadData | |
▶Nhmtslam | Classes related to the implementation of Hybrid Metric Topological (HMT) SLAM |
CCHierarchicalMapMHPartition | Represents a set of nodes and arcs, posibly only a part of the whole hierarchical, multi-hypothesis map |
CCHierarchicalMHMap | The most high level class for storing hybrid, multi-hypothesis maps in a graph-based model |
CCHMHMapArc | A class for representing an arc between two nodes in a hierarchical, multi-hypothesis map |
CCHMHMapNode | A class for representing a node in a hierarchical, multi-hypothesis map |
▶CCHMTSLAM | An implementation of Hybrid Metric Topological SLAM (HMT-SLAM) |
CTMessageLSLAMfromAA | Message definition: |
▶CTMessageLSLAMfromTBI | Message definition: |
CTBI_info | |
CTMessageLSLAMtoTBI | Message definition: |
CTOptions | A variety of options and configuration params (private, use loadOptions) |
▶CCLocalMetricHypothesis | This class is used in HMT-SLAM to represent each of the Local Metric Hypotheses (LMHs) |
CTRobotPosesPartitioning | Used by AA thread |
▶CCLSLAM_RBPF_2DLASER | Implements a 2D local SLAM method based on a RBPF over an occupancy grid map |
CTPathBin | Auxiliary structure |
CCLSLAMAlgorithmBase | Virtual base for local SLAM methods, used in mrpt::slam::CHMTSLAM |
CCLSLAMParticleData | 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) |
CCRobotPosesGraph | 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 |
▶CCTopLCDetector_FabMap | |
CTOptions | Options for a TLC-detector of type FabMap, used from CHMTSLAM |
▶CCTopLCDetector_GridMatching | |
CTOptions | Options for a TLC-detector of type gridmap-matching, used from CHMTSLAM |
CCTopLCDetectorBase | The virtual base class for Topological Loop-closure Detectors; used in HMT-SLAM |
CTArcList | A class for storing a sequence of arcs (a path) |
CTHypothesisIDSet | A set of hypothesis IDs, used for arcs and nodes in multi-hypothesis hybrid maps |
CTPoseInfo | Information kept for each robot pose used in CRobotPosesGraph |
▶Nhwdrivers | Contains classes for various device interfaces |
CC2DRangeFinderAbstract | This is the base, abstract class for "software drivers" interfaces to 2D scanners (laser range finders) |
CCBoardENoses | A class for interfacing an e-Noses via a FTDI USB link |
CCBoardSonars | This "software driver" implements the communication protocol for interfacing a Ultrasonic range finder SRF10 through a custom USB board |
CCCameraSensor | The central class for camera grabbers in MRPT, implementing the "generic sensor" interface |
CCCameraSensorPtr | |
CCCANBusReader | 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) |
CCDUO3DCamera | This "software driver" implements the communication protocol for interfacing a DUO3D Stereo Camera |
CCEnoseModular | A class for interfacing an e-NoseModular via a FTDI USB link |
CCFFMPEG_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 |
▶CCGenericSensor | A generic interface for a wide-variety of sensors designed to be used in the application RawLogGrabber |
CCLASSINIT_GENERIC_SENSOR | Auxiliary structure used for CSerializable runtime class ID support |
CCGenericSensorPtr | |
CCGillAnemometer | This class implements a driver for the Gill Windsonic Option 1 Anemometer The sensor is accessed via a standard serial port |
CCGPS_NTRIP | A combination of GPS receiver + NTRIP receiver capable of submitting GGA frames to enable RTCM 3.0 |
CCGPSInterface | 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 |
CCGyroKVHDSP3000 | A class for interfacing KVH DSP 3000 gyroscope with an assynchronous serial communication (product SN : 02-1222-01) |
▶CCHokuyoURG | This software driver implements the protocol SCIP-2.0 for interfacing HOKUYO URG/UTM/UXM/UST laser scanners (USB or Ethernet) |
CTSensorInfo | Used in CHokuyoURG::displayVersionInfo |
CCIbeoLuxETH | This "software driver" implements the communication protocol for interfacing a Ibeo Lux laser scanners through an ethernet controller |
▶CCImageGrabber_dc1394 | A class for grabing images from a IEEE1394 (Firewire) camera using the libdc1394-2 library |
CTCameraInfo | Used in enumerateCameras |
CCImageGrabber_FlyCapture2 | A wrapper for Point Gray Research (PGR) FlyCapture2 API for capturing images from Firewire, USB3 or GigaE cameras and stereo cameras |
CCImageGrabber_OpenCV | A class for grabing images from a "OpenCV"-compatible camera, or from an AVI video file |
CCImpinjRFID | This class implements an interface to an Impinj RFID reader |
CCIMUIntersense | A class for interfacing Intersense Inertial Measuring Units (IMUs) |
CCIMUXSens | A class for interfacing XSens 3rd generation Inertial Measuring Units (IMUs), the "XSens MTi" model |
CCIMUXSens_MT4 | A class for interfacing XSens 4th generation Inertial Measuring Units (IMUs): MTi 10-series, MTi 100-series |
CCInterfaceFTDI | A definition of a CStream actually representing a USB connection to a FTDI chip |
CCJoystick | Access to joysticks and gamepads (read buttons and position), and request number of joysticks in the system |
CCKinect | A class for grabing "range images", intensity images (either RGB or IR) and other information from an Xbox Kinect sensor |
CCLMS100Eth | This "software driver" implements the communication protocol for interfacing a SICK LMS100 laser scanners through an ethernet controller |
▶CCNationalInstrumentsDAQ | An interface to read from data acquisition boards compatible with National Instruments "DAQmx Base" or "DAQmx" |
▶CTaskDescription | Each of the tasks to create in CNationalInstrumentsDAQ::initialize() |
Cdesc_ai_t | |
Cdesc_ao_t | |
Cdesc_ci_ang_encoder_t | |
Cdesc_ci_count_edges_t | |
Cdesc_ci_lin_encoder_t | |
Cdesc_ci_period_t | |
Cdesc_ci_pulse_width_t | |
Cdesc_co_pulses_t | |
Cdesc_di_t | |
Cdesc_do_t | |
CTInfoPerTask | |
▶CCNTRIPClient | A client for NTRIP (HTTP) sources of differential GPS corrections from internet servers, or Global navigation satellite system (GNSS) internet radio |
CNTRIPArgs | The arguments for connecting to a NTRIP stream, used in CNTRIPClient::open |
CTMountPoint | A descriptor of one stream in an NTRIP Caster - See CNTRIPClient::retrieveListOfMountpoints |
CCNTRIPEmitter | This "virtual driver" encapsulates a NTRIP client (see CNTRIPClient) but adds the functionality of dumping the received datastream to a given serial port |
CCOpenNI2_RGBD360 | A class for grabing RGBD images from several OpenNI2 sensors |
▶CCOpenNI2Generic | An abstract class for accessing OpenNI2 compatible sensors |
CCDevice | |
CCOpenNI2Sensor | A class for grabing "range images", intensity images (either RGB or IR) and other information from an OpenNI2 sensor |
CCPhidgetInterfaceKitProximitySensors | : An interface for the phidget Interface kit board (1018) |
CCPtuBase | This class implements initialization and comunication methods to control a generic Pan and Tilt Unit, working in radians |
CCPtuDPerception | This class implements initialization and comunication methods to control a Pan and Tilt Unit model PTU-46-17.5, working in radians |
CCRaePID | 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 |
CCRoboPeakLidar | Interfaces a Robo Peak LIDAR laser scanner |
CCRoboticHeadInterface | This "software driver" implements the communication protocol for interfacing a Robotic Head Board through a custom USB RS-422 interface board |
▶CCRovio | A class to interface a Rovio robot (manufactured by WowWee) |
CTEncoders | |
CTOptions | |
CTRovioState | |
CCSerialPort | A communications serial port built as an implementation of a utils::CStream |
CCServoeNeck | A USB-interface for a custom "robotic neck" designed at MAPIR lab |
CCSickLaserSerial | 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) |
CCSickLaserUSB | This "software driver" implements the communication protocol for interfacing a SICK LMS2XX laser scanners through a custom USB RS-422 interface board |
CCSkeletonTracker | A class for grabbing mrpt::obs::CObservationSkeleton from a PrimeSense camera |
CCStereoGrabber_Bumblebee_libdc1394 | Grabs from a "Bumblebee" or "Bumblebee2" stereo camera using raw access to the libdc1394 library |
CCStereoGrabber_SVS | A class for grabing stereo images from a STOC camera of Videre Design NOTE: |
CCSwissRanger3DCamera | A class for grabing "range images" from a MESA imaging SwissRanger 3D cameras (SR-2, SR-3000, SR-4k) |
CCTuMicos | This class implements initialization and comunication methods to control a Tilt Unit model DT-80, working in radians |
▶CCVelodyneScanner | A C++ interface to Velodyne laser scanners (HDL-64, HDL-32, VLP-16), working on Linux and Windows |
CTModelProperties | Hard-wired properties of LIDARs depending on the model |
CTModelPropertiesFactory | Access to default sets of parameters for Velodyne LIDARs |
CCWirelessPower | This class implements a wireless power probe |
CTCaptureCVOptions | Options used when creating an OpenCV capture object Some options apply to IEEE1394 cameras only |
CTCaptureOptions_bumblebee | Options used when creating a bumblebee camera capture object |
CTCaptureOptions_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 |
CTCaptureOptions_DUO3D | Options used when creating a camera capture object of type CImageGrabber_FlyCapture2 |
CTCaptureOptions_FlyCapture2 | Options used when creating a camera capture object of type CImageGrabber_FlyCapture2 |
CTCaptureOptions_SVS | Options used when creating a STOC Videre Design camera capture object |
CTFTDIDevice | A list of FTDI devices and their descriptors |
CTSensorClassId | A structure for runtime ID class type information in the context of hwdrivers::CGenericSensor |
▶Nkinematics | |
CCKinematicChain | A open-loop kinematic chain model, suitable to robotic manipulators |
CCVehicleSimul_DiffDriven | Simulates the kinematics of a differential-driven planar mobile robot/vehicle, including odometry errors and dynamics limitations |
▶CCVehicleSimul_Holo | Kinematic simulator of a holonomic 2D robot capable of moving in any direction, with "blended" velocity profiles |
CTVelRampCmd | |
CCVehicleSimulVirtualBase | This class can be used to simulate the kinematics and dynamics of a differential driven planar mobile robot, including odometry errors and dynamics limitations |
▶CCVehicleVelCmd | Virtual base for velocity commands of different kinematic models of planar mobile robot |
CTVelCmdParams | Parameters that may be used by cmdVel_limits() in any derived classes |
CCVehicleVelCmd_DiffDriven | Kinematic model for Ackermann-like or differential-driven vehicles |
CCVehicleVelCmd_Holo | Kinematic model for |
CTKinematicLink | An individual kinematic chain element (one link) which builds up a CKinematicChain |
▶Nmaps | |
▶Ndetail | |
CloadFromRangeImpl | |
Clogoddscell_traits | |
Clogoddscell_traits< int16_t > | |
Clogoddscell_traits< int8_t > | |
Cpointmap_traits | |
Cpointmap_traits< CColouredPointsMap > | |
Cpointmap_traits< CSimplePointsMap > | |
Cpointmap_traits< CWeightedPointsMap > | |
▶Ninternal | |
CTMetricMapTypesRegistry | Class factory & registry for map classes |
CCBeacon | The class for storing individual "beacon landmarks" under a variety of 3D position PDF distributions |
▶CCBeaconMap | A class for storing a map of 3D probabilistic beacons, using a Montecarlo, Gaussian, or Sum of Gaussians (SOG) representation (for range-only SLAM) |
CTInsertionOptions | This struct contains data for choosing the method by which new beacons are inserted in the map |
CTLikelihoodOptions | With this struct options are provided to the likelihood computations |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCColouredOctoMap | A three-dimensional probabilistic occupancy grid, implemented as an octo-tree with the "octomap" C++ library |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCColouredPointsMap | A map of 2D/3D points with individual colours (RGB) |
CTColourOptions | The definition of parameters for generating colors from laser scans |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCGasConcentrationGridMap2D | CGasConcentrationGridMap2D represents a PDF of gas concentrations over a 2D area |
CTGaussianCell | |
CTGaussianWindTable | |
CTInsertionOptions | Parameters related with inserting observations into the map: |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCHeightGridMap2D | Digital Elevation Model (DEM), a mesh or grid representation of a surface which keeps the estimated height for each (x,y) location |
CTInsertionOptions | Parameters related with inserting observations into the map |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCHeightGridMap2D_Base | Virtual base class for Digital Elevation Model (DEM) maps |
CTPointInsertParams | Extra params for insertIndividualPoint() |
▶CCHeightGridMap2D_MRF | CHeightGridMap2D_MRF represents digital-elevation-model over a 2D area, with uncertainty, based on a Markov-Random-Field (MRF) estimator |
CTInsertionOptions | Parameters related with inserting observations into the map |
CTMapDefinition | |
CTMapDefinitionBase | |
CCLandmark | The class for storing "landmarks" (visual or laser-scan-extracted features,...) |
▶CCLandmarksMap | A class for storing a map of 3D probabilistic landmarks |
CTCustomSequenceLandmarks | The list of landmarks: the wrapper class is just for maintaining the KD-Tree representation |
CTFuseOptions | With this struct options are provided to the fusion process |
CTInsertionOptions | With this struct options are provided to the observation insertion process |
CTInsertionResults | This struct stores extra results from invoking insertObservation |
▶CTLikelihoodOptions | With this struct options are provided to the likelihood computations |
CTGPSOrigin | 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 |
CTMapDefinition | |
CTMapDefinitionBase | |
CCLogOddsGridMap2D | A generic provider of log-odds grid-map maintainance functions |
CCLogOddsGridMapLUT | 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 |
CCMetricMap | Declares a virtual base class for all metric maps storage classes |
▶CCMultiMetricMap | This class stores any customizable set of metric maps |
CProxyFilterContainerByClass | 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 |
CProxySelectorContainerByClass | 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) |
▶CCMultiMetricMapPDF | 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) |
CTPredictionParams | The struct for passing extra simulation parameters to the prediction/update stage when running a particle filter |
▶CCOccupancyGridMap2D | A class for storing an occupancy grid map |
CTCriticalPointsList | The structure used to store the set of Voronoi diagram critical points |
CTEntropyInfo | Used for returning entropy related information |
CTInsertionOptions | With this struct options are provided to the observation insertion process |
CTLaserSimulUncertaintyParams | Input params for laserScanSimulatorWithUncertainty() |
CTLaserSimulUncertaintyResult | Output params for laserScanSimulatorWithUncertainty() |
CTLikelihoodOptions | With this struct options are provided to the observation likelihood computation process |
CTLikelihoodOutput | Some members of this struct will contain intermediate or output data after calling "computeObservationLikelihood" for some likelihood functions |
CTMapDefinition | |
CTMapDefinitionBase | |
CTUpdateCellsInfoChangeOnly | An internal structure for storing data related to counting the new information apported by some observation |
▶CCOctoMap | A three-dimensional probabilistic occupancy grid, implemented as an octo-tree with the "octomap" C++ library |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCOctoMapBase | A three-dimensional probabilistic occupancy grid, implemented as an octo-tree with the "octomap" C++ library |
CTInsertionOptions | With this struct options are provided to the observation insertion process |
CTLikelihoodOptions | Options used when evaluating "computeObservationLikelihood" |
CTRenderingOptions | Options for the conversion of a mrpt::maps::COctoMap into a mrpt::opengl::COctoMapVoxels |
▶CCPointCloudFilterBase | Virtual base class for all point-cloud filtering algorithm |
CTExtraFilterParams | |
▶CCPointCloudFilterByDistance | Implementation of pointcloud filtering based on requisities for minimum neigbouring points in both, the current timestamp and a previous one |
CFrameInfo | |
CTOptions | |
▶CCPointsMap | A cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors |
CTInsertionOptions | With this struct options are provided to the observation insertion process |
CTLaserRange2DInsertContext | Helper struct used for internal_loadFromRangeScan2D_prepareOneRange() |
CTLaserRange3DInsertContext | Helper struct used for internal_loadFromRangeScan3D_prepareOneRange() |
CTLikelihoodOptions | Options used when evaluating "computeObservationLikelihood" in the derived classes |
▶CCRandomFieldGridMap2D | 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) |
CConnectivityDescriptor | Base class for user-supplied objects capable of describing cells connectivity, used to build prior factors of the MRF graph |
CTInsertionOptionsCommon | Parameters common to any derived class |
CTObservationGMRF | |
CTPriorFactorGMRF | |
▶CCRandomFieldGridMap3D | CRandomFieldGridMap3D represents a 3D regular grid where each voxel is associated one real-valued property which is to be estimated by this class |
CConnectivityDescriptor | Base class for user-supplied objects capable of describing voxels connectivity, used to build prior factors of the MRF graph |
CTInsertionOptions | Parameters common to any derived class |
CTObservationGMRF | |
CTPriorFactorGMRF | |
CCRBPFParticleData | Auxiliary class used in mrpt::maps::CMultiMetricMapPDF |
▶CCReflectivityGridMap2D | A 2D grid map representing the reflectivity of the environment (for example, measured with an IR proximity sensor) |
CTInsertionOptions | Parameters related with inserting observations into the map |
CTMapDefinition | |
CTMapDefinitionBase | |
CCSimpleMap | This class stores a sequence of <Probabilistic Pose,SensoryFrame> pairs, thus a "metric map" can be totally determined with this information |
▶CCSimplePointsMap | A cloud of points in 2D or 3D, which can be built from a sequence of laser scans |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCWeightedPointsMap | A cloud of points in 2D or 3D, which can be built from a sequence of laser scans |
CTMapDefinition | |
CTMapDefinitionBase | |
▶CCWirelessPowerGridMap2D | CWirelessPowerGridMap2D represents a PDF of wifi concentrations over a 2D area |
CTInsertionOptions | Parameters related with inserting observations into the map: |
CTMapDefinition | |
CTMapDefinitionBase | |
CLAS_HeaderInfo | Extra information gathered from the LAS file header |
CLAS_LoadParams | Optional settings for loadLASFile() |
CLAS_WriteParams | Optional settings for saveLASFile() |
CmrptEventMetricMapClear | Event emitted by a metric up upon call of clear() |
CmrptEventMetricMapInsert | Event emitted by a metric up upon a succesful call to insertObservation() |
CTHeightGridmapCell | The contents of each cell in a CHeightGridMap2D map |
CTMapGenericParams | Common params to all maps derived from mrpt::maps::CMetricMap |
CTMatchingExtraResults | Additional results from the determination of matchings between point clouds, etc., apart from the pairings themselves |
CTMatchingParams | Parameters for the determination of matchings between point clouds, etc |
CTMatchingRatioParams | Parameters for CMetricMap::compute3DMatchingRatio() |
CTMetricMapInitializer | 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() |
CTRandomFieldCell | The contents of each cell in a CRandomFieldGridMap2D map |
CTRandomFieldVoxel | The contents of each voxel in a CRandomFieldGridMap3D map |
CTSetOfMetricMapInitializers | 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 |
▶Nmath | This base provides a set of functions for maths stuff |
▶Ndetail | |
CAccessorIterator | Template class for matrix accessor's iterators |
CgetVicinity | This huge template encapsulates a function to get the vicinity of an element, with maximum genericity |
CMatrixWrapper | This template is a trick to switch the type of a variable using a boolean variable in the template |
CMatrixWrapper< U, false > | |
CMatrixWrapper< U, true > | |
CReverseAccessorIterator | Template class for matrix accessor's iterators |
CTAuxResizer | Internal resize which compiles to nothing on fixed-size matrices |
CTAuxResizer< MAT,-1 > | |
CVicinityTraits | 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 |
CVicinityTraits< CMatrixFixedNumeric< T, D, D > > | Vicinity traits class specialization for fixed size matrices |
CVicinityTraits< CMatrixTemplateNumeric< T > > | Vicinity traits class specialization for fixed size matrices |
CCArrayDouble | A partial specialization of CArrayNumeric for double numbers |
CCArrayFloat | A partial specialization of CArrayNumeric for float numbers |
CCArrayInt | A partial specialization of CArrayNumeric for int numbers |
CCArrayNumeric | CArrayNumeric is an array for numeric types supporting several mathematical operations (actually, just a wrapper on Eigen::Matrix<T,N,1>) |
CCArrayUInt | A partial specialization of CArrayNumeric for unsigned int numbers |
CCAtan2LookUpTable | A look-up-table (LUT) of atan values for any (x,y) value in a square/rectangular grid of predefined resolution |
CCAtan2LookUpTableMultiRes | Like CAtan2LookUpTable but with a multiresolution grid for increasingly better accuracy in points nearer to the origin |
CCBinaryRelation | This class models a binary relation through the elements of any given set |
CCConstMatrixColumnAccessor | A vector-like wrapper for a const Matrix for accessing the elements of a given column with a [] operator |
CCConstMatrixColumnAccessorExtended | A vector-like wrapper for a const Matrix for accessing the elements of a given column with a [] operator, with offset and custom spacing |
CCConstMatrixRowAccessor | A vector-like wrapper for a const Matrix for accessing the elements of a given row with a [] operator |
CCConstMatrixRowAccessorExtended | A vector-like wrapper for a const Matrix for accessing the elements of a given row with a [] operator, with offset and custom spacing |
CCExceptionNotDefPos | Used in mrpt::math::CSparseMatrix |
CCHistogram | This class provides an easy way of computing histograms for unidimensional real valued variables |
▶CCLevenbergMarquardtTempl | An implementation of the Levenberg-Marquardt algorithm for least-square minimization |
CTResultInfo | |
CCMatrix | This class is a "CSerializable" wrapper for "CMatrixFloat" |
CCMatrixB | This class is a "CSerializable" wrapper for "CMatrixBool" |
CCMatrixBool | Declares a matrix of booleans (non serializable) |
CCMatrixColumnAccessor | A vector-like wrapper for a Matrix for accessing the elements of a given column with a [] operator |
CCMatrixColumnAccessorExtended | A vector-like wrapper for a Matrix for accessing the elements of a given column with a [] operator, with offset and custom spacing |
CCMatrixD | This class is a "CSerializable" wrapper for "CMatrixTemplateNumeric<double>" |
CCMatrixFixedNumeric | A numeric matrix of compile-time fixed size |
CCMatrixRowAccessor | A vector-like wrapper for a Matrix for accessing the elements of a given row with a [] operator |
CCMatrixRowAccessorExtended | A vector-like wrapper for a Matrix for accessing the elements of a given row with a [] operator, with offset and custom spacing |
CCMatrixTemplate | This template class provides the basic functionality for a general 2D any-size, resizable container of numerical or non-numerical elements |
CCMatrixTemplateNumeric | A matrix of dynamic size |
CCMatrixTemplateObjects | This template class extends the class "CMatrixTemplate" for storing "objects" at each matrix entry |
CCMatrixTemplateSize | Auxiliary class used in CMatrixTemplate:size(), CMatrixTemplate::resize(), CMatrixFixedNumeric::size(), CMatrixFixedNumeric::resize(), to mimic the behavior of STL-containers |
▶CCMonteCarlo | Montecarlo simulation for experiments in 1D |
CCStatisticalAnalyzer | |
CContainerType | ContainerType<T>::element_t exposes the value of any STL or Eigen container |
CContainerType< Eigen::EigenBase< Derived > > | Specialization for Eigen containers |
CCPolygon | A wrapper of a TPolygon2D class, implementing CSerializable |
CCQuaternion | 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 |
▶CCRuntimeCompiledExpression | A wrapper of exprtk runtime expression compiler: it takes a string representing an expression (from a simple mathematical formula to a complete program), compiles it and evaluates its result as many times as required |
CExprVerbose | |
▶CCSparseMatrix | A sparse matrix structure, wrapping T |
CCholeskyDecomp | Auxiliary class to hold the results of a Cholesky factorization of a sparse matrix |
CCSparseMatrixTemplate | A sparse matrix container (with cells of any type), with iterators |
CCSparseSymmetricalMatrix | A sparse matrix container for square symmetrical content around the main diagonal |
CCSplineInterpolator1D | A (persistent) sequence of (x,y) coordinates, allowing queries of intermediate points through spline interpolation, where possible |
Cdynamic_vector | Column vector, like Eigen::MatrixX*, but automatically initialized to zeros since construction |
CFAddPoint | |
▶CKDTreeCapable | A generic adaptor class for providing Nearest Neighbor (NN) lookup via the nanoflann library |
CTKDTreeDataHolder | Internal structure with the KD-tree representation (mainly used to avoid copying pointers with the = operator) |
CTKDTreeSearchParams | |
CLowPassFilter_IIR1 | 1-order low-pass IIR filter |
▶CMatrixBlockSparseCols | A templated column-indexed efficient storage of block-sparse Jacobian or Hessian matrices, together with other arbitrary information |
CTEntry | |
▶CModelSearch | Model search implementations: RANSAC and genetic algorithm |
CTSpecies | |
CRANSAC_Template | A generic RANSAC implementation with models as matrices |
CRobustKernel | |
CRobustKernel< rkLeastSquares, T > | No robust kernel, use standard least squares: rho(r) = r^2 |
CRobustKernel< rkPseudoHuber, T > | Pseudo-huber robust kernel: rho(r) = 2 * delta^2 * ( -1+sqrt( 1+ r^2/delta^2 ) ) |
CTLine2D | 2D line without bounds, represented by its equation |
CTLine3D | 3D line, represented by a base point and a director vector |
▶CTObject2D | Standard type for storing any lightweight 2D type |
Ctobject2d_data_t | Union type storing pointers to every allowed type |
▶CTObject3D | Standard object for storing any 3D lightweight object |
Ctobject3d_data_t | Union containing pointer to actual data |
CTPlane | 3D Plane, represented by its equation |
CTPoint2D | Lightweight 2D point |
CTPoint3D | Lightweight 3D point |
CTPoint3Df | Lightweight 3D point (float version) |
CTPointXYZfIu8 | XYZ point (float) + Intensity(u8) |
CTPointXYZfRGBu8 | XYZ point (float) + RGB(u8) |
CTPointXYZIu8 | XYZ point (double) + Intensity(u8) |
CTPointXYZRGBu8 | XYZ point (double) + RGB(u8) |
CTPolygon2D | 2D polygon, inheriting from std::vector<TPoint2D> |
CTPolygon3D | 3D polygon, inheriting from std::vector<TPoint3D> |
CTPolygonWithPlane | Slightly heavyweight type to speed-up calculations with polygons in 3D |
CTPose2D | Lightweight 2D pose |
CTPose3D | Lightweight 3D pose (three spatial coordinates, plus three angular coordinates) |
CTPose3DQuat | Lightweight 3D pose (three spatial coordinates, plus a quaternion ) |
CTSegment2D | 2D segment, consisting of two points |
CTSegment3D | 3D segment, consisting of two points |
CTTwist2D | 2D twist: 2D velocity vector (vx,vy) + planar angular velocity (omega) |
CTTwist3D | 3D twist: 3D velocity vector (vx,vy,vz) + angular velocity (wx,wy,wz) |
▶Nmrpt | Determines whether this is an X86 or AMD64 platform |
▶Nutils | |
▶Ndetail | |
CPointCloudAdapterHelperNoRGB | 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 |
CCProfilerProxy | |
CPointCloudAdapter | An adapter to different kinds of point cloud object |
▶Nnav | |
▶CCAbstractHolonomicReactiveMethod | A base class for holonomic reactive navigation methods |
CNavInput | Input parameters for CAbstractHolonomicReactiveMethod::navigate() |
CNavOutput | Output for CAbstractHolonomicReactiveMethod::navigate() |
▶CCAbstractNavigator | This is the base class for any reactive/planned navigation system |
CTAbstractNavigatorParams | |
CTargetInfo | Individual target info in CAbstractNavigator::TNavigationParamsBase and derived classes |
CTErrorReason | |
CTNavigationParams | The struct for configuring navigation requests |
CTNavigationParamsBase | Base for all high-level navigation commands |
CTPendingEvent | |
CTRobotPoseVel | |
▶CCAbstractPTGBasedReactive | 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 |
CPTGTarget | |
CTAbstractPTGNavigatorParams | |
CTInfoPerPTG | |
CTNavigationParamsPTG | The struct for configuring navigation requests to CAbstractPTGBasedReactive and derived classes |
CTSentVelCmd | |
▶CCHolonomicFullEval | Full evaluation of all possible directions within the discrete set of input directions |
CEvalOutput | |
CTOptions | Algorithm options |
CCHolonomicLogFileRecord | A base class for log records for different holonomic navigation methods |
▶CCHolonomicND | An implementation of the holonomic reactive navigation method "Nearness-Diagram" |
CTGap | The structure used to store a detected gap in obstacles |
CTOptions | Algorithm options |
▶CCHolonomicVFF | A holonomic reactive navigation method, based on Virtual Force Fields (VFF) |
CTOptions | Algorithm options |
CClearanceDiagram | Clearance information for one particular PTG and one set of obstacles |
▶CCLogFileRecord | A class for storing, saving and loading a reactive navigation log record for the CReactiveNavigationSystem class |
CTInfoPerPTG | The structure used to store all relevant information about each transformation into TP-Space |
CCLogFileRecord_FullEval | A class for storing extra information about the execution of CHolonomicFullEval navigation |
CCLogFileRecord_ND | A class for storing extra information about the execution of CHolonomicND navigation |
CCLogFileRecord_VFF | A class for storing extra information about the execution of CHolonomicVFF navigation |
▶CCMultiObjectiveMotionOptimizerBase | Virtual base class for multi-objective motion choosers, as used for reactive navigation engines |
CTParamsBase | Common params for all children |
CTResultInfo | |
▶CCMultiObjMotionOpt_Scalarization | Implementation of multi-objective motion chooser using scalarization: a user-given formula is used to collapse all the scores into a single scalar score |
CTParams | |
▶CCNavigatorManualSequence | "Fake navigator" for tests: it just sends out a pre-programmed sequence of commands to the robot |
CTVelCmd | |
▶CCParameterizedTrajectoryGenerator | This is the base class for any user-defined PTG |
CTNavDynamicState | Dynamic state that may affect the PTG path parameterization |
CCPTG_DiffDrive_alpha | The "a(symptotic)-alpha PTG", as named in PTG papers |
CCPTG_DiffDrive_C | A PTG for circular paths ("C" type PTG in papers) |
CCPTG_DiffDrive_CC | A PTG for optimal paths of type "C|C" , as named in PTG papers |
CCPTG_DiffDrive_CCS | A PTG for optimal paths of type "C|C,S" (as named in PTG papers) |
▶CCPTG_DiffDrive_CollisionGridBased | Base class for all PTGs suitable to non-holonomic, differentially-driven (or Ackermann) vehicles based on numerical integration of the trajectories and collision look-up-table |
CCCollisionGrid | An internal class for storing the collision grid |
CTCellForLambdaFunction | Specifies the min/max values for "k" and "n", respectively |
CCPTG_DiffDrive_CS | A PTG for optimal paths of type "CS", as named in PTG papers |
CCPTG_Holo_Blend | A PTG for circular-shaped robots with holonomic kinematics |
CCPTG_RobotShape_Circular | Base class for all PTGs using a 2D circular robot shape model |
CCPTG_RobotShape_Polygonal | Base class for all PTGs using a 2D polygonal robot shape model |
▶CCReactiveNavigationSystem | See base class CAbstractPTGBasedReactive for a description and instructions of use |
CTReactiveNavigatorParams | |
▶CCReactiveNavigationSystem3D | See base class CAbstractPTGBasedReactive for a description and instructions of use |
CTPTGmultilevel | A set of PTGs of the same type, one per "height level" |
CCRobot2NavInterface | The pure virtual interface between a real or simulated robot and any CAbstractNavigator -derived class |
CCRobot2NavInterfaceForSimulator_DiffDriven | CRobot2NavInterface implemented for a simulator object based on mrpt::kinematics::CVehicleSimul_DiffDriven Only senseObstacles() remains virtual for the user to implement it |
CCRobot2NavInterfaceForSimulator_Holo | CRobot2NavInterface implemented for a simulator object based on mrpt::kinematics::CVehicleSimul_Holo |
▶CCWaypointsNavigator | This class extends CAbstractNavigator with the capability of following a list of waypoints |
CTNavigationParamsWaypoints | The struct for configuring navigation requests to CWaypointsNavigator and derived classes |
CTWaypointsNavigatorParams | |
▶CPlannerRRT_SE2_TPS | TP Space-based RRT path planning for SE(2) (planar) robots |
CTPlannerInput | |
CTPlannerResult | |
CPlannerSimple2D | Searches for collision-free path in 2D occupancy grids for holonomic circular robots |
▶CPlannerTPS_VirtualBase | Virtual base class for TP-Space-based path planners |
CTRenderPlannedPathOptions | Options for renderMoveTree() |
CPoseDistanceMetric | Generic base for metrics |
CPoseDistanceMetric< TNodeSE2 > | Pose metric for SE(2) |
CPoseDistanceMetric< TNodeSE2_TP > | Pose metric for SE(2) limited to a given PTG manifold |
CRRTAlgorithmParams | |
CRRTEndCriteria | |
CTCandidateMovementPTG | Stores a candidate movement in TP-Space-based navigation |
CTCPoint | Trajectory points in C-Space for non-holonomic robots |
CTMoveEdgeSE2_TP | An edge for the move tree used for planning in SE2 and TP-space |
▶CTMoveTree | This class contains motions and motions tree structures for the hybrid navigation algorithm |
Cnode_t | |
CTNodeSE2 | |
CTNodeSE2_TP | |
CTPlannerInputTempl | |
CTPlannerResultTempl | |
CTRobotShape | A 3D robot shape stored as a "sliced" stack of 2D polygons, used for CReactiveNavigationSystem3D Depending on each PTG, only the 2D polygon or the circular radius will be taken into account |
CTWaypoint | A single waypoint within TWaypointSequence |
CTWaypointSequence | The struct for requesting navigation requests for a sequence of waypoints |
CTWaypointsRenderingParams | Used in getAsOpenglVisualization() |
CTWaypointStatus | A waypoint with an execution status |
CTWaypointStatusSequence | The struct for querying the status of waypoints navigation |
▶Nobs | This namespace contains representation of robot actions and observations |
▶Ndetail | |
CTLevMarData | |
▶Ngnss | GNSS (GPS) data structures, mainly for use within mrpt::obs::CObservationGPS |
Cgnss_message | Pure virtual base for all message types |
Cgnss_message_ptr | A smart pointer to a GNSS message |
▶CMessage_NMEA_GGA | NMEA datum: GGA |
Ccontent_t | |
▶CMessage_NMEA_GLL | NMEA datum: GLL |
Ccontent_t | |
▶CMessage_NMEA_RMC | NMEA datum: RMC |
Ccontent_t | |
▶CMessage_NMEA_VTG | NMEA datum: VTG |
Ccontent_t | |
▶CMessage_NMEA_ZDA | NMEA datum: ZDA |
Ccontent_t | |
CMessage_NV_OEM6_GENERIC_FRAME | Novatel generic frame (to store frames without a parser at the present time) |
CMessage_NV_OEM6_GENERIC_SHORT_FRAME | Novatel generic short-header frame (to store frames without a parser at the present time) |
▶CMessage_NV_OEM6_RANGECMP | Novatel frame: NV_OEM6_RANGECMP |
CTCompressedRangeLog | |
▶CMessage_NV_OEM6_VERSION | Novatel frame: NV_OEM6_VERSION |
CTComponentVersion | |
CMessage_TOPCON_PZS | GPS datum for TopCon's mmGPS devices: PZS |
CMessage_TOPCON_SATS | TopCon mmGPS devices: SATS, a generic structure for statistics about tracked satelites and their positions |
Cnv_oem6_header_t | Novatel OEM6 regular header structure |
Cnv_oem6_short_header_t | Novatel OEM6 short header structure |
CUTC_time | UTC (Coordinated Universal Time) time-stamp structure for GPS messages |
CCAction | Declares a class for storing a robot action |
CCActionCollection | Declares a class for storing a collection of robot actions |
▶CCActionRobotMovement2D | Represents a probabilistic 2D movement of the robot mobile base |
▶CTMotionModelOptions | The parameter to be passed to "computeFromOdometry" |
CTOptions_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/ |
CTOptions_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/ |
▶CCActionRobotMovement3D | Represents a probabilistic 3D (6D) movement |
▶CTMotionModelOptions | The parameter to be passed to "computeFromOdometry" |
CTOptions_6DOFModel | |
CCObservation | Declares a class that represents any robot's observation |
CCObservation2DRangeScan | A "CObservation"-derived class that represents a 2D range scan measurement (typically from a laser scanner) |
▶CCObservation2DRangeScanWithUncertainty | A 2D range scan plus an uncertainty model for each range |
CTEvalParams | |
▶CCObservation3DRangeScan | 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 |
CTCached3DProjTables | Look-up-table struct for project3DPointsFromDepthImageInto() |
CTPixelLabelInfo | |
CTPixelLabelInfoBase | Virtual interface to all pixel-label information structs |
▶CCObservation6DFeatures | 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 |
CTMeasurement | Each one of the measurements |
CCObservationBatteryState | This represents a measurement of the batteries on the robot |
▶CCObservationBeaconRanges | Declares a class derived from "CObservation" that represents one (or more) range measurements to labeled beacons |
CTMeasurement | Each one of the measurements |
▶CCObservationBearingRange | This observation represents a number of range-bearing value pairs, each one for a detected landmark, which optionally can have identification IDs |
CTMeasurement | Each one of the measurements: |
CCObservationCANBusJ1939 | This class stores a message from a CAN BUS with the protocol J1939 |
CCObservationComment | This "observation" is actually a placeholder for a text block with comments or additional parameters attached to a given rawlog file |
▶CCObservationGasSensors | Declares a class derived from "CObservation" that represents a set of readings from gas sensors |
▶CCMOSmodel | Declares a class within "CObservationGasSensors" that represents a set of gas concentration readings from the modelation of a MOS gas sensor readings |
CTdataMap | The content of each m_lastObservations in the estimation when using the option : MOS_MODEl (useMOSmodel =1) |
CTObservationENose | The structure for each e-nose |
▶CCObservationGPS | This class stores messages from GNSS or GNSS+IMU devices, from consumer-grade inexpensive GPS receivers to Novatel/Topcon/.. |
Cinternal_msg_test_proxy | Proxy class for type-based testing existence of data inside CObservationGPS::messages |
CCObservationImage | Declares a class derived from "CObservation" that encapsules an image from a camera, whose relative pose to robot is also stored |
CCObservationIMU | This class stores measurements from an Inertial Measurement Unit (IMU) (attitude estimation, raw gyroscope and accelerometer values), altimeters or magnetometers |
CCObservationOdometry | An observation of the current (cumulative) odometry for a wheeled robot |
▶CCObservationRange | Declares a class derived from "CObservation" that encapsules a single range measurement, and associated parameters |
CTMeasurement | |
CCObservationRawDAQ | Store raw data from a Data Acquisition (DAQ) device, such that input or output analog and digital channels, counters from encoders, etc |
CCObservationReflectivity | Declares a class derived from "CObservation" that encapsules a single short-range reflectivity measurement |
▶CCObservationRFID | This represents one or more RFID tags observed by a receiver |
CTTagReading | Each of the individual readings of a RFID tag |
CCObservationRGBD360 | Declares a class derived from "CObservation" that encapsules an omnidirectional RGBD measurement from a set of RGBD sensors |
CCObservationRobotPose | An observation providing an alternative robot pose from an external source |
▶CCObservationSkeleton | This class stores a skeleton as tracked by OPENNI2 & NITE2 libraries from PrimeSense sensors |
CTSkeletonJoint | A generic joint for the skeleton observation |
CCObservationStereoImages | Observation class for either a pair of left+right or left+disparity images from a stereo camera |
CCObservationStereoImagesFeatures | Declares a class derived from "CObservation" that encapsules a pair of cameras and a set of matched image features extracted from them |
▶CCObservationVelodyneScan | A CObservation -derived class for RAW DATA (and optionally, point cloud) of scans from 3D Velodyne LIDAR scanners |
Claser_return_t | |
Craw_block_t | Raw Velodyne data block |
CTGeneratePointCloudParameters | |
CTGeneratePointCloudSE3Results | Results for generatePointCloudAlongSE3Trajectory() |
CTPointCloud | See point_cloud and scan_packets |
CTVelodynePositionPacket | Payload of one POSITION packet |
CTVelodyneRawPacket | One unit of data from the scanner (the payload of one UDP DATA packet) |
CCObservationVisualLandmarks | Declares a class derived from "CObservation" that stores a Landmarks Map as seen from a stereo camera at a given instant of time |
CCObservationWindSensor | Declares a class derived from "CObservation" that represents the wind measurements taken on the robot by an anemometer |
CCObservationWirelessPower | This represents a measurement of the wireless strength perceived by the robot |
▶CCRawlog | This class stores a rawlog (robotic datasets) in one of two possible formats: |
Cconst_iterator | A normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence |
Citerator | A normal iterator, plus the extra method "getType" to determine the type of each entry in the sequence |
CCSensoryFrame | 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 |
▶CCSinCosLookUpTableFor2DScans | A smart look-up-table (LUT) of sin/cos values for 2D laser scans |
CTSinCosValues | A pair of vectors with the cos and sin values |
CT2DScanProperties | Auxiliary struct that holds all the relevant geometry information about a 2D scan |
CT3DPointsProjectionParams | Used in CObservation3DRangeScan::project3DPointsFromDepthImageInto() |
CT3DPointsTo2DScanParams | Used in CObservation3DRangeScan::convertTo2DScan() |
CTRangeImageFilter | Mainly for internal use within CObservation3DRangeScan::project3DPointsFromDepthImageInto() |
CTRangeImageFilterParams | Used in CObservation3DRangeScan::project3DPointsFromDepthImageInto() |
CTStereoImageFeatures | |
▶CVelodyneCalibration | Velodyne calibration data, for usage in mrpt::obs::CObservationVelodyneScan |
CPerLaserCalib | |
▶Nopengl | The namespace for 3D scene representation and rendering |
▶Ngl_utils | A set of auxiliary functions that can be called to render OpenGL primitives from MRPT or user code |
CTRenderInfo | Information about the rendering process being issued |
▶CC3DSScene | This element keeps a set of objects imported from a 3DStudio file (.3ds) |
CTImpl3DS | A container for automatic deletion of lib3ds's scene when the last reference of the smart_ptr's is destroyed |
▶CCAngularObservationMesh | A mesh built from a set of 2D laser scan observations |
CFTrace1D | Internal functor class to trace a ray |
CFTrace2D | Internal functor class to trace a set of rays |
▶CTDoubleRange | Range specification type, with several uses |
Crd | Union type with the actual data |
CCArrow | A 3D arrow |
▶CCAssimpModel | This class can load & render 3D models in a number of different formats (requires the library assimp) |
CTImplAssimp | A container for automatic deletion of lib3ds's scene when the last reference of the smart_ptr's is destroyed |
CTInfoPerTexture | |
CCAxis | Draw a 3D world axis, with coordinate marks at some regular interval |
CCBox | 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) |
CCCamera | 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 |
CCColorBar | A colorbar indicator |
CCCylinder | A cylinder or cone whose base lies in the XY plane |
CCDisk | A planar disk in the XY plane |
CCEllipsoid | A 2D ellipse or 3D ellipsoid, depending on the size of the m_cov matrix (2x2 or 3x3) |
CCEllipsoidInverseDepth2D | An especial "ellipsoid" in 3D computed as the uncertainty iso-surfaces of a (inv_range,yaw) variable |
CCEllipsoidInverseDepth3D | An especial "ellipsoid" in 3D computed as the uncertainty iso-surfaces of a (inv_range,yaw,pitch) variable |
CCEllipsoidRangeBearing2D | An especial "ellipsoid" in 2D computed as the uncertainty iso-surfaces of a (range,bearing) variable |
CCFBORender | A class for rendering 3D scenes off-screen directly into an image using OpenGL extensions (glext) |
CCFrustum | A solid or wireframe frustum in 3D (a rectangular truncated pyramid), with arbitrary (possibly assymetric) field-of-view angles |
▶CCGeneralizedCylinder | This object represents any figure obtained by extruding any profile along a given axis |
CTQuadrilateral | Auxiliary struct holding any quadrilateral, represented by foour points |
CCGeneralizedEllipsoidTemplate | A class that generalizes the concept of an ellipsoid to arbitrary parameterizations of uncertainty shapes in either 2D or 3D |
CCGridPlaneXY | A grid of lines over the XY plane |
CCGridPlaneXZ | A grid of lines over the XZ plane |
CCLight | Each of the possible lights of a 3D scene |
▶CCMesh | A planar (XY) grid where each cell has an associated height and, optionally, a texture map |
CTTriangleVertexIndices | |
CCMesh3D | A 3D mesh composed of Triangles and/or Quads |
CCMeshFast | A planar (XY) grid where each cell has an associated height and, optionally, a texture map |
▶CCOctoMapVoxels | A flexible renderer of voxels, typically from a 3D octo map (see mrpt::maps::COctoMap) |
CTGridCube | The info of each grid block |
CTInfoPerVoxelSet | |
CTVoxel | The info of each of the voxels |
▶CCOctreePointRenderer | Template class that implements the data structure and algorithms for Octree-based efficient rendering |
CTNode | The structure for each octree spatial node |
CTRenderQueueElement | |
CCOpenGLScene | This class allows the user to create, load, save, and render 3D scenes using OpenGL primitives |
CCOpenGLStandardObject | Objects of this class represent a generic openGL object without specific geometric properties |
▶CCOpenGLViewport | A viewport within a COpenGLScene, containing a set of OpenGL objects to render |
CTLastProjectiveMatrixInfo | |
CCPlanarLaserScan | This object renders a 2D laser scan by means of three elements: the points, the line along end-points and the 2D scanned surface |
CCPointCloud | A cloud of points, all with the same color or each depending on its value along a particular coordinate axis |
▶CCPointCloudColoured | A cloud of points, each one with an individual colour (R,G,B) |
CTPointColour | |
▶CCPolyhedron | This class represents arbitrary polyhedra |
CTPolyhedronEdge | Struct used to store a polyhedron edge |
CTPolyhedronFace | Struct used to store a polyhedron face |
CCRenderizable | The base class of 3D objects that can be directly rendered through OpenGL |
CCRenderizableDisplayList | A renderizable object suitable for rendering with OpenGL's display lists |
CCSetOfLines | A set of independent lines (or segments), one line with its own start and end positions (X,Y,Z) |
CCSetOfObjects | A set of object, which are referenced to the coordinates framework established in this object |
▶CCSetOfTexturedTriangles | A set of textured triangles |
CTTriangle | Triangle |
CTVertex | Triangle vertex |
▶CCSetOfTriangles | A set of colored triangles |
CTTriangle | Triangle definition |
CCSimpleLine | A line segment |
CCSphere | A solid or wire-frame sphere |
CCText | A 2D text (bitmap rendering): it always "faces the observer" despite it's at some 3D location |
CCText3D | A 3D text (rendered with OpenGL primitives), with selectable font face and drawing style |
CCTextMessageCapable | Keeps a list of text messages which can be rendered to OpenGL contexts by graphic classes |
CCTexturedObject | A base class for all OpenGL objects with loadable textures |
CCTexturedPlane | A 2D plane in the XY plane with a texture image |
CCVectorField2D | A 2D vector field representation, consisting of points and arrows drawn on a plane (invisible grid) |
CCVectorField3D | A 3D vector field representation, consisting of points and arrows drawn at any spatial position |
CmrptEventGLPostRender | An event sent by an mrpt::opengl::COpenGLViewport after calling the scene OpenGL drawing primitives and before doing a glSwapBuffers |
CmrptEventGLPreRender | 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 |
CT2DTextData | 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 |
CTFontParams | A description of a bitmapped or vectorized text font |
▶Npbmap | |
Cconfig_heuristics | A class used to define the heuristic parameters and thresholds used to match sets of planes |
CConsistencyTest | |
CframeRGBDandPose | |
CPbMap | A class used to store a Plane-based Map (PbMap) |
CPbMapLocaliser | |
CPbMapMaker | |
CPlane | A class used to store a planar feature (Plane for short) |
CPlaneInferredInfo | A class used to infer some semantic meaning to the planes of a PbMap |
CSegment | |
CSemanticClustering | |
CSubgraph | |
CSubgraphMatcher | |
▶Nposes | Classes for 2D/3D geometry representation, both of single values and probability density distributions (PDFs) in many forms |
▶Ndetail | Internal, auxiliary templates for MRPT classes |
Cpose_point_impl | |
Cpose_point_impl< DERIVEDCLASS, 0 > | |
Cpose_point_impl< DERIVEDCLASS, 1 > | |
CT3DTypeHelper | |
CT3DTypeHelper< CPoint2D > | |
CT3DTypeHelper< CPoint3D > | |
CT3DTypeHelper< CPose2D > | |
CT3DTypeHelper< CPose3D > | |
CT3DTypeHelper< CPose3DQuat > | |
CT3DTypeHelper< CPose3DRotVec > | |
CCPoint | A base class for representing a point in 2D or 3D |
CCPoint2D | A class used to store a 2D point |
CCPoint2DPDF | Declares a class that represents a Probability Distribution function (PDF) of a 2D point (x,y) |
CCPoint2DPDFGaussian | A gaussian distribution for 2D points |
CCPoint3D | A class used to store a 3D point |
CCPointPDF | Declares a class that represents a Probability Distribution function (PDF) of a 3D point (x,y,z) |
CCPointPDFGaussian | A gaussian distribution for 3D points |
CCPointPDFParticles | A probability distribution of a 2D/3D point, represented as a set of random samples (particles) |
▶CCPointPDFSOG | Declares a class that represents a Probability Density function (PDF) of a 3D point |
CTGaussianMode | The struct for each mode: |
CCPose | A base class for representing a pose in 2D or 3D |
CCPose2D | A class used to store a 2D pose, including the 2D coordinate point and a heading (phi) angle |
CCPose2DGridTemplate | This is a template class for storing a 3D (2D+heading) grid containing any kind of data |
CCPose2DInterpolator | This class stores a time-stamped trajectory in SE(2) (mrpt::math::TPose2D poses) |
CCPose3D | A class used to store a 3D pose (a 3D translation + a rotation in 3D) |
CCPose3DInterpolator | This class stores a time-stamped trajectory in SE(3) (CPose3D poses) |
CCPose3DPDF | Declares a class that represents a Probability Density Function (PDF) of a 3D pose (6D actually) |
CCPose3DPDFGaussian | Declares a class that represents a Probability Density function (PDF) of a 3D pose |
CCPose3DPDFGaussianInf | 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 |
CCPose3DPDFParticles | Declares a class that represents a Probability Density function (PDF) of a 3D pose |
▶CCPose3DPDFSOG | Declares a class that represents a Probability Density function (PDF) of a 3D(6D) pose |
CTGaussianMode | The struct for each mode: |
▶CCPose3DQuat | A class used to store a 3D pose as a translation (x,y,z) and a quaternion (qr,qx,qy,qz) |
Cconst_iterator | |
Citerator | |
CCPose3DQuatPDF | 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] |
CCPose3DQuatPDFGaussian | Declares a class that represents a Probability Density function (PDF) of a 3D pose using a quaternion |
CCPose3DQuatPDFGaussianInf | Declares a class that represents a Probability Density function (PDF) of a 3D pose using a quaternion |
CCPose3DRotVec | A 3D pose, with a 3D translation and a rotation in 3D parameterized in rotation-vector form (equivalent to axis-angle) |
CCPoseInterpolatorBase | Base class for SE(2)/SE(3) interpolators |
CCPoseOrPoint | The base template class for 2D & 3D points and poses |
CCPosePDF | Declares a class that represents a probability density function (pdf) of a 2D pose (x,y,phi) |
CCPosePDFGaussian | Declares a class that represents a Probability Density function (PDF) of a 2D pose |
CCPosePDFGaussianInf | A Probability Density function (PDF) of a 2D pose as a Gaussian with a mean and the inverse of the covariance |
CCPosePDFGrid | Declares a class that represents a Probability Distribution function (PDF) of a 2D pose (x,y,phi) |
CCPosePDFParticles | Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples |
▶CCPosePDFSOG | Declares a class that represents a Probability Density function (PDF) of a 2D pose |
CTGaussianMode | The struct for each mode: |
CCPoseRandomSampler | An efficient generator of random samples drawn from a given 2D (CPosePDF) or 3D (CPose3DPDF) pose probability density function (pdf) |
CCPoses2DSequence | This class stores a sequence of relative, incremental 2D poses |
CCPoses3DSequence | This class stores a sequence of relative, incremental 3D poses |
▶CCRobot2DPoseEstimator | A simple filter to estimate and extrapolate the robot 2D (x,y,phi) pose from asynchronous odometry and localization/SLAM data |
CTOptions | |
▶CFrameTransformer | See docs in FrameTransformerInterface |
CTF_TreeEdge | |
CFrameTransformerInterface | Virtual base class for interfaces to a ROS tf2-like service capable of "publishing" and "looking-up" relative poses between two "coordinate frames" |
CSE_average< 2 > | Computes weighted and un-weighted averages of SE(2) poses |
CSE_average< 3 > | Computes weighted and un-weighted averages of SE(3) poses |
CSE_traits< 2 > | Specialization of SE for 2D poses |
CSE_traits< 3 > | Specialization of SE for 3D poses |
CSO_average< 2 > | Computes weighted and un-weighted averages of SO(2) orientations |
CSO_average< 3 > | Computes weighted and un-weighted averages of SO(3) orientations |
CTSimple3DPoint | Data within each particle |
▶Nrandom | A namespace of pseudo-random numbers genrators of diferent distributions |
▶CCRandomGenerator | A thred-safe pseudo random number generator, based on an internal MT19937 randomness generator |
CTMT19937_data | Data used internally by the MT19937 PRNG algorithm |
▶Nslam | |
▶Ndetail | |
▶CTPathBin2D | Auxiliary structure |
Clt_operator | Less-than ordering of bins for usage in STL containers |
▶CTPoseBin2D | Auxiliary structure used in KLD-sampling in particle filters |
Clt_operator | Less-than ordering of bins for usage in STL containers |
▶CTPoseBin3D | Auxiliary structure used in KLD-sampling in particle filters |
Clt_operator | Less-than ordering of bins for usage in STL containers |
▶CCGridMapAligner | 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 |
CTConfigParams | The ICP algorithm configuration data |
▶CTReturnInfo | The ICP algorithm return information |
CTPairPlusDistance | |
▶CCICP | Several implementations of ICP (Iterative closest point) algorithms for aligning two point maps or a point map wrt a grid map |
CTConfigParams | The ICP algorithm configuration data |
CTReturnInfo | The ICP algorithm return information |
▶CCIncrementalMapPartitioner | This class can be used to make partitions on a map/graph build from observations taken at some poses/nodes |
CTOptions | Configuration of the algorithm: |
▶CCMetricMapBuilder | This virtual class is the base for SLAM implementations |
CTOptions | Options for the algorithm |
▶CCMetricMapBuilderICP | A class for very simple 2D SLAM based on ICP |
CTConfigParams | Algorithm configuration params |
CTDist | Traveled distances from last map update / ICP-based localization |
▶CCMetricMapBuilderRBPF | This class implements a Rao-Blackwelized Particle Filter (RBPF) approach to map building (SLAM) |
CTConstructionOptions | Options for building a CMetricMapBuilderRBPF object, passed to the constructor |
CTStats | This structure will hold stats after each execution of processActionObservation |
CCMetricMapsAlignmentAlgorithm | A base class for any algorithm able of maps alignment |
CCMonteCarloLocalization2D | Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples |
CCMonteCarloLocalization3D | 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 |
CCOccupancyGridMapFeatureExtractor | A class for detecting features from occupancy grid maps |
▶CCRangeBearingKFSLAM | An implementation of EKF-based SLAM with range-bearing sensors, odometry, a full 6D robot pose, and 3D landmarks |
CTDataAssocInfo | Information for data-association: |
CTOptions | The options for the algorithm |
▶CCRangeBearingKFSLAM2D | An implementation of EKF-based SLAM with range-bearing sensors, odometry, and a 2D (+heading) robot pose, and 2D landmarks |
CTDataAssocInfo | Information for data-association: |
CTOptions | The options for the algorithm |
▶CCRejectionSamplingRangeOnlyLocalization | An implementation of rejection sampling for generating 2D robot pose from range-only measurements within a landmarks (beacons) map |
CTDataPerBeacon | Data for each beacon observation with a correspondence with the map |
CPF_implementation | A set of common data shared by PF implementations for both SLAM and localization |
CTAuxDataRecursiveJCBB | |
CTDataAssociationResults | The results from mrpt::slam::data_association |
CTKLDParams | Option set for KLD algorithm |
CTMonteCarloLocalizationParams | The struct for passing extra simulation parameters to the prediction stage when running a particle filter |
▶Nsynch | This namespace provides multitask, synchronization utilities |
CCAbstractMutex | |
CCCriticalSection | This class provides simple critical sections functionality |
CCCriticalSectionLocker | A class acquiring a CCriticalSection at its constructor, and releasing it at destructor |
CCCriticalSectionRecursive | Recursive mutex: allow recursive locks by the owner thread |
CCPipe | A pipe, portable across different OS |
CCPipeBaseEndPoint | Common interface of read & write pipe end-points |
CCPipeReadEndPoint | The read end-point in a pipe created with mrpt::synch::CPipe |
CCPipeWriteEndPoint | The write end-point in a pipe created with mrpt::synch::CPipe |
CCSemaphore | A semaphore for inter-thread synchronization |
CCThreadSafeVariable | A template for created thread-safe variables with an internal critical section controlled each read or write |
CMT_buffer | This class is a bulk sequence of bytes with MultiThread (MT)-safe read and write operations |
▶Nsystem | 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 |
CBlockedRange | |
▶CCDirectoryExplorer | This class allows the enumeration of the files/directories that exist into a given path |
CTFileInfo | This represents the information about each file |
▶CCFileSystemWatcher | This class subscribes to notifications of file system changes, thus it can be used to efficiently stay informed about changes in a directory tree |
CTFileSystemChange | Each of the changes detected by utils::CFileSystemWatcher |
CCGenericMemoryPool | A generic system for versatile memory pooling |
CSplit | |
CTCallStackBackTrace | See: getCallStackBackTrace() |
CTCallStackEntry | Used in getCallStackBackTrace() |
CTThreadHandle | A MRPT thread handle |
CTTimeParts | The parts of a date/time (it's like the standard 'tm' but with fractions of seconds) |
▶Ntfest | Functions for estimating the optimal transformation between two frames of references given measurements of corresponding points |
CTPotentialMatch | For each individual-compatibility (IC) test, the indices of the candidate match between elements in both reference frames |
CTSE2RobustParams | Parameters for se2_l2_robust() |
CTSE2RobustResult | Output placeholder for se2_l2_robust() |
CTSE3RobustParams | Parameters for se3_l2_robust() |
CTSE3RobustResult | Output placeholder for se3_l2_robust() |
▶Ntopography | This namespace provides topography helper functions, coordinate transformations |
CTCoords | 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 |
CTDatum10Params | Parameters for a topographic transfomation |
CTDatum1DTransf | Parameters for a topographic transfomation |
CTDatum7Params | Parameters for a topographic transfomation |
CTDatum7Params_TOPCON | |
CTDatumHelmert2D | Parameters for a topographic transfomation |
CTDatumHelmert2D_TOPCON | |
CTDatumHelmert3D | Parameters for a topographic transfomation |
CTDatumHelmert3D_TOPCON | Parameters for a topographic transfomation |
CTDatumTransfInterpolation | Parameters for a topographic transfomation |
CTEllipsoid | |
CTGeodeticCoords | A set of geodetic coordinates: latitude, longitude and height, defined over a given geoid (typically, WGS84) |
CTPathFromRTKInfo | Used to return optional information from mrpt::topography::path_from_rtk_gps |
▶Nutils | Classes for serialization, sockets, ini-file manipulation, streams, list of properties-values, timewatch, extensions to STL |
▶Ndetail | |
CPointCloudAdapterHelperNoRGB | 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 |
▶Ninternal | |
CCopyCloner | |
CCopyStatic | |
Cdynamic_grid_txt_saver | |
Cgeneric_copier_ptr | |
CTFreeFnDataForZMQ | |
▶Nmetaprogramming | A set of utility objects for metaprogramming with STL algorithms |
CBinaryMemberFunctionWrapper | This template encapsulates a binary member function and a single object into a function expecting the two parameters of the member function |
CMemberFunctionWrapper | This template encapsulates a member function without arguments and a single object into a function |
CMemoryBypasserIterator | 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* |
CNonConstBind1st | Equivalent of std::bind1st for functions with non-const arguments |
CNonConstBind2nd | Equivalent of std::bind2nd for functions with non-const arguments |
CObjectClear | An object for clearing an object (invokes its method "->clear()") given a pointer or smart-pointer, intended for being used in STL algorithms |
CObjectClear2 | An object for clearing an object (invokes its method ".clear()") given a pointer or smart-pointer, intended for being used in STL algorithms |
CObjectClearSecond | An object for clearing an object->second (invokes its method "clear()") given a pointer or smart-pointer, intended for being used in STL algorithms |
CObjectClearUnique | An object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms |
CObjectConvert | An object for transforming between types/classes, intended for being used in STL algorithms |
CObjectDelete | An object for deleting pointers (intended for STL algorithms) |
CObjectMakeUnique | An object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms |
CObjectPairMakeUnique | An object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms |
CObjectReadFromStream | An object for reading objects from a stream, intended for being used in STL algorithms |
CObjectReadFromStreamToPtrs | |
CObjectWriteToStream | An object for writing objects to a stream, intended for being used in STL algorithms |
CUnaryMemberFunctionWrapper | This template encapsulates an unary member function and a single object into a function expecting the parameter of the member function |
▶Nsimpleini | |
▶CCSimpleIniTempl | Simple INI file reader |
CConverter | Characterset conversion utility class to convert strings to the same format as is used for the storage |
▶CEntry | Key entry |
CKeyOrder | Strict less ordering by name of key only |
CLoadOrder | Strict less ordering by order, and then name of key |
CFileWriter | OutputWriter class to write the INI data to a file |
COutputWriter | Interface definition for the OutputWriter object to pass to Save() in order to output the INI file data |
CStreamWriter | OutputWriter class to write the INI data to an ostream |
CStringWriter | OutputWriter class to write the INI data to a string |
▶CMRPT_IniFileParser | MRPT custom INI file parser to allow minimal file preprocessing: |
CParseContext | |
CSI_ConvertA | Null conversion class for MBCS/UTF-8 to char (or equivalent) |
CSI_GenericCase | Generic case-sensitive less than comparison |
CSI_GenericNoCase | Generic ASCII case-insensitive less than comparison |
Cbimap | 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 |
CCArray | A STL container (as wrapper) for arrays of constant size defined at compile time |
CCArray< T, 0 > | |
CCCanvas | This virtual class defines the interface of any object accepting drawing primitives on it |
CCClassRegistry | A singleton with the central registry for CSerializable run-time classes: users do not use this class in any direct way |
CCClientTCPSocket | 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 |
CCConfigFile | This class allows loading and storing values and vectors of different types from ".ini" files easily |
CCConfigFileBase | 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.. |
CCConfigFileMemory | This class implements a config file-like interface over a memory-stored string list |
CCConfigFilePrefixer | A wrapper for other CConfigFileBase-based objects that prefixes a given token to every key and/or section |
CCConsoleRedirector | 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 |
CCDebugOutputCapable | 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 |
CCDynamicGrid | A 2D grid of dynamic size which stores any kind of data at each cell |
CCDynamicGrid3D | A 3D rectangular grid of dynamic size which stores any kind of data at each voxel |
CCEnhancedMetaFile | This class represents a Windows Enhanced Meta File (EMF) for generating and saving graphics |
CCExceptionEOF | Used in mrpt::utils::CStream |
CCExceptionExternalImageNotFound | Used in mrpt::utils::CImage |
CCFileGZInputStream | Transparently opens a compressed "gz" file and reads uncompressed data from it |
CCFileInputStream | This CStream derived class allow using a file as a read-only, binary stream |
CCFileOutputStream | This CStream derived class allow using a file as a write-only, binary stream |
CCFileStream | This CStream derived class allow using a file as a read/write binary stream, creating it if the file didn't exist |
▶Cci_less | A case-insensitive comparator struct for usage within STL containers, eg: map<string,string,ci_less> |
Cnocase_compare | |
CCImage | A class for storing images as grayscale or RGB bitmaps |
Ccircular_buffer | A circular buffer of fixed size (defined at construction-time), implemented with a std::vector as the underlying storage |
CCLASSINIT | Auxiliary structure used for CObject-based RTTI |
CCListOfClasses | A list (actually based on a std::set) of MRPT classes, capable of keeping any class registered by the mechanism of CSerializable classes |
CCLoadableOptions | This is a virtual base class for sets of options than can be loaded from and/or saved to configuration plain-text files |
CCMappedImage | 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) |
CCMemoryChunk | A memory buffer (implements CStream) which can be itself serialized |
CCMemoryStream | This CStream derived class allow using a memory buffer as a CStream |
CCMessage | A class that contain generic messages, that can be sent and received from a "CClientTCPSocket" object |
CCMHPropertiesValuesList | An arbitrary list of "annotations", or named attributes, each being an instance of any CSerializable object (Multi-hypotheses version) |
CCMRPTException | The base for MRPT-especific exceptions |
CCObject | The virtual base class of all MRPT classes with a unified RTTI system |
CCObjectPtr | |
CCObservable | Inherit from this class for those objects capable of being observed by a CObserver class |
CCObserver | Inherit from this class to get notified about events from any CObservable object after subscribing to it |
CContainerReadOnlyProxyAccessor | A generic proxy accessor template that only allows read-only access to the original binded STL container object |
Ccopiable_NULL_ptr | A wrapper class for pointers that, if copied with the "=" operator, should be set to NULL in the new copy |
Ccopiable_NULL_ptr_basic | A wrapper class for pointers that, if copied with the "=" operator, should be set to NULL in the copy |
Ccopy_ptr | Smart pointer for non-polymorphic classes |
CCProbabilityDensityFunction | A generic template for probability density distributions (PDFs) |
CCProfilerProxy | |
▶CCPropertiesValuesList | An arbitrary list of "annotations", or named attributes, each being an instance of any CSerializable object |
CTPropertyValuePair | |
CCRateTimer | A class for calling sleep() in a loop, such that the amount of sleep time will be computed to make the loop run at the desired rate (in Hz) |
CCRobotSimulator | |
CCSerializable | The virtual base class which provides a unified interface for all persistent objects in MRPT |
CCServerTCPSocket | A TCP socket that can be wait for client connections to enter |
CCSimpleDatabase | This class impements a very simple database system |
CCSimpleDatabaseTable | This class implements the tables of databases |
CCStdOutStream | This CStdOutStream derived class allow printing to standard out, normally the console text output |
CCStream | This base class is used to provide a unified interface to files,memory buffers,..Please see the derived classes |
CCStringList | A class for storing a list of text lines |
CCTextFileLinesParser | A class for parsing text files, returning each non-empty and non-comment line, along its line number |
CCThreadSafeQueue | 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*" |
CCTicTac | This class implements a high-performance stopwatch |
▶CCTimeLogger | A versatile "profiler" that logs the time spent within each pair of calls to enter(X)-leave(X), among other stats |
CTCallData | Data of all the calls: |
CTCallStats | Data of each call section: # of calls, minimum, maximum, average and overall execution time (in seconds) |
CCTimeLoggerEntry | 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 |
CCTypeSelector | This class represents a std::string derived class which is also CSerializable |
CCUncopiable | The base class of classes that cannot be copied: compile-time errors will be issued on any copy operation |
Cignored_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" |
Cint_select_by_bytecount | Usage: int_select_by_bytecount<N>type var; allows defining var as a signed integer with, at least, N bytes |
Cint_select_by_bytecount< 1 > | |
Cint_select_by_bytecount< 2 > | |
Cint_select_by_bytecount< 3 > | |
Cint_select_by_bytecount< 4 > | |
Cint_select_by_bytecount< 8 > | |
Clist_searchable | This class implements a STL container with features of both, a std::set and a std::list |
Cmap_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 |
▶Cmap_traits_map_as_vector | Traits for using a mrpt::utils::map_as_vector<> (dense, fastest representation) |
Cmap | |
▶Cmap_traits_stdmap | Traits for using a std::map<> (sparse representation) |
Cmap | |
CmrptEvent | The basic event type for the observer-observable pattern in MRPT |
CmrptEventOnDestroy | An event sent by any CObservable object (automatically) just before being destroyed and telling its observers to unsubscribe |
Cnon_copiable_ptr | A wrapper class for pointers that can NOT be copied with "=" operator, raising an exception at runtime if a copy is attempted |
Cnon_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 |
Cpimpl | Pointer to IMPLementation auxiliary structure to make raw pointers movable, copiable and automatically deleted |
CPLY_Exporter | A virtual base class that implements the capability of exporting 3D point clouds and faces to a file in the Stanford PLY format |
CPLY_Importer | A virtual base class that implements the capability of importing 3D point clouds and faces from a file in the Stanford PLY format |
CPointCloudAdapter | An adapter to different kinds of point cloud object |
CPointCloudAdapter< mrpt::maps::CColouredPointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CColouredPointsMap> |
CPointCloudAdapter< mrpt::maps::CPointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CPointsMap> |
CPointCloudAdapter< mrpt::maps::CSimplePointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CSimplePointsMap> |
CPointCloudAdapter< mrpt::maps::CWeightedPointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::maps::CWeightedPointsMap> |
CPointCloudAdapter< mrpt::obs::CObservation3DRangeScan > | Specialization mrpt::utils::PointCloudAdapter<CObservation3DRangeScan> |
CPointCloudAdapter< mrpt::opengl::CPointCloud > | Specialization mrpt::utils::PointCloudAdapter<mrpt::opengl::CPointCloud> |
CPointCloudAdapter< mrpt::opengl::CPointCloudColoured > | Specialization mrpt::utils::PointCloudAdapter<mrpt::opengl::CPointCloudColoured> |
CPointCloudAdapter< pcl::PointCloud< pcl::PointXYZ > > | Specialization mrpt::utils::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZ> > for an XYZ point cloud (without RGB) |
CPointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGB > > | Specialization mrpt::utils::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZRGB> > for an XYZ point cloud with RGB |
CPointCloudAdapter< pcl::PointCloud< pcl::PointXYZRGBA > > | Specialization mrpt::utils::PointCloudAdapter<pcl::PointCloud<pcl::PointXYZRGBA> > for an XYZ point cloud with RGB |
Cpoly_ptr | Smart pointer for polymorphic classes with a clone() method |
Cpoly_ptr_ptr | Wrapper to a smart pointer to polymorphic classes, capable of handling copy operator, etc |
Csafe_ptr | A wrapper class for pointers that can be safely copied with "=" operator without problems |
Csafe_ptr_basic | A wrapper class for pointers that can be safely copied with "=" operator without problems |
CTCamera | Structure to hold the parameters of a pinhole camera model |
CTColor | A RGB color - 8bit |
CTColorf | A RGB color - floats in the range [0,1] |
CTColorManager | Manage R, G, B color triads and ask class instance of the next unique RGB combination |
CTEnumType | A helper class that can convert an enum value into its textual representation, and viceversa |
CTEnumTypeFiller | Only specializations of this class are defined for each enum type of interest |
CTEnumTypeFiller< bayes::TKFMethod > | |
CTEnumTypeFiller< hwdrivers::CGPSInterface::PARSERS > | |
CTEnumTypeFiller< hwdrivers::CKinect::TVideoChannel > | |
CTEnumTypeFiller< hwdrivers::CVelodyneScanner::model_t > | |
CTEnumTypeFiller< hwdrivers::CVelodyneScanner::return_type_t > | |
CTEnumTypeFiller< maps::CHeightGridMap2D::TMapRepresentation > | |
CTEnumTypeFiller< maps::CRandomFieldGridMap2D::TMapRepresentation > | |
CTEnumTypeFiller< mrpt::nav::CAbstractNavigator::TState > | |
CTEnumTypeFiller< mrpt::obs::CObservation3DRangeScan::TIntensityChannelID > | |
CTEnumTypeFiller< mrpt::poses::TInterpolatorMethod > | |
CTEnumTypeFiller< nav::CHolonomicND::TSituations > | |
CTEnumTypeFiller< nav::THolonomicMethod > | |
CTEnumTypeFiller< slam::CGridMapAligner::TAlignerMethod > | |
CTEnumTypeFiller< slam::TDataAssociationMethod > | |
CTEnumTypeFiller< slam::TDataAssociationMetric > | |
CTEnumTypeFiller< slam::TICPAlgorithm > | |
CTEnumTypeFiller< slam::TICPCovarianceMethod > | |
CTMatchingPair | A structure for holding correspondences between two sets of points or points-like entities in 2D or 3D |
CTMatchingPairList | A list of TMatchingPair |
CTParameters | For usage when passing a dynamic number of (numeric) arguments to a function, by name |
CTPixelCoord | A pair (x,y) of pixel coordinates (integer resolution) |
CTPixelCoordf | A pair (x,y) of pixel coordinates (subpixel resolution) |
CTPropertyValueIDTriplet | Internal triplet for each property in utils::CMHPropertiesValuesList |
CTRuntimeClassId | A structure that holds runtime class type information |
Cts_map_entry | |
CTStereoCamera | Structure to hold the parameters of a pinhole stereo camera model |
CTTypeName | A template to obtain the type of its argument as a string at compile time |
CTTypeName< mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS > > | |
CTTypeName< mrpt::math::CArrayDouble< N > > | |
CTTypeName< mrpt::math::CArrayFloat< N > > | |
CTTypeName< mrpt::math::CArrayNumeric< T, N > > | |
CTTypeName< mrpt::math::CMatrixFixedNumeric< T, N, M > > | |
CTTypeName< mrpt::math::CMatrixTemplateNumeric< T > > | |
CTTypeName< mrpt::opengl::CLight > | |
CTTypeName< std::pair< T1, T2 > > | |
Cuint_select_by_bytecount | Usage: uint_select_by_bytecount<N>type var; allows defining var as a unsigned integer with, at least, N bytes |
Cuint_select_by_bytecount< 1 > | |
Cuint_select_by_bytecount< 2 > | |
Cuint_select_by_bytecount< 3 > | |
Cuint_select_by_bytecount< 4 > | |
Cuint_select_by_bytecount< 8 > | |
▶Nvision | Classes for computer vision, detectors, features, etc |
▶Ndetail | |
CTSIFTDesc2KDTree_Adaptor | |
CTSURFDesc2KDTree_Adaptor | |
▶Npnp | Perspective n Point (PnP) Algorithms toolkit for MRPT |
CCPnP | This class is used for Pose estimation from a known landmark using a monocular camera |
Cdls | |
Cepnp | |
Clhm | |
Cp3p | |
Cposit | |
Cppnp | |
Crpnp | |
Cupnp | |
▶CCCamModel | This class represent a pinhole camera model for Monocular SLAM and implements some associated Jacobians |
CCameraTempVariables | |
CCDifodo | This abstract class implements a method called "Difodo" to perform Visual odometry with range cameras |
▶CCFeature | 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 |
CTDescriptors | All the possible descriptors this feature may have |
▶CCFeatureExtraction | The central class from which images can be analyzed in search of different kinds of interest points and descriptors computed for them |
▶CTOptions | The set of parameters for all the detectors & descriptor algorithms |
CTBCDOptions | BCD Options |
CTFASTOptions | FAST and FASTER Options |
CTHarrisOptions | Harris Options |
CTKLTOptions | KLT Options |
CTLogPolarImagesOptions | LogPolarImagesOptions Options |
CTORBOptions | ORB Options |
CTPolarImagesOptions | PolarImagesOptions Options |
CTSIFTOptions | SIFT Options |
CTSpinImagesOptions | |
CTSURFOptions | |
CCFeatureList | A list of visual features, to be used as output by detectors, as input/output by trackers, etc |
CCFeatureListKDTree | 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 |
CCFeatureTracker_KL | Track a set of features from old_img -> new_img using sparse optimal flow (classic KL method) |
▶CCGenericFeatureTracker | A virtual interface for all feature trackers, implementing the part of feature tracking that is common to any specific tracker implementation |
CTExtraOutputInfo | |
CCImagePyramid | 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) |
CCMatchedFeatureList | A list of features |
CCStereoRectifyMap | Use this class to rectify stereo images if the same distortion maps are reused over and over again |
CCUndistortMap | Use this class to undistort monocular images if the same distortion map is used over and over again |
CCVideoFileWriter | An output stream which takes a sequence of images and writes a video file in any of a given of compatible formats |
CJacData | |
CKeypointResponseSorter | A helper struct to sort keypoints by their response: It can be used with these types: |
Clm_stat_t | |
CTFeatureObservation | One feature observation entry, used within sequences with TSequenceFeatureObservations |
CTImageCalibData | 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) |
CTImageROI | A structure for defining a ROI within an image |
CTImageStereoCalibData | 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) |
CTImageStereoCallbackData | Params of the optional callback provided by the user |
CTMatchingOptions | A structure containing options for the matching |
CTMultiResDescMatchOptions | Struct containing the options when matching multi-resolution SIFT-like descriptors |
CTMultiResDescOptions | Struct containing the options when computing the multi-resolution SIFT-like descriptors |
CTMultiResMatchingOutput | Struct containing the output after matching multi-resolution SIFT-like descriptors |
CTRelativeFeaturePos | One relative feature observation entry, used with some relative bundle-adjustment functions |
CTResidJacobElement | Data associated to each observation in the Lev-Marq |
CTROI | A structure for storing a 3D ROI |
CTSequenceFeatureObservations | A complete sequence of observations of features from different camera frames (poses) |
CTSIFTDescriptorsKDTreeIndex | A kd-tree builder for sets of features with SIFT descriptors |
CTSimpleFeature_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 |
CTSimpleFeatureList_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 |
CTSimpleFeatureTraits | |
CTSimpleFeatureTraits< TSimpleFeature > | |
CTSimpleFeatureTraits< TSimpleFeaturef > | |
CTStereoCalibParams | Input parameters for mrpt::vision::checkerBoardStereoCalibration |
CTStereoCalibResults | Output results for mrpt::vision::checkerBoardStereoCalibration |
CTStereoSystemParams | Parameters associated to a stereo system |
CTSURFDescriptorsKDTreeIndex | A kd-tree builder for sets of features with SURF descriptors |
Caligned_containers | Helper types for STL containers with Eigen memory allocators |
CGreater | |
CLess | |
Cptr_cast | Converts a smart pointer Base::Ptr to Derived::Ptr, in a way compatible with MRPT >=1.5.4 and MRPT 2.x series |
▶Nrp | |
▶Narch | |
▶Nnet | |
Craw_serial | |
▶Nhal | |
CAutoLocker | |
CEvent | |
CLocker | |
Cserial_rxtx | |
CThread | |
▶Nstandalone | |
▶Nrplidar | |
CRPlidarDriver | |
CRPlidarDriverSerialImpl | |
▶Nxsens | The namespace of all Xsens software since 2006 |
CCmt1f | The low-level file communication class |
CCmt1s | The low-level serial communication class |
CCmt2f | The mid-level file communication class |
CCmt2s | Mid-level serial communication class |
CCmt3 | High-level communication class |
CFifoQueue | A FIFO queue with limited length (cyclic) |
CFifoQueueBasic | A FIFO queue with limited length (cyclic) |
CIntList | |
CItypes | |
CJanitorClassFunc | Class function calling janitor class |
CJanitorDelete | Memory releasing janitor class |
CJanitorDeleteArray | Memory releasing janitor class |
CJanitorFree | Memory releasing janitor class |
CJanitorFunc | Function calling janitor class |
CJanitorFuncStdCall | Function calling janitor class |
CJanitorLogFunc | Log / printf-like function calling janitor class |
CJanitorRestore | Value restoring janitor class |
CJanitorSet | Value restoring janitor class |
CList | Dynamic list class |
CMessage | Class for storing a single message |
▶CMessageHeader | A message header |
▶C_mdl | |
▶C_mextd | |
C_mlen | |
▶CPacket | A structure containing MT data + timestamp and formatting information |
CPacketInfo | Contains information about data in the packet and the format of that data |
C__GLXEvent | |
C_GPU_DEVICE | |
C_rplidar_ans_header_t | |
C_rplidar_cmd_packet_t | |
C_rplidar_payload_acc_board_flag_t | |
C_rplidar_payload_express_scan_t | |
C_rplidar_payload_motor_pwm_t | |
C_rplidar_response_acc_board_flag_t | |
C_rplidar_response_cabin_nodes_t | |
C_rplidar_response_capsule_measurement_nodes_t | |
C_rplidar_response_device_health_t | |
C_rplidar_response_device_info_t | |
C_rplidar_response_measurement_node_t | |
C_rplidar_response_sample_rate_t | |
CALLXMLClearTag | |
Cbacking_store_struct | |
CBitCheck | |
CBitCheck< N, N > | |
Cbitread_perm_state | |
Cbitread_working_state | |
Cbox | |
Cc_derived_tbl | |
CCAngularObservationMesh_fnctr | |
CCDialogAskUserForCamera | |
CCDisplayWindow_WXAPP | |
CCGraphSlamHandler | Manage variables and methods related to applications executing graphSLAM using the mrpt-graphslam API |
CCmtAnalogInData | |
CCmtBinaryData | |
CCmtCalData | |
CCmtDataFormat | A structure for storing data formats |
▶CCmtDeviceConfiguration | Structure containing a full device configuration as returned by the ReqConfig message |
C_devInfo | |
CCmtDeviceMode | A structure for storing device modes |
CCmtDeviceMode2 | A structure for storing device modes using period and skip factor (new default) |
CCmtEuler | |
CCmtGpsSatelliteInfo | |
CCmtGpsStatus | |
CCmtMatrix | |
CCmtPortInfo | Structure for storing information about a serial port |
CCmtQuat | |
CCmtRawData | |
CCmtRawGpsData | |
CCmtScenario | A structure for storing scenario information |
CCmtShortVector | |
CCmtSyncInSettings | A structure for storing sync in settings |
CCmtSyncOutSettings | A structure for storing sync out settings |
CCmtUtcTime | A structure for storing UTC Time values |
CCmtVector | |
CCmtVersion | A structure for storing the firmware version |
CCMyRedirector | This auxiliary class redirects the output sent to a streambuf to a wxTextCtrl object |
CCObject | |
CCObservation3DRangeScan_Points_MemPoolData | |
CCObservation3DRangeScan_Points_MemPoolParams | |
CCObservation3DRangeScan_Ranges_MemPoolData | |
CCObservation3DRangeScan_Ranges_MemPoolParams | |
Ccode | |
Cconfig_pbmap | |
Cct_data_s | |
CCTexturedObject_MemPoolData | |
CCTexturedObject_MemPoolParams | |
CCvCBCorner | |
CCvCBQuad | |
CCvContourEx | |
Cd_derived_tbl | |
Cdetection_data | Holds feature data relevant to detection |
CEdgeAdder | |
CEdgeAdder< mrpt::poses::CPose2D > | |
CEdgeAdder< mrpt::poses::CPose3D > | |
CEdgeAdder< mrpt::poses::CPose3DPDFGaussianInf > | |
CEdgeAdder< mrpt::poses::CPosePDFGaussianInf > | |
CFAddUntracedLines | |
CFCreatePolygon | |
CFCreatePolygonFromFace | |
Cfeature |
Structure to represent an affine invariant image feature |
CFSetColor | |
CFUnprojectPolygon2D | |
CGLXBufferClobberEventSGIX | |
CGLXHyperpipeConfigSGIX | |
CGLXHyperpipeNetworkSGIX | |
CGLXPbufferClobberEvent | |
CGLXPipeRect | |
CGLXPipeRectLimits | |
CGraphSlamLevMarqTest | |
CGraphTester | |
Cgz_header_s | |
Chuff_entropy_decoder | |
Chuff_entropy_encoder | |
CHypothesisNotFoundException | |
CICPTests | |
Cimaxdiv_t | |
Cinflate_state | |
Cinternal_state | |
CInternalDataPacket | |
CIoInterface | An abstract IO interface |
CIoInterfaceFile | The low-level file communication class |
CIProtocolHandler | Interface class for protocol handlers |
CJHUFF_TBL | |
Cjpeg_c_coef_controller | |
Cjpeg_c_main_controller | |
Cjpeg_c_prep_controller | |
Cjpeg_color_converter | |
Cjpeg_color_deconverter | |
Cjpeg_color_quantizer | |
Cjpeg_common_struct | |
Cjpeg_comp_master | |
Cjpeg_component_info | |
Cjpeg_compress_struct | |
Cjpeg_d_coef_controller | |
Cjpeg_d_main_controller | |
Cjpeg_d_post_controller | |
Cjpeg_decomp_master | |
Cjpeg_decompress_struct | |
Cjpeg_destination_mgr | |
Cjpeg_downsampler | |
Cjpeg_entropy_decoder | |
Cjpeg_entropy_encoder | |
Cjpeg_error_mgr | |
Cjpeg_forward_dct | |
Cjpeg_input_controller | |
Cjpeg_inverse_dct | |
Cjpeg_marker_reader | |
Cjpeg_marker_struct | |
Cjpeg_marker_writer | |
Cjpeg_memory_mgr | |
Cjpeg_progress_mgr | |
Cjpeg_scan_info | |
Cjpeg_source_mgr | |
Cjpeg_transform_info | |
Cjpeg_upsampler | |
CJQUANT_TBL | |
Cjvirt_barray_control | |
Cjvirt_sarray_control | |
Ckd_node | Node in a k-d tree |
▶CKmTree | |
CNode | |
Clarge_pool_struct | |
CLegacyDataPacket | Contains an MTData XsMessage and supports functions for extracting contained data |
CMapAuxPFCleanup | |
CMapCanComputeLikelihood | |
CMapComputeLikelihood | |
CMapExecutor | |
CMapGetAs3DObject | |
CMapInsertObservation | |
CMapIsEmpty | |
CMapVectorClearer | |
CMatchingVertex | |
CMD5 | |
CMessageLocation | Stores the location of a message in a buffer using a start position and a size |
Cmin_pq | Minimizing priority queue |
CmPointHull | ! mPointHull serves to calculate the convex hull of a set of points in 2D, which are defined by its position (x,y) and an identity id |
Cmrpt_destination_mgr | |
CMtwSdiData | Class to store strapdown integration data |
Cmultiplier_table | |
Cmy_coef_controller | |
Cmy_color_converter | |
Cmy_color_deconverter | |
Cmy_comp_master | |
Cmy_cquantizer | |
Cmy_decomp_master | |
Cmy_destination_mgr | |
Cmy_downsampler | |
Cmy_fdct_controller | |
Cmy_idct_controller | |
Cmy_input_controller | |
Cmy_main_controller | |
Cmy_marker_reader | |
Cmy_marker_writer | |
Cmy_memory_mgr | |
Cmy_post_controller | |
Cmy_prep_controller | |
Cmy_source_mgr | |
Cmy_upsampler | |
CMyGlobalProfiler | |
CNextToken | |
CPacketFixedData | A structure containing fixed packet data, which should not change during a measurement for the same device |
CPacketInfo | Contains offset information about data in the packet |
CPacketStamper | Supplies functionality for timestamping data packets |
Cphuff_entropy_decoder | |
Cphuff_entropy_encoder | |
CPlyElement | |
CPlyFile | |
CPlyProperty | |
CPointCloudStorageWrapper | Auxiliary class used to refactor CObservationVelodyneScan::generatePointCloud() |
CPose3DPDFGaussTests | |
CPose3DQuatPDFGaussTests | |
CPose3DQuatTests | |
CPose3DRotVecTests | |
▶CPose3DTests | |
CTParams_func_jacob_Aexpe_D | |
CPosePDFGaussTests | |
CPOSIT | |
Cpq_node | Element in a minimizing priority queue |
CProtocolHandler | Message protocol handling class |
CQuaternionTests | |
Cransac_data | Holds feature data relevant to ransac |
Csavable_state | |
▶CSE_traits_tests | |
CTParams | |
CSegmentVector | |
CSerialInterface | The low-level serial communication class |
Csmall_pool_struct | |
Csort_pred | |
CStreamInterface | A stream interface |
CT2ListsOfSegments | |
CtagSFG_Context | |
CtagSFG_Display | |
CtagSFG_Enumerator | |
CtagSFG_Font | |
CtagSFG_List | |
CtagSFG_Menu | |
CtagSFG_MenuContext | |
CtagSFG_MenuEntry | |
CtagSFG_Node | |
CtagSFG_State | |
CtagSFG_StrokeChar | |
CtagSFG_StrokeFont | |
CtagSFG_StrokeStrip | |
CtagSFG_StrokeVertex | |
CtagSFG_Structure | |
CtagSFG_Time | |
CtagSFG_Timer | |
CtagSFG_Window | |
CtagSFG_WindowList | |
CtagSFG_WindowState | |
CtagSFG_XYUse | |
CTAux | |
CTAuxDLData | |
CTAuxLoadFunctor | |
CTAuxRangeMeasInfo | Auxiliary for optimal sampling in RO-SLAM |
CTCommonRegion | |
CTDistance | |
CTDNSThreadData | |
CTDUOParams | |
CTFace | |
CTFunctorLaserSimulData | |
CTGap | |
CTInterpQuery | |
CTLocalPoint | Local stucture used in the next method (must be here for usage within STL stuff) |
CTObs | |
CTOldCellTypeInVersion1 | |
CTOpenGLNameBooker | |
CToXMLStringTool | Helper class to create XML files using "printf", "fprintf", "cout",... functions |
CTParsersRegistry | |
CTPrevious | |
Ctree_desc_s | |
CTSegmentWithLine | |
CTTempIntersection | |
CTVertex | |
CUsbInterface | An IoInterface for dealing specifically with Xsens USB devices |
▶CUsbInterfacePrivate | Private object for UsbInterface |
CUsbContext | A context manager for libusb |
Cworking_state | |
CXML | |
CXMLAttribute | Structure for XML attribute |
CXMLCharacterEntity | |
CXMLClear | Structure for XML clear (unformatted) node (usually comments) |
▶CXMLNode | Main Class representing a XML node |
CXMLNodeDataTag | |
CXMLNodeContents | This structure is given by the function XMLNode::enumContents |
CXMLParserBase64Tool | Helper class to include binary data inside XML strings using "Base64 encoding" |
CXMLResults | Structure used to obtain error details if the parse fails |
CXsAnalogInData | Data from analog inputs from sensors |
CXsArray | |
CXsArrayDescriptor | This object describes how to treat the data in an array |
CXsAtomicInt | Wrapper class for easy use of XsAtomicIntValue values |
CXsCalibratedData | |
CXsDataFormat | A structure for storing data formats |
CXsDataPacket | Contains data received from a device or read from a file |
CXsDeviceId | |
CXsEuler | |
CXsGpsPvtData | Data from the GPS unit of a legacy MTi-G |
CXsLibraryLoader | The Xsens dynamic library loader base class |
▶CXsLibUsb | |
C_LIBUSB_API | |
CXsMatrix | |
CXsMatrix3x3 | |
CXsMessage | Structure for storing a single message |
▶CXsMessageHeader | A message header |
▶CLengthData | Contains optional extended length of message and first byte of data buffer |
▶CExtendedLength | Contains extended length information and first byte of data buffer if normal length is 255 |
CExtendedParts | The high and low byte of the extended length |
CXsOutputConfiguration | Single data type output configuration |
CXsPortInfo | |
CXsPressure | Pressure data |
CXsQuaternion | |
CXsRange | |
CXsRawGpsDop | A container for NAV-DOP data |
CXsRawGpsSol | A container for NAV-SOL data |
CXsRawGpsSvInfo | A container for NAV-SVINFO data |
CXsRawGpsTimeUtc | A container for NAV-TIMEUTC data |
CXsScrData | Container for raw sensor measurement data |
CXsSdiData | |
CXsSvInfo | A container for information of one satellite |
CXsSyncSetting | A structure for storing all xsens sync settings |
CXsTimeStamp | Class for managing timestamps in a unified way |
CXsTriggerIndicationData | Data for a trigger indication message |
▶CXsUdev | |
C_UDEV_API | |
CXsUShortVector | A vector containing 3 short values |
CXsUtcTime | A structure for storing UTC Time values |
CXsVector | |
CXsVector3 | |
CXsVersion | |
▶CXsWinUsb | Class for dynamic loading of winusb |
C_WINUSB_API | |
Cz_stream_s | |