#include "general.h"#include "to_string.h"#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>#include "geometry.h"#include <ros/message_traits.h>#include <ros/ros.h>#include <tf/transform_listener.h>#include <tf/exceptions.h>#include <boost/type_traits/remove_const.hpp>#include <boost/optional.hpp>#include <graph_mapping_msgs/Node.h>#include <graph_mapping_msgs/Edge.h>#include <graph_mapping_msgs/NodePoses.h>

Go to the source code of this file.
General utilities for internal use in the graph_mapping stack
Definition in file utils.h.