#include "../include/icr_server.h"
#include <sensor_msgs/PointCloud2.h>
#include <algorithm>
#include <Eigen/Core>
#include "rosbag/bag.h"
Go to the source code of this file.
Namespaces | |
namespace | ICR |
Subscribes to gazebo_msgs/ContactsState outputted by the sensor_bumpers and computes the average contact position. |