Main MRPT website > C++ reference for MRPT 1.4.0
Namespaces | Classes | Typedefs | Functions

Detailed Description

This is the global namespace for all Mobile Robot Programming Toolkit (MRPT) libraries.

Determines whether this is an X86 or AMD64 platform.

Namespaces

namespace  bayes
 The namespace for Bayesian filtering algorithm: different particle filters and Kalman filter algorithms.
 
namespace  compress
 Data compression/decompression algorithms.
 
namespace  detectors
 <>
 
namespace  global_settings
 Global variables to change the run-time behaviour of some MRPT classes within mrpt-base.
 
namespace  graphs
 Abstract graph and tree data structures, plus generic graph algorithms.
 
namespace  graphslam
 SLAM methods related to graphs of pose constraints.
 
namespace  gui
 Classes for creating GUI windows for 2D and 3D visualization.
 
namespace  hmtslam
 Classes related to the implementation of Hybrid Metric Topological (HMT) SLAM.
 
namespace  hwdrivers
 Contains classes for various device interfaces.
 
namespace  kinematics
 
namespace  maps
 
namespace  math
 This base provides a set of functions for maths stuff.
 
namespace  nav
 
namespace  obs
 This namespace contains representation of robot actions and observations.
 
namespace  opengl
 The namespace for 3D scene representation and rendering.
 
namespace  pbmap
 
namespace  poses
 Classes for 2D/3D geometry representation, both of single values and probability density distributions (PDFs) in many forms.
 
namespace  random
 A namespace of pseudo-random numbers genrators of diferent distributions.
 
namespace  scanmatching
 
namespace  slam
 
namespace  synch
 This namespace provides multitask, synchronization utilities.
 
namespace  system
 This namespace provides a OS-independent interface to many useful functions: filenames manipulation, time and date, string parsing, file I/O, threading, memory allocation, etc.
 
namespace  tfest
 Functions for estimating the optimal transformation between two frames of references given measurements of corresponding points.
 
namespace  topography
 This namespace provides topography helper functions, coordinate transformations.
 
namespace  utils
 Classes for serialization, sockets, ini-file manipulation, streams, list of properties-values, timewatch, extensions to STL.
 
namespace  vision
 Classes for computer vision, detectors, features, etc.
 

Classes

struct  aligned_containers
 Helper types for STL containers with Eigen memory allocators. More...
 

Typedefs

typedef std::vector< int8_tvector_signed_byte
 
typedef std::vector< int16_tvector_signed_word
 
typedef std::vector< int32_tvector_int
 
typedef std::vector< int64_t > vector_long
 
typedef std::vector< size_t > vector_size_t
 
typedef std::vector< uint8_tvector_byte
 
typedef std::vector< uint16_tvector_word
 
typedef std::vector< uint32_tvector_uint
 
typedef std::vector< bool > vector_bool
 A type for passing a vector of bools.
 
typedef std::vector< std::string > vector_string
 A type for passing a vector of strings.
 

Functions

std::string BASE_IMPEXP format (const char *fmt,...) MRPT_printf_format_check(1
 A std::string version of C sprintf.
 

Function Documentation

◆ format()

std::string BASE_IMPEXP mrpt::format ( const char *  fmt,
  ... 
)

A std::string version of C sprintf.

You can call this to obtain a std::string using printf-like syntax. Based on very nice code by Paul Senzee, published at http://senzee.blogspot.com/2006/05/c-formatting-stdstring.html Function implemented in format.cpp

References BASE_IMPEXP, and MRPT_NO_THROWS.

Referenced by mrpt::math::TPoint2D::asString(), mrpt::math::TPoint3D::asString(), mrpt::math::TPose3DQuat::asString(), mrpt::poses::CPoint< DERIVEDCLASS >::asString(), mrpt::poses::CPose3D::asString(), mrpt::poses::CPose3DQuat::asString(), mrpt::poses::CPose3DRotVec::asString(), mrpt::math::CMatrixTemplate< T >::CMatrixTemplate(), mrpt::math::CQuaternion< T >::CQuaternion(), mrpt::utils::CCanvas::drawFeatures(), mrpt::math::CLevenbergMarquardtTempl< VECTORTYPE, USERPARAM >::execute(), mrpt::utils::TTypeName< mrpt::math::CArrayNumeric< T, N > >::get(), mrpt::utils::TTypeName< mrpt::math::CArrayDouble< N > >::get(), mrpt::utils::TTypeName< mrpt::math::CArrayFloat< N > >::get(), mrpt::utils::TTypeName< mrpt::math::CMatrixFixedNumeric< T, N, M > >::get(), mrpt::math::CMatrixTemplate< T >::get_unsafe(), mrpt::math::CMatrixTemplate< T >::get_unsafe_row(), mrpt::topography::TCoords::getAsString(), mrpt::graphs::CDirectedGraph< TYPE_EDGES, EDGE_ANNOTATIONS >::getEdge(), mrpt::graphs::CNetworkOfPoses< CPOSE, MAPS_IMPLEMENTATION, NODE_ANNOTATIONS, EDGE_ANNOTATIONS >::getEdgeSquareError(), mrpt::obs::CObservationGPS::getMsgByClass(), mrpt::graphs::CDijkstra< TYPE_GRAPH, MAPS_IMPLEMENTATION >::getTreeGraph(), mrpt::graphs::detail::graph_ops< graph_t >::graph_edge_sqerror(), mrpt::opengl::graph_tools::graph_visualize(), mrpt::graphs::detail::graph_ops< graph_t >::load_graph_of_poses_from_text_file(), mrpt::math::CMatrixTemplate< T >::operator()(), mrpt::math::CMatrixTemplate< T >::operator=(), mrpt::math::operator>>(), mrpt::utils::operator>>(), mrpt::graphslam::optimize_graph_spa_levmarq(), mrpt::utils::CConfigFileBase::read_enum(), mrpt::graphs::CGraphPartitioner< GRAPH_MATRIX, num_t >::RecursiveSpectralPartition(), mrpt::poses::CPoint2D::resize(), mrpt::poses::CPoint3D::resize(), mrpt::poses::CPose2D::resize(), mrpt::poses::CPose3D::resize(), mrpt::poses::CPose3DQuat::resize(), mrpt::poses::CPose3DRotVec::resize(), mrpt::math::CArray< T, N >::resize(), mrpt::maps::COccupancyGridMap2D::saveAsBitmapFileWithLandmarks(), mrpt::graphs::CDirectedGraph< TYPE_EDGES, EDGE_ANNOTATIONS >::saveAsDot(), mrpt::math::CMatrixTemplate< T >::set_unsafe(), mrpt::system::sprintf_container(), and mrpt::utils::sprintf_vector().




Page generated by Doxygen 1.9.6 for MRPT 1.4.0 SVN: at Fri Jan 20 00:13:14 UTC 2023