Gesture Based Controller
This package maps linear acceleration from a wrist worn IMU to linear and angular velocity for a mobile robot
 All Classes Functions Variables Enumerations Enumerator
gb_controller.py
1 #! /usr/bin/env python
2 import rospy
3 from geometry_msgs.msg import Pose, Twist
4 from sensor_msgs.msg import Imu
5 from std_msgs.msg import UInt16
6 
7 ## Gesture Controller class subscribes to the "/inertial" topic and publishes to "/cmd_vel" the velocity commands generated using wrist linear accelerations.
8 class GestureController(object):
9 
10  ## Initializer function
11  #
12  # @param self The object pointer
13  def __init__(self):
14  ## Node frequency (Hz)
15  self.update_rate = 10
16 
17  ## Mapping coefficient for linear velocity
18  self.linear_coefficent = rospy.get_param ('linear_coefficient', 0.05)
19  ## Mapping coefficient for angular velocity
20  self.angular_coefficent = rospy.get_param ('angular_coefficient', 0.05)
21 
22  ## Stores the last acceleration received by the node
23  self.last_acc = [0,0,0]
24  ## Time instant in which the last acceleration message arrived
25  self.last_time = 0
26 
27  ## Velocity commands publisher
28  self.pub_twist = rospy.Publisher('/cmd_vel', Twist, queue_size=1)
29  ## Control modality publisher
30  self.pub_mode = rospy.Publisher('/cmd_mode', UInt16, queue_size=1)
31  rospy.Subscriber('/inertial', Imu, self.callback_continuos_control)
32 
33  ## Callback manager
34  #
35  # @param self The object pointer
36  # @param data The ROS message received
38  self.last_acc[0] = data.linear_acceleration.x
39  self.last_acc[1] = data.linear_acceleration.y
40  self.last_acc[2] = data.linear_acceleration.z
41  self.last_time = data.header.stamp.secs
42 
43  ## Controller starter
44  #
45  # @param self The object pointer
46  def run(self):
47  self.init()
48  r = rospy.Rate(self.update_rate)
49  while True:
50  try:
51  now = rospy.get_rostime()
52  if (now.secs-self.last_time) < 1:
53  self.update()
54  r.sleep()
55  else:
56  self.acceleration_reset()
57  self.update()
58  r.sleep()
59  except KeyboardInterrupt:
60  self.acceleration_reset()
61  self.reset()
62  break
63 
64  ## Reset velocities to zero
65  #
66  # @param self The object pointer
67  def acceleration_reset(self):
68 
69  self.last_acc = [0,0,0]
70 
71  ## Shutdown handler
72  #
73  # @param self The object pointer
74  def reset(self):
75  print "\n"
76  rospy.loginfo("RESETTING VELOCITY COMMANDS ON SHUTDOWN")
77  self.update()
78 
79  ## Mapping of acceleration to robot angular and linear velocities
80  #
81  # @param self The object pointer
82  def update(self):
83  if rospy.is_shutdown():
84  return
85  twist = Twist()
86  twist.linear.x = self.last_acc[0] * self.linear_coefficent
87  twist.angular.z = self.last_acc[1] * self.angular_coefficent
88  self.pub_twist.publish(twist)
89 
90 
91 def main():
92  rospy.init_node('gb_controller', disable_signals=True)
93  controller = GestureController()
94  controller.run()
95 
96 
97 if __name__ == '__main__':
98  main()
def acceleration_reset
Reset velocities to zero.
Gesture Controller class subscribes to the "/inertial" topic and publishes to "/cmd_vel" the velocity...
Definition: gb_controller.py:8
def update
Mapping of acceleration to robot angular and linear velocities.
angular_coefficent
Mapping coefficient for angular velocity.
linear_coefficent
Mapping coefficient for linear velocity.
def reset
Shutdown handler.
pub_twist
Velocity commands publisher.
def callback_continuos_control
Callback manager.
def __init__
Initializer function.
def run
Controller starter.
update_rate
Node frequency (Hz)
pub_mode
Control modality publisher.
last_acc
Stores the last acceleration received by the node.
last_time
Time instant in which the last acceleration message arrived.