#include <pose_graph/exception.h>#include <graph_mapping_utils/utils.h>#include "general.h"#include "to_string.h"#include "geometry.h"#include "ros.h"#include "msg.h"#include <graph_mapping_msgs/Node.h>#include <graph_mapping_msgs/Edge.h>#include <graph_mapping_msgs/PoseWithPrecision.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "geometry_msgs/Pose.h"#include <boost/foreach.hpp>#include <pose_graph/constraint_graph.h>

Go to the source code of this file.
Namespaces | |
| namespace | pose_graph |
Typedefs | |
| typedef map< unsigned, GraphEdge > | pose_graph::EdgeMap |
| typedef pair< unsigned, unsigned > | pose_graph::IncidentNodes |
| typedef map< unsigned, GraphVertex > | pose_graph::NodeMap |
Implementation for constraint_graph.h
Definition in file constraint_graph.cpp.