#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Pose2D.h>
#include <geometry_msgs/Point.h>
#include <string>
#include <boost/format.hpp>
#include <boost/lexical_cast.hpp>
#include <iostream>
#include <set>
#include <numeric>
#include <tf/transform_datatypes.h>
Go to the source code of this file.
Namespaces | |
namespace | graph_mapping_utils |
Functions | |
template<class T > | |
std::string | graph_mapping_utils::concatenate (const std::string &s, const T &x) |
std::string | graph_mapping_utils::toString (const btQuaternion &q) |
std::string | graph_mapping_utils::toString (const btVector3 &v) |
std::string | graph_mapping_utils::toString (const btTransform &t) |
template<class T > | |
std::string | graph_mapping_utils::toString (const std::vector< T > &v) |
template<class T > | |
std::string | graph_mapping_utils::toString (const std::set< T > &set) |
string | graph_mapping_utils::toString (const gm::Pose &pose) |
string | graph_mapping_utils::toString (const gm::Point &p) |
string | graph_mapping_utils::toString (const gm::Pose2D &pose) |
string | graph_mapping_utils::toString2D (const tf::Pose &pose) |
string | graph_mapping_utils::toString2D (const gm::Pose &pose) |
Conversion of various types to string / operator<<
Definition in file to_string.h.