▶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 |
▶Ndetail | Auxiliary functions, for internal usage of MRPT classes |
CCRunOneKalmanIteration_addNewLandmarks | |
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 | |
CCDetectable2DPtr | |
CCDetectable3D | |
CCDetectable3DPtr | |
CCDetectableObject | Base class that contains common atributes and functions of detectable objects |
CCDetectableObjectPtr | |
▶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 |
Cedge_annotations_empty | An empty structure |
Cgraph_ops | Helper struct with static template functions |
Cnode_annotations_empty | An empty structure |
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 | A special kind of graph in the form of a tree with directed edges and optional edge annotations of templatized type "TYPE_EDGES" |
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 pose between pairs of nodes indentified by their numeric IDs (of type 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 |
CTGraphvizExportParams | Used in mrpt::graphs export functions to .dot files |
▶Ngraphslam | SLAM methods related to graphs of pose constraints |
▶Ndetail | Internal auxiliary classes |
CAuxErrorEval | |
CAuxErrorEval< CPose2D, gst > | |
CAuxErrorEval< CPose3D, gst > | |
CAuxErrorEval< CPose3DPDFGaussianInf, gst > | |
CAuxErrorEval< CPosePDFGaussianInf, gst > | |
▶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() |
▶Ngui | Classes for creating GUI windows for 2D and 3D visualization |
CCBaseGUIWindow | The base class for GUI window classes |
CCBaseGUIWindowPtr | |
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 |
CCDisplayWindow3DPtr | |
CCDisplayWindowPlots | Create a GUI window and display plots with MATLAB-like interfaces and commands |
CCDisplayWindowPlotsPtr | |
CCDisplayWindowPtr | |
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 |
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 |
CWxSubsystem | This class implements the GUI thread required for the wxWidgets-based GUI |
▶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 |
CCHierarchicalMHMapPtr | |
CCHMHMapArc | A class for representing an arc between two nodes in a hierarchical, multi-hypothesis map |
CCHMHMapArcPtr | |
CCHMHMapNode | A class for representing a node in a hierarchical, multi-hypothesis map |
CCHMHMapNodePtr | |
▶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) |
CCHMTSLAMPtr | |
▶CCLocalMetricHypothesis | This class is used in HMT-SLAM to represent each of the Local Metric Hypotheses (LMHs) |
CTRobotPosesPartitioning | Used by AA thread |
CCLocalMetricHypothesisPtr | |
▶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) |
CCLSLAMParticleDataPtr | |
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 |
CCRobotPosesGraphPtr | |
▶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 |
CTHypothesisIDSetPtr | |
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) |
▶CCActivMediaRobotBase | This software driver implements the communications (and some rudimentary control) for ActivMedia robotic bases (Pioneer DX/AT, PeopleBot, etc) |
CTRobotDescription | A structure describing the robot |
CCBoardDLMS | An interface to a custom board which interfaces two SICK laser scanners |
CCBoardENoses | A class for interfacing an e-Noses via a FTDI USB link |
CCBoardIR | A parser of NMEA commands, for connecting to a GPS by a serial port |
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 |
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) |
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 |
CCGPSInterface | A parser of NMEA commands, for connecting to a GPS by a serial port |
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 and UXM laser scanners |
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_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 |
CCIMUXSens | A class for interfacing Inertial Measuring Units (IMUs) of the type "XSens MTi" It uses a serial port connection to the device |
CCInterfaceFTDI | A definition of a CStream actually representing a USB connection to a FTDI chip |
CCInterfaceNI845x | A generic C++ wrapper for the specific API of the SPI/I2C board "National Instruments USB 8451/8452" |
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 |
▶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 |
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 |
▶CCPtuHokuyo | |
Cmy_pos | |
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 |
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 |
CCStereoGrabber_Bumblebee | A class for grabing stereo images from a "Bumblebee" or "Bumblebee2" camera NOTE: |
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 |
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_SVS | Options used when creating a STOC Videre Design camera capture object |
CTFTDIDevice | A list of FTDI devices and their descriptors |
CThreadParams | |
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 |
CCKinematicChainPtr | |
CTKinematicLink | An individual kinematic chain element (one link) which builds up a CKinematicChain |
▶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 |
CCArray | A STL container (as wrapper) for arrays of constant size defined at compile time - Users will most likely prefer to use CArrayPOD and its derived classes instead |
CCArray< T, 0 > | |
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 |
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" |
CCMatrixBPtr | |
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>" |
CCMatrixDPtr | |
CCMatrixFixedNumeric | A numeric matrix of compile-time fixed size |
CCMatrixPtr | |
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 | |
CCPolygon | A wrapper of a TPolygon2D class, implementing CSerializable |
CCPolygonPtr | |
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 |
▶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 |
CCSplineInterpolator1DPtr | |
▶CKDTreeCapable | A generic adaptor class for providing Approximate Nearest Neighbors (ANN) (via the nanoflann library) to MRPT classses |
CTKDTreeDataHolder | Internal structure with the KD-tree representation (mainly used to avoid copying pointers with the = operator) |
CTKDTreeSearchParams | |
▶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 |
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 |
CTObject3D | Standard object for storing any 3D lightweight object |
CTPlane | 3D Plane, represented by its equation |
CTPoint2D | Lightweight 2D point |
CTPoint3D | Lightweight 3D point |
CTPoint3Df | Lightweight 3D point (float version) |
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 |
▶Nmrpt | This is the global namespace for all Mobile Robot Programming Toolkit (MRPT) libraries |
▶Nmath | |
▶Ndetail | |
CgetVicinity | This huge template encapsulates a function to get the vicinity of an element, with maximum genericity |
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 |
CCMatrixTemplate | |
CCMatrixTemplateObjects | |
▶Nsynch | |
CCAtomicCounter | This class acts exactly as an int (or long) variable, but with atomic increment and decrement operators |
▶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 |
▶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 |
Caligned_containers | Helper types for STL containers with Eigen memory allocators |
Cdynamicsize_vector | The base class of MRPT vectors, actually, Eigen column matrices of dynamic size with specialized constructors that resemble std::vector |
▶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 |
CC3DSScenePtr | |
▶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 |
CCAngularObservationMeshPtr | |
CCArrow | A 3D arrow |
CCArrowPtr | |
CCAxis | Draw a 3D world axis, with coordinate marks at some regular interval |
CCAxisPtr | |
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) |
CCBoxPtr | |
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 |
CCCameraPtr | |
CCCylinder | A cylinder or cone whose base lies in the XY plane |
CCCylinderPtr | |
CCDisk | A planar disk in the XY plane |
CCDiskPtr | |
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 |
CCEllipsoidInverseDepth2DPtr | |
CCEllipsoidInverseDepth3D | An especial "ellipsoid" in 3D computed as the uncertainty iso-surfaces of a (inv_range,yaw,pitch) variable |
CCEllipsoidInverseDepth3DPtr | |
CCEllipsoidPtr | |
CCEllipsoidRangeBearing2D | An especial "ellipsoid" in 2D computed as the uncertainty iso-surfaces of a (range,bearing) variable |
CCEllipsoidRangeBearing2DPtr | |
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 |
CCFrustumPtr | |
▶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 |
CCGeneralizedCylinderPtr | |
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 |
CCGridPlaneXYPtr | |
CCGridPlaneXZ | A grid of lines over the XZ plane |
CCGridPlaneXZPtr | |
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 | |
CCMeshPtr | |
▶CCOctoMapVoxels | A flexible renderer of voxels, typically from a 3D octo map (see mrpt::slam::COctoMap) |
CTGridCube | The info of each grid block |
CTInfoPerVoxelSet | |
CTVoxel | The info of each of the voxels |
CCOctoMapVoxelsPtr | |
▶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 |
CCOpenGLScenePtr | |
CCOpenGLStandardObject | Objects of this class represent a generic openGL object without specific geometric properties |
CCOpenGLStandardObjectPtr | |
▶CCOpenGLViewport | A viewport within a COpenGLScene, containing a set of OpenGL objects to render |
CTLastProjectiveMatrixInfo | |
CCOpenGLViewportPtr | |
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 |
CCPlanarLaserScanPtr | |
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 | |
CCPointCloudColouredPtr | |
CCPointCloudPtr | |
▶CCPolyhedron | This class represents arbitrary polyhedra |
CTPolyhedronEdge | Struct used to store a polyhedron edge |
CTPolyhedronFace | Struct used to store a polyhedron face |
CCPolyhedronPtr | |
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 |
CCRenderizableDisplayListPtr | |
CCRenderizablePtr | |
CCSetOfLines | A set of independent lines (or segments), one line with its own start and end positions (X,Y,Z) |
CCSetOfLinesPtr | |
CCSetOfObjects | A set of object, which are referenced to the coordinates framework established in this object |
CCSetOfObjectsPtr | |
▶CCSetOfTexturedTriangles | A set of textured triangles |
CTTriangle | Triangle |
CTVertex | Triangle vertex |
CCSetOfTexturedTrianglesPtr | |
▶CCSetOfTriangles | A set of colored triangles |
CTTriangle | Triangle definition |
CCSetOfTrianglesPtr | |
CCSimpleLine | A line segment |
CCSimpleLinePtr | |
CCSphere | A solid or wire-frame sphere |
CCSpherePtr | |
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 |
CCText3DPtr | |
CCTextMessageCapable | Keeps a list of text messages which can be rendered to OpenGL contexts by graphic classes |
CCTextPtr | |
CCTexturedObject | A base class for all OpenGL objects with loadable textures |
CCTexturedObjectPtr | |
CCTexturedPlane | A 2D plane in the XY plane with a texture image |
CCTexturedPlanePtr | |
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 | |
CPbMapPtr | |
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 |
CPlanePtr | |
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 |
CCPoint2DPDFGaussianPtr | |
CCPoint2DPDFPtr | |
CCPoint2DPtr | |
CCPoint3D | A class used to store a 3D point |
CCPoint3DPtr | |
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 |
CCPointPDFGaussianPtr | |
CCPointPDFParticles | A probability distribution of a 2D/3D point, represented as a set of random samples (particles) |
CCPointPDFParticlesPtr | |
CCPointPDFPtr | |
▶CCPointPDFSOG | Declares a class that represents a Probability Density function (PDF) of a 3D point |
CTGaussianMode | The struct for each mode: |
CCPointPDFSOGPtr | |
CCPose | A base class for representing a pose in 2D or 3D |
CCPose2D | A class used to store a 2D pose |
CCPose2DGridTemplate | This is a template class for storing a 3D (2D+heading) grid containing any kind of data |
CCPose2DPtr | |
CCPose3D | A class used to store a 3D pose (a 3D translation + a rotation in 3D) |
CCPose3DInterpolator | A trajectory in time and in 6D (CPose3D) that interpolates using splines the intervals between a set of given time-referenced poses |
CCPose3DInterpolatorPtr | |
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 |
CCPose3DPDFGaussianInfPtr | |
CCPose3DPDFGaussianPtr | |
CCPose3DPDFParticles | Declares a class that represents a Probability Density function (PDF) of a 3D pose |
CCPose3DPDFParticlesPtr | |
CCPose3DPDFPtr | |
▶CCPose3DPDFSOG | Declares a class that represents a Probability Density function (PDF) of a 3D(6D) pose |
CTGaussianMode | The struct for each mode: |
CCPose3DPDFSOGPtr | |
CCPose3DPtr | |
▶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 |
CCPose3DQuatPDFGaussianInfPtr | |
CCPose3DQuatPDFGaussianPtr | |
CCPose3DQuatPDFPtr | |
CCPose3DQuatPtr | |
CCPose3DRotVec | A 3D pose, with a 3D translation and a rotation in 3D parameterized in rotation-vector form (equivalent to axis-angle) |
CCPose3DRotVecPtr | |
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 |
CCPosePDFGaussianInfPtr | |
CCPosePDFGaussianPtr | |
CCPosePDFGrid | Declares a class that represents a Probability Distribution function (PDF) of a 2D pose (x,y,phi) |
CCPosePDFGridPtr | |
CCPosePDFParticles | Declares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples |
CCPosePDFParticlesPtr | |
CCPosePDFPtr | |
▶CCPosePDFSOG | Declares a class that represents a Probability Density function (PDF) of a 2D pose |
CTGaussianMode | The struct for each mode: |
CCPosePDFSOGPtr | |
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 |
CCPoses2DSequencePtr | |
CCPoses3DSequence | This class stores a sequence of relative, incremental 3D poses |
CCPoses3DSequencePtr | |
▶CCRobot2DPoseEstimator | A simple filter to estimate and extrapolate the robot 2D (x,y,phi) pose from asynchronous odometry and localization data |
CTOptions | |
CSE_traits< 2 > | Specialization of SE for 2D poses |
CSE_traits< 3 > | Specialization of SE for 3D poses |
CTSimple3DPoint | Data within each particle |
CTSimple3DPointPtr | |
▶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 |
▶Nreactivenav | This namespace contains classes for building a TP-Space Reactive Navigation System |
CCAbstractHolonomicReactiveMethod | A base class for holonomic reactive navigation methods |
▶CCAbstractReactiveNavigationSystem | This is the base class for any reactive navigation system |
CTNavigationParams | The struct for configuring the navigation request |
CCHolonomicLogFileRecord | A base class for log records for different holonomic navigation methods |
CCHolonomicLogFileRecordPtr | |
▶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 |
▶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_ND | A class for storing extra information about the execution of CHolonomicND navigation |
CCLogFileRecord_NDPtr | |
CCLogFileRecord_VFF | A class for storing extra information about the execution of CHolonomicVFF navigation |
CCLogFileRecord_VFFPtr | |
CCLogFileRecordPtr | |
▶CCParameterizedTrajectoryGenerator | This is the base class for any user defined PTG |
CCColisionGrid | An internal class for storing the collision grid |
CTCellForLambdaFunction | Specifies the min/max values for "k" and "n", respectively |
CTCPoint | The trajectories in the C-Space: |
▶CCPRRTNavigator | This class is a multi-threaded mobile robot navigator, implementing an (anytime) PTG-based Rapidly-exploring Random Tree (PRRT) search algorithm |
▶CTOptions | |
CTPathTrackingOpts | |
CTPlannerOpts | |
CTPathData | Each data point in m_planned_path |
CCPTG1 | A PTG for circular paths |
CCPTG2 | The alpha-PTG |
CCPTG3 | A PTG for optimal paths of type "C|C,S" |
CCPTG4 | A PTG for optimal paths of type "C|C" |
CCPTG5 | A PTG for optimal paths of type "C|C,S" |
CCPTG6 | A PTG for circular paths |
CCPTG7 | A PTG for circular paths |
CCReactiveInterfaceImplementation | The pure virtual class that a user of CAbstractReactiveNavigationSystem-derived classes must implement in order to allow the navigator sense the world and send motion commands to the robot |
▶CCReactiveNavigationSystem | Implements a reactive navigation system based on TP-Space, with an arbitrary holonomic reactive method running on it, and any desired number of PTG for transforming the navigation space |
CTHolonomicMovement | The structure used for storing a movement generated by a holonomic-method |
▶CCReactiveNavigationSystem3D | |
CTHolonomicMovement | The structure used for storing a movement generated by a holonomic-method |
CTPTGmultilevel | |
CTRobotShape | The implemented reactive navigation methods |
▶Nslam | This namespace contains algorithms for SLAM, localization, map building, representation of robot's actions and observations, and representation of many kinds of metric maps |
▶Ndetail | |
CloadFromRangeImpl | |
Clogoddscell_traits | |
Clogoddscell_traits< int16_t > | |
Clogoddscell_traits< int8_t > | |
Cpointmap_traits | |
▶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 |
CCAction | Declares a class for storing a robot action |
CCActionCollection | Declares a class for storing a collection of robot actions |
CCActionCollectionPtr | |
CCActionPtr | |
▶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 |
CTOptions_ThrunModel | Options for the Thrun's model, which generates a CPosePDFParticles object in poseChange |
CCActionRobotMovement2DPtr | |
CCActionRobotMovement3D | Represents a probabilistic 3D (6D) movement |
CCActionRobotMovement3DPtr | |
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 |
CCBeaconMapPtr | |
CCBeaconPtr | |
▶CCColouredPointsMap | A map of 2D/3D points with individual colours (RGB) |
CTColourOptions | The definition of parameters for generating colors from laser scans |
CCColouredPointsMapPtr | |
▶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 |
▶CCGasConcentrationGridMap2D | CGasConcentrationGridMap2D represents a PDF of gas concentrations over a 2D area |
CTGaussianCell | |
CTGaussianWindTable | |
CTInsertionOptions | Parameters related with inserting observations into the map: |
CCGasConcentrationGridMap2DPtr | |
▶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 | |
▶CCHeightGridMap2D | A mesh representation of a surface which keeps the estimated height for each (x,y) location |
CTInsertionOptions | Parameters related with inserting observations into the map |
CCHeightGridMap2DPtr | |
▶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: |
CCIncrementalMapPartitionerPtr | |
CCLandmark | The class for storing "landmarks" (visual or laser-scan-extracted features,...) |
CCLandmarkPtr | |
▶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 |
CCLandmarksMapPtr | |
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 |
▶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 |
CCMetricMapPtr | |
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 |
▶CCMultiMetricMap | This class stores any customizable set of metric maps |
CTOptions | Some options for this class: |
▶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 |
CCMultiMetricMapPDFPtr | |
CCMultiMetricMapPtr | |
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) |
CCObservation2DRangeScanPtr | |
▶CCObservation3DRangeScan | Declares a class derived from "CObservation" that encapsules a 3D range scan measurement (e.g |
CTCached3DProjTables | Look-up-table struct for project3DPointsFromDepthImageInto() |
CCObservation3DRangeScanPtr | |
CCObservationBatteryState | This represents a measurement of the batteries on the robot |
CCObservationBatteryStatePtr | |
▶CCObservationBeaconRanges | Declares a class derived from "CObservation" that represents one (or more) range measurements to labeled beacons |
CTMeasurement | Each one of the measurements: |
CCObservationBeaconRangesPtr | |
▶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: |
CCObservationBearingRangePtr | |
CCObservationCANBusJ1939 | This class stores a message from a CAN BUS with the protocol J1939 |
CCObservationCANBusJ1939Ptr | |
CCObservationComment | This "observation" is actually a placeholder for a text block with comments or additional parameters attached to a given rawlog file |
CCObservationCommentPtr | |
▶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 |
CCObservationGasSensorsPtr | |
▶CCObservationGPS | Declares a class derived from "CObservation" that represents a Global Positioning System (GPS) reading |
CTGPSDatum_GGA | The GPS datum for GGA commands |
CTGPSDatum_PZS | The GPS datum for TopCon's mmGPS devices |
CTGPSDatum_RMC | The GPS datum for RMC commands |
CTGPSDatum_SATS | A generic structure for statistics about tracked satelites and their positions |
CTUTCTime | A UTC time-stamp structure for GPS messages |
CCObservationGPSPtr | |
CCObservationImage | Declares a class derived from "CObservation" that encapsules an image from a camera, whose relative pose to robot is also stored |
CCObservationImagePtr | |
CCObservationIMU | This class stores measurements from an Inertial Measurement Unit (IMU), and/or its attitude estimation (integration of raw measurements) |
CCObservationIMUPtr | |
CCObservationOdometry | An observation of the current (cumulative) odometry for a wheeled robot |
CCObservationOdometryPtr | |
CCObservationPtr | |
▶CCObservationRange | Declares a class derived from "CObservation" that encapsules a single range measurement, and associated parameters |
CTMeasurement | |
CCObservationRangePtr | |
CCObservationReflectivity | Declares a class derived from "CObservation" that encapsules a single short-range reflectivity measurement |
CCObservationReflectivityPtr | |
▶CCObservationRFID | This represents one or more RFID tags observed by a receiver |
CTTagReading | Each of the individual readings of a RFID tag |
CCObservationRFIDPtr | |
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 |
CCObservationStereoImagesFeaturesPtr | |
CCObservationStereoImagesPtr | |
CCObservationVisualLandmarks | Declares a class derived from "CObservation" that stores a Landmarks Map as seen from a stereo camera at a given instant of time |
CCObservationVisualLandmarksPtr | |
CCObservationWindSensor | Declares a class derived from "CObservation" that represents the wind measurements taken on the robot by an anemometer |
CCObservationWindSensorPtr | |
CCObservationWirelessPower | This represents a measurement of the wireless strength perceived by the robot |
CCObservationWirelessPowerPtr | |
▶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 |
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 |
CTUpdateCellsInfoChangeOnly | An internal structure for storing data related to counting the new information apported by some observation |
CCOccupancyGridMap2DPtr | |
CCOccupancyGridMapFeatureExtractor | A class for detecting features from occupancy grid maps |
▶CCOctoMap | 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::slam::COctoMap into a mrpt::opengl::COctoMapVoxels |
CCOctoMapPtr | |
CCPathPlanningCircularRobot | An implementation of CPathPlanningMethod |
CCPathPlanningMethod | A virtual base class for computing the optimal path for a robot from a origin location to a target point |
▶CCPointsMap | A cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors |
CLAS_HeaderInfo | Extra information gathered from the LAS file header |
CLAS_LoadParams | Optional settings for loadLASFile() |
CLAS_WriteParams | Optional settings for saveLASFile() |
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 |
CCPointsMapPtr | |
▶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) |
CTInsertionOptionsCommon | Parameters common to any derived class |
CTobservationGMRF | |
CCRandomFieldGridMap2DPtr | |
▶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 |
▶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 |
CCRawlogPtr | |
CCRBPFParticleData | Auxiliary class used in mrpt::slam::CMultiMetricMapPDF |
CCRBPFParticleDataPtr | |
▶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 |
CCReflectivityGridMap2DPtr | |
▶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 |
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 |
CCSensoryFramePtr | |
CCSimpleMap | This class stores a sequence of <Probabilistic Pose,SensoryFrame> pairs, thus a "metric map" can be totally determined with this information |
CCSimpleMapPtr | |
CCSimplePointsMap | A cloud of points in 2D or 3D, which can be built from a sequence of laser scans |
CCSimplePointsMapPtr | |
▶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 |
CCWeightedPointsMap | A cloud of points in 2D or 3D, which can be built from a sequence of laser scans |
CCWeightedPointsMapPtr | |
▶CCWirelessPowerGridMap2D | CWirelessPowerGridMap2D represents a PDF of wifi concentrations over a 2D area |
CTInsertionOptions | Parameters related with inserting observations into the map: |
CCWirelessPowerGridMap2DPtr | |
CmrptEventMetricMapClear | Event emitted by a metric up upon call of clear() |
CmrptEventMetricMapInsert | Event emitted by a metric up upon a succesful call to insertObservation() |
CPF_implementation | A set of common data shared by PF implementations for both SLAM and localization |
CT2DScanProperties | Auxiliary struct that holds all the relevant geometry information about a 2D scan |
CTDataAssociationResults | The results from mrpt::slam::data_association |
CTHeightGridmapCell | The contents of each cell in a CHeightGridMap2D map |
CTKLDParams | Option set for KLD algorithm |
▶CTMetricMapInitializer | Each structure of this kind will determine the kind (and initial configuration) of one map to be build into a CMultiMetricMap object |
CCBeaconMapOptions | Specific options for landmarks maps (mrpt::slam::CBeaconMap) |
CCColouredPointsMapOptions | Specific options for coloured point maps (mrpt::slam::CPointsMap) |
CCGasConcentrationGridMap2DOptions | Specific options for gas grid maps (mrpt::slam::CGasConcentrationGridMap2D) |
CCHeightGridMap2DOptions | Specific options for height grid maps (mrpt::slam::CHeightGridMap2D) |
CCLandmarksMapOptions | Specific options for landmarks maps (mrpt::slam::CLandmarksMap) |
CCPointsMapOptions | Specific options for point maps (mrpt::slam::CPointsMap) |
CCReflectivityGridMap2DOptions | Specific options for height grid maps (mrpt::slam::CReflectivityGridMap2D) |
CCWeightedPointsMapOptions | Specific options for coloured point maps (mrpt::slam::CPointsMap) |
CCWirelessPowerGridMap2DOptions | Specific options for wifi grid maps (mrpt::slam::CWirelessPowerGridMap2D) |
CTOccGridMap2DOptions | Specific options for 2D grid maps (mrpt::slam::COccupancyGridMap2D) |
CTOctoMapOptions | Specific options for 3D octo maps (mrpt::slam::COctoMap) |
CTMonteCarloLocalizationParams | The struct for passing extra simulation parameters to the prediction stage when running a particle filter |
CTRandomFieldCell | The contents of each cell in a CRandomFieldGridMap2D 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 |
CTStereoImageFeatures | |
▶Nsrba | An heavily template-based implementation of Relative Bundle Adjustment (RBA) - See [mrpt-srba] |
▶Ninternal | |
Csolver_engine | Generic solver declaration |
Csolver_engine< false, false, RBA_ENGINE > | SOLVER: Lev-Marq without Schur, with Sparse Cholesky (CSparse library) |
Csolver_engine< true, false, RBA_ENGINE > | SOLVER: Lev-Marq with Schur, with Sparse Cholesky (CSparse library) |
Csolver_engine< true, true, RBA_ENGINE > | SOLVER: Lev-Marq with Schur, with Sparse Cholesky (CSparse library) |
▶Nkf2kf_poses | |
CSE2 | |
CSE3 | |
▶Nlandmarks | |
CEuclidean2D | A parameterization of landmark positions in Euclidean coordinates (2D) |
CEuclidean3D | A parameterization of landmark positions in Euclidean coordinates (3D) |
CRelativePoses2D | A parameterization of SE(2) relative poses ("fake landmarks" to emulate graph-SLAM) |
▶Nobservations | |
▶CCartesian_2D | Observation = XY coordinates of landmarks relative to the sensor |
Cobs_data_t | The observation-specific data structure |
CTObservationParams | The type "TObservationParams" must be declared in each "observations::TYPE" to hold sensor-specific parameters, etc |
▶CCartesian_3D | Observation = XYZ coordinates of landmarks relative to the sensor |
Cobs_data_t | The observation-specific data structure |
CTObservationParams | The type "TObservationParams" must be declared in each "observations::TYPE" to hold sensor-specific parameters, etc |
▶CMonocularCamera | Observation = one monocular camera feature (the coordinates of one pixel) |
Cobs_data_t | The observation-specific data structure |
CTObservationParams | The type "TObservationParams" must be declared in each "observations::TYPE" to hold sensor-specific parameters, etc |
▶CRangeBearing_2D | Observation = Range+Bearing (yaw) of landmarks relative to the sensor, for planar environments only |
Cobs_data_t | The observation-specific data structure |
CTObservationParams | The type "TObservationParams" must be declared in each "observations::TYPE" to hold sensor-specific parameters, etc |
▶CRangeBearing_3D | Observation = Range+Bearing (yaw & pitch) of landmarks relative to the sensor |
Cobs_data_t | The observation-specific data structure |
CTObservationParams | The type "TObservationParams" must be declared in each "observations::TYPE" to hold sensor-specific parameters, etc |
▶CRelativePoses_2D | Observation = Relative SE(2) poses (x,y,yaw) |
Cobs_data_t | The observation-specific data structure |
CTObservationParams | The type "TObservationParams" must be declared in each "observations::TYPE" to hold sensor-specific parameters, etc |
▶CStereoCamera | Observation = one stereo camera feature (the coordinates of two pixels) |
Cobs_data_t | The observation-specific data structure |
CTObservationParams | The type "TObservationParams" must be declared in each "observations::TYPE" to hold sensor-specific parameters, etc |
▶Noptions | |
▶Ninternal | |
Cresulting_pose_t | Typedefs for determining whether the result of combining a KF pose (+) a sensor pose leads to a SE(2) or SE(3) pose |
Cresulting_pose_t< sensor_pose_on_robot_none, 3 > | Typedefs for determining whether the result of combining a KF pose (+) a sensor pose leads to a SE(2) or SE(3) pose |
Cresulting_pose_t< sensor_pose_on_robot_none, 6 > | |
Cresulting_pose_t< sensor_pose_on_robot_se3, 3 > | Typedefs for determining whether the result of combining a KF pose (+) a sensor pose leads to a SE(2) or SE(3) pose |
Cresulting_pose_t< sensor_pose_on_robot_se3, 6 > | |
▶Cobservation_noise_constant_matrix | Usage: A possible type for RBA_OPTIONS::obs_noise_matrix_t |
Cnoise_data_per_obs_t | Internal struct for data that must be stored for each observation |
Cparameters_t | Observation noise parameters to be filled by the user in srba.parameters.obs_noise |
▶Cobservation_noise_identity | Usage: A possible type for RBA_OPTIONS::obs_noise_matrix_t |
Cnoise_data_per_obs_t | Internal struct for data that must be stored for each observation |
Cparameters_t | Observation noise parameters to be filled by the user in srba.parameters.obs_noise |
▶Csensor_pose_on_robot_none | Usage: A possible type for RBA_OPTIONS::sensor_pose_on_robot_t |
Cparameters_t | In this case there are no needed parameters |
▶Csensor_pose_on_robot_se3 | Usage: A possible type for RBA_OPTIONS::sensor_pose_on_robot_t |
Cparameters_t | In this case there are no needed parameters |
▶Csolver_LM_no_schur_sparse_cholesky | Usage: A possible type for RBA_OPTIONS::solver_t |
Cextra_results_t | Extra output information to be found in RbaEngine<>::TOptimizeExtraOutputInfo::extra_results |
▶Csolver_LM_schur_dense_cholesky | Usage: A possible type for RBA_OPTIONS::solver_t |
Cextra_results_t | Extra output information to be found in RbaEngine<>::TOptimizeExtraOutputInfo::extra_results |
▶Csolver_LM_schur_sparse_cholesky | Usage: A possible type for RBA_OPTIONS::solver_t |
Cextra_results_t | Extra output information to be found in RbaEngine<>::TOptimizeExtraOutputInfo::extra_results |
Ccompute_jacobian_dAepsDx_deps | Auxiliary sub-jacobian used in compute_jacobian_dh_dp() (it's a static method within specializations of this struct) |
Ccompute_jacobian_dAepsDx_deps< jacob_point_landmark, 2, 3, RBA_ENGINE_T > | |
Ccompute_jacobian_dAepsDx_deps< jacob_point_landmark, 3, 3, RBA_ENGINE_T > | |
Ccompute_jacobian_dAepsDx_deps< jacob_point_landmark, 3, 6, RBA_ENGINE_T > | |
Ccompute_jacobian_dAepsDx_deps< jacob_relpose_landmark, 3, 3, RBA_ENGINE_T > | |
Ccompute_jacobian_dAepsDx_deps_SE2 | Case: 2D or 3D points, SE(2) poses Both cases are grouped because a SE(2) pose doesn't transform the "z" of 3D points, so both sets of Jacobians are almost identical |
Chessian_traits | Types for the Hessian blocks: |
Cjacobian_traits | Types for the Jacobians: |
▶Ckf2kf_pose_traits | The argument "POSE_TRAITS" can be any of those defined in srba/models/kf2kf_poses.h (typically, either kf2kf_poses::SE3 or kf2kf_poses::SE2) |
Ck2k_edge_t | Keyframe-to-keyframe edge: an unknown of the problem |
Cpose_flag_t | A joint structure for one relative pose + an "up-to-date" flag (needed for spanning trees numeric updates) |
▶Clandmark_rendering_as_point | Render 2D/3D point landmarks |
CTOpenGLRepresentationOptionsExtra | Parameters to be merged with RbaEngine<>::TOpenGLRepresentationOptions |
▶Clandmark_rendering_as_pose_constraints | Render "fake graph-slam-like landmarks" as keyframe-to-keyframe constraints |
CTOpenGLRepresentationOptionsExtra | Parameters to be merged with RbaEngine<>::TOpenGLRepresentationOptions |
▶Clandmark_rendering_none | Not to be rendered |
CTOpenGLRepresentationOptionsExtra | Parameters to be merged with RbaEngine<>::TOpenGLRepresentationOptions |
▶Clandmark_traits | The argument "LM_TRAITS" can be any of those defined in srba/models/landmarks.h (typically, either landmarks::Euclidean3D or landmarks::Euclidean2D) |
CTLandmarkEntry | Used in the vector "all_lms" |
CTRelativeLandmarkPos | One relative feature observation entry, used with some relative bundle-adjustment functions |
CLandmarkRendererBase | |
CLandmarkRendererBase< landmark_rendering_as_point > | Landmark renderer for: landmark_rendering_as_point |
CLandmarkRendererBase< landmark_rendering_as_pose_constraints > | Landmark renderer for: landmark_rendering_as_pose_constraints |
CLandmarkRendererBase< landmark_rendering_none > | Landmark renderer for: landmark_rendering_none |
▶Cobservation_traits | |
Cobservation_t | Elemental observation data |
▶Crba_joint_parameterization_traits_t | Useful data structures that depend of a combination of "OBSERVATION_TYPE"+"LANDMARK_PARAMETERIZATION_TYPE"+"RELATIVE_POSE_PARAMETERIZATION" |
Ck2f_edge_t | Keyframe-to-feature edge: observation data stored for each keyframe |
Ckeyframe_info | Information per key-frame needed for RBA |
Ckf_observation_t | Keyframe-to-feature edge: observations in the problem |
Cnew_kf_observation_t | Observations, as provided by the user |
CRBA_OPTIONS_DEFAULT | The set of default settings for RbaEngine |
▶CRbaEngine | The main class for the mrpt-srba: it defines a Relative Bundle-Adjustment (RBA) problem with (optionally, partially known) landmarks, the methods to update it with new observations and to optimize the relative poses with least squares optimizers |
CTAllParameters | The unique struct which hold all the parameters from the different SRBA modules (sensors, optional features, optimizers,...) |
CTBFSEntryEdges | Private aux structure for BFS searches |
CTNewKeyFrameInfo | Information returned by RbaEngine::define_new_keyframe() |
CTNumeric_dh_dAp_params | |
CTNumeric_dh_df_params | |
CTObsUsed | Each of the observations used during the optimization |
CTOpenGLRepresentationOptions | |
CTOptimizeExtraOutputInfo | All the information returned by the local area optimizer |
CTOptimizeLocalAreaParams | Parameters for optimize_local_area() |
CTSRBAParameters | Different parameters for the SRBA methods |
CVisitorOptimizeLocalArea | Aux visitor struct, used in optimize_local_area() |
▶CSchurComplement | A generic symbolic and numeric Schur-complement handler for builing reduced systems of equations |
▶CTGradApSymbolicEntry | |
CTEntry | |
▶CTHApSymbolicEntry | Info for each block in HAp |
CTEntry | |
CTInfoPerHfBlock | |
Csensor_model | Generic declaration, of which specializations are defined for each combination of LM+OBS type |
Csensor_model< landmarks::Euclidean2D, observations::Cartesian_2D > | Sensor model: 2D landmarks in Euclidean coordinates + Cartesian 2D observations |
Csensor_model< landmarks::Euclidean2D, observations::RangeBearing_2D > | Sensor model: 2D landmarks in Euclidean coordinates + 2D Range-Bearing observations |
Csensor_model< landmarks::Euclidean3D, observations::Cartesian_3D > | Sensor model: 3D landmarks in Euclidean coordinates + Cartesian 3D observations |
Csensor_model< landmarks::Euclidean3D, observations::MonocularCamera > | Sensor model: 3D landmarks in Euclidean coordinates + Monocular camera observations (no distortion) |
Csensor_model< landmarks::Euclidean3D, observations::RangeBearing_3D > | Sensor model: 3D landmarks in Euclidean coordinates + 3D Range-Bearing observations |
Csensor_model< landmarks::Euclidean3D, observations::StereoCamera > | Sensor model: 3D landmarks in Euclidean coordinates + Stereo camera observations (no distortion) |
Csensor_model< landmarks::RelativePoses2D, observations::RelativePoses_2D > | Sensor model: 2D landmarks in Euclidean coordinates + 2D Range-Bearing observations |
CTBFSEntry | |
▶CTHessianSymbolicInfo | Symbolic information of each Hessian block |
CTHessianSymbolicInfoEntry | This Hessian block equals the sum of all J1^t * * J2, with J1=first, J2=second in each std::pair "const char *" are pointers to the validity bit of each Jacobian, so if it evaluates to false we should discard the Hessian entry |
CTJacobianSymbolicInfo_dh_dAp | Symbolic information of each Jacobian dh_dAp |
CTJacobianSymbolicInfo_dh_df | Symbolic information of each Jacobian dh_df |
CTNewEdgeInfo | Used in TNewKeyFrameInfo |
▶CTRBA_Problem_state | All the important data of a RBA problem at any given instant of time Operations on this structure are performed via the public API of srba::RbaEngine |
CTLinearSystem | |
▶CTSpanningTree | |
CTSpanningTreeSym | The "symbolic" part of the spanning tree |
CTSpanTreeEntry | Used in TRBA_Problem_state |
▶Nstlplus | |
Cclone_copy | |
Cconstructor_copy | |
Cend_dereference | |
Cillegal_copy | |
Cno_copy | |
Cnull_dereference | |
Csmart_ptr | |
Csmart_ptr_base | |
Csmart_ptr_clone | |
Csmart_ptr_holder | |
Csmart_ptr_nocopy | |
Cwrong_object | |
▶Nsynch | This namespace provides multitask, synchronization utilities |
CCAtomicCounter | This class acts exactly as an int (or long) variable, but with atomic increment and decrement operators |
CCCriticalSection | This class provides simple critical sections functionality |
CCCriticalSectionLocker | A class acquiring a CCriticalSection at its constructor, and releasing it at destructor |
CCEvent | This class provides a simple way of waiting for and signaling events (NOT IMPLEMENTED YET!) |
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 |
▶Ndetail | Auxiliary classes used internally to MRPT |
CThreadCreateFunctor | |
CThreadCreateFunctor< void * > | |
CThreadCreateFunctorNoParams | |
CThreadCreateObjectFunctor | |
CThreadCreateObjectFunctorNoParams | |
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 | |
CTThreadHandle | This structure contains the information needed to interface the threads API on each platform: |
CTTimeParts | The parts of a date/time (it's like the standard 'tm' but with fractions of seconds) |
▶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 |
▶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 |
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 |
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 |
CCCanvas | This virtual class defines the interface of any object accepting drawing primitives on it |
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 |
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 |
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 |
CCImagePtr | |
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 |
CCLog | A decorator of CStringList special for keeping logs |
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 |
CCMemoryChunkPtr | |
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) |
CCMHPropertiesValuesListPtr | |
CCMRPTException | The base for MRPT-especific exceptions |
CCObject | The virtual base class of all MRPT classes with a unified RTTI system |
CCObjectPtr | A smart pointer to a CObject object |
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 |
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 |
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 | |
CCPropertiesValuesListPtr | |
CCReferencedMemBlock | Represents a memory block (via "void*") that can be shared between several objects through copy operator (=) |
CCRobotSimulator | This class can be used to simulate the kinematics and dynamics of a differential driven planar mobile robot, including odometry errors and dynamics limitations |
CCSerializable | The virtual base class which provides a unified interface for all persistent objects in MRPT |
CCSerializablePtr | |
CCServerTCPSocket | A TCP socket that can be wait for client connections to enter |
CCSimpleDatabase | This class impements a very simple database system |
CCSimpleDatabasePtr | |
CCSimpleDatabaseTable | This class implements the tables of databases |
CCSimpleDatabaseTablePtr | |
CCStartUpClassesRegister | A helper class that automatically register at start up a custom function to register all the CObject-derived classes in a given MRPT library or user application |
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 |
CCStringListPtr | |
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 |
CCTypeSelectorPtr | |
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" |
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 |
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< 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< mrpt::slam::CColouredPointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::slam::CColouredPointsMap> |
CPointCloudAdapter< mrpt::slam::CPointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::slam::CPointsMap> |
CPointCloudAdapter< mrpt::slam::CSimplePointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::slam::CSimplePointsMap> |
CPointCloudAdapter< mrpt::slam::CWeightedPointsMap > | Specialization mrpt::utils::PointCloudAdapter<mrpt::slam::CWeightedPointsMap> |
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 |
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 |
CTCameraPtr | |
CTColor | A RGB color - 8bit |
CTColorf | A RGB color - floats in the range [0,1] |
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::CKinect::TVideoChannel > | |
CTEnumTypeFiller< mrpt::srba::TCovarianceRecoveryPolicy > | |
CTEnumTypeFiller< mrpt::srba::TEdgeCreationPolicy > | |
CTEnumTypeFiller< poses::CPose3DInterpolator::TInterpolatorMethod > | |
CTEnumTypeFiller< reactivenav::CHolonomicND::TSituations > | |
CTEnumTypeFiller< slam::CGridMapAligner::TAlignerMethod > | |
CTEnumTypeFiller< slam::CHeightGridMap2D::TMapRepresentation > | |
CTEnumTypeFiller< slam::CMultiMetricMap::TOptions::TMapSelectionForLikelihood > | |
CTEnumTypeFiller< slam::CObservation3DRangeScan::TIntensityChannelID > | |
CTEnumTypeFiller< slam::CRandomFieldGridMap2D::TMapRepresentation > | |
CTEnumTypeFiller< slam::TDataAssociationMethod > | |
CTEnumTypeFiller< slam::TDataAssociationMetric > | |
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 |
CTStereoCamera | Structure to hold the parameters of a pinhole stereo camera model |
CTStereoCameraPtr | |
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 > > | |
▶Nvision | Classes for computer vision, detectors, features, etc |
▶Ndetail | |
CTSIFTDesc2KDTree_Adaptor | |
CTSURFDesc2KDTree_Adaptor | |
▶CCCamModel | This class represent a pinhole camera model for Monocular SLAM and implements some associated Jacobians |
CCameraTempVariables | |
▶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 |
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 |
CCFeaturePtr | |
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 |
CKeypointResponseSorter | A helper struct to sort keypoints by their response: It can be used with these types: |
CRobustKernel | |
CRobustKernel< static_cast< int >(rkLeastSquares), T > | No robust kernel, use standard least squares: rho(r)= 1/2 * r^2 |
CRobustKernel< static_cast< int >(rkPseudoHuber), T > | Pseudo-huber robust kernel: rho(r) = b^2 * (-1+sqrt(1+(r)^2)) |
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 |
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 |
Cdynamicsize_vector | The base class of MRPT vectors, actually, Eigen column matrices of dynamic size with specialized constructors that resemble std::vector |
▶Nnanoflann | |
Carray_or_vector_selector | Used to declare fixed-size arrays when DIM>0, dynamically-allocated vectors when DIM=-1 |
Carray_or_vector_selector<-1, T > | Dynamic size version |
CCArray | A STL container (as wrapper) for arrays of constant size defined at compile time (class imported from the MRPT project) This code is an adapted version from Boost, modifed for its integration within MRPT (JLBC, Dec/2009) (Renamed array -> CArray to avoid possible potential conflicts) |
CIndexDist_Sorter | Operator "<" for std::sort() |
CKDTreeEigenMatrixAdaptor | A simple KD-tree adaptor for working with data directly stored in an Eigen Matrix, without duplicating the data storage |
▶CKDTreeSingleIndexAdaptor | Kd-tree index |
CBranchStruct | This record represents a branch point when finding neighbors in the tree |
CInterval | |
CNode | |
CKDTreeSingleIndexAdaptorParams | Parameters (see http://code.google.com/p/nanoflann/ for help choosing the parameters) |
CKNNResultSet | |
CL1_Adaptor | Manhattan distance functor (generic version, optimized for high-dimensionality data sets) |
CL2_Adaptor | Squared Euclidean distance functor (generic version, optimized for high-dimensionality data sets) |
CL2_Simple_Adaptor | Squared Euclidean distance functor (suitable for low-dimensionality datasets, like 2D or 3D point clouds) Corresponding distance traits: nanoflann::metric_L2_Simple |
▶Cmetric_L1 | Metaprogramming helper traits class for the L1 (Manhattan) metric |
Ctraits | |
▶Cmetric_L2 | Metaprogramming helper traits class for the L2 (Euclidean) metric |
Ctraits | |
▶Cmetric_L2_Simple | Metaprogramming helper traits class for the L2_simple (Euclidean) metric |
Ctraits | |
CPooledAllocator | |
CRadiusResultSet | A result-set class used when performing a radius based search |
CSearchParams | Search options for KDTreeSingleIndexAdaptor::findNeighbors() |
▶Noctomap | OctoMap: A probabilistic, flexible, and compact 3D mapping library for robotic systems |
CAbstractOccupancyOcTree | Interface class for all octree types that store occupancy |
CAbstractOcTree | This abstract class is an interface to all octrees and provides a factory design pattern for readin and writing all kinds of OcTrees to files (see read()) |
CAbstractOcTreeNode | |
▶CColorOcTree | |
CStaticMemberInitializer | Static member object which ensures that this OcTree's prototype ends up in the classIDMapping only once |
▶CColorOcTreeNode | |
CColor | |
▶CCountingOcTree | An AbstractOcTree which stores an internal counter per node / volume |
CStaticMemberInitializer | Static member object which ensures that this OcTree's prototype ends up in the classIDMapping only once |
CCountingOcTreeNode | An Octree-node which stores an internal counter per node / volume |
Cequal_keys | Comparator for keys |
Chash_key | |
CKeyRay | |
CMapCollection | |
CMapNode | |
COccupancyOcTreeBase | Base implementation for Occupancy Octrees (e.g |
▶COcTree | Octomap main map data structure, stores 3D occupancy grid map in an OcTree |
CStaticMemberInitializer | Static member object which ensures that this OcTree's prototype ends up in the classIDMapping only once |
COcTreeBase | |
▶COcTreeBaseImpl | OcTree base class, to be used with with any kind of OcTreeDataNode |
▶Citerator_base | Base class for OcTree iterators |
CStackElement | Element on the internal recursion stack of the iterator |
Cleaf_bbx_iterator | Bounding-box leaf iterator |
Cleaf_iterator | Iterator to iterate over all leafs of the tree |
Ctree_iterator | Iterator over the complete tree (inner nodes and leafs) |
COcTreeBaseSE | |
COcTreeDataNode | Basic node in the OcTree that can hold arbitrary data of type T in value |
▶COcTreeKey | OcTreeKey is a container class for internal key addressing |
CKeyHash | Provides a hash function on Keys |
COcTreeLUT | Implements a lookup table that allows to computer keys of neighbor cells directly, see: Samet 1989, "Implementing ray tracing with octrees and neighbor finding" |
COcTreeNode | Nodes to be used in OcTree |
COcTreeNodeStamped | |
▶COcTreeStamped | |
CStaticMemberInitializer | Static member object which ensures that this OcTree's prototype ends up in the classIDMapping only once |
CPointcloud | A collection of 3D coordinates (point3d), which are regarded as endpoints of a 3D laser scan |
CScanEdge | A connection between two ScanNodes |
CScanGraph | A ScanGraph is a collection of ScanNodes, connected by ScanEdges |
CScanNode | A 3D scan as Pointcloud, performed from a Pose6D |
▶Noctomath | OctoMap: A probabilistic, flexible, and compact 3D mapping library for robotic systems |
CPose6D | This class represents a tree-dimensional pose of an object |
CQuaternion | This class represents a Quaternion |
CVector3 | This class represents a three-dimensional vector |
▶Nstlplus | |
Cclone_copy | |
Cconstructor_copy | |
Cend_dereference | |
Cillegal_copy | |
Cno_copy | |
Cnull_dereference | |
Csmart_ptr | |
Csmart_ptr_base | |
Csmart_ptr_clone | |
Csmart_ptr_holder | |
Csmart_ptr_nocopy | |
Cwrong_object | |
▶NTCLAP | |
▶NMULTI_ARG_HELPER | |
CValueExtractor | This class is used to extract a value from an argument |
CValueExtractor< std::string > | Specialization for string |
▶NVALUE_ARG_HELPER | |
CValueExtractor | This class is used to extract a value from an argument |
CValueExtractor< std::string > | Specialization for string |
CActionDoneException | (Added by JLBC for MRPT): An exception that indicates to CmdLine::parse that help,version,.. |
CArg | A virtual base class that defines the essential data for all arguments |
CArgException | A simple class that defines and argument exception |
CArgParseException | Thrown from within the child Arg classes when it fails to properly parse the argument it has been passed |
CCmdLine | The base class that manages the command line definition and passes along the parsing to the appropriate Arg classes |
CCmdLineInterface | The base class that manages the command line definition and passes along the parsing to the appropriate Arg classes |
CCmdLineOutput | The interface that any output object must implement |
CCmdLineParseException | Thrown from CmdLine when the arguments on the command line are not properly specified, e.g |
CConstraint | The interface that defines the interaction between the Arg and Constraint |
CDocBookOutput | A class that generates DocBook output for usage() method for the given CmdLine and its Args |
CHelpVisitor | A Visitor object that calls the usage method of the given CmdLineOutput object for the specified CmdLine object |
CIgnoreRestVisitor | A Vistor that tells the CmdLine to begin ignoring arguments after this one is parsed |
CMultiArg | An argument that allows multiple values of type T to be specified |
CMultiSwitchArg | A multiple switch argument |
COptionalUnlabeledTracker | |
CSpecificationException | Thrown from Arg and CmdLine when an Arg is improperly specified, e.g |
CStdOutput | A class that isolates any output from the CmdLine object so that it may be easily modified |
CSwitchArg | A simple switch argument |
CUnlabeledMultiArg | Just like a MultiArg, except that the arguments are unlabeled |
CUnlabeledValueArg | The basic unlabeled argument that parses a value |
CValueArg | The basic labeled argument that parses a value |
CValuesConstraint | A Constraint that constrains the Arg to only those values specified in the constraint |
CVersionVisitor | A Vistor that will call the version method of the given CmdLineOutput for the specified CmdLine object and then exit |
CVisitor | A base class that defines the interface for visitors |
CXorHandler | This class handles lists of Arg's that are to be XOR'd on the command line |
Ccs_dmperm_results | |
Ccs_numeric | |
Ccs_sparse | |
Ccs_symbolic | |
Cimaxdiv_t | |
CmpBitmapLayer | This virtual class represents objects that can be moved to an arbitrary 2D location+rotation |
CmpCovarianceEllipse | A 2D ellipse, described by a 2x2 covariance matrix |
CmpFX | Abstract base class providing plot and labeling functionality for functions F:X->Y |
CmpFXY | Abstract base class providing plot and labeling functionality for a locus plot F:N->X,Y |
CmpFXYVector | A class providing graphs functionality for a 2D plot (either continuous or a set of points), from vectors of data |
CmpFY | Abstract base class providing plot and labeling functionality for functions F:Y->X |
CmpInfoCoords | Implements an overlay box which shows the mouse coordinates in plot units |
CmpInfoLayer | Base class to create small rectangular info boxes mpInfoLayer is the base class to create a small rectangular info box in transparent overlay over plot layers |
CmpInfoLegend | Implements the legend to be added to the plot This layer allows you to add a legend to describe the plots in the window |
CmpLayer | Plot layer, abstract base class |
CmpMovableObject | This virtual class represents objects that can be moved to an arbitrary 2D location+rotation |
CmpPolygon | An arbitrary polygon, descendant of mpMovableObject |
CmpPrintout | Printout class used by mpWindow to draw in the objects to be printed |
CmpProfile | Abstract base class providing plot and labeling functionality for functions F:Y->X |
CmpScaleX | Plot layer implementing a x-scale ruler |
CmpScaleY | Plot layer implementing a y-scale ruler |
CmpText | Plot layer implementing a text string |
CmpWindow | Canvas for plotting mpLayer implementations |