24 #ifndef KATANA_TELEOP_KEY_H__ 25 #define KATANA_TELEOP_KEY_H__ 35 #include <sensor_msgs/JointState.h> 36 #include <katana_msgs/JointMovementAction.h> 37 #include <control_msgs/GripperCommandAction.h> 43 typedef control_msgs::GripperCommandGoal
GCG;
45 #define KEYCODE_A 0x61 46 #define KEYCODE_D 0x64 47 #define KEYCODE_S 0x73 48 #define KEYCODE_W 0x77 50 #define KEYCODE_R 0x72 51 #define KEYCODE_Q 0x71 52 #define KEYCODE_I 0x69 54 #define KEYCODE_O 0x6F 55 #define KEYCODE_C 0x63 57 #define KEYCODE_PLUS 0x2B 58 #define KEYCODE_NUMBER 0x23 59 #define KEYCODE_POINT 0x2E 60 #define KEYCODE_COMMA 0x2C 62 #define KEYCODE_0 0x30 63 #define KEYCODE_1 0x31 64 #define KEYCODE_2 0x32 65 #define KEYCODE_3 0x33 66 #define KEYCODE_4 0x34 67 #define KEYCODE_5 0x35 68 #define KEYCODE_6 0x36 69 #define KEYCODE_7 0x37 70 #define KEYCODE_8 0x38 71 #define KEYCODE_9 0x39 76 struct termios cooked,
raw;
bool send_gripper_action(int32_t goal_type)
std::vector< std::string > gripper_joint_names_
void jointStateCallback(const sensor_msgs::JointState::ConstPtr &js)
sensor_msgs::JointState current_pose_
control_msgs::GripperCommandGoal GCG
sensor_msgs::JointState initial_pose_
std::vector< std::string > combined_joints_
sensor_msgs::JointState movement_goal_
actionlib::SimpleActionClient< katana_msgs::JointMovementAction > JMAC
std::vector< std::string > joint_names_
actionlib::SimpleActionClient< control_msgs::GripperCommandAction > gripper_
struct termios cooked raw
double increment_step_scaling
bool matchJointGoalRequest(double increment)