#include <ros/ros.h>
#include <pr2_controllers_msgs/Pr2GripperCommandAction.h>
#include <pr2_gripper_sensor_msgs/PR2GripperEventDetectorAction.h>
#include <actionlib/client/simple_action_client.h>
#include <pr2_controllers_msgs/JointTrajectoryAction.h>
Go to the source code of this file.
Classes | |
class | Gripper |
class | RobotArm |
Typedefs | |
typedef actionlib::SimpleActionClient < pr2_controllers_msgs::Pr2GripperCommandAction > | GripperClient |
typedef actionlib::SimpleActionClient < pr2_gripper_sensor_msgs::PR2GripperEventDetectorAction > | PlaceClient |
typedef actionlib::SimpleActionClient < pr2_controllers_msgs::JointTrajectoryAction > | TrajClient |
Functions | |
int | main (int argc, char **argv) |
typedef actionlib::SimpleActionClient<pr2_controllers_msgs::Pr2GripperCommandAction> GripperClient |
Definition at line 51 of file low_five.cpp.
typedef actionlib::SimpleActionClient<pr2_gripper_sensor_msgs::PR2GripperEventDetectorAction> PlaceClient |
Definition at line 49 of file low_five.cpp.
typedef actionlib::SimpleActionClient< pr2_controllers_msgs::JointTrajectoryAction > TrajClient |
Definition at line 47 of file low_five.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 273 of file low_five.cpp.