Entrance to Aeronet, Episode 4: Find and Fuck



Today, we are combining an autonomous drone control program with a ball detection program in order to burst a balloon with an autonomous drone.







In previous articles, we examined the launch of an autonomous virtual and real drone, as well as the development of an ROS node that defines and transfers the coordinates of a ball in space . Now we’ll remake the drone control program so that it automatically tries to burst the ball.







The program flying to the ball



The program flying to the ball is based on the same speed control cycle as in the manual control program .

The difference is that instead of the control keys from the keyboard, the drone velocity vector is controlled by information on the position of the ball obtained from the topic /baloon_detector/twist



.

setvel_forward



speeds and setvel_forward



vector setvel



set so that the drone flew right into the ball.

If the drone does not see the ball for more than 0.2 seconds, we believe that we burst it and put the drone in landing mode.







The full text of the program is given below: (crash_baloon.py)
 #!/usr/bin/env python # coding=UTF-8 # baloon position steering import rospy import mavros import mavros.command as mc from mavros_msgs.msg import State from geometry_msgs.msg import PoseStamped, Twist, Quaternion, TwistStamped from mavros_msgs.srv import CommandBool from mavros_msgs.srv import SetMode import tf.transformations as t import math current_state=State() current_pose = PoseStamped() current_vel = Twist() baloon_twist = TwistStamped() def state_callback(data): global current_state current_state=data def localpose_callback(data): global current_pose current_pose = data def baloon_callback(data): global baloon_twist baloon_twist = data def publish_setvel(event): global current_pose, setvel_pub, setvel, setvel_forward, baloon_twist q=current_pose.pose.orientation.x, current_pose.pose.orientation.y,current_pose.pose.orientation.z,current_pose.pose.orientation.w roll, pitch, yaw = t.euler_from_quaternion(q) setvel.linear.x = setvel_forward * math.cos(yaw) setvel.linear.y = setvel_forward * math.sin(yaw) setvel_pub.publish(setvel) def main(): global current_pose, setvel, setvel_pub, setvel_forward, baloon_twist rospy.init_node("offbrd",anonymous=True) rate=rospy.Rate(10) state=rospy.Subscriber("/mavros/state",State,state_callback) pose_sub=rospy.Subscriber("/mavros/local_position/pose",PoseStamped,localpose_callback) baloon_sub=rospy.Subscriber("/baloon_detector/twist",TwistStamped,baloon_callback) setvel_pub=rospy.Publisher("/mavros/setpoint_velocity/cmd_vel_unstamped",Twist,queue_size=1) arming_s=rospy.ServiceProxy("/mavros/cmd/arming",CommandBool) set_mode=rospy.ServiceProxy("/mavros/set_mode",SetMode) setvel=Twist() setvel_forward = 0 arming_s(True) set_mode(0,"AUTO.TAKEOFF") print 'Taking off.....\r' rospy.sleep(5) for i in range (0,10): setvel_pub.publish(setvel) rate.sleep() set_mode(0,"OFFBOARD") setvel_timer = rospy.Timer(rospy.Duration(0.05), publish_setvel) while not rospy.is_shutdown(): time_delay = rospy.Time.now().to_sec() - baloon_twist.header.stamp.to_sec() #print baloon_twist print 'time delay = ',time_delay if time_delay<0.2:#    0.2   if baloon_twist.twist.linear.x > 0.8: setvel_forward = 1.5 elif baloon_twist.twist.linear.x > 0.8: setvel_forward = 0.0 else: setvel_forward = -0.5 setvel.angular.z = baloon_twist.twist.angular.z*4 if baloon_twist.twist.angular.y<0: setvel.linear.z=0.5 elif baloon_twist.twist.angular.y>0.2: setvel.linear.z=-0.25 else: setvel.linear.z=0 else:#    setvel.angular.z=setvel_forward=setvel.linear.z=0 print setvel, setvel_forward rate.sleep() set_mode(0,"AUTO.LAND") print 'Landing.......\r' setvel_timer.shutdown() rospy.sleep(5) if __name__=="__main__": main()
      
      





Debugging Recommendations



For debugging, we recommend choosing an open space, attaching the ball to the base, making sure that there are no red objects nearby so that there are no false positives of the guidance program.

The operation of the guidance program, before the flight, should be checked using a browser, at 192.168.11.1:8080:







If everything is configured correctly, the program must confidently distinguish the ball and not cause false positives.







At the start of the guidance program, it is assumed that the drone should see the ball after takeoff. Otherwise, the drone will think that the ball has already burst, and will switch to landing mode.

In the future, you can modify the program - to fly up to the ball, for example, using the AUTO.MISSION mode. And after reaching the desired GPS point, switch to visual search mode.

The selection of coefficients for speeds in the main cycle of the program is carried out experimentally for a specific drone.







At competitions, attempts to burst the ball looked like this:









I would be grateful for comments and questions from those who try to repeat our experiment.







Source codes for the programs are uploaded to Github .








All Articles