#include <pose_graph/pose_graph.h>
#include <graph_slam/GraphLocalization.h>
#include <geometry_msgs/PoseStamped.h>
#include <boost/shared_ptr.hpp>
#include <vector>
#include <map>
Go to the source code of this file.
Classes | |
class | graph_slam::ConstraintGenerator |
struct | graph_slam::NodeConstraint |
Namespaces | |
namespace | graph_slam |
namespace | ros |
Typedefs | |
typedef boost::shared_ptr < ConstraintGenerator > | graph_slam::ConstraintGenPtr |
typedef std::vector < NodeConstraint, Eigen3::aligned_allocator < NodeConstraint > > | graph_slam::NodeConstraintVector |
typedef std::map< pg::NodeId, geometry_msgs::Pose > | graph_slam::NodePoseMap |
Functions | |
ConstraintGenPtr | graph_slam::createConstraintGenerator (const ros::NodeHandle &nh) |
Define a base class for constraint generators
Definition in file constraint_generator.h.