7 from geometry_msgs.msg
import Twist
9 if __name__ ==
'__main__':
10 rospy.init_node(
'vel_publisher')
11 pub = rospy.Publisher(
'/raspimouse_on_gazebo/diff_drive_controller/cmd_vel', Twist, queue_size=10)
13 while not rospy.is_shutdown():
15 direction = raw_input(
'w: forward, s: backward, a: left, d: right, q: quit > ')
21 vel.angular.z = 90*3.14/180.0
23 vel.angular.z = -90*3.14/180.0
28 except rospy.ROSInterruptException: