#include "ros/ros.h"
#include <geometry_msgs/PoseStamped.h>
#include <actionlib/client/simple_action_client.h>
#include <message_filters/synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <message_filters/subscriber.h>
#include <pr2_controllers_msgs/Pr2GripperCommandAction.h>
#include <ee_cart_imped_msgs/EECartImpedGoal.h>
#include <geometry_msgs/Twist.h>
#include <tf/transform_listener.h>
#include <std_srvs/Empty.h>
Go to the source code of this file.
Classes | |
class | DoorOpener |
Typedefs | |
typedef actionlib::SimpleActionClient < pr2_controllers_msgs::Pr2GripperCommandAction > | gripActClient |
typedef message_filters::sync_policies::ApproximateTime < geometry_msgs::PoseStamped, geometry_msgs::PoseStamped, geometry_msgs::PoseStamped > | MySyncPolicy |
Functions | |
void | printTransform (const tf::Transform &t, const std::string &name) |
Definition at line 18 of file unlatching.h.
typedef message_filters::sync_policies::ApproximateTime<geometry_msgs::PoseStamped, geometry_msgs::PoseStamped, geometry_msgs::PoseStamped> MySyncPolicy |
Definition at line 23 of file unlatching.h.
void printTransform | ( | const tf::Transform & | t, |
const std::string & | name | ||
) |
Definition at line 390 of file unlatching.cpp.