Next Article in Journal
Rapid and Sensitive Quantification of the Pesticide Lindane by Polymer Modified Electrochemical Sensor
Next Article in Special Issue
A UAV-Based Eddy Covariance System for Measurement of Mass and Energy Exchange of the Ecosystem: Preliminary Results
Previous Article in Journal
Rapid SARS-CoV-2 Detection Using Electrochemical Immunosensor
Previous Article in Special Issue
Application of a Small Unmanned Aerial System to Measure Ammonia Emissions from a Pilot Amine-CO2 Capture System
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Development of Non Expensive Technologies for Precise Maneuvering of Completely Autonomous Unmanned Aerial Vehicles †

1
Dipartimento di Ingegneria dell’Informazione (DINFO), Università di Firenze, via di Santa Marta 3, 50139 Firenze, Italy
2
Dipartimento di Fisica e Astronomia & LENS, Università di Firenze, via G. Sansone 1, 50019 Sesto Fiorentino, Italy
*
Author to whom correspondence should be addressed.
This paper is an extended version of our paper published in Basso, M.; Bigazzi, L.; Innocenti, G. DART Project: A High Precision UAV Prototype Exploiting On-board Visual Sensing. In Proceedings of the Fifteenth International Conference on Autonomic and Autonomous Systems (ICAS), Athens, Greece, 2–6 June 2019.
Submission received: 31 October 2020 / Revised: 30 December 2020 / Accepted: 31 December 2020 / Published: 8 January 2021
(This article belongs to the Special Issue Sensors for Unmanned Aircraft Systems and Related Technologies)

Abstract

:
In this paper, solutions for precise maneuvering of an autonomous small (e.g., 350-class) Unmanned Aerial Vehicles (UAVs) are designed and implemented from smart modifications of non expensive mass market technologies. The considered class of vehicles suffers from light load, and, therefore, only a limited amount of sensors and computing devices can be installed on-board. Then, to make the prototype capable of moving autonomously along a fixed trajectory, a “cyber-pilot”, able on demand to replace the human operator, has been implemented on an embedded control board. This cyber-pilot overrides the commands thanks to a custom hardware signal mixer. The drone is able to localize itself in the environment without ground assistance by using a camera possibly mounted on a 3 Degrees Of Freedom (DOF) gimbal suspension. A computer vision system elaborates the video stream pointing out land markers with known absolute position and orientation. This information is fused with accelerations from a 6-DOF Inertial Measurement Unit (IMU) to generate a “virtual sensor” which provides refined estimates of the pose, the absolute position, the speed and the angular velocities of the drone. Due to the importance of this sensor, several fusion strategies have been investigated. The resulting data are, finally, fed to a control algorithm featuring a number of uncoupled digital PID controllers which work to bring to zero the displacement from the desired trajectory.

1. Introduction

In the last decade, research in multi-rotor Unmanned Aerial Vehicles (UAVs) drawn increasing interest and funding from both academic and industrial communities, thanks to their versatility, low-cost realization, and promising unexplored applications [1,2]. Indeed, UAV research led to technological advances in mechatronic servo-systems, microelectronics, and sensors, which, combined with novel economically affordable and high-performing micro-controllers and embedded boards, rapidly increased their general performance [3,4,5].
Notable examples of successful application of UAV technologies can be found in precision agriculture [6,7,8], where drones equipped with Real-Time Kinematic Global Navigation Satellite Systems (GNSSs-RTK) [9] are used to minimize human intervention. Other important applications, instead, are related to monitoring and patrolling. For example, drones are well suited to explore or inspect large environments and buildings [10,11,12,13] aiming, for instance, to 3D reconstruction. Moreover, drones with high maneuverability in small spaces fits both urban missions [14,15,16,17,18], such as monitoring road traffic, and rescue missions [19,20,21,22,23,24,25], such as patrolling dangerous zone after natural disasters. In many of these applications Vision-Based Navigation (VBN) algorithms are often used to improve accuracy in the positioning [26,27,28,29,30,31,32,33,34]. Film makers and video studios are successfully using UAVs for aerial shooting [35,36]. These drones are usually big, because they need to load heavy cameras and their gimbals. The size, the weight, and the large number of engines make them very stable, and so, under the driving of skillful pilots, they are able to accomplish high precision maneuvers of the order of tens of centimeters. On-board systems are only used for improving stability and assisted maneuvering, while the navigation performance is completely left to the pilot’s ability and sensitivity.
In the field of autonomous UAVs, the actual precision for outdoor applications is limited by the mostly used sensing technology, that is, by standard GNSS devices, which today are able to locate the drone within a one meter radius at the very best [37,38]. The development of novel applications is severely limited by this performance level, and, therefore, the demand for better technologies is growing by the day. When higher performance is required, then, a finer positioning system turns out to be necessary, as it already happens for acrobatic drones [39,40,41]. To the authors’ knowledge, in this case the most effective approach consists in exploiting a ground-assisted positioning system. For example, in indoor applications, the typical solution involves a large number of fixed cameras, which are able to detect special markers on the drone. A ground station processes the data from the cameras by a computer vision algorithm that generates a high-precision position estimate at high-frequency. Possibly, the cameras can be replaced by other ground localization systems without changing the overall paradigm [42,43,44,45,46,47,48,49,50]. The ground station either can send the computed information to the drone, or, more usually, can pilot directly the UAV exploiting this data. Whichever the case, this solution prevents a completely autonomous drone.
The degree of autonomy of a UAV is a non-secondary factor when developing new applications, because any necessary environmental set up represents a cost and a delay. Recent projects, indeed, are investigating solutions, which may lessen the limits of the actual technologies recurring to an extensive use of sensor fusion techniques [51,52,53]. Nevertheless, precision and complete autonomy are yet difficult features to get together.
In this work, following up on the conference paper in Reference [54], we present relevant advancements on our project “Dart”, an UAV—pictured in Figure 1—able to switch to a completely autonomous mode, sustained only by on-board systems, that is, without any ground assistance. The project scope is to obtain positioning and path following with centimetric precision by using only mass market technologies, in order to ascertain the gap between a completely autonomous ultra-high precision drones and actual commercial products with affordable prices. To this aim, Dart core has been designed to feature a high precision on-board vision-based positioning system made by assembling only mass market products, namely a small camera carried by a gimbal, an embedded electronic board, and an open-source computer vision library. The scenery captured by the camera is processed by a custom software, based on the computer vision library, which is designed to measure the drone position with respect to known markers. This information is then fused with data coming from a IMU to estimate the state of the drone. This system, therefore, acts as a virtual sensor that provides the automatic pilot with the information needed by the controllers designed to make the UAV follow the reference trajectory.
The paper is structured as follows. In Section 1.1 an overview of the Dart drone architecture is presented. In Section 2 each component of the hardware is illustrated, while Section 3 is devoted to describe the functionalities performed by the software modules, and the algorithms at their core. Section 4 describes the internal communications and the information flow, and also explains the schedule of each function. Finally, in Section 5 the results from the experimental tests are presented and discussed. Some final remarks and outlooks conclude the paper.

1.1. Overview of the Project & Article Novelties

Dart project is aimed to investigate if suitable modifications of standard technologies can be used to implement a completely autonomous high-precision drone, that is, a drone able to follow a reference trajectory with centimetric precision exploiting only on-board systems without any assistance from the ground, neither for sensing nor for computing. So far, this objective could be realized only on professional class drones with additional equipment as payload specifically conceived for the application in hand using proprietary software development kits. More recently, professional drones have improved their on-board resources, thus reducing the need of additional devices. Nevertheless, this approach comes with completely proprietary tools and more constraints on the development of new solutions. On a different perspective, it is also of great interest to measure how this kind of drones is far from mass market. Indeed, low-cost technologies are considered a key factor to boost the market of many innovative drone applications [55,56]. Considered this situation, we aim to develop an autonomous navigation device that can be introduced in any drone with sufficient payload. The adaptability of this solution will be guaranteed by a receiver by-pass, while on the cost side we will use only non expensive components to make its implementation sufficiently cheap. To test this novel technology, we will develop a custom drone, which is only meant to provide us with a flexible test bench.
The general architecture of the drone here presented consists in a 350-class UAV, where sufficient space and payload for some additional on-board devices can be obtained. Besides the basic electronics for engines and batteries, the drone features a 2.4 GHz remote receiver and a flight controller that has the sole task of stabilizing the attitude. Autonomy, meant as the capability to move along a desired trajectory without a driving pilot, comes from a digital signal mixer that allows the on-board navigation system to override the human commands and to replace the pilot, as long as this latter decides to get the control back. This way, the navigation system just substitutes the human pilot, and thus, they share the same interface with the drone. Due to its peculiar nature the automatic pilot is here referred to as “cyber-pilot”.
The concept behind Dart project is to separate the simpler tasks all concerning attitude stabilization from the so-called “smart” tasks related to complex navigation routines, such as the tracking of a complex trajectory in the 3D space. In our prototype, attitude stabilization is performed by a commercial board that constitutes the “low-level hardware”; instead, we consider the “high-level hardware” all the additional customized electronics that are necessary for autonomous navigation. This choice provides a two-fold advantage: (i) it requires the least number of modifications and the smallest customization; (ii) it allows us to focus only on the development of intelligent “high-level” algorithms for computer vision and tracking. Here, it is worth noting that in our drone, high- and low-level tasks are performed by two different hardware, since attitude stabilization—unlike high-level tasks—needs a control high-band to be successfully carried out. The first hardware is able to execute complex calculations at a lower rate (generally, a few hundred Hz) with respect to a standard micro-controller, while the second is optimized just to perform simple calculations but at a very high-frequency (in the order of kHz). Indeed, the attitude variation is much faster than the dynamics of its position. As it will be detailed in the following sections, experiments show the effectiveness of this solution. Finally, it is worth remarking that this functional stack, divided into low-level and high-level tasks, can be implemented by a modular hardware architecture, thus making the presented solutions very versatile and easy to implement in any other drone that can handle the payload required for the additional hardware.
In our drone prototype, the on-board navigation system has been developed on a popular programmable control board, which generates the maneuvering commands by computing only the information coming from an IMU and a camera mounted on a 3-DOF gimbal. The video stream of the camera is elaborated with a computer vision tool with the aim to infer the actual position of the drone with respect to the visible landmarks. Hence, the camera plays the role of a virtual position sensor. Data from this latter are then fused with those from the IMU to enhance the estimation of the drone state, that is, its position, speed and attitude. Eventually, the state estimate is compared with the reference path, and the displacement error used by the navigation system is thus generated to pilot the drone.
Dart drone has been designed, developed, and implemented employing very popular hardware components and electronic boards readily available on the market. This approach, however, does not mean the methods here presented to achieve autonomy are limited to this custom configuration or can not be applied to other off-the-shelf drone solutions. Rather, this choice has been functional for the preliminary investigation phase, when drone technologies and their interactions have been thoroughly analysed to point out where the additional devices for autonomy would provide the best trade off between effectiveness and cost. Moreover, commercial drones, even when conceived as developing platforms [57], cast serious restrictions to the designer’s creativity. In our case, for instance, the cyber-pilot idea is feasible in most drones, but it requires to implement a hardware by-pass on the receiver, which is not the most natural and obvious approach even in developer’s drones. Moreover, having complete access to the Dart hardware has been crucial during the first experiments, when the aim was in detecting any undesired effect between the additional devices of the cyber-pilot and the rest of the components.
The graphical scheme of the above architecture is illustrated in Figure 2. Moving backward from the process output up to the inputs, the signal chain can be summarized as follows.
  • Engines
  • Flight Controller
  • Signal Mixer
    Receiver
    *
    Human pilot
    Navigation System (Cyber-pilot)
    *
    Sensors
    ·
    IMU
    ·
    Stabilized Camera
In the next section, the hardware configuration of the drone will be detailed, and the core devices for developing the cyber-pilot technology (i.e., signal mixer and navigation system) will be (roughly) priced for the sake of a cost quantification.

2. Hardware Architecture

In this section the hardware configuration of our drone prototype Dart is introduced. In particular, the sensors units, with a special focus on the adopted computer vision system and the gimbal suspension, are discussed highlighting the main features that turn out critical for the precise positioning of the drone.

2.1. Mechanical Structure

The Dart body frame is mostly composed by laminated standard carbon fiber parts which improve the rigidity of the frame and reduce its weight. The body frame hosts other custom parts which have been 3D printed at low density, leaving empty spaces inside the material to make it lighter. These parts serve assembly of the additional hardware necessary for autonomous navigation and computer vision tasks.

2.2. Hardware Configuration

The architecture of the hardware is shown in Figure 2, where one can observe the interconnections between all components. A Raspberry PI 3 B+ board (Raspberry Pi Foundation, Cambridge, UK, ~$35) is connected with a Raspicam camera (price range $20–$40 depending on lens type) and a 6-DOF IMU, sensor units from which vision and inertial data are obtained. The navigation software running on the Raspberry board generates set-points for attitude and motors thrust, which are sent to the low-level flight controller realized on a CC3D Revo board (Open hardware). Currently, the low-level board has the sole task of stabilizing the attitude by following the set-points provided by the cyber-pilot (i.e., the high-level board) or by the human one. Between the Raspberry PI and the low-level, we employ a custom signal mixer board (Arduino Nano based on ATMEL AT328p micro-controller, Atmel Corporation, San Jose, CA, USA, ~$5) that we refer to as mid-level board, an important hardware novelty introduced in this paper.
The mixer board takes in input the attitude set-points coming from the Raspberry (by using bidirectional UART protocol to convey the data stream) and the manual set-points coming from the 2.4 GHz receiver through the Pulse Position Modulation (PPM) protocol. As output the mixer generates a second PPM signal that is obtained by properly elaborating the inputs. The resulting device is able to switch safely between autonomous and manual flight modes. The autonomous flight mode is still a hybrid mode where the cyber-pilot commands are overlapped to the manual controls. The concurrence between manual and autonomous controls also allows for the rectification of possible anomalous behaviors of the drone along the chosen trajectory, thus improving the safety. In Figure 3 we show the blocks diagram of the algorithm representing the operating logic of the mixer board.
In details, the algorithm takes as input signals the manual PPM and the autonomous contribute transmitted via UART protocol. The PPM signal is decoded in a vector of time intervals, which are expressed as integer numbers where each unit increment equals to 1 μs. Each time interval identifies a specific set-point that has been converted into the low-level flight controller format. Instead the autonomous contribute is already coded as time intervals by the Raspberry PI, in order to decrease the computational effort of the mixer and, thus, to improve the rate of the output signals. Then, we sum together the time intervals coming respectively from the manual PPM signal and the autonomous contribute, by also taking into account their sign. The resulting time intervals are finally re-encoded in a PPM signal, which is then sent to the low-level flight control board. In other terms, one can see the mixer board as an interface between the high-level navigation system (managed by the Raspberry board) and the attitude stabilization algorithm, which is implemented on the low-level controller. The main advantage of this architecture is to generate command signals directly in the standard protocol for drone flight controllers. This allows the use of any flight controller available on the market, without making any changes to the low-level firmware, thus deleting the possibility to generate catastrophic and uncontrolled errors in the code.

2.3. Sensors Units

The sensors units employed in this project are composed by: (i) the 6-DOF IMU connected to the Raspberry PI through the I2C serial bus, and (ii) a Raspicam camera for the purpose of computer vision. More specifically, the IMU is a Pololu AltIMU-10 v5 (Pololu Corporation, Las Vegas, NV, ~$20) that implements several standard sensors commonly used to estimate the pose of smart devices: gyroscope, accelerometer, compass, and altimeter. It is worth saying that the algorithms for position estimation, which we are going to present hereafter, only use the camera, the gyroscope and the accelerometer, but not the other sensors. Instead, regarding the Raspicam camera, it is connected to the Raspberry PI through a Mobile Industry Processor Interface (MIPI) cable.

2.4. Gimbal Suspension

In the following, among the novelties with respect to Reference [54], we will introduce four different algorithms to estimate the drone position. Two of them use a mechanical system to stabilize the Raspicam camera and to decouple its frame from the drone body. In particular, two different, inexpensive (price range < $120), and general purpose suspensions from the popular brand Tarot have been tested: a 2-DOF and a 3-DOF gimbal, both ensuring 0.02 degrees of precision. The former guarantees the stabilization of the pitch and roll angles, while the latter stabilizes all the three attitude angles. Each gimbal suspension is composed by: (i) two or three brushless motors to correct the attitude angles, (ii) a dedicated IMU to estimate the camera attitude, and (iii) a micro-controller to control the gimbal. These systems can behave according to different operative modes, but, roughly speaking, they act to “freeze” the camera attitude when it is close to a standing still state.

3. Software Modules

3.1. Low-Level Module: Internal Control of the System Attitude

The low-level module is made up of an open source hardware/software platform, that is, a CC3D-Revo board loaded with the LibrePilot firmware (open source software). This module has the sole task of stabilizing the attitude of the drone with respect to the set-points received from the signal mixer through the PPM protocol. Since neither the altitude nor of the position is controlled by the low-level module, another controller is required to carry out these tasks, as it will be shown in the next subsection. As a further remark, it is worth noting that the low-level flight controller allows for the hovering of the drone even in case of faults from the high-level navigation system.

3.2. High-Level Module: Autonomous Navigation System

The main elements of the navigation system, that is, the computer vision system, the multi-PID controller, and a Madgwick sensor fusion filter are here discussed.
Before continuing, we stress the fact that we use two different representations for the drone attitude—in Section 3.2.3, for the purpose of implementing the Madgwick sensor fusion filter, it is more convenient at the software level to describe the attitude via the quaternion formalism, while the representation with rotation matrices is adopted in Section 3.2.4 to simply get the estimate of the drone position. Since our drone is realized by means of non expensive mass market technologies, we have to prefer solutions that allow to reduce as much as possible the complexity of the software implementation.

3.2.1. Computer Vision System

A computer vision algorithm is used to provide the drone with absolute references for position and attitude. This way, the drone can be accurately driven in the 3D space in a desired manner by referring the time-variation of its pose (position and orientation) to these fixed references captured from the environment.
In the presented UAV prototype, the computer vision system is the main element of the drone navigation system. The vision algorithm, that manages the acquisition of the images and that takes care of stitching together the acquired frames, is set to detect one or more known markers in the environment. The algorithm estimates the relative pose of the drone with respect to the markers, and, by knowing their absolute pose, is able to infer the absolute pose of the drone, as well. The camera has been tested both as a built-in device inside the body frame and mounted on a stabilized gimbal (see Section 3.2.4), as shown in Figure 4. It is worth noting that the lens frame and the one referring to the center of the thrust do not usually have the same orientation.
The marker used in this implementation of the drone are boards featuring black and white squares. Their recognition is achieved, according to a standard practice [58], by evaluating for each pixel of the image the local magnitude of the pixels gradient, given by point-to-point differences in the pixel colour scale. Then, the gradient direction is evaluated, and pixels with similar gradient directions and magnitudes are grouped into sets by using graph-based methods. A line segment is eventually fit to each clustered pixel set. Such sets of pixels identify in the image edges from which the algorithm searches for the correct marker sequence, whose position is defined in pixel coordinates by the two-dimensional vector [ u , v ] T , as shown in Figure 5.
The position of the marker is located in the 3D space by referring [ u , v ] T with respect to the lens frame. In such a frame, the coordinates
Q m [ x m , y m , z m ] T
of the marker (denoted by means of the subscript m in the formulas) are computed through the following relations (in this regard, see also Reference [54]) that also take into account the barrel distortion:
x m z m = ( u u 0 ) ( 1 + k u d r 2 ) ρ x
y m z m = ( v v 0 ) ( 1 + k u d r 2 ) ρ y ,
where
r 2 = ( u u 0 ) 2 ρ x 2 + ( v v 0 ) 2 ρ y 2 ,
and [ u 0 , v 0 ] T denotes the coordinates in pixel of the principal (reference) point in respect of which the image is calibrated. Instead, the parameters ρ x e ρ y are the ratio between the focal length and the size of the pixel, while k u d is the parameter that corrects lens distortions. Note that k u d , ρ x and ρ y are intrinsic camera parameters, which are commonly obtained through an iterative calibration process involving the acquisition of frames of a known image in different poses. In this project, the calibration process has been performed off-line and is based on acquiring at regular time intervals at least 5 images of a chessboard with known dimension in different poses.
As further remark, observe that, if the geometrical properties (shape and dimension) of the marker are known, it is possible to retrieve additional information also with a monocular camera, such as the distance z m between the camera lens and the marker or the relative orientation among the marker and lens frames.
Therefore, the computer vision module is definitely able to provide information both on the position vector and on the attitude vector of the marker with respect to the drone. Hence, if the marker has a known position and attitude, also the position and orientation of the drone can be straightforwardly obtained. From here on, we will define with
Φ [ φ , θ , ψ ] T
the attitude vector of the marker with respect to the camera lens. Note that we have removed the subscript m from each element of Φ for the sake of simplicity of notation.

3.2.2. PID-Based Control System

The autonomous driving module, that is, the core of the cyber-pilot running on the Rasperry board, computes the commands in the same form of those coming from the remote control receiver, that is, as proper reference values for roll, pitch, yaw and thrust. During the preliminary implementation stage of the project, they were conceived to maintain the drone over time in a desired position, denoted as Q ¯ [ x ¯ , y ¯ , z ¯ ] T , with zero yaw relative angle ψ ¯ = 0 , intending that the drone was facing the marker. More generally, the computer vision system provides both relative orientation and position with respect to the marker frame. This information is further integrated by means of a fusion algorithm with data coming from the on-board IMU to improve the estimate from the sole image processing, as shown in next paragraph. With the current software and hardware the computer vision system works at about 30–40 Hz, while the IMU provides data at higher frequency. The different sampling rates are managed thanks to the development of a multitasking software architecture, as explained below. The final result of the sensor fusion process is a refined estimate of the drone position Q [ x , y , z ] T . Four different algorithms have been tested to compute Q with different performance.
As illustrated in Figure 6, the information on the errors of the drone pose, respectively given by the differences Q ¯ Q and ψ ¯ ψ , are used to feed four distinct (decoupled) PID controllers ( C x , C y , C z and C ψ ), which respectively generate the driving commands that the low-level module uses as references inputs to control roll and pitch angles, yaw angular velocity, and thrust. One can observe that the control architecture of the autonomous driver is composed by simple modules that individually act on a different pose degree of freedom. This decoupled control architecture does not directly consider the mutual interconnections among the components of the drone pose, as the fact, for example, that a change in the pitch modifies the net thrust. However, this solution for the control system has to be preferred for its reliable implementation, robustness and low computational cost. Moreover, also note that, in a first phase, each PID controller has been tuned after numerical simulations based on a simplified model of the actual drone. Then, experiments have been carried out thanks to a large number of repeated flights (about 50).

3.2.3. Madgwick Sensor Fusion Filter

The navigation system implemented in the Dart drone works without explicitly modeling the dynamics of the UAV. This choice is mainly dictated by the following two reasons. First, the computational cost has not to exceed a certain threshold in order to not overload the Raspberry processor. Second, the aim is to ensure that the response of the drone to control pulses is as fast as possible, as well as the convergence of the control error.
In the chosen architecture, all the information about the pose of the drone needs to be extrapolated solely from the on-board sensors data stream. To perform the already anticipated data fusion, the Madgwick filter [59] has been chosen, since it represents the state-of-art to efficiently fuse the data coming from the accelerometer and the gyroscope within the IMU, respectively for the tracking of the translational and rotational DOFs. On one hand, the gyroscope evaluates the angular velocities of the portion of the UAV on which the IMU is mounted. The measured angular velocities are referred to the frame chosen as reference for the IMU. In principle, the corresponding orientation of the drone could be computed by integrating over time the angular velocities; however, this solution is usually highly discouraged due to the error originating from such a calculation. On the other hand, the accelerometer measures the gravitational field of the earth, taken as absolute reference. Also the information from the accelerometer is affected by noises, and this especially holds true when the sensor is moving.
The Madgwick sensor fusion filter estimates the orientation of the drone by optimally fusing the data stream from the accelerometer and the gyroscope. The orientation processed and returned by the filter is described by the quaternion representation, as for example, adopted in References [60,61]. The quaternion is a vector with four elements and generally describes the orientation of a coordinate frame with respect to another. For example, the relative orientation between the coordinate frame A and B by the angle α around the generic axis r [ r x , r y , r z ] T can be represented by quaternion
q B A [ cos ( θ / 2 ) , r x sin ( θ / 2 ) , r y sin ( θ / 2 ) , r z sin ( θ / 2 ) ] T = [ q 1 , q 2 , q 3 , q 4 ] T ,
that by definition is of unitary length. To each quaternion is uniquely associated the rotation matrix R B A that rotates the coordinate frame A towards B according to a sequence of at least 3 rotations of the so-called Euler angles around the x , y , z axes.
In the quaternion formalism, the angular velocities measured by the gyroscope are arranged in the quaternion
ω IMU [ 0 , ω x , ω y , ω z ] T .
Thus, if we solely use the data coming from the gyroscope, the orientation of the drone, expressed in the IMU coordinate frame that in turn is referred to the North-East-Down (NED) coordinates, at the k-th discrete time instant is equal to
q g NED IMU [ k T ] = q ^ [ ( k 1 ) T ] + q ˙ NED IMU [ k T ] T ,
where T is the sampling period, q ^ [ ( k 1 ) T ] denotes the estimate of the orientation at the previous time instant, and q ˙ is the quaternion derivative. For the specific case of the gyroscope, the quaternion derivative is just given by the quaternion product (for more details on the quaternions algebra the reader can refer for example, to References [59,60,61]) between the estimate q ^ [ ( k 1 ) T ] and the quaternion of angular velocities ω IMU [ k T ] at discrete time k T .
On the other hand, the tri-axis accelerometer evaluates the magnitude and direction of the field of gravity with respect to the sensor coordinate frame. This means that, the gravity earth field being known, the vector of measured accelerations,
a IMU [ 0 , a x , a y , a z ] T ,
can be automatically referred to earth coordinate frame, here given in the NED coordinates. As conventionally taken, we assume that the direction of the gravity field is along the vertical z axis and is thus defined by the quaternion
g NED [ 0 , 0 , 0 , 1 ] T .
Then, the orientation of the accelerometer is obtained by numerically solving the following optimization problem: Minimize a cost function f ( a IMU , g NED , q a NED IMU ) that identifies the distance between the vector of measured accelerations a IMU and the direction of the gravity field g NED rotated by the quaternion q a NED IMU , the unknown parameter to be determined. The explicit analytical expression of the cost function f can be found in Reference [59]. Here, it is worth observing that the possibility to resort to the solution of a minimum problem comes from the evidence that the direction of the gravity field is uniquely defined in the NED coordinate frame. Thus, once measured the accelerations a IMU , one can determine the unknown quaternion q a NED IMU . As proposed in Reference [59], to carry out the minimization
min q NED IMU f ( a IMU , g NED , q a NED IMU )
in our drone we have implemented an iterative mechanism based on the gradient descent algorithm. Hence, the orientation from the accelerometer at the k-th discrete time instant turns out given by
q a NED IMU [ k T ] = q ^ [ ( k 1 ) T ] μ [ k T ] f f [ k T ] ,
where f denotes the gradient of the geometrical surface defined by the cost function f, and μ is the step-size (in general, a time-dependent parameter) associated to the minimization procedure. The latter parameter determines the rate of convergence of the optimization. In this experimental work, the value of μ has been chosen constant and large in magnitude, so as to ensure that the convergence rate is equal or greater than the physical rate steering the change of the sensor orientation.
Then, the resulting estimate of the orientation provided by the Madgwick filter is obtained by fusing the orientations q NED IMU (for each discrete time instant k T ) as given by Equations (8) and (12), respectively from the gyroscope and the accelerometer. The fusion is practically attained according to the following relation:
q ^ [ k T ] = γ q a NED IMU [ k T ] + ( 1 γ ) q g NED IMU [ k T ] ,
with γ [ 0 , 1 ] . Also the value of γ , depending on the value of μ , has been empirically chosen, so that Equation (13), which realizes the fusion of the gyroscope and accelerometer data streams, is properly balanced, that is, q a NED IMU and q g NED IMU have on average the same convergence rate. On the experimental side, this assumption leads to a quite small value of γ that privileges the stream data coming from the gyroscope with respect to the ones from the accelerometer.
In Figure 7 the plots of pitch, roll and yaw attitude angles, provided by the Madgwick filter implemented in Dart prototype, are reported as functions of time. In particular, the blue solid lines refer to the orientation estimates provided by the Madgwick filter where the data from the IMU is updated with a frequency rate of 200 Hz. Instead, the red dotted lines are obtained implementing the same algorithm using a frequency rate of 20 Hz. In the figure one can observe that the red and blue lines have the same phase profile, though a greater amount of noise is present in the red curves. This difference can be immediately attributed to the different values of the frequency rate sampling the IMU data stream. Similarly, it is also worth noting that a higher sampling frequency rate leads to a less pronounced drift of the yaw orientation angle, which stems from the choice of not using the magnetometer as further sensor.

3.2.4. Position Estimation Methods

In this section four different methods to estimate the drone position exploiting the marker frame as reference are presented.
The first implemented algorithm—named Fixed Camera Frame Complementary Filter (FCF-CF) and partly presented in Reference [54]—only uses the computer vision system and the gyroscope. The schematic representation of the algorithm is depicted in Figure 8. To merge the information flows from the two sensors, we adopt a complementary filter that works according to the following relation:
Φ ^ k + 1 = λ ( Φ ^ k + T Ω k ) + ( 1 λ ) Φ k ,
where λ is a real number belonging to [ 0 , 1 ] , T is the actual sampling period, Φ k [ φ k , θ k , ψ k ] T is the attitude vector from the vision system and
Ω k = ω x , ω y , ω z T
is the vector of the angular velocities around the three main drone axes coming from the gyroscope.
The new attitude estimate Φ ^ k + 1 at the discrete time instant ( k + 1 ) T provided by Equation (14) (from now on Φ ^ k + 1 will be abbreviated with Φ ^ ) can now be employed in the following coordinates transformation returning the estimate of the drone position:
Q ^ = x y z = R XYZ ( Φ ^ ) x m + x off y m + y off z m + z off = R XYZ ( Φ ^ ) Q m + Q off .
In Equation (16), the rotation matrix
R XYZ ( Φ ^ ) = c φ c ψ c φ s ψ s θ + s φ c θ c φ s ψ c θ + s φ s θ s φ c ψ s φ s ψ s θ + c φ c θ s φ s ψ c θ + c φ s θ s ψ c ψ s θ c ψ c θ
brings the marker and lens frames to match, while the vector Q ^ is the estimate of the drone position with respect to the marker frame. Instead, Q off is a constant offset vector that takes into account the distance between the camera and the center of thrust of the drone. In this regard, by defining Q ct as the position of the marker with respect to the center of thrust, Equation (16) can be rewritten as
Q ^ = R XYZ ( Φ ^ ) Q ct .
It is worth observing that in the FCF-CF algorithm the camera is mounted on the drone in a fixed position, which results in a persistent noise affecting the data stream coming from the camera, as a consequence of the coupling among the pose components. The resulting error is eventually amplified as the ratio between the marker distance and the camera resolution increases. However, the FCF-CF algorithm is simple to implement and has low computational cost.
In order to lessen the drawbacks of the first algorithm, the Fixed Camera Frame Madgwick Filter (FCF-MF) has been developed. In this new scenario, the Raspicam camera is still fixed with respect to the drone body, but the complementary filter has been replaced by the Madgwick filter. The schematic representation of this algorithm is shown in Figure 9. Comparing FCF-MF to the previous FCF-CF, it is worth noting that the attitude vector coming from the vision (very noisy for the coupling effects magnified by distance) is no longer necessary, since the Madgwick filter estimates it by exploiting the data from the IMU (accelerometer and gyroscope). This way, instead, the accuracy does not depend on the marker distance. Again, the attitude estimate Φ ^ is transformed into an estimate of the drone position through the rotation matrix R XYZ .
The third algorithm features the Raspicam camera mounted on a 2-DOF gimbal in order to stabilize the lens frame. Thus, the position estimation method, named as Stabilized Camera Frame Madgwick Filter 2DOF (SCF-MF-2DOF), has been accordingly adapted. The block diagram of the SCF-MF-2DOF algorithm is shown in Figure 10.
As in the previous method, the algorithm uses the Madgwick sensor fusion filter to process the data stream from the IMU, but here Q m and Q off , denoting respectively the coordinates of the marker and of the center of thrust with respect to the camera (constant offset vector between the frames of the lens and the center of thrust), can rotate independently. Notice that, while Q off must be corrected by the matrix R XYZ defined in Equation (17) before its application to the estimate Φ ^ , in SCF-MF-2DOF the marker coordinates need to be stabilized only around the z-axis of the estimated yaw angle ψ ^ just thanks to the 2-DOF gimbal suspension. More formally,
Q ^ = R Z ( ψ ^ ) Q m + R XYZ ( Φ ^ ) Q off ,
where
R Z ( ψ ^ ) = cos ψ ^ sin ψ ^ 0 sin ψ ^ cos ψ ^ 0 0 0 1 .
The experiments reported in next section show that, with respect to previous methods, SCF-MF-2DOF reduces the noises and improves the accuracy almost by a factor five, thanks to the stabilization of the video stream around the pitch and roll angles by the 2-DOF gimbal.
Finally, in the fourth estimation method, the 2-DOF gimbal is replaced by a 3-DOF gimbal. Hence, the marker coordinates are mechanically stabilized also with respect to the yaw angle ψ . The corresponding algorithm is here forth denoted as Stabilized Camera Frame Madgwick filter 3DOF (SCF-MF-3DOF). See Figure 11 for its schematic representation, whereby the block related to the correction of the marker position has been eliminated.
Accordingly, to estimate the drone position, the marker coordinates do not need to be stabilized, and, therefore, Q ^ is just provided by the following equation:
Q ^ = Q m + R XYZ ( Φ ^ ) Q off .
In addition to reducing the effects of noise on vision stream data, the 3-DOF gimbal has also the advantage of reducing the computational load, thus improving the precision in the estimate of both attitude and position vectors.

4. Tasks Architecture and Managing

The higher levels in the software stack of the drone navigation system comprises four distinct principal tasks. They are managed by a standard Linux scheduler set as SCHED FIFO (meaning “first input first output scheduler”), such that threads with the same priority are managed with FIFO policy. This mode can be used to implement real-time policies and it can be activated only with root permissions. It is usually adopted to reduce the time variability of the execution period of individual tasks, which is a desired feature when working with sampled processes. All the software in the higher level of the navigation system is written in C++ language and currently implemented on the Raspberry Pi 3 model B+ platform, as already described in Section 2. Figure 12 depicts how software and hardware stacks overlap.
The main task manages the computer vision system and it is responsible to carry out the processes for the marker detection and the estimation of its position and attitude. In particular, the computer vision is an aperiodic task that works at about 30 FPS (frame per second) with a resolution of 660 × 660 pixels. After many experimental tests on different configurations, this working condition has been found a good compromise between the number of FPS (i.e., the computational load) and the precision of the results. To improve the performance, the main task has been parallelized in four sub-tasks, one for each Raspberry core, which process part of the same frame at the same time. This way, a better use of the available calculation resources is reached, and the computations are performed faster.
The second task is a thread that manages the IMU and performs (i) the acquisition of the inertial data from the IMU itself, (ii) the Madgwick filter routine for the estimation of the drone attitude, and (iii) the drone position estimation process. Since the IMU thread is a lightweight process, it is completely lead by the IMU internal sampling time, which makes it periodic with working frequency at 200 Hz.
Instead, the third task is the thread for the control of the position trajectory: Given the desired (reference) trajectory, which in the simplest case the drone has to track point-by-point with possible constraints on the velocity profile, the control routine uses the position displacement error to generate the attitude set-points to be sent to the signal mixer. The control samples are computed only when the autonomous flight mode is activated. This control routine is managed as a periodic task forced to work at 22 Hz. The frequency is decided by the PPM protocol: Since the maximum bandwidth ensured by the PPM protocol is 44 Hz, the control routine cannot occupy more than 22 Hz, that is, half of the maximum bandwidth, so to avoid aliasing effects. However, as it will be shown in the next section on experimental results, the band of the dynamics of the drone position is comparable with the working frequency of the control task, thus making this architecture sufficient to accurately control the drone, especially when gimbal suspension are implemented. On a technical note, the integral component of the PID controllers is activated only at specific instants, that is, whenever the autonomous flight mode is enabled (event reported by a specific variable). This choice is motivated by the need to avoid discontinuities caused by the wind-up effect, when the autonomous mode is activated.
The fourth task, finally, is a communication thread which coordinates the transmission of the set-points to the mixer, that, in the autonomous mode, will send them to the flight controller. To reduce the computational load of the mixer, the attitude set-points are first converted into time intervals (see also Section 2.2) and then sent to the other boards. The communication task is a periodic routine, working at 44 Hz to exploit all the available bandwidth provided by the PPM protocol.
Eventually, a parallel task generates the mission log by saving all the data in a plain text file for offline processing. This task has the least priority and due to the access to the memory it works almost periodically at 20 Hz.
As a final technical remark, let us stress that the tasks architecture is based on a readers-writers synchronization method, where several tasks, which need to read shared variables (reader task), can access them simultaneously. Having implemented this distinction between readers and writers tasks, the software has better performance with respect to the standard case (mutual exclusion synchronization method, that is, readers and writers can access to the shared variables separately and one-at-a-time) and, thus, the data exchange process between threads is sped up.

5. Experimental Tests

The reference scenario used for the experimental tests presented in this section consists in tracking of a straight trajectory with triangular velocity profile. To carry out these tests, the drone takes off manually and is driven to a position where the Raspicam camera is able to identify the marker. The drone is then switched to an autonomous hovering mode (i.e., a flying mode where the reference trajectory is a point and the velocity profiles is constantly equal to zero), and finally the mission begins: The navigation software generates (on the three environmental axes x, y and z) a rectilinear trajectories with respect to the marker, and its tracking starts.

5.1. Validation of the On-Board Computer Vision System

Some preliminary tests were conceived to first verify the precision of the on-board computer vision system. To this aim, the drone was driven in front of a marker and set to hovering at a distance of about 4 m. The navigation algorithm computed the drone camera position (here stabilized by the 3-axis gimbal) and the related data was logged with respect to the marker inertial frame. During the experiment, a specific tag on the back of the drone camera was recorded by a high precision external camera mounted on a tripod, and the corresponding video was processed off-line by the open-source software “Kinovea”, which is able to infer the tag position with respect to the camera point of view. Such a signal, computed independently from the on-board system of the drone, was finally scaled to the marker reference system. A comparison between the off- and on-board measured trajectories along the y-axis (altitude) is reported in Figure 13. In the lower panel the difference between the two estimates is shown in yellow. In this experiment the standard deviation of this difference over the acquisition interval [ 0 , 70 ] seconds is about 4.2 mm, confirmed by other tests which witness similar values. In conclusion, the data from the on-board computer vision system turned out sufficiently informative and the very limited differences could be likely explained by the transient dynamics of the gimbal stabilization system.

5.2. Comparison between the Position Estimation Methods

In this subsection, the performance reached with the proposed position estimation methods and their ability to be used in a reliable virtual position sensors for the drone navigation system are discussed.
In a first experiment, the drone has just been set to hovering in front of a marker at 4 m distance. Given the same control system described in Section 3.2.2, the experiment has been repeated alternatively using the algorithms FCF-CF, FCF-MF, and SCF-MF-2DOF, and eventually the drone ability to hover in the right position has been investigated. In Figure 14 the drone position p y (altitude) as it has been estimated by the algorithms FCF-CF, FCF-MF and SCF-MF-2DOF is compared to the desired reference. As one can observe, the FCF-CF and FCF-MF algorithms achieve similar control performance, whereas the estimation yielded by the SCF-MF-2DOF method allows for an altitude profile much closer to the desired setpoint p y = 0 . To clearly quantify the performance of the algorithms, in Table 1 we provide the corrected sample standard deviation s ε of the error ε computed as the difference between the estimated drone position and the desired trajectory within the time interval under investigation. The sample standard deviation is defined as
s ε 1 N 1 k = 1 N ε ε ¯ 2 ,
where N = 50 is the number of performed experimental tests and ε ¯ k = 1 N ε / N .
As shown in the table, the performance of the algorithm SCF-MF-2DOF are much better than the ones of the first two proposed estimation methods and, quantitatively, the sample standard deviations s ε of the error are halved.
In Figure 15 it is reported, for a similar experiment, the comparison between the estimation algorithms SCF-MF-2DOF and SCF-MF-3DOF taking this time into account the horizontal position p x .

5.3. Autonomous Flight Test

Indeed, in this latter case the camera yaw angle is now stabilized by the use of the 3-DOF gimbal suspension and is always pointing at the same direction. In terms of tracking precision, the performance of the SCF-MF-3DOF algorithm has to be mainly evaluated along the horizontal axis x, being unchanged for the other axes. The sample standard deviation s ε of the estimation errors for the algorithms SCF-MF-2DOF and SCF-MF-3DOF have been computed again by repeating N = 50 times the same experiments with fixed working conditions. The values of the error standard deviations are provided in Table 2.
From the table, the error along the horizontal axis turns out larger than the one along the vertical axis. Nevertheless, the standard deviation of the error is about 2.5 cm, thus proving overall a few centimeter precision in controlling the position of the Dart drone prototype when exploiting the SCF-MF-3DOF on-board navigation system.
In Figure 16, we show the time-behaviour of the drone position (blue solid lines for the elements p x , p y , p z ) while the drone is in the autonomous flight mode, during the tracking of a preset rectilinear trajectory. The measured position of the drone is also compared with the desired trajectory (black dashed lines) that has to be tracked. During the time evolution in the interval [ 25 , 50 ] seconds, the autonomous hovering mode is enabled, which results in having an almost constant value of the 3D-position. Instead, from t = 50 s until the end of the test, the autonomous flight mode was enabled, so as to allow for the tracking of a straight trajectory with a triangular velocity profile. In the test, the maximum value of the velocity is 0.1 m/s. This implies a variation of the desired trajectory (blue curve) along z. The mission ends when the drone reaches a distance of 1.5 m away from the marker. At that distance, the drone automatically returns to the autonomous hovering mode and stops moving.
Both the hovering and autonomous modes mainly use the data stream from the computer vision system and from the IMU. Although signals from the sensors are filtered from external noise sources and fused together, we are able to achieve a correct tracking of the trajectory along the three axes but with a self-sustained oscillation perceptible on p x and p y . Such oscillations are originated by a delay of around 0.2 s in the video acquisition process (due to data buffer) and affects the performance of the navigation control system. This aspect, that has been already partially discussed in Reference [46], will be properly addressed in future research.

6. Conclusions

In this paper, a prototype of UAV, able to autonomously track 3D trajectories, has been presented. In order to have easy and complete access to all the parts of the system, the drone has been developed from scratch by using only “standard” components, that is, inexpensive equipment already present in the mass market. The developed solutions, however, can be applied to off-the-shelf drones as well, at least to the class of professional UAVs that can support a reasonable payload. Indeed, the core idea of the proposed technology for autonomy is the “cyber-pilot”, that is, a vision based navigation system, exploiting only on-board devices, which can substitute the human commands in driving the drone along a desired trajectory with high precision. The additional hardware necessary for the cyber-pilot is made of two programmable embedded boards (Raspberry Pi 3B+ and Arduino Nano), a small camera (Raspicam), a 6-DOF IMU, and, possibly, a gimbal (2DOF or 3DOF). A rough estimate of the cost ranges from $80 to $200 depending of the actual market prices and on the chosen configuration (with or without gimbal). This hardware is used to implement a “virtual sensor”, that is, a sensor fusion algorithm which merges data from the IMU and the on-board computer vision system. The resulting information is exploited by a simple control logic which makes the navigation system override human commands when it is in autonomous mode. Experiments suggest that low-cost technologies, such as the ones used to implement the UAV, are very close to enable the sought passage from meter- to centimeter-scale precision in autonomous maneuvering of multi-rotor drones that would represent a noteworthy generation change in their application range. Moreover, both the hardware and the software proposed architectures are modular and they can easily be extended and enhanced, for instance, by replacing more refined algorithms into the programs, or by substituting a device with a better performing equipment. Such a feature is crucial for the maintenance of the project. Indeed, new modules are actually under working to update the drone thanks to novel devices, which have recently win over the mass market.

Author Contributions

Conceptualization, L.B., G.I. and M.B.; hardware and software, L.B.; formal analysis and data curation, L.B. and S.G.; numerical simulations, S.G. and M.B.; experiments, L.B.; writing—original draft preparation, S.G. and L.B.; writing—review and editing, S.G., L.B., G.I. and M.B.; supervision, G.I. and M.B. All authors have read and agreed to the submitted version of the manuscript.

Funding

This project has received funding from the European Union’s Horizon 2020 research and innovation programme under grant agreement No 101007134.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

All experimental data will be made available on request to the corresponding author with appropriate justification.

Acknowledgments

The authors gratefully acknowledge M. Pieraccini for fruitful discussions and support.

Conflicts of Interest

The authors declare no conflict of interest.

Abbreviations

The following abbreviations are used in this manuscript:
DOFDegrees of freedom
IMUInertial measurement unit
UAVUnmanned aerial vehicle
PIDProportional–integral–derivative
PPMPulse position modulation
NEDNorth-east-down
FIFOFirst input first output
FPSFrame per second
FCF-CFFixed camera frame complementary filter
FCF-MFFixed camera frame Madgwick filter
SCF-MF-2DOFStabilized camera frame Madgwick filter 2DOF
SCF-MF-3DOFStabilized camera frame Madgwick filter 3DOF

References

  1. Chan, K.W.; Nirmal, U.; Cheaw, W.G. Progress on drone technology and their applications: A comprehensive review. AIP Conf. Proc. 2018, 2030, 020308. [Google Scholar]
  2. Shakhatreh, H.; Sawalmeh, A.H.; Al-Fuqaha, A.; Dou, Z.; Almaita, E.; Khalil, I.; Othman, N.S.; Khreishah, A.; Guizani, M. Unmanned aerial vehicles (UAVs): A survey on civil applications and key research challenge. IEEE Access 2019, 7, 48572–48634. [Google Scholar] [CrossRef]
  3. Shakeri, R.; Al-Garadi, M.A.; Badawy, A.; Mohamed, A.; Khattab, T.; Al-Ali, A.K.; Harras, K.A.; Guizani, M. Design challenges of multi-UAV systems in cyber-physical applications: A comprehensive survey and future directions. IEEE Commun. Surv. Tutor. 2019, 21, 3340–3385. [Google Scholar] [CrossRef] [Green Version]
  4. Wang, X.; Huang, Z.; Sui, G.; Lian, H. Analysis on the development trend of future UAV equipment technology. Acad. J. Eng. Technol. Sci. 2019, 2. [Google Scholar] [CrossRef]
  5. Ghazzai, H.; Menouar, H.; Kadri, A.; Massoud, Y. Future UAV-based ITS: A comprehensive scheduling framework. IEEE Access 2019, 7, 75678–75695. [Google Scholar] [CrossRef]
  6. Alsalam, B.H.Y.; Morton, K.; Campbell, D.; Gonzalez, F. Autonomous UAV with vision based on-board decision making for remote sensing and precision agriculture. In Proceedings of the 2017 IEEE Aerospace Conference, Big Sky, MT, USA, 4–11 March 2017. [Google Scholar]
  7. Tokekar, P.; Hook, J.V.; Mulla, D.; Isler, V. Sensor planning for a symbiotic UAV and UGV system for precision agriculture. IEEE Trans. Robot. 2016, 32, 1498–1511. [Google Scholar] [CrossRef]
  8. Kim, J.; Kim, S.; Ju, C.; Son, H.I. Unmanned aerial vehicles in agriculture: A review of perspective of platform, control, and applications. IEEE Access 2019, 7, 105100–105115. [Google Scholar] [CrossRef]
  9. Henkel, P.; Mittmann, U.; Iafrancesco, M. Real-time kinematic positioning with GPS and GLONASS. In Proceedings of the 2016 24th European Signal Processing Conference (EUSIPCO), Budapest, Hungary, 29 August–2 September 2016; pp. 1063–1067. [Google Scholar]
  10. Jordan, S.; Moore, J.; Hovet, S.; Box, J.; Perry, J.; Kirsche, K.; Lewis, D.; Tse, Z.T.H. State-of-the-art technologies for UAV inspections. IET Radar Sonar Navig. 2018, 12, 151–164. [Google Scholar] [CrossRef]
  11. Dinesh, M.A.; Kumar, S.S.; Sanath, J.; Akarsh, K.N.; Gowda, K.M.M. Development of an Autonomous Drone for Surveillance Application. Proc. Int. Res. J. Eng. Technol. IRJET 2018, 5, 331–333. [Google Scholar]
  12. Saska, M. Large sensors with adaptive shape realised by self-stabilised compact groups of micro aerial vehicles. Robot. Res. 2020, 10, 101–107. [Google Scholar]
  13. Lu, L.; Redondo, C.; Campoy, P. Optimal Frontier-Based Autonomous Exploration in Unconstructed Environment Using RGB-D Sensor. Sensors 2020, 20, 6507. [Google Scholar] [CrossRef] [PubMed]
  14. Zhou, H.; Kong, H.; Wei, L.; Creighton, D.; Nahavandi, S. Efficient road detection and tracking for unmanned aerial vehicle. IEEE Trans. Intell. Transp. Syst. 2015, 16, 297–309. [Google Scholar] [CrossRef]
  15. Srini, V.P. A vision for supporting autonomous navigation in urban environments. Computer 2006, 39, 68–77. [Google Scholar] [CrossRef]
  16. Nonami, K. Research and Development of Drone and Roadmap to Evolution. J. Robot. Mechatron. 2018, 30, 322–336. [Google Scholar] [CrossRef]
  17. Elloumi, M.; Dhaou, R.; Escrig, B.; Idoudi, H.; Saidane, L.A. Monitoring road traffic with a UAV-based system. In Proceedings of the 2018 IEEE Wireless Communications and Networking Conference (WCNC), Barcelona, Spain, 15–18 April 2018; pp. 1–6. [Google Scholar]
  18. Cheng, L.; Zhong, L.; Tian, S.; Xing, J. Task Assignment Algorithm for Road Patrol by Multiple UAVs With Multiple Bases and Rechargeable Endurance. IEEE Access 2019, 7, 144381–144397. [Google Scholar] [CrossRef]
  19. Erdelj, M.; Król, M.; Natalizio, E. Wireless sensor networks and multi-UAV systems for natural disaster management. Comput. Netw. 2017, 124, 72–86. [Google Scholar] [CrossRef]
  20. Ren, H.; Zhao, Y.; Xiao, W.; Hu, Z. A review of UAV monitoring in mining areas: Current status and future perspectives. Int. J. Coal Sci. Technol. 2019, 6, 320–333. [Google Scholar] [CrossRef] [Green Version]
  21. Erdelj, M.; Natalizio, E.; Chowdhury, K.R.; Kaushik, R.; Akyildiz, I.F. Help from the sky: Leveraging UAVs for disaster management. IEEE Pervasive Comput. 2017, 16, 24–32. [Google Scholar] [CrossRef]
  22. Avanzato, R.; Beritelli, F. A Smart UAV-Femtocell Data Sensing System for Post-Earthquake Localization of People. IEEE Access 2020, 8, 30262–30270. [Google Scholar] [CrossRef]
  23. Aljehani, M.; Inoue, M. Performance evaluation of multi-UAV system in post-disaster application: Validated by HITL simulator. IEEE Access 2019, 7, 64386–64400. [Google Scholar] [CrossRef]
  24. Alotaibi, E.T.; Alqefari, S.S.; Koubaa, A. Lsar: Multi-uav collaboration for search and rescue missions. IEEE Access 2019, 7, 55817–55832. [Google Scholar] [CrossRef]
  25. Petrlík, M.; Báča, T.; Heřt, D.; Vrba, M.; Krajník, T.; Saska, M. A Robust UAV System for Operations in a Constrained Environment. IEEE Robot. Autom. Lett. 2020, 5, 2169–2176. [Google Scholar] [CrossRef]
  26. Zhang, J.; Wu, Y.; Liu, W.; Chen, X. Novel Approach to Position and Orientation Estimation in Vision-Based UAV Navigation. IEEE Trans. Aerosp. Electron. Syst. 2010, 46, 687–700. [Google Scholar] [CrossRef]
  27. Cesetti, A.; Frontoni, E.; Mancini, A.; Zingaretti, P.; Longhi, S. A Vision-Based Guidance System for UAV Navigation and Safe Landing using Natural Landmarks. J. Intell. Robot. Syst. 2010, 57, 233. [Google Scholar] [CrossRef]
  28. Khansari-Zadeh, S.M.; Saghafi, F. Vision-Based Navigation in Autonomous Close Proximity Operations using Neural Networks. IEEE Trans. Aerosp. Electron. Syst. 2011, 47, 864–883. [Google Scholar] [CrossRef]
  29. Zhang, J.; Liu, W.; Wu, Y. Novel Technique for Vision-Based UAV Navigation. IEEE Trans. Aerosp. Electron. Syst. 2011, 47, 2731–2741. [Google Scholar] [CrossRef]
  30. Carrillo, L.R.G.; Lopez, A.E.D.; Lozano, R.; Pegard, C. Combining Stereo Vision and Inertial Navigation System for a Quad-Rotor UAV. J. Intell. Robot. Syst. 2012, 65, 373–387. [Google Scholar] [CrossRef]
  31. Aguilar, W.G.; Salcedo, V.S.; Sandoval, D.S.; Cobena, B. Developing of a Video-Based Model for UAV Autonomous Navigation. In 2017 Latin American Workshop on Computational Neuroscience (LAWCN): Computational Neuroscience; Springer: Cham, Switzerland, 2017; pp. 94–105. [Google Scholar]
  32. Miller, B.M.; Stepanyan, K.V.; Popov, A.K.; Miller, A.B. UAV navigation based on videosequences captured by the onboard video camera. Autom. Remote Control 2017, 78, 2211–2221. [Google Scholar] [CrossRef]
  33. Lu, Y.; Xue, Z.; Xia, G.-S.; Zhang, L. A survey on vision-based UAV navigation. Geo-Spat. Inf. Sci. 2018, 21, 21–32. [Google Scholar] [CrossRef] [Green Version]
  34. Rodriguez-Ramos, A.; Alvarez-Fernandez, A.; Bavle, H.; Campoy, P.; How, J.P. Vision-Based Multirotor Following Using Synthetic Learning Techniques. Sensors 2019, 19, 4794. [Google Scholar] [CrossRef] [Green Version]
  35. Mademlis, I.; Torres-González, A.; Capitán, J.; Cunha, R.; Guerreiro, B.J.N.; Messina, A.; Negro, F.; Barz, C.L.; Gonçalves, T.F.; Tefas, A.; et al. A multiple-uav software architecture for autonomous media production. In Proceedings of the Workshop on Signal Processing Computer vision and Deep Learning for Autonomous Systems (EUSIPCO2019), A Coruna, Spain, 2–6 September 2019. [Google Scholar]
  36. Mademlis, I.; Nikolaidis, N.; Tefas, A.; Pitas, I.; Wagner, T.; Messina, A. Autonomous UAV cinematography: A tutorial and a formalized shot-type taxonomy. ACM Comput. Surv. CSUR 2019, 52, 1–33. [Google Scholar] [CrossRef]
  37. GPS Accuracy, Official U.S. Government Information about the Global Positioning System (GPS) and Related Topics. Available online: https://www.gps.gov/systems/gps/performance/accuracy/ (accessed on 12 December 2020).
  38. Zhao, S.; Chen, Y.; Farrell, J.A. High-precision vehicle navigation in urban environments using an MEM’s IMU and single-frequency GPS receiver. IEEE Trans. Intell. Transp. Syst. 2016, 17, 2854–2867. [Google Scholar] [CrossRef]
  39. Lu, Q.; Zhang, Y.; Lin, J.; Wu, M. Dynamic Electromagnetic Positioning System for Accurate Close-Range Navigation of Multirotor UAVs. IEEE Sens. J. 2020, 20, 4459–4468. [Google Scholar] [CrossRef]
  40. Liu, H.; Yang, B. Quadrotor Singularity Free Modeling and Acrobatic Maneuvering. In Proceedings of the International Design Engineering Technical Conferences and Computers and Information in Engineering Conference, Anaheim, CA, USA, 18–21 August 2019; Volume 59230, p. V05AT07A055. [Google Scholar]
  41. Yang, Q.; Zhang, J.; Shi, G.; Hu, J.; Wu, Y. Maneuver decision of UAV in short-range air combat based on deep reinforcement learning. IEEE Access 2019, 8, 363–378. [Google Scholar] [CrossRef]
  42. Padhy, R.P.; Xia, F.; Choudhury, S.K.; Sa, P.K.; Bakshi, S. Monocular Vision Aided Autonomous UAV Navigation in Indoor Corridor Environments. IEEE Trans. Sustain. Comput. 2019, 4, 96–108. [Google Scholar] [CrossRef]
  43. Grzonka, S.; Grisetti, G.; Burgard, W. A Fully Autonomous Indoor Quadrotor. IEEE Trans. Robot. 2012, 28, 90–100. [Google Scholar] [CrossRef] [Green Version]
  44. How, J.P.; Behihke, B.; Frank, A.; Dale, D.; Vian, J. Real-time indoor autonomous vehicle test environment. IEEE Control Syst. Mag. 2008, 28, 51–64. [Google Scholar] [CrossRef]
  45. Yang, S.; Scherer, S.A.; Yi, X.; Zell, A. Multi-camera visual SLAM for autonomous navigation of micro aerial vehicles. Robot. Auton. Syst. 2017, 93, 116–134. [Google Scholar] [CrossRef]
  46. Mac, T.T.; Copot, C.; Keyser, R.D.; Ionescu, C.M. The development of an autonomous navigation system with optimal control of an UAV in partly unknown indoor environment. Mechatronics 2018, 49, 187–196. [Google Scholar] [CrossRef]
  47. Mustafah, Y.M.; Azman, A.W.; Akbar, F. Indoor UAV Positioning Using Stereo Vision Sensor. Procedia Eng. 2012, 41, 575–579. [Google Scholar] [CrossRef] [Green Version]
  48. Zhang, J.; Wang, X.; Yu, Z.; Lyu, Y.; Mao, S.; Periaswamy, S.C.G.; Patton, J.; Wang, X. Robust rfid based 6-dof localization for unmanned aerial vehicles. IEEE Access 2019, 7, 77348–77361. [Google Scholar] [CrossRef]
  49. Balderas, L.I.; Reyna, A.; Panduro, M.A.; Rio, C.D.; Gutiérrez, A.R. Low-profile conformal UWB antenna for UAV applications. IEEE Access 2019, 7, 127486–127494. [Google Scholar] [CrossRef]
  50. You, W.; Li, F.; Liao, L.; Huang, M. Data Fusion of UWB and IMU Based on Unscented Kalman Filter for Indoor Localization of Quadrotor UAV. IEEE Access 2020, 8, 64971–64981. [Google Scholar] [CrossRef]
  51. Gonzalez-Sieira, A.; Cores, D.; Mucientes, M.; Bugarin, A. Autonomous navigation for UAVs managing motion and sensing uncertainty. Robot. Auton. Syst. 2020, 126, 103455. [Google Scholar] [CrossRef]
  52. Imanberdiyev, N.; Fu, C.; Kayacan, E.; Chen, I.-M. Autonomous navigation of UAV by using real-time model-based reinforcement learning. In Proceedings of the 2016 14th International Conference on Control, Automation, Robotics and Vision (ICARCV), Phuket, Thailand, 13–15 November 2016; pp. 1–6. [Google Scholar]
  53. Lugo, J.J.; Zell, A. Framework for Autonomous On-board Navigation with the AR. Drone. J. Intell. Robot. Syst. 2014, 73, 401–412. [Google Scholar] [CrossRef]
  54. Basso, M.; Bigazzi, L.; Innocenti, G. DART Project: A High Precision UAV Prototype Exploiting On-board Visual Sensing. In Proceedings of the 15th International Conference on Autonomic and Autonomous Systems (ICAS), Athens, Greece, 2–6 June 2019. [Google Scholar]
  55. Kim, J.-H.; Sukkarieh, S.; Wishart, S. Real-Time Navigation, Guidance, and Control of a UAV Using Low-Cost Sensors. Field Serv. Robot. 2006, 24, 299–309. [Google Scholar]
  56. Gageik, N.; Benz, P.; Montenegro, S. Obstacle detection and collision avoidance for a UAV with complementary low-cost sensors. IEEE Access 2015, 3, 599–609. [Google Scholar] [CrossRef]
  57. RIIS Blog, Four Drone Manufacturers Providing SDKs. Available online: https://riis.com/blog/four_drone_sdks/ (accessed on 12 December 2020).
  58. Wang, J.; Olson, E. AprilTag2: Efficient and robust fiducial detection. In Proceedings of the 2016 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Daejeon, Korea, 9–14 October 2016. [Google Scholar]
  59. Madgwick, S.O.H. An efficient orientation filter for inertial and inertial/magnetic sensor arrays. Rep. x-io Univ. Bristol UK 2010, 25, 113–118. [Google Scholar]
  60. Gebre-Egziabher, D.; Hayward, R.C.; Powell, J.D. Design of multi-sensor attitude determination systems. IEEE Trans. Aerosp. Electron. Syst. 2004, 40, 627–649. [Google Scholar] [CrossRef]
  61. Sabatini, A.M. Quaternion-based extended Kalman filter for determining orientation by inertial and magnetic sensing. IEEE Trans Biomed. Eng. 2006, 53, 1346–1356. [Google Scholar] [CrossRef]
Figure 1. A picture of the Dart prototype.
Figure 1. A picture of the Dart prototype.
Sensors 21 00391 g001
Figure 2. Hardware configuration and dependencies. The PPM-mixer board is an interface between the low-level flight controller and a Raspberry PI board, on which the high-level navigation software is implemented.
Figure 2. Hardware configuration and dependencies. The PPM-mixer board is an interface between the low-level flight controller and a Raspberry PI board, on which the high-level navigation software is implemented.
Sensors 21 00391 g002
Figure 3. Functional scheme of the mixer board. The two input command signals, converted in time intervals, are merged into a single signal at the output of the board. We have named this operating logic as Hybrid Mode.
Figure 3. Functional scheme of the mixer board. The two input command signals, converted in time intervals, are merged into a single signal at the output of the board. We have named this operating logic as Hybrid Mode.
Sensors 21 00391 g003
Figure 4. 3-DOF gimbal stabilizing the Raspicam camera and thus decreasing the so-called video noise. Indeed, if we do not use the gimbal, the low refresh rate of the camera data stream is responsible for the generation of video noise contributions due to high-frequency changes of the drone attitude. Video noise implies blurred images.
Figure 4. 3-DOF gimbal stabilizing the Raspicam camera and thus decreasing the so-called video noise. Indeed, if we do not use the gimbal, the low refresh rate of the camera data stream is responsible for the generation of video noise contributions due to high-frequency changes of the drone attitude. Video noise implies blurred images.
Sensors 21 00391 g004
Figure 5. Detection and tracking process: the marker reference frame is shown in red, green and blue for x, y and z axes, respectively. The computer vision algorithm runs on Raspberry PI with a frequency rate of 30 Hz and provides the marker attitude and position in the lens frame [54].
Figure 5. Detection and tracking process: the marker reference frame is shown in red, green and blue for x, y and z axes, respectively. The computer vision algorithm runs on Raspberry PI with a frequency rate of 30 Hz and provides the marker attitude and position in the lens frame [54].
Sensors 21 00391 g005
Figure 6. Control architecture. The navigation control system is a feedback control loop composed by four PID controllers, respectively C x , C y , C z and C ψ one for each pose degree of freedom, and a position estimation module fusing together stream data from the IMU and the Raspicam camera. C k , with k { x , y , z } , have as input signals drone position errors and provide in output an attitude reference signal to be sent to the low-level module. Instead, C ψ takes in input an error signal on ψ and returns a reference for the yaw angular velocity.
Figure 6. Control architecture. The navigation control system is a feedback control loop composed by four PID controllers, respectively C x , C y , C z and C ψ one for each pose degree of freedom, and a position estimation module fusing together stream data from the IMU and the Raspicam camera. C k , with k { x , y , z } , have as input signals drone position errors and provide in output an attitude reference signal to be sent to the low-level module. Instead, C ψ takes in input an error signal on ψ and returns a reference for the yaw angular velocity.
Sensors 21 00391 g006
Figure 7. The attitude pitch, roll and yaw angles are here plotted during a flight which includes both a take-off and a hovering phase. The blue solid lines denote the output signals from the Madgwick fusion filter elaborated on board at the frequency rate of 200 Hz, whereas the red dotted lines are computed at 20 Hz.
Figure 7. The attitude pitch, roll and yaw angles are here plotted during a flight which includes both a take-off and a hovering phase. The blue solid lines denote the output signals from the Madgwick fusion filter elaborated on board at the frequency rate of 200 Hz, whereas the red dotted lines are computed at 20 Hz.
Sensors 21 00391 g007
Figure 8. Schematic representation of the algorithm “Fixed Camera Frame Complementary Filter” (FCF-CF). The method adopts a complementary filter that fuses the stream data from the computer vision system and the gyroscope (here, the accelerator is not used). This allows to recover the information on the dynamics of the drone that is separately lost (not detected) by the two sensors. The complementary filter returns the estimate Φ ^ of the drone attitude vector. In this way, by rotating of such an estimated angles the position of the marker (rectified by the offset vector Q off ), one can also derive the estimate of the drone position.
Figure 8. Schematic representation of the algorithm “Fixed Camera Frame Complementary Filter” (FCF-CF). The method adopts a complementary filter that fuses the stream data from the computer vision system and the gyroscope (here, the accelerator is not used). This allows to recover the information on the dynamics of the drone that is separately lost (not detected) by the two sensors. The complementary filter returns the estimate Φ ^ of the drone attitude vector. In this way, by rotating of such an estimated angles the position of the marker (rectified by the offset vector Q off ), one can also derive the estimate of the drone position.
Sensors 21 00391 g008
Figure 9. Schematic representation of the algorithm “Fixed Camera Frame Madgwick Filter” (FCF-MF). Unlike the algorithm FCF-CF, only the data stream from the accelerometer and the gyroscope are sent as input signals to the Madgwick sensor fusion filter. The latter provides an estimate of the drone orientation, whose precision does not depend on the distance between the drone and the marker.
Figure 9. Schematic representation of the algorithm “Fixed Camera Frame Madgwick Filter” (FCF-MF). Unlike the algorithm FCF-CF, only the data stream from the accelerometer and the gyroscope are sent as input signals to the Madgwick sensor fusion filter. The latter provides an estimate of the drone orientation, whose precision does not depend on the distance between the drone and the marker.
Sensors 21 00391 g009
Figure 10. Schematic representation of the algorithm “Stabilized Camera Frame Madgwick Filter 2DOF“ (SCF-MF-2DOF). Differently to previous methods, the 2-DOF gimbal suspension is used to stabilize the video stream data with respect to the pitch and roll angles of the attitude vector. As a result, the marker coordinates have to be corrected by means of a rotation just along the z-axis of the estimated attitude yaw angle ψ ^ . This stabilization procedure has the advantage to reduce the noise in the video stream and thus improve the accuracy of position estimation.
Figure 10. Schematic representation of the algorithm “Stabilized Camera Frame Madgwick Filter 2DOF“ (SCF-MF-2DOF). Differently to previous methods, the 2-DOF gimbal suspension is used to stabilize the video stream data with respect to the pitch and roll angles of the attitude vector. As a result, the marker coordinates have to be corrected by means of a rotation just along the z-axis of the estimated attitude yaw angle ψ ^ . This stabilization procedure has the advantage to reduce the noise in the video stream and thus improve the accuracy of position estimation.
Sensors 21 00391 g010
Figure 11. Schematic representation of the algorithm “Stabilized Camera Frame Madgwick filter 3DOF” (SCF-MF-3DOF). By improving the mechanical stabilization of the camera by means of a 3-DOF gimbal suspension, the marker coordinates Q m are directly summed, without being corrected, to the term R XYZ ( Φ ^ ) Q off to obtain the estimation Q ^ of the drone position. In this way, the noise on the video stream data is further mitigated, and also less calculations are necessary to carry out the estimation procedure.
Figure 11. Schematic representation of the algorithm “Stabilized Camera Frame Madgwick filter 3DOF” (SCF-MF-3DOF). By improving the mechanical stabilization of the camera by means of a 3-DOF gimbal suspension, the marker coordinates Q m are directly summed, without being corrected, to the term R XYZ ( Φ ^ ) Q off to obtain the estimation Q ^ of the drone position. In this way, the noise on the video stream data is further mitigated, and also less calculations are necessary to carry out the estimation procedure.
Sensors 21 00391 g011
Figure 12. The core of the software stack is composed of four task. The vision thread is responsible for the marker detection and its position estimation from the frames acquired by the on-board camera. Its output is processed along with data from the IMU by a Madgwick filter whose aim is estimating the drone position. This latter information is then processed by the navigation thread which performs the control routines to keep the estimated trajectory as close as possible to the desired one. The navigation thread output are reference points which are transmitted to the low-level flight controller by the signal mixer, which also handles the commands of the human pilot coming from the receiver. The detailed information flow across vision and fusion threads is depicted in Figure 8, Figure 9 and Figure 10, while that of the navigation thread is shown in Figure 6.
Figure 12. The core of the software stack is composed of four task. The vision thread is responsible for the marker detection and its position estimation from the frames acquired by the on-board camera. Its output is processed along with data from the IMU by a Madgwick filter whose aim is estimating the drone position. This latter information is then processed by the navigation thread which performs the control routines to keep the estimated trajectory as close as possible to the desired one. The navigation thread output are reference points which are transmitted to the low-level flight controller by the signal mixer, which also handles the commands of the human pilot coming from the receiver. The detailed information flow across vision and fusion threads is depicted in Figure 8, Figure 9 and Figure 10, while that of the navigation thread is shown in Figure 6.
Sensors 21 00391 g012
Figure 13. Comparison between the on-board and off-board estimations of the vision system data. In the upper panel, the estimation of the on-board altitude (blue solid line) is plotted together with the values (red solid line) measured by the fixed camera mounted on a tripod externally to the drone. Instead, the trend of the difference between the two estimates is reported in the lower panel. The mean deviation of such a difference is about 4.2 mm, while the maximum error value is around 1 cm.
Figure 13. Comparison between the on-board and off-board estimations of the vision system data. In the upper panel, the estimation of the on-board altitude (blue solid line) is plotted together with the values (red solid line) measured by the fixed camera mounted on a tripod externally to the drone. Instead, the trend of the difference between the two estimates is reported in the lower panel. The mean deviation of such a difference is about 4.2 mm, while the maximum error value is around 1 cm.
Sensors 21 00391 g013
Figure 14. Comparison between the algorithms FCF-CF, FCF-MF and SCF-MF-2DOF for the estimation of the drone position along the altitude axis y. It can be observed that, if the SCF-MF-2DOF algorithm is used, the difference between the altitude estimates and the desired altitude profile ( p y = 0 ) is of an order of magnitude smaller than the other two analyzed methods.
Figure 14. Comparison between the algorithms FCF-CF, FCF-MF and SCF-MF-2DOF for the estimation of the drone position along the altitude axis y. It can be observed that, if the SCF-MF-2DOF algorithm is used, the difference between the altitude estimates and the desired altitude profile ( p y = 0 ) is of an order of magnitude smaller than the other two analyzed methods.
Sensors 21 00391 g014
Figure 15. Comparison between the algorithms SCF-MF-2DOF (with 2-DOF gimbal) and SCF-MF-3DOF that uses a 3-DOF gimbal suspension for the stabilization of the yaw angle. In this case, the comparison is made between the estimates obtained along the horizontal axis x.
Figure 15. Comparison between the algorithms SCF-MF-2DOF (with 2-DOF gimbal) and SCF-MF-3DOF that uses a 3-DOF gimbal suspension for the stabilization of the yaw angle. In this case, the comparison is made between the estimates obtained along the horizontal axis x.
Sensors 21 00391 g015
Figure 16. Drone position vs time: the blue solid curves represent the 3D-position of the drone in an experimental test with a desired straight trajectory having a triangular velocity profile (black dashed lines) starting at t = 50 s. The estimated positions of the drone are obtained on-board applying the implemented SCF-MF-3DOF algorithm to the data from the IMU and the camera during the flight.
Figure 16. Drone position vs time: the blue solid curves represent the 3D-position of the drone in an experimental test with a desired straight trajectory having a triangular velocity profile (black dashed lines) starting at t = 50 s. The estimated positions of the drone are obtained on-board applying the implemented SCF-MF-3DOF algorithm to the data from the IMU and the camera during the flight.
Sensors 21 00391 g016
Table 1. Standard deviation of the altitude position error for different algorithms.
Table 1. Standard deviation of the altitude position error for different algorithms.
AlgorithmStandard Deviation (Along y)
FCF-CF5.35 cm
FCF-MF4.01 cm
SCF-2DOF1.77 cm
Table 2. Standard deviation of the position error along the x-axis for different algorithms.
Table 2. Standard deviation of the position error along the x-axis for different algorithms.
AlgorithmStandard Deviation (Along x)
SCF-2DOF3.42 cm
SCF-3DOF2.54 cm
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Bigazzi, L.; Gherardini, S.; Innocenti, G.; Basso, M. Development of Non Expensive Technologies for Precise Maneuvering of Completely Autonomous Unmanned Aerial Vehicles. Sensors 2021, 21, 391. https://0-doi-org.brum.beds.ac.uk/10.3390/s21020391

AMA Style

Bigazzi L, Gherardini S, Innocenti G, Basso M. Development of Non Expensive Technologies for Precise Maneuvering of Completely Autonomous Unmanned Aerial Vehicles. Sensors. 2021; 21(2):391. https://0-doi-org.brum.beds.ac.uk/10.3390/s21020391

Chicago/Turabian Style

Bigazzi, Luca, Stefano Gherardini, Giacomo Innocenti, and Michele Basso. 2021. "Development of Non Expensive Technologies for Precise Maneuvering of Completely Autonomous Unmanned Aerial Vehicles" Sensors 21, no. 2: 391. https://0-doi-org.brum.beds.ac.uk/10.3390/s21020391

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop