graph_search.h File Reference

#include <pose_graph/constraint_graph.h>
#include <graph_mapping_utils/ros.h>
#include <ros/message_traits.h>
#include <ros/ros.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 "std_msgs/Header.h"
#include "geometry_msgs/TransformStamped.h"
#include <iostream>
#include <iomanip>
#include <cmath>
#include <sstream>
#include <map>
#include <stdexcept>
#include <list>
#include <boost/thread/mutex.hpp>
#include "tf/transform_datatypes.h"
#include "tf/exceptions.h"
#include "LinearMath/btTransform.h"
#include <boost/signals.hpp>
#include "geometry_msgs/Vector3.h"
#include "ros/callback_queue.h"
#include "ros/service_traits.h"
#include "boost/thread.hpp"
#include <boost/type_traits/remove_const.hpp>
#include <boost/optional.hpp>
#include <boost/foreach.hpp>
#include <boost/graph/filtered_graph.hpp>
#include <boost/graph/breadth_first_search.hpp>
Include dependency graph for graph_search.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  pose_graph::AllEdges
 dummy predicate that always returns true for edges More...
struct  pose_graph::OptimizedDistancePredicate

Namespaces

namespace  pose_graph

Typedefs

typedef std::pair< std::vector
< unsigned >, std::vector
< unsigned > > 
pose_graph::ShortestPath

Functions

NodeSet pose_graph::componentContaining (const ConstraintGraph &g, unsigned n)
std::vector< NodeSet > pose_graph::connectedComponents (const ConstraintGraph &g)
template<class NodePredicate , class EdgePredicate >
NodeSet pose_graph::filterNearbyNodes (const ConstraintGraph &g, const unsigned n, const NodePredicate &node_pred, const EdgePredicate &edge_pred)
template<class Predicate >
NodeSet pose_graph::filterNearbyNodes (const ConstraintGraph &g, const unsigned n, const Predicate &p)
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)

Detailed Description

Graph algorithms

Author:
Bhaskara Marthi

Definition in file graph_search.h.

 All Classes Namespaces Files Functions Variables Typedefs Defines


pose_graph
Author(s): Bhaskara Marthi
autogenerated on Fri Jan 11 09:37:06 2013