MRPT logo

Class List

Here are the classes, structs, unions and interfaces with brief descriptions:
mrpt::hwdrivers::C2DRangeFinderAbstractThis is the base, abstract class for "software drivers" interfaces to 2D scanners (laser range finders)
mrpt::opengl::C3DSSceneThis element keeps a set of objects imported from a 3DStudio file (.3ds)
mrpt::opengl::C3DSScene::C3DSScene::TImpl3DSA container for automatic deletion of lib3ds's scene when the last reference of the smart_ptr's is destroyed
mrpt::reactivenav::CAbstractHolonomicReactiveMethodA base class for holonomic reactive navigation methods
mrpt::reactivenav::CAbstractReactiveNavigationSystemThis is the base class for any reactive navigation system
mrpt::reactivenav::CAbstractReactiveNavigationSystem::CAbstractReactiveNavigationSystem::TDebugThis struct is used as a placeholder for functors related to robot movement
mrpt::reactivenav::CAbstractReactiveNavigationSystem::CAbstractReactiveNavigationSystem::TEventsLaunchingThis struct is used as a placeholder for fuctors related to launching events
mrpt::reactivenav::CAbstractReactiveNavigationSystem::CAbstractReactiveNavigationSystem::TNavigationParamsThe struct for configuring the navigation request
mrpt::reactivenav::CAbstractReactiveNavigationSystem::CAbstractReactiveNavigationSystem::TRobotMotionControlThis struct is used as a placeholder for fuctors related to robot movement
mrpt::reactivenav::CAbstractReactiveNavigationSystem::CAbstractReactiveNavigationSystem::TSensorsThis struct is used as a placeholder for fuctors related to sensing
mrpt::slam::CActionDeclares a class for storing a robot action
mrpt::slam::CActionCollectionDeclares a class for storing a collection of robot actions
mrpt::slam::CActionRobotMovement2DRepresents a probabilistic 2D movement of the robot mobile base
mrpt::slam::CActionRobotMovement2D::CActionRobotMovement2D::TMotionModelOptionsThe parameter to be passed to "computeFromOdometry"
mrpt::slam::CActionRobotMovement2D::CActionRobotMovement2D::TMotionModelOptions::CActionRobotMovement2D::TMotionModelOptions::TOptions_GaussianModelOptions for the gaussian model, which generates a CPosePDFGaussian object in poseChange
mrpt::slam::CActionRobotMovement2D::CActionRobotMovement2D::TMotionModelOptions::CActionRobotMovement2D::TMotionModelOptions::TOptions_ThrunModelOptions for the Thrun's model, which generates a CPosePDFParticles object in poseChange
mrpt::slam::CActionRobotMovement3DRepresents a probabilistic 3D (6D) movement
mrpt::hwdrivers::CActivMediaRobotBaseThis software driver implements the communications (and some rudimentary control) for ActivMedia robotic bases (Pioneer DX/AT, PeopleBot, etc)
mrpt::opengl::CAngularObservationMeshA mesh built from a set of 2D laser scan observations
mrpt::opengl::CAngularObservationMesh::CAngularObservationMesh::FTrace1D< T >
mrpt::opengl::CAngularObservationMesh::CAngularObservationMesh::FTrace2D< T >
mrpt::opengl::CAngularObservationMesh::CAngularObservationMesh::TFloatRange
mrpt::opengl::CAngularObservationMesh::CAngularObservationMesh::TFloatRange::CAngularObservationMesh::TFloatRange::rd
mrpt::opengl::CArrowA 3D arrow
mrpt::opengl::CAxisDraw a 3D world axis, with coordinate marks at some regular interval
mrpt::slam::CBeaconThe class for storing individual "beacon landmarks" under a variety of 3D position PDF distributions
mrpt::slam::CBeaconMapA class for storing a map of 3D probabilistic beacons, using a Montecarlo, Gaussian, or Sum of Gaussians (SOG) representation (for range-only SLAM)
mrpt::slam::CBeaconMap::CBeaconMap::TInsertionOptionsThis struct contains data for choosing the method by which new beacons are inserted in the map
mrpt::slam::CBeaconMap::CBeaconMap::TLikelihoodOptionsWith this struct options are provided to the likelihood computations
mrpt::hwdrivers::CBoardDLMSAn interface to a custom board which interfaces two SICK laser scanners
mrpt::hwdrivers::CBoardENosesA class for interfacing an e-Noses via a FTDI USB link
mrpt::hwdrivers::CBoardSonarsThis "software driver" implements the communication protocol for interfacing a Ultrasonic range finder SRF10 through a custom USB board
mrpt::opengl::CCameraA 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
mrpt::hwdrivers::CCameraSensorA container of different camera grabbers under the MRPT's "generic sensor" implementation
mrpt::vision::CCamModelThis class represent the camera model for Monocular SLAM
mrpt::utils::CClientTCPSocketA 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
mrpt::slam::CColouredPointsMapA map of 2D/3D points with individual colours (RGB)
mrpt::slam::CColouredPointsMap::CColouredPointsMap::TColourOptionsThe definition of parameters for generating colors from laser scans
mrpt::utils::CConfigFileThis class allows loading and storing values and vectors of different types from ".ini" files easily
mrpt::utils::CConfigFileBaseThis class allows loading and storing values and vectors of different types from a configuration text, which can be implemented as a ".ini" file, a memory-stored string, etc
mrpt::utils::CConfigFileMemoryThis class implements a config file-like interface over a memory-stored string list
mrpt::slam::CConsistentObservationAlignmentAn algorithm for globally, consistent alignment of a sequence of observations
mrpt::slam::CConsistentObservationAlignment::CConsistentObservationAlignment::TOptionsThe options for the method
mrpt::utils::CConsoleRedirectorBy 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
mrpt::synch::CCriticalSectionThis class provides simple critical sections functionality
mrpt::synch::CCriticalSectionLockerA class acquiring a CCriticalSection at its constructor, and releasing it at destructor
mrpt::opengl::CCylinderA cylinder or cone whose base lies in the XY plane
mrpt::utils::CDebugOutputCapableThis 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
mrpt::slam::CDetectorDoorCrossing
mrpt::slam::CDetectorDoorCrossing::CDetectorDoorCrossing::TDoorCrossingOutParamsA structure used as output in this method
mrpt::slam::CDetectorDoorCrossing::CDetectorDoorCrossing::TOptionsIn this structure parameters can be changed to customize the behaviour of this algorithm
mrpt::system::CDirectoryExplorerThis class allows the enumeration of the files/directories that exist into a given path
mrpt::system::CDirectoryExplorer::CDirectoryExplorer::TFileInfoThis represents the information about each file
mrpt::opengl::CDiskA planar disk in the XY plane
mrpt::gui::CDisplayWindowThis class creates a window as a graphical user interface (GUI) for displaying images to the user
mrpt::gui::CDisplayWindow3DA graphical user interface (GUI) for efficiently rendering 3D scenes in real-time
mrpt::gui::CDisplayWindowPlotsCreate a GUI window and display plots with MATLAB-like interfaces and commands
mrpt::utils::CDynamicGrid< T >A 2D grid of dynamic size which stores any kind of data at each cell
mrpt::opengl::CEllipsoidA 2D ellipse or 3D ellipsoid, depending on the size of the m_cov matrix (2x2 or 3x3)
mrpt::utils::CEnhancedMetaFileThis class represents a Windows Enhanced Meta File (EMF) for generating and saving graphics
mrpt::synch::CEventThis class provides a simple way of waiting for and signaling events
mrpt::utils::CExceptionEOFUsed in mrpt::utils::CStream
mrpt::utils::CExceptionExternalImageNotFoundUsed in mrpt::utils::CMRPTImage
mrpt::vision::CFeatureA generic 2D feature from an image
mrpt::vision::CFeatureExtraction
mrpt::vision::CFeatureExtraction::CFeatureExtraction::TOptions
mrpt::vision::CFeatureExtraction::CFeatureExtraction::TOptions::CFeatureExtraction::TOptions::TBCDOptions
mrpt::vision::CFeatureExtraction::CFeatureExtraction::TOptions::CFeatureExtraction::TOptions::THarrisOptions
mrpt::vision::CFeatureExtraction::CFeatureExtraction::TOptions::CFeatureExtraction::TOptions::TKLTOptions
mrpt::vision::CFeatureExtraction::CFeatureExtraction::TOptions::CFeatureExtraction::TOptions::TSIFTOptions
mrpt::vision::CFeatureListA list of features
mrpt::utils::CFileGZInputStreamTransparently opens a compressed "gz" file and reads uncompressed data from it
mrpt::utils::CFileInputStreamThis CStream derived class allow using a file as a read-only, binary stream
mrpt::utils::CFileOutputStreamThis CStream derived class allow using a file as a write-only, binary stream
mrpt::utils::CFileStreamThis CStream derived class allow using a file as a read/write binary stream, creating it if the file didn't exist
mrpt::system::CFileSystemWatcherThis class subscribes to notifications of file system changes, thus it can be used to efficiently stay informed about changes in a directory tree
mrpt::system::CFileSystemWatcher::CFileSystemWatcher::TFileSystemChangeEach of the changes detected by utils::CFileSystemWatcher
mrpt::slam::CGasConcentrationGridMap2DCGasConcentrationGridMap2D represents a PDF of gas concentrations over a 2D area
mrpt::slam::CGasConcentrationGridMap2D::CGasConcentrationGridMap2D::TInsertionOptionsParameters related with inserting observations into the map:
mrpt::vision::CGaussianConvolutionKernelThis class represents a generic "convolution kernel", that can actually represent any Gaussian or DOG filter
mrpt::opengl::CGeneralizedCylinder
mrpt::opengl::CGeneralizedCylinder::CGeneralizedCylinder::TQuadrilateral
mrpt::hwdrivers::CGenericSensorA generic interface for a wide-variety of sensors designed to be used in the application RawLogGrabber
mrpt::hwdrivers::CGenericSensor::CGenericSensor::CLASSINIT_GENERIC_SENSORAuxiliary structure used for CSerializable runtime class ID support
mrpt::hwdrivers::CGPSInterfaceA parser of NMEA commands, for connecting to a GPS by a serial port
mrpt::math::CGraphPartitionerAlgorithms for finding the min-normalized-cut of a weighted undirected graph
mrpt::slam::CGridMapAlignerA class for aligning two multi-metric maps (with an occupancy grid maps and a points map, at least) based on features extraction and matching
mrpt::slam::CGridMapAligner::CGridMapAligner::TConfigParamsThe ICP algorithm configuration data
mrpt::slam::CGridMapAligner::CGridMapAligner::TReturnInfoThe ICP algorithm return information
mrpt::slam::CGridMapAligner::CGridMapAligner::TReturnInfo::CGridMapAligner::TReturnInfo::TPairPlusDistance
mrpt::opengl::CGridPlaneXYA grid of lines over the XY plane
mrpt::opengl::CGridPlaneXZA grid of lines over the XZ plane
mrpt::slam::CHeightGridMap2DA mesh representation of a surface which keeps the estimated height for each (x,y) location
mrpt::slam::CHeightGridMap2D::CHeightGridMap2D::TInsertionOptionsParameters related with inserting observations into the map
mrpt::math::CHistogramThis class provides an easy way of computing histograms for unidimensional real valued variables
mrpt::hwdrivers::CHokuyoURGThis software driver implements the protocol SCIP-2.0 for interfacing HOKUYO URG and UTM laser scanners
mrpt::hwdrivers::CHokuyoURG::CHokuyoURG::TSensorInfoUsed in CHokuyoURG::displayVersionInfo
mrpt::reactivenav::CHolonomicLogFileRecordA base class for log records for different holonomic navigation methods
mrpt::reactivenav::CHolonomicNDAn implementation of the holonomic reactive navigation method "Nearness-Diagram"
mrpt::reactivenav::CHolonomicND::CHolonomicND::TGapThe structure used to store a detected gap in obstacles
mrpt::reactivenav::CHolonomicVFFA holonomic reactive navigation method, based on Virtual Force Fields (VFF)
mrpt::slam::CICPSeveral implementations of ICP (Iterative closest point) algorithms for aligning two point maps
mrpt::slam::CICP::CICP::TConfigParamsThe ICP algorithm configuration data
mrpt::slam::CICP::CICP::TReturnInfoThe ICP algorithm return information
mrpt::vision::CImageConvolutionThis class performs filtering on a image based on Gaussian or DOG filters
mrpt::vision::CImageGrabber_dc1394A class for grabing images from a IEEE1394 (Firewire) camera using the libdc1394-2 library
mrpt::vision::CImageGrabber_OpenCVA class for grabing images from a "OpenCV"-compatible camera, or from an AVI video file
mrpt::hwdrivers::CIMUXSensA class for interfacing Inertial Measuring Units (IMUs) of the type "XSens MTi" It uses a serial port connection to the device
mrpt::slam::CIncrementalMapPartitionerThis class can be used to make partitions on a map/graph build from observations taken at some poses/nodes
mrpt::slam::CIncrementalMapPartitioner::CIncrementalMapPartitioner::TOptionsConfiguration of the algorithm:
mrpt::hwdrivers::CInterfaceFTDIA definition of a CStream actually representing a USB connection to a FTDI chip
mrpt::hwdrivers::CInterfaceFTDIMessagesAn implementation of message passing over a FTDI USB link
mrpt::hwdrivers::CJoystickAccess to joysticks and gamepads (read buttons and position), and request number of joysticks in the system
mrpt::bayes::CKalmanFilterCapableVirtual base for Kalman Filter (EKF,IEKF,UKF) implementations
mrpt::bayes::CKalmanFilterCapable::CKalmanFilterCapable::TKF_optionsGeneric options for the Kalman Filter algorithm in itself
mrpt::slam::CLandmarkThe class for storing "landmarks" (visual or laser-scan-extracted features,
mrpt::slam::CLandmarksMapA class for storing a map of 3D probabilistic landmarks
mrpt::slam::CLandmarksMap::CLandmarksMap::TCustomSequenceLandmarksThe list of landmarks: the wrapper class is just for maintaining the KD-Tree representation
mrpt::slam::CLandmarksMap::CLandmarksMap::TFuseOptionsWith this struct options are provided to the fusion process
mrpt::slam::CLandmarksMap::CLandmarksMap::TInsertionOptionsWith this struct options are provided to the observation insertion process
mrpt::slam::CLandmarksMap::CLandmarksMap::TInsertionResultsThis struct stores extra results from invoking insertObservation
mrpt::slam::CLandmarksMap::CLandmarksMap::TLikelihoodOptionsWith this struct options are provided to the likelihood computations
mrpt::slam::CLandmarksMap::CLandmarksMap::TLikelihoodOptions::CLandmarksMap::TLikelihoodOptions::TGPSOriginThis struct store de GPS longitude, latitude (in degrees ) and altitude (in meters) for the first GPS observation compose with de sensor position on the robot
mrpt::utils::CLASSINITAuxiliary structure used for CSerializable runtime class ID support
mrpt::math::CLevenbergMarquardtTempl< NUMTYPE >An implementation of the Levenberg-Marquardt algorithm for least-square minimization
mrpt::math::CLevenbergMarquardtTempl< NUMTYPE >::CLevenbergMarquardtTempl::TResultInfo
mrpt::utils::CLoadableOptionsThis is a virtual base class for sets of options than can be loaded from a ".ini" file
mrpt::reactivenav::CLogFileRecordA class for storing, saving and loading a reactive navigation log record for the CReactiveNavigationSystem class
mrpt::reactivenav::CLogFileRecord::CLogFileRecord::TInfoPerPTGThe structure used to store all relevant information about each transformation into TP-Space
mrpt::reactivenav::CLogFileRecord_NDA class for storing extra information about the execution of CHolonomicND navigation
mrpt::reactivenav::CLogFileRecord_VFFA class for storing extra information about the execution of CHolonomicVFF navigation
stlplus::clone_copy< T >
mrpt::utils::CMappedImageThis class encapsulates a MRPT Image and allows the sampling of individual pixels with sub-pixel accuracy and with a change of coordinates (eg, meters)
mrpt::vision::CMatchedFeatureListA list of features
mrpt::math::CMatrixThis class is a "CSerializable" wrapper for "CMatrixFloat"
mrpt::math::CMatrixBThis class is a "CSerializable" wrapper for "CMatrixBool"
mrpt::math::CMatrixDThis class is a "CSerializable" wrapper for "CMatrixTemplateNumeric<double>"
mrpt::math::CMatrixTemplate< T >This template class provides the basic functionality for a general 2D any-size, resizable container of numerical or non-numerical elements
mrpt::math::CMatrixTemplateNumeric< T >This template class extends the class "CMatrixTemplate" with many common operations with numerical matrixes
mrpt::math::CMatrixTemplateObjects< T >This template class extends the class "CMatrixTemplate" for storing "objects" at each matrix entry
mrpt::utils::CMemoryChunkA memory buffer (implements CStream) which can be itself serialized
mrpt::utils::CMemoryStreamThis CStream derived class allow using a memory buffer as a CStream
mrpt::opengl::CMeshA set of connected colored triangles
mrpt::utils::CMessageQueueA thread-safe class for message passing between threads
mrpt::slam::CMetricMapDeclares a virtual base class for all metric maps storage classes
mrpt::slam::CMetricMap::CMetricMap::TMatchingPairAn structure for returning the points pair-matchings
mrpt::slam::CMetricMap::CMetricMap::TMatchingPairListA list of TMatchingPair
mrpt::slam::CMetricMapBuilderThis virtual class is the base for SLAM implementations
mrpt::slam::CMetricMapBuilder::CMetricMapBuilder::TOptionsOptions for the algorithm
mrpt::slam::CMetricMapBuilderICPA class for very simple 2D SLAM based on ICP
mrpt::slam::CMetricMapBuilderICP::CMetricMapBuilderICP::TConfigParamsAlgorithm configuration params
mrpt::slam::CMetricMapBuilderRBPFThis class implements a Rao-Blackwelized Particle Filter (RBPF) approach to map building (SLAM)
mrpt::slam::CMetricMapBuilderRBPF::CMetricMapBuilderRBPF::TConstructionOptionsOptions for building a CMetricMapBuilderRBPF object, passed to the constructor
mrpt::slam::CMetricMapBuilderRBPF::CMetricMapBuilderRBPF::TStatsThis structure will hold stats after each execution of processActionObservation
mrpt::slam::CMetricMapsAlignmentAlgorithmA base class for any algorithm able of maps alignment
mrpt::utils::CMHPropertiesValuesListAn arbitrary list of "annotations", or named attributes, each being an instance of any CSerializable object (Multi-hypotheses version)
mrpt::utils::CMRPTCanvasThis virtual class defines the interface of any object accepting drawing primitives on it
mrpt::utils::CMRPTExceptionThe base for MRPT-especific exceptions
mrpt::utils::CMRPTImageA class for storing images as grayscale or RGB bitmaps
mrpt::utils::CMRPTImageFloatIn this class a grayscale image can be stored with float-type pixels
mrpt::utils::CMRPTMessageA class that contain generic messages, that can be sent and received from a "CClientTCPSocket" object
mrpt::slam::CMultiMetricMapThis class stores any customizable set of metric maps
mrpt::slam::CMultiMetricMap::CMultiMetricMap::TOptionsSome options for this class:
mrpt::slam::CMultiMetricMapPDFDeclares a class that represents a Rao-Blackwellized set of particles for solving the SLAM problem (This class is the base of RBPF-SLAM applications)
mrpt::slam::CMultiMetricMapPDF::CMultiMetricMapPDF::TPathBinAuxiliary structure
mrpt::slam::CMultiMetricMapPDF::CMultiMetricMapPDF::TPredictionParamsThe struct for passing extra simulation parameters to the prediction/update stage when running a particle filter
mrpt::slam::CObservationDeclares a class that represents any robot's observation
mrpt::slam::CObservation2DRangeScanDeclares a class derived from "CObservation" that encapsules a 2D range scan measurement (typically from a laser scanner)
mrpt::slam::CObservation2DRangeScan::CObservation2DRangeScan::CAuxMapWrapper
mrpt::slam::CObservationBatteryStateThis represents a measurement of the batteries on the robot
mrpt::slam::CObservationBeaconRangesDeclares a class derived from "CObservation" that represents one (or more) range measurements to labeled beacons
mrpt::slam::CObservationBeaconRanges::CObservationBeaconRanges::TMeasurementEach one of the measurements:
mrpt::slam::CObservationBearingRangeThis observation represents a number of range-bearing value pairs, each one for a detected landmark, which optionally can have identification IDs
mrpt::slam::CObservationBearingRange::CObservationBearingRange::TMeasurementEach one of the measurements:
mrpt::slam::CObservationCommentThis "observation" is actually a placeholder for a text block with comments or additional parameters attached to a given rawlog file
mrpt::slam::CObservationGasSensorsDeclares a class derived from "CObservation" that represents a set of readings from gas sensors
mrpt::slam::CObservationGasSensors::CObservationGasSensors::TObservationENoseThe structure for each e-nose
mrpt::slam::CObservationGPSDeclares a class derived from "CObservation" that represents a Global Positioning System (GPS) reading
mrpt::slam::CObservationGPS::CObservationGPS::TGPSDatum_GGAThe GPS datum for GGA commands
mrpt::slam::CObservationGPS::CObservationGPS::TGPSDatum_RMCThe GPS datum for RMC commands
mrpt::slam::CObservationGPS::CObservationGPS::TUTCTimeA UTC time-stamp structure for GPS messages
mrpt::slam::CObservationImageDeclares a class derived from "CObservation" that encapsules an image from a camera, whose relative pose to robot is also stored
mrpt::slam::CObservationIMUThis class stores both sequences of raw measurements from an IMU, and/or its attitude estimation (integration of raw measurements)
mrpt::slam::CObservationOdometryAn observation of the current (cumulative) odometry for a wheeled robot
mrpt::slam::CObservationRangeDeclares a class derived from "CObservation" that encapsules a single range measurement, and associated parameters
mrpt::slam::CObservationRange::CObservationRange::TMeasurement
mrpt::slam::CObservationStereoImagesDeclares a class derived from "CObservation" that encapsule a pair of images taken by a stereo camera
mrpt::slam::CObservationStereoImages::CObservationStereoImages::CAuxMapWrapperIf buildAuxiliarMap is called before, this will contain the landmarks-map representation of the observation, for the robot located at the origin
mrpt::slam::CObservationVisualLandmarksDeclares a class derived from "CObservation" that stores a Landmarks Map as seen from a stereo camera at a given instant of time
mrpt::slam::COccupancyGridMap2DCOccupancyGridMap2D is a class for storing an occupancy grid map
mrpt::slam::COccupancyGridMap2D::COccupancyGridMap2D::TCriticalPointsListThe structure used to store the set of Voronoi diagram critical points
mrpt::slam::COccupancyGridMap2D::COccupancyGridMap2D::TEntropyInfoUsed for returning entropy related information
mrpt::slam::COccupancyGridMap2D::COccupancyGridMap2D::TInsertionOptionsWith this struct options are provided to the observation insertion process
mrpt::slam::COccupancyGridMap2D::COccupancyGridMap2D::TLikelihoodOptionsWith this struct options are provided to the observation likelihood computation process
mrpt::slam::COccupancyGridMap2D::COccupancyGridMap2D::TLikelihoodOutputSome members of this struct will contain intermediate or output data after calling "computeObservationLikelihood" for some likelihood functions
mrpt::slam::COccupancyGridMap2D::COccupancyGridMap2D::TUpdateCellsInfoChangeOnlyAn internal structure for storing data related to counting the new information apported by some observation
stlplus::constructor_copy< T >
mrpt::opengl::COpenGLSceneThis class allows the user to create, load, save, and render 3D scenes using OpenGL primitives
mrpt::opengl::COpenGLStandardObjectAny OpenGLObject without special geometric properties
mrpt::opengl::COpenGLViewportA viewport within a COpenGLScene, containing a set of OpenGL objects to render
mrpt::utils::copiable_NULL_ptr< T >A wrapper class for pointers that, if copied with the "=" operator, should be set to NULL in the new copy
mrpt::utils::copiable_NULL_ptr_basic< T >A wrapper class for pointers that, if copied with the "=" operator, should be set to NULL in the copy
mrpt::reactivenav::CParameterizedTrajectoryGeneratorThis is the base class for any user defined PTG
mrpt::reactivenav::CParameterizedTrajectoryGenerator::CParameterizedTrajectoryGenerator::CColisionGridAn internal class for storing the collision grid
mrpt::reactivenav::CParameterizedTrajectoryGenerator::CParameterizedTrajectoryGenerator::CColisionGrid::CParameterizedTrajectoryGenerator::CColisionGrid::TCellThe cell structure:
mrpt::reactivenav::CParameterizedTrajectoryGenerator::CParameterizedTrajectoryGenerator::CListColisionGridsThe collision grids for different security distance values:
mrpt::reactivenav::CParameterizedTrajectoryGenerator::CParameterizedTrajectoryGenerator::TCellForLambdaFunctionSpecifies the min/max values for "k" and "n", respectively
mrpt::reactivenav::CParameterizedTrajectoryGenerator::CParameterizedTrajectoryGenerator::TCPointThe trajectories in the C-Space:
mrpt::bayes::CParticleFilterThis 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
mrpt::bayes::CParticleFilter::CParticleFilter::TParticleFilterOptionsThe configuration of a particle filter
mrpt::bayes::CParticleFilter::CParticleFilter::TParticleFilterStatsStatistics for being returned from the "execute" method
mrpt::bayes::CParticleFilterCapableThis virtual class defines the interface that any particles based PDF class must implement in order to be executed by a mrpt::bayes::CParticleFilter
mrpt::bayes::CParticleFilterCapable::CParticleFilterCapable::TFastDrawAuxVarsAuxiliary vectors, see CParticleFilterCapable::prepareFastDrawSample for more information
mrpt::bayes::CParticleFilterData< T >This template class declares the array of particles and its internal data, managing some memory-related issues and providing an easy implementation of virtual methods required for implementing a CParticleFilterCapable
mrpt::slam::CPathPlanningCircularRobotAn implementation of CPathPlanningMethod
mrpt::slam::CPathPlanningMethodA virtual base class for computing the optimal path for a robot from a origin location to a target point
mrpt::opengl::CPlanarLaserScanThis object renders a 2D laser scan by means of three elements: the points, the line along end-points and the 2D scanned surface
mrpt::poses::CPointA virtual base class to represent a point in 2D or 3D
mrpt::poses::CPoint2DA class used to store a 2D point
mrpt::poses::CPoint3DA class used to store a 3D point
mrpt::opengl::CPointCloudA cloud of points, all with the same color or each depending on it's "z" coordinate
mrpt::opengl::CPointCloudColouredA cloud of points, each one with an individual colour (R,G,B)
mrpt::opengl::CPointCloudColoured::CPointCloudColoured::TPointColour
mrpt::poses::CPointPDFDeclares a class that represents a Probability Distribution function (PDF) of a 3D point (x,y,z)
mrpt::poses::CPointPDFGaussianA gaussian distribution for 3D points
mrpt::poses::CPointPDFParticlesA probability distribution of a 2D/3D point, represented as a set of random samples (particles)
mrpt::poses::CPointPDFSOGDeclares a class that represents a Probability Density function (PDF) of a 3D point $ p(\mathbf{x}) = [x ~ y ~ z ]^t $
mrpt::poses::CPointPDFSOG::CPointPDFSOG::TGaussianModeThe struct for each mode:
mrpt::slam::CPointsMapA cloud of points in 2D or 3D, which can be built from a sequence of laser scans or other sensors
mrpt::slam::CPointsMap::CPointsMap::TInsertionOptionsWith this struct options are provided to the observation insertion process
mrpt::slam::CPointsMap::CPointsMap::TKDTreeDataInternal structure with a KD-tree representation
mrpt::math::CPolygonA simple 2D polygon class, mainly for checking points falling inside it
mrpt::opengl::CPolyhedronAn arbitrary polyhedron
mrpt::opengl::CPolyhedron::CPolyhedron::TPolyhedronEdge
mrpt::opengl::CPolyhedron::CPolyhedron::TPolyhedronFace
mrpt::poses::CPoseA virtual base class to represent a pose in 2D or 3D
mrpt::poses::CPose2DA class used to store a 2D pose
mrpt::poses::CPose2DGridTemplate< T >This is a template class for storing a 3D (2D+heading) grid containing any kind of data
mrpt::poses::CPose3DA class used to store a 3D pose
mrpt::poses::CPose3DInterpolatorA trajectory in time and in 6D (CPose3D) that interpolates using splines the intervals between a set of given time-referenced poses
mrpt::poses::CPose3DPDFDeclares a class that represents a Probability Density Function (PDF) of a 3D pose (6D actually)
mrpt::poses::CPose3DPDFGaussianDeclares a class that represents a Probability Density function (PDF) of a 3D pose $ p(\mathbf{x}) = [x ~ y ~ z ~ yaw ~ pitch ~ roll]^t $
mrpt::poses::CPose3DPDFParticlesDeclares a class that represents a Probability Density function (PDF) of a 3D pose This class implements that PDF using a set of m_particles (for using particle filter methods), where M weighted m_particles represent the PDF
mrpt::poses::CPose3DPDFSOGDeclares a class that represents a Probability Density function (PDF) of a 3D(6D) pose $ p(\mathbf{x}) = [x ~ y ~ z ~ yaw ~ pitch ~ roll]^t $
mrpt::poses::CPose3DPDFSOG::CPose3DPDFSOG::TGaussianModeThe struct for each mode:
mrpt::poses::CPoseOrPointThe base class for 2D points, 3D points, 2D poses and 3D poses
mrpt::poses::CPosePDFDeclares a class that represents a probability density function (pdf) of a 2D pose (x,y,phi)
mrpt::poses::CPosePDFGaussianDeclares a class that represents a Probability Density function (PDF) of a 2D pose $ p(\mathbf{x}) = [x ~ y ~ \phi ]^t $
mrpt::poses::CPosePDFGridDeclares a class that represents a Probability Distribution function (PDF) of a 2D pose (x,y,phi)
mrpt::poses::CPosePDFParticlesDeclares a class that represents a Probability Density Function (PDF) over a 2D pose (x,y,phi), using a set of weighted samples
mrpt::poses::CPosePDFParticles::CPosePDFParticles::lt_TPoseBinAuxiliary structure
mrpt::poses::CPosePDFParticles::CPosePDFParticles::TPoseBinAuxiliary structure
mrpt::poses::CPosePDFParticles::CPosePDFParticles::TPredictionParamsThe struct for passing extra simulation parameters to the prediction stage when running a particle filter
mrpt::poses::CPosePDFSOGDeclares a class that represents a Probability Density function (PDF) of a 2D pose $ p(\mathbf{x}) = [x ~ y ~ \phi ]^t $
mrpt::poses::CPosePDFSOG::CPosePDFSOG::TGaussianModeThe struct for each mode:
mrpt::poses::CPoseRandomSamplerAn efficient generator of random samples drawn from a given 2D (CPosePDF) or 3D (CPose3DPDF) pose probability density function (pdf)
mrpt::poses::CPoses2DSequenceThis class stores a sequence of relative, incremental 2D poses
mrpt::poses::CPoses3DSequenceThis class stores a sequence of relative, incremental 3D poses
mrpt::bayes::CProbabilityParticle< T >A template class for holding a the data and the weight of a particle
mrpt::utils::CPropertiesValuesListAn arbitrary list of "annotations", or named attributes, each being an instance of any CSerializable object
mrpt::utils::CPropertiesValuesList::CPropertiesValuesList::TPropertyValuePair
mrpt::reactivenav::CPTG1A PTG for circular paths
mrpt::reactivenav::CPTG2A PTG for circular paths
mrpt::reactivenav::CPTG3A PTG for optimal paths of type "C|C,S"
mrpt::reactivenav::CPTG4A PTG for optimal paths of type "C|C"
mrpt::reactivenav::CPTG5A PTG for optimal paths of type "C|C,S"
mrpt::reactivenav::CPTG6A PTG for circular paths
mrpt::reactivenav::CPTG7A PTG for circular paths
mrpt::hwdrivers::CPtuBaseThis class implements initialization and comunication methods to control a generic Pan and Tilt Unit, working in radians
mrpt::hwdrivers::CPtuDPerceptionThis class implements initialization and comunication methods to control a Pan and Tilt Unit model PTU-46-17.5, working in radians
mrpt::hwdrivers::CPtuHokuyo
mrpt::hwdrivers::CPtuHokuyo::CPtuHokuyo::my_pos
mrpt::math::CQuaternion< T >
mrpt::slam::CRangeBearingKFSLAMA simple implementation of EKF-based SLAM with range-bearing sensors, odometry, a full 6D robot pose, and 3D landmarks
mrpt::slam::CRangeBearingKFSLAM::CRangeBearingKFSLAM::TOptionsThe options for the algorithm
mrpt::slam::CRawlogThis class stores a rawlog (robotic datasets) in one of two possible formats:
  • Format #1: A sequence of actions and observations
mrpt::slam::CRawlog::CRawlog::const_iteratorA normal iterator, plus the extra methods "isAction", "isObservation" to determine the type of each entry in the sequence
mrpt::slam::CRawlog::CRawlog::iteratorA normal iterator, plus the extra methods "isAction", "isObservation" to determine the type of each entry in the sequence
mrpt::slam::CRawlogXXLThis class is identical to slam::CRawlog but it transparently manages the dump of objects to a temporary file in disk, so it can handle very large rawlogs that otherwise don't fit in memory (EXPERIMENTAL, DO NOT USE!!!!)
mrpt::slam::CRawlogXXL::CRawlogXXL::const_iteratorA normal const iterator, plus the extra methods to determine the type of each entry in the sequence
mrpt::slam::CRawlogXXL::CRawlogXXL::iteratorA normal iterator, plus the extra methods to determine the type of each entry in the sequence
mrpt::slam::CRawlogXXL::CRawlogXXL::TObjectElementXXL
mrpt::slam::CRBPFParticleDataAuxiliary class used in mrpt::slam::CMultiMetricMapPDF
mrpt::reactivenav::CReactiveNavigationSystemImplements 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
mrpt::reactivenav::CReactiveNavigationSystem::CReactiveNavigationSystem::CDynamicWindowFor taken the dynamics of the robot into account
mrpt::reactivenav::CReactiveNavigationSystem::CReactiveNavigationSystem::THolonomicMovementThe structure used for storing a movement generated by a holonomic-method
mrpt::utils::CReferencedMemBlockRepresents a memory block (via "void*") that can be shared between several objects through copy operator (=)
mrpt::bayes::CRejectionSamplingCapable< TStateSpace >A base class for implementing rejection sampling in a generic state space
mrpt::slam::CRejectionSamplingRangeOnlyLocalizationAn implementation of rejection sampling for generating 2D robot pose from range-only measurements within a landmarks (beacons) map
mrpt::slam::CRejectionSamplingRangeOnlyLocalization::CRejectionSamplingRangeOnlyLocalization::TDataPerBeaconData for each beacon observation with a correspondence with the map
mrpt::opengl::CRenderizableThe base class of 3D objects that can be directly rendered through OpenGL
mrpt::hwdrivers::CRoboticHeadInterfaceThis "software driver" implements the communication protocol for interfacing a Robotic Head Board through a custom USB RS-422 interface board
mrpt::slam::CRobotSimulatorThis class can be used to simulate the kinematics and dynamics of a differential driven planar mobile robot, including odometry errors and dynamics limitations
mrpt::synch::CSemaphoreA semaphore for inter-thread synchronization
mrpt::slam::CSensFrameProbSequenceThis class stores a sequence of <Probabilistic Pose,SensoryFrame> pairs, thus a "metric map" can be totally determined with this information
mrpt::slam::CSensoryFrameDeclares a class for storing a "sensory frame", thus a set of "observations" of the robot, taken exactly from the same location.The "observations" can be of many different kinds
mrpt::utils::CSerializableThe virtual base class which provides a unified interface for all persistent objects in MRPT
mrpt::hwdrivers::CSerialPortA communications serial port built as an implementation of a utils::CStream
mrpt::utils::CServerTCPSocketA TCP socket that can be wait for client connections to enter
mrpt::opengl::CSetOfLinesA set of independent lines (or segments), one line with its own start and end positions (X,Y,Z)
mrpt::opengl::CSetOfObjectsA set of object, which are referenced to the coordinates framework established in this object
mrpt::opengl::CSetOfTexturedTrianglesA set of textured triangles
mrpt::opengl::CSetOfTexturedTriangles::CSetOfTexturedTriangles::TTriangleTriangle
mrpt::opengl::CSetOfTexturedTriangles::CSetOfTexturedTriangles::TVertexTriangle vertex
mrpt::opengl::CSetOfTrianglesA set of colored triangles
mrpt::opengl::CSetOfTriangles::CSetOfTriangles::TTriangle
mrpt::hwdrivers::CSickLaserUSBThis "software driver" implements the communication protocol for interfacing a SICK LMS200 laser scanners through a custom USB RS-422 interface board
mrpt::utils::CSimpleDatabaseThis class impements a very simple database system
mrpt::utils::CSimpleDatabaseTableThis class implements the tables of databases
mrpt::opengl::CSimpleLineA line segment
mrpt::slam::CSimplePointsMapA cloud of points in 2D or 3D, which can be built from a sequence of laser scans
mrpt::opengl::CSphereA solid or wire-frame sphere
mrpt::math::CSplineInterpolator1DA (persistent) sequence of (x,y) coordinates, allowing queries of intermediate points through spline interpolation, where possible
mrpt::utils::CStdOutStreamThis CStdOutStream derived class allow printing to standard out, normally the console text output
mrpt::vision::CStereoGrabber_BumblebeeA class for grabing stereo images from a "Bumblebee" camera NOTE:
  • This class is only available when compiling MRPT with "#define MRPT_HAS_BUMBLEBEE 1" in the "config.h"
mrpt::vision::CStereoImagesTo3DA class for processing a pair of stereo images and generateing a disparity image and/or a 3D landmarks map
mrpt::vision::CStereoServerBumblebee
mrpt::utils::CStreamThis base class is used to provide a unified interface to files,memory buffers,
mrpt::utils::CStringListA class for storing a list of text lines
mrpt::opengl::CTextA 2D text (bitmap rendering): it always "faces the observer" despite it's at some 3D location
mrpt::opengl::CTexturedPlaneA 2D plane in the XY plane with a texture image
mrpt::utils::CTicTacThis class implements a high-performance stopwatch
mrpt::utils::CTypeSelectorThis class represents a std::string derived class which is also CSerializable
mrpt::utils::CUncopiableThe base class of classes that cannot be copied: compile-time errors will arise if the copy is tried
mrpt::math::CVectorTemplate< T >This template class provides the basic functionality for a general 1D any-size, resizable container of numerical or non-numerical elements
mrpt::vision::CVisualOdometryStereoVisual odometry for stereo cameras
mrpt::utils::deque_serializable< T >A STL-vector derived class that implements basic read/write to ease implementing the mrpt::utils::CSerializable interface in classes having this type of data members
stlplus::end_dereference
stlplus::illegal_copy
imaxdiv_t
mrpt::utils::list_searchable< T >This class implements a STL container with features of both, a std::set and a std::list
mrpt::utils::list_searchable_serializable< T >A list_searchable with basic read/write to ease implementing the mrpt::utils::CSerializable interface in classes having this type of data members
mrpt::utils::map_serializable< K, V >A std::map with basic read/write to ease implementing the mrpt::utils::CSerializable interface in classes having this type of data members
mrpt::utils::multimap_serializable< K, V >A std::multimap with basic read/write to ease implementing the mrpt::utils::CSerializable interface in classes having this type of data members
stlplus::no_copy< T >
mrpt::utils::non_copiable_ptr< T >A wrapper class for pointers that can NOT be copied with "=" operator, raising an exception at runtime if a copy is attempted
mrpt::utils::non_copiable_ptr_basic< T >A wrapper class for pointers that can NOT be copied with "=" operator, raising an exception at runtime if a copy is attempted
stlplus::null_dereference
mrpt::utils::metaprogramming::ObjectClearAn object for clearing an object (invokes its method "clear()") given a pointer or smart-pointer, intended for being used in STL algorithms
mrpt::utils::metaprogramming::ObjectClearUniqueAn object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
mrpt::utils::metaprogramming::ObjectConvert< TARGET_TYPE >An object for transforming between types/classes, intended for being used in STL algorithms
mrpt::utils::metaprogramming::ObjectDeleteAn object for deleting pointers (intended for STL algorithms)
mrpt::utils::metaprogramming::ObjectMakeUniqueAn object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
mrpt::utils::metaprogramming::ObjectPairMakeUniqueAn object for making smart pointers unique (ie, making copies if necessary), intended for being used in STL algorithms
mrpt::utils::metaprogramming::ObjectReadFromStreamAn object for reading objects from a stream, intended for being used in STL algorithms
mrpt::utils::safe_ptr< T >A wrapper class for pointers that can be safely copied with "=" operator without problems
mrpt::utils::safe_ptr_basic< T >A wrapper class for pointers that can be safely copied with "=" operator without problems
stlplus::smart_ptr< T >
stlplus::smart_ptr_base< T, C >
stlplus::smart_ptr_clone< T >
stlplus::smart_ptr_holder< T >
stlplus::smart_ptr_nocopy< T >
mrpt::vision::TCameraAJOGD Estructura para almacenar los datos de la camara para MONOSLAM
mrpt::vision::TCaptureCVOptionsOptions used when creating an OpenCV capture object Some options apply to IEEE1394 cameras only
mrpt::vision::TCaptureOptions_dc1394Options used when creating an dc1394 capture object All but the frame size, framerate, and color_coding can be changed dynamically by CImageGrabber_dc1394::changeCaptureOptions
mrpt::utils::TColorA RGB color - 8bit
mrpt::utils::TColorfA RGB color - floats in the range [0,1]
mrpt::hwdrivers::TFTDIDeviceA list of FTDI devices and their descriptors
mrpt::slam::TGasConcentrationCellThe contents of each cell in a CGasConcentrationGridMap2D map
mrpt::slam::THeightGridmapCellThe contents of each cell in a CHeightGridMap2D map
mrpt::hwdrivers::ThreadParams
mrpt::vision::TImageCalibDataData associated to each image in the calibration process mrpt::vision::checkerBoardCameraCalibration (All the information can be left empty and will be filled up in the calibration method)
mrpt::vision::TImageROIA structure for defining a ROI within an image
mrpt::slam::TKLDParamsOption set for KLD algorithm
mrpt::vision::TMatchingOptionsA structure containing options for the matching
mrpt::slam::TMetricMapInitializerEach structure of this kind will determine the kind (and initial configuration) of one map to be build into a CMultiMetricMap object
mrpt::slam::TMetricMapInitializer::TMetricMapInitializer::CBeaconMapOptionsEspecific options for landmarks maps (mrpt::slam::CBeaconMap)
mrpt::slam::TMetricMapInitializer::TMetricMapInitializer::CColouredPointsMapOptionsEspecific options for coloured points maps (mrpt::slam::CPointsMap)
mrpt::slam::TMetricMapInitializer::TMetricMapInitializer::CGasConcentrationGridMap2DOptionsEspecific options for gas grid maps (mrpt::slam::CGasConcentrationGridMap2D)
mrpt::slam::TMetricMapInitializer::TMetricMapInitializer::CHeightGridMap2DOptionsEspecific options for height grid maps (mrpt::slam::CHeightGridMap2D)
mrpt::slam::TMetricMapInitializer::TMetricMapInitializer::CLandmarksMapOptionsEspecific options for landmarks maps (mrpt::slam::CLandmarksMap)
mrpt::slam::TMetricMapInitializer::TMetricMapInitializer::CPointsMapOptionsEspecific options for points maps (mrpt::slam::CPointsMap)
mrpt::slam::TMetricMapInitializer::TMetricMapInitializer::TOccGridMap2DOptionsEspecific options for grid maps (mrpt::slam::COccupancyGridMap2D)
mrpt::vision::TOdometryOptionsA structure containing options for the visual odometry
mrpt::topography::TPathFromRTKInfoUsed to return optional information from mrpt::topography::path_from_rtk_gps
mrpt::vision::TPixelCoordA pair (x,y) of pixel coordinates (integer resolution)
mrpt::vision::TPixelCoordfA pair (x,y) of pixel coordinates (subpixel resolution)
mrpt::utils::TPropertyValueIDTripletInternal triplet for each property in utils::CMHPropertiesValuesList
mrpt::vision::TROIA structure for storing a 3D ROI
mrpt::utils::TRuntimeClassIdA structure that holds runtime class type information
mrpt::hwdrivers::TSensorClassIdA structure for runtime ID class type information in the context of hwdrivers::CGenericSensor
mrpt::slam::TSetOfMetricMapInitializersA 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
mrpt::poses::TSimple3DPointData within each particle
mrpt::vision::TStereoSystemParamsParameters associated to a stereo system
mrpt::system::TThreadHandleThis structure contains the information needed to interface the threads API on each platform:
mrpt::system::TTimePartsThe parts of a date/time (it's like the standard 'tm' but with fractions of seconds)
mrpt::utils::vector_serializable< T >A STL-vector derived class that implements basic read/write to ease implementing the mrpt::utils::CSerializable interface in classes having this type of data members
stlplus::wrong_object
mrpt::gui::WxSubsystemThis class implements the GUI thread required for the wxWidgets-based GUI



Page generated by Doxygen 1.5.8 for MRPT 0.6.5 SVN: at Thu Feb 26 02:19:01 EST 2009