aboutsummaryrefslogtreecommitdiff
path: root/integrationtests
diff options
context:
space:
mode:
authorAndreas Antener <antener_a@gmx.ch>2015-03-15 15:44:01 +0100
committerAndreas Antener <antener_a@gmx.ch>2015-03-15 15:44:01 +0100
commit6f44b4d3543ff702dd9cf465212b20d7c3ae8d2e (patch)
treee835e27779135c692da356a1a151289ef6736fd8 /integrationtests
parent4b65e6259595f1f6dfb70fe8b44e229b49896f28 (diff)
downloadpx4-firmware-6f44b4d3543ff702dd9cf465212b20d7c3ae8d2e.tar.gz
px4-firmware-6f44b4d3543ff702dd9cf465212b20d7c3ae8d2e.tar.bz2
px4-firmware-6f44b4d3543ff702dd9cf465212b20d7c3ae8d2e.zip
remove gazebo plugin command fake, fix some lint warnings
Diffstat (limited to 'integrationtests')
-rwxr-xr-xintegrationtests/demo_tests/manual_input.py24
1 files changed, 8 insertions, 16 deletions
diff --git a/integrationtests/demo_tests/manual_input.py b/integrationtests/demo_tests/manual_input.py
index 7072464de..167221285 100755
--- a/integrationtests/demo_tests/manual_input.py
+++ b/integrationtests/demo_tests/manual_input.py
@@ -35,7 +35,6 @@
#
# @author Andreas Antener <andreas@uaventure.com>
#
-import sys
import rospy
from px4.msg import manual_control_setpoint
@@ -46,17 +45,12 @@ from std_msgs.msg import Header
#
# Manual input control helper
#
-# 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. Probably this whole class will disappear once
-# arming works correctly.
-#
-class ManualInput:
+class ManualInput(object):
def __init__(self):
rospy.init_node('test_node', anonymous=True)
- self.pubMcsp = rospy.Publisher('iris/manual_control_setpoint', manual_control_setpoint, queue_size=10)
- self.pubOff = rospy.Publisher('iris/offboard_control_mode', offboard_control_mode, queue_size=10)
- self.pubAtt = rospy.Publisher('iris/command/attitude', CommandAttitudeThrust, queue_size=10)
+ self.pub_mcsp = rospy.Publisher('iris/manual_control_setpoint', manual_control_setpoint, queue_size=10)
+ self.pub_off = rospy.Publisher('iris/offboard_control_mode', offboard_control_mode, queue_size=10)
def arm(self):
rate = rospy.Rate(10) # 10hz
@@ -81,9 +75,7 @@ class ManualInput:
rospy.loginfo("zeroing")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
- self.pubMcsp.publish(pos)
- # Fake input to iris commander
- self.pubAtt.publish(att)
+ self.pub_mcsp.publish(pos)
rate.sleep()
count = count + 1
@@ -93,7 +85,7 @@ class ManualInput:
rospy.loginfo("arming")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
- self.pubMcsp.publish(pos)
+ self.pub_mcsp.publish(pos)
rate.sleep()
count = count + 1
@@ -118,7 +110,7 @@ class ManualInput:
rospy.loginfo("triggering posctl")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
- self.pubMcsp.publish(pos)
+ self.pub_mcsp.publish(pos)
rate.sleep()
count = count + 1
@@ -147,7 +139,7 @@ class ManualInput:
rospy.loginfo("setting offboard mode")
time = rospy.get_rostime().now()
mode.timestamp = time.secs * 1e6 + time.nsecs / 1000
- self.pubOff.publish(mode)
+ self.pub_off.publish(mode)
rate.sleep()
count = count + 1
@@ -169,7 +161,7 @@ class ManualInput:
rospy.loginfo("triggering offboard")
time = rospy.get_rostime().now()
pos.timestamp = time.secs * 1e6 + time.nsecs / 1000
- self.pubMcsp.publish(pos)
+ self.pub_mcsp.publish(pos)
rate.sleep()
count = count + 1