#include <pose_graph/graph_search.h>#include <pose_graph/constraint_graph.h>#include <graph_mapping_utils/ros.h>#include "../../src/graph_search_impl.h"#include <pose_graph/exception.h>#include <graph_mapping_utils/general.h>#include "general.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/PoseStamped.h"#include <tf/transform_datatypes.h>#include <geometry_msgs/Pose.h>#include <geometry_msgs/Point32.h>#include <sensor_msgs/PointCloud.h>#include "std_msgs/Header.h"#include <boost/graph/connected_components.hpp>#include <boost/graph/dijkstra_shortest_paths.hpp>#include <list>#include <iostream>

Go to the source code of this file.
Classes | |
| struct | pose_graph::AllNodes |
Namespaces | |
| namespace | pose_graph |
Typedefs | |
| typedef pair< DistanceMap, PredecessorMap > | pose_graph::DijkstraResult |
| typedef map< GraphVertex, double > | pose_graph::DistanceMap |
| typedef map< GraphVertex, GraphVertex > | pose_graph::PredecessorMap |
Functions | |
| NodeSet | pose_graph::componentContaining (const ConstraintGraph &g, unsigned n) |
| std::vector< NodeSet > | pose_graph::connectedComponents (const ConstraintGraph &g) |
| DijkstraResult | pose_graph::dijkstra (const Graph &g, const GraphVertex &src) |
| tf::Pose | pose_graph::relativePose (const ConstraintGraph &g, const unsigned n1, const unsigned n2) |
| ShortestPath | pose_graph::shortestPath (const ConstraintGraph &g, const unsigned src, const unsigned dest) |
Implementation of graph_search.h
Definition in file graph_search.cpp.