#include "geometry.h"#include "ids.h"#include <occupancy_grid_utils/LocalizedCloud.h>#include <boost/scoped_ptr.hpp>#include <boost/optional.hpp>#include <set>#include <vector>

Go to the source code of this file.
Classes | |
| class | pose_graph::PoseGraph |
| struct | pose_graph::ShortestPathResult |
| Result of a shortest path query. More... | |
Namespaces | |
| namespace | pose_graph |
Typedefs | |
| typedef std::map< NodeId, geometry_msgs::Pose > | pose_graph::NodePoseMap |
| Maps Node ids to poses. | |
Functions | |
| const std::string | pose_graph::OPTIMIZED_FRAME ("graph_optimization") |
| Implicit frame for graph optimization. | |
Contains the interface for the (ros-independent) pose graph data structures
Definition in file pose_graph.h.