aboutsummaryrefslogtreecommitdiff
path: root/integrationtests/demo_tests/manual_input.py
diff options
context:
space:
mode:
authorAndreas Antener <antener_a@gmx.ch>2015-03-01 23:56:05 +0100
committerAndreas Antener <antener_a@gmx.ch>2015-03-02 00:18:34 +0100
commit9252124cfc84ad31f4a88d937343c7e5682e3339 (patch)
treea9c40866f9777ed218d6678e8393a5864a529304 /integrationtests/demo_tests/manual_input.py
parentedfbde1505456e89d79c11be5c8780a1219cce30 (diff)
downloadpx4-firmware-9252124cfc84ad31f4a88d937343c7e5682e3339.tar.gz
px4-firmware-9252124cfc84ad31f4a88d937343c7e5682e3339.tar.bz2
px4-firmware-9252124cfc84ad31f4a88d937343c7e5682e3339.zip
- updated test names, fixed lying comments and updated notes, misc. cleanup
- added mavros attitude control test - using manual arming for mavros tests so they succeed for the moment, arming should be implemented soon
Diffstat (limited to 'integrationtests/demo_tests/manual_input.py')
-rwxr-xr-xintegrationtests/demo_tests/manual_input.py14
1 files changed, 7 insertions, 7 deletions
diff --git a/integrationtests/demo_tests/manual_input.py b/integrationtests/demo_tests/manual_input.py
index 55911bede..cf139bb1d 100755
--- a/integrationtests/demo_tests/manual_input.py
+++ b/integrationtests/demo_tests/manual_input.py
@@ -45,7 +45,7 @@ from std_msgs.msg import Header
#
# Manual input control helper
#
-# Note: this is not the way to do it. ATM it fakes input to iris/command/attitude because else
+# FIXME: this is not the way to do it! ATM it fakes input to iris/command/attitude because else
# the simulator does not instantiate our controller.
#
class ManualInput:
@@ -74,7 +74,7 @@ class ManualInput:
pos.offboard_switch = 3
count = 0
- while not rospy.is_shutdown() and count < 10:
+ while not rospy.is_shutdown() and count < 5:
rospy.loginfo("zeroing")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
@@ -86,7 +86,7 @@ class ManualInput:
pos.r = 1
count = 0
- while not rospy.is_shutdown() and count < 10:
+ while not rospy.is_shutdown() and count < 5:
rospy.loginfo("arming")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
@@ -111,7 +111,7 @@ class ManualInput:
pos.offboard_switch = 3
count = 0
- while not rospy.is_shutdown() and count < 10:
+ while not rospy.is_shutdown() and count < 5:
rospy.loginfo("triggering posctl")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
@@ -122,7 +122,7 @@ class ManualInput:
def offboard(self):
rate = rospy.Rate(10) # 10hz
- # triggers posctl
+ # triggers offboard
pos = manual_control_setpoint()
pos.x = 0
pos.z = 0
@@ -136,8 +136,8 @@ class ManualInput:
pos.offboard_switch = 1
count = 0
- while not rospy.is_shutdown() and count < 10:
- rospy.loginfo("triggering posctl")
+ while not rospy.is_shutdown() and count < 5:
+ rospy.loginfo("triggering offboard")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
self.pubMcsp.publish(pos)