3 from geometry_msgs.msg
import Pose, Twist
4 from sensor_msgs.msg
import Imu
5 from std_msgs.msg
import UInt16
28 self.
pub_twist = rospy.Publisher(
'/cmd_vel', Twist, queue_size=1)
30 self.
pub_mode = rospy.Publisher(
'/cmd_mode', UInt16, queue_size=1)
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
51 now = rospy.get_rostime()
59 except KeyboardInterrupt:
76 rospy.loginfo(
"RESETTING VELOCITY COMMANDS ON SHUTDOWN")
83 if rospy.is_shutdown():
88 self.pub_twist.publish(twist)
92 rospy.init_node(
'gb_controller', disable_signals=
True)
97 if __name__ ==
'__main__':
def acceleration_reset
Reset velocities to zero.
Gesture Controller class subscribes to the "/inertial" topic and publishes to "/cmd_vel" the velocity...
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.