#include <icp_2d.h>
#include <perception.h>
#include <angles/angles.h>
#include <tf/tf.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <list>
#include <queue>
#include <string>
#include <vector>
Go to the source code of this file.
Functions | |
double | getPoseDistance (const geometry_msgs::Pose a, const geometry_msgs::Pose b) |
double getPoseDistance | ( | const geometry_msgs::Pose | a, |
const geometry_msgs::Pose | b | ||
) |
Definition at line 32 of file perception.cpp.