const_thrust.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 import rospy
00004 from geometry_msgs.msg import Twist
00005 
00006 if __name__ == '__main__':
00007     rospy.init_node('crazyflie_demo_const_thrust', anonymous=True)
00008     p = rospy.Publisher('cmd_vel', Twist)
00009     twist = Twist()
00010     r = rospy.Rate(50)
00011     #for i in range(0, 100):
00012     #    p.publish(twist)
00013     #    r.sleep()
00014 
00015     twist.linear.z = 12000
00016     while not rospy.is_shutdown():
00017         p.publish(twist)
00018         r.sleep()


crazyflie_demo
Author(s): Wolfgang Hoenig
autogenerated on Sun Oct 8 2017 02:48:01