armadillo_teleop.h
Go to the documentation of this file.
1 //
2 // Created by armadillo2 on 27/12/17.
3 //
4 
5 #ifndef ARMADILLO2_TELEOP_ARMADILLO_JOY_H
6 #define ARMADILLO2_TELEOP_ARMADILLO_JOY_H
7 
8 #include <ros/forwards.h>
9 #include <ros/ros.h>
10 #include <geometry_msgs/Twist.h>
11 #include <std_msgs/Float64.h>
12 
13 struct twist_joy
14 {
15  float axis_linear = 0;
16  float axis_angular = 0;
17 
18  float scale_angular = 1;
19  float scale_linear = 1;
20 
21  int joy_axis_linear = 3;
23 };
24 
25 struct torso_joy
26 {
27  float axis_updown = 0;
28  float inc_updown = 0.01; //meters
29 
30  int joy_axis_updown = 7;
31 };
32 
33 struct arm_joy
34 {
35  float axis_rotation1 = 0;
36  float axis_rotation2 = 0;
37  float axis_shoulder1 = 0;
38  float axis_shoulder2 = 0;
39  float axis_shoulder3 = 0;
40  float axis_wrist = 0;
41 
42  float inc_rotation1 = 0;
43  float inc_rotation2 = 0;
44  float inc_shoulder1 = 0;
45  float inc_shoulder2 = 0;
46  float inc_shoulder3 = 0;
47  float inc_wrist = 0;
48 };
49 
51 {
52  float axis_right_finger = 0;
53  float axis_left_finger = 0;
54 
55  float inc_right_finger = 0;
56  float inc_left_finger = 0;
57 };
58 
60 {
61  float axis_pan = 0;
62  float axis_tilt = 0;
63 
64  float inc_pan = 0;
65  float inc_tilt = 0;
66 };
67 
69 {
70 private:
74 
75 
76 public:
82 
84  void drive();
85  void moveTorso();
86  void moveArm();
87  void moveHead();
88 };
89 
90 #endif //ARMADILLO2_TELEOP_ARMADILLO_JOY_H
float scale_linear
int joy_axis_angular
gripper_joy gripper
float axis_linear
ros::NodeHandle * nh_
ros::Publisher twist_pub_
ros::Publisher torso_pub_
pan_tilt_joy pan_tilt
float axis_angular
float scale_angular


armadillo2_teleop
Author(s):
autogenerated on Wed Jan 3 2018 03:47:53