#include <graph_mapping_msgs/ConstraintGraphDiff.h>#include <graph_mapping_msgs/GetPoses.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 "ros/service_traits.h"#include "geometry_msgs/Pose.h"#include "general.h"#include <graph_mapping_msgs/LocalizationDistribution.h>#include <tf/transform_datatypes.h>#include <geometry_msgs/Point32.h>#include <geometry_msgs/Pose2D.h>#include <sensor_msgs/PointCloud.h>#include <sensor_msgs/LaserScan.h>#include <laser_slam/LocalizedScan.h>#include <pose_graph/diff_subscriber.h>#include <pose_graph/graph_db.h>#include <tf/transform_listener.h>#include <ros/ros.h>#include <boost/optional.hpp>

Go to the source code of this file.
Classes | |
| struct | laser_slam::BarycenterDistancePredicate |
Namespaces | |
| namespace | laser_slam |
Typedefs | |
| typedef boost::optional< const msg::ConstraintGraphDiff & > | laser_slam::OptionalDiff |
| typedef boost::shared_ptr < tf::TransformListener > | laser_slam::TfPtr |
Functions | |
| pg::NodeSet | laser_slam::largestComp (const pg::ConstraintGraph &g) |
| void | laser_slam::optimizeGraph (pg::ConstraintGraph *g, pg::NodePoseMap *poses, const pg::NodeSet &nodes, ros::ServiceClient &srv) |
Utilities for laser slam code
Definition in file util.h.