Main Page
Namespaces
Classes
Files
File List
File Members
scripts
const_thrust.py
Go to the documentation of this file.
1
#!/usr/bin/env python
2
3
import
rospy
4
from
geometry_msgs.msg
import
Twist
5
6
if
__name__ ==
'__main__'
:
7
rospy.init_node(
'crazyflie_demo_const_thrust'
, anonymous=
True
)
8
p = rospy.Publisher(
'cmd_vel'
, Twist)
9
twist = Twist()
10
r = rospy.Rate(50)
11
#for i in range(0, 100):
12
# p.publish(twist)
13
# r.sleep()
14
15
twist.linear.z = 12000
16
while
not
rospy.is_shutdown():
17
p.publish(twist)
18
r.sleep()
crazyflie_demo
Author(s): Wolfgang Hoenig
autogenerated on Mon Sep 28 2020 03:40:12