#include <string>
#include <boost/bind.hpp>
#include <tf/LinearMath/Quaternion.h>
#include <tf/LinearMath/Matrix3x3.h>
#include <pr2_mechanism_msgs/SwitchController.h>
#include <geometry_msgs/Twist.h>
#include <trajectory_msgs/JointTrajectory.h>
#include <moveit_msgs/GetPositionFK.h>
#include <moveit_msgs/GetPositionIK.h>
#include <polled_camera/GetPolledImage.h>
#include "pr2_teleop_general/pr2_teleop_general_commander.h"
#include "urdf_model/pose.h"
Go to the source code of this file.
const double GRIPPER_CLOSE_MAX_EFFORT = 10000.0 |
|
static |
const double GRIPPER_CLOSE_POSITION = 0.000 |
|
static |
const double GRIPPER_OPEN_MAX_EFFORT = 10000.0 |
|
static |
const double GRIPPER_OPEN_POSITION = 0.086 |
|
static |
const std::string HEAD_MANNEQUIN_CONTROLLER = "head_traj_controller_loose" |
|
static |
const std::string HEAD_POSITION_CONTROLLER = "head_traj_controller" |
|
static |
const std::string LEFT_ARM_MANNEQUIN_CONTROLLER = "l_arm_controller_loose" |
|
static |
const std::string LEFT_HAND_LINK_TO_TRACK = "l_gripper_palm_link" |
|
static |
const double MAX_HEAD_TRACK_SPEED = 2.0 |
|
static |
const std::string RIGHT_ARM_MANNEQUIN_CONTROLLER = "r_arm_controller_loose" |
|
static |
const std::string RIGHT_HAND_LINK_TO_TRACK = "r_gripper_palm_link" |
|
static |
const unsigned int WALK_BUFFER = 10 |
|
static |