#include "../include/grasp_server.h"
#include <tf/tf.h>
#include <geometry_msgs/PointStamped.h>
#include "icr_msgs/ContactPoint.h"
#include "icr_msgs/Grasp.h"
#include "icr_msgs/StampedContactPose.h"
#include <geometry_msgs/PoseStamped.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. |