SlideShare a Scribd company logo
TELKOMNIKA Telecommunication, Computing, Electronics and Control
Vol. 18, No. 5, October 2020, pp. 2674~2681
ISSN: 1693-6930, accredited First Grade by Kemenristekdikti, Decree No: 21/E/KPT/2018
DOI: 10.12928/TELKOMNIKA.v18i5.16716  2674
Journal homepage: http://journal.uad.ac.id/index.php/TELKOMNIKA
Development of control system for quadrotor unmanned aerial
vehicle using LoRa wireless and GPS tracking
Teddy Surya Gunawan1
, Wan Atheerah Yahya2
, Erwin Sulaeman3
, Mira Kartiwi4
, Zuriati Janin5
1,2
Department of Electrical and Computer Engineering, International Islamic University Malaysia, Malaysia
1
Fakultas Teknik dan Ilmu Komputer, Universitas Potensi Utama, Indonesia
3
Department of Mechanical Engineering, International Islamic University Malaysia, Malaysia
4
Departement of Information Systems, International Islamic University Malaysia, Malaysia
5
Faculty of Electrical Engineering, Universiti Teknologi MARA, Malaysia
Article Info ABSTRACT
Article history:
Received Jan 17, 2020
Revised Apr 29, 2020
Accepted May 11, 2020
In the past decades, there has been a growing interest in unmanned aerial
vehicles (UAVs) for educational, research, business, and military purposes.
The most critical data for a flight system is the telemetry data from the GPS
and wireless transmitter and also from the gyroscope and accelerometer.
The objective of this paper is to develop a control system for UAV using
long-range wireless communication and GPS. First, Matlab simulation was
conducted to obtain an optimum PID gains controller. Then LoRa wireless was
evaluated during clear and rainy days. Static and dynamic points measurement
was conducted to validate and optimize GPS accuracy. GeoMapping in Matlab
and Google GPS GeoPlanner were then used to analyze the traveled UAV
flight path.
Keywords:
GPS
LoRa
PID controller
Quadrotor UAV
Telemetry data This is an open access article under the CC BY-SA license.
Corresponding Author:
Teddy Surya Gunawan,
Department of Electrical and Computer Engineering,
International Islamic University Malaysia, Malaysia.
Email: tsgunawan@iium.edu.my
1. INTRODUCTION
In the past few years, the quadrotor unmanned aerial vehicle (UAV) has gained interest due to its
compact size, agility, and autonomous flight [1]. UAV is an aircraft without a pilot on board and can be flown
by a remote controller from a ground control station. UAVs can fly autonomously and also manually by remote
controller. There are many types of UAV across the world, and they have specific task and mission that depends
on the person who built the UAV. A quadrotor system can be used for surveillance [2, 3], rescue [4, 5], aerial
photography [6, 7], precision agriculture [8, 9], and other works that are dangerous or space limited for human
beings [10].
At first, UAV was not autonomously controlled. It was controlled by remote control and by manual
radio, just like a typical aircraft. The control systems of quadrotor UAV has been conducted by many
researchers.In [11, 12], the rigid body dynamics of a quadrotor UAV and several effects of aerodynamics
were investigated. Several controller can be implemented, including the PID controller [12], backstepping
controller [13, 14], sliding-mode controller [15, 16], adaptive control [17], fuzzy logic [18, 19], quantitative
feedback [20], reinforcement learning [21], etc. A review of various control systems' performance can be
found in [22].
TELKOMNIKA Telecommun Comput El Control 
Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan)
2675
Despite a sophisticated digital avionic system installed on the present aircraft, which defines aircraft
altitude, speed, and continuous position, we still need the UAV in various emergency situations. In this paper,
we introduce the use of long-range (LoRa) wireless module and also the GPS tracking to enable the Quadrotor
UAV to obtain telemetry data, for example, a continuous GPS position. The dynamics and control system of
the quadrotor UAV was modeled and simulated in Matlab. In order to get precise and continuous data telemetry
from the UAV to the ground control station (GCS), we use the long-range (LoRa) wireless communication
system [23].
2. QUADROTOR UNMANNED AERIAL VEHICLE (UAV) MODELLING
The majority of commercial quadrotors are marketed with the aim of doing aerial photography, e.g.,
Aeryon scout, Microdrones md4-1000, Quanser Qball, Parrot AR. Drone 2.0, DJI Phantom 3, AscTec,
Mikrokopter, etc. In addition, there are many communities and university-based open-source projects for
quadrotors development, e.g., STARMAC X4, ANU X4-Flyer, Arduino ATmega based, Mikrokopter based,
STM32 based, etc [24]. The structure of the quadrotor UAVs investigated in this paper is as shown in
Figure 1. There are two key states of the quadrotor UAV, i.e., position (𝑋, 𝑌, 𝑍) and attitude (roll, pitch, yaw).
The position describes the translation between the world frame and body frame. The attitude describes rotation
between the world and body frames. Roll describes how the right and left sides are elevated with respect to
each other (if the left side pushed down, and the right side is pushed up, the UAV will move to the left). Pitch
describes how the front and back are elevated with respect to each other (if the front is moved down, and
the back is up, it will move forward). And yaw describes the rotation of the drone (if the front, back, and both
sides are leveled, it can turn around the yaw axis without shifting position).
The dynamic of quadrotor UAVs can be formulated as described in [12, 17]. The position 𝑝 𝑥, 𝑝 𝑦, 𝑝𝑧
and attitude (roll, pitch, yaw) 𝜑, 𝜃, 𝜓, can be formulated as:
𝑝̈ 𝑥 = (cos 𝜑 sin 𝜃 cos 𝜓 + sin 𝜑 sin 𝜓)
𝜏4
𝑚
+ 𝑑1
𝑝̈ 𝑦 = (cos 𝜑 sin 𝜃 sin 𝜓 − sin 𝜑 cos 𝜓)
𝜏4
𝑚
+ 𝑑2
𝑝̈ 𝑧 = cos 𝜑 cos 𝜑
𝜏4
𝑚
− 𝑔 + 𝑑3
𝜑̈ = 𝜑̇ 𝜓̇ (
𝐽𝑧𝑧 − 𝐽𝑥𝑥
𝐽 𝑦𝑦
) +
𝐽 𝑅
𝐽 𝑦𝑦
𝜑̇ Ω 𝑅 +
𝐿
𝐽 𝑦𝑦
𝜏1 + 𝑑4
𝜃̈ = 𝜃̇ 𝜓̇ (
𝐽 𝑦𝑦 − 𝐽𝑧𝑧
𝐽𝑥𝑥
) −
𝐽 𝑅
𝐽𝑥𝑥
𝜃̇Ω 𝑅 +
𝐿
𝐽𝑥𝑥
𝜏2 + 𝑑5
𝜓̈ = 𝜑̇ 𝜃̇ (
𝐽𝑥𝑥 − 𝐽 𝑦𝑦
𝐽𝑧𝑧
) +
1
𝐽𝑧𝑧
𝜏3 + 𝑑6
(1)
where 𝑚 is the mass of the quadrotor and its payload, 𝐽𝑥𝑥, 𝐽 𝑦𝑦, 𝐽𝑧𝑧 are the moments of inertia of the quadrotor,
𝐿 is he length from the barycentre to the center of each rotor, 𝐽 𝑅 and Ω 𝑅 provide the moments of inertia and
angular velocity of the propeller blades, 𝑑1, ⋯ , 𝑑6 are bounded disturbances. 𝜏1, 𝜏2, 𝜏3 are thrusts in
the direction of roll, pitch, yaw and 𝜏4 is the collective thrust. The relationships between the thrust
[𝜏1, 𝜏2, 𝜏3, 𝜏4] 𝑇
and control signals [𝑢1, 𝑢2, 𝑢3, 𝑢4] 𝑇
for motors are shown as:
𝜏1 = 𝑐 𝑇(𝑢2 − 𝑢4)
𝜏2 = 𝑐 𝑇(𝑢1 − 𝑢3)
𝜏3 = 𝑐 𝑀(𝑢1 − 𝑢2 + 𝑢3 − 𝑢4)
𝜏4 = 𝑐 𝑇(𝑢1 + 𝑢2 + 𝑢3 + 𝑢4)
(2)
where [𝑢1, 𝑢2, 𝑢3, 𝑢4] 𝑇
are control signals that range from 0 to 1, 𝐶 𝑇 and 𝐶 𝑀 are the parameters which translate
control signals to thrusts and torque. The proportional integral derivative (PID) controller can be used due to
its relatively simple structure, which can be easily understood and implemented in practice.
𝑢(𝑡) = 𝐾𝑃 𝑒(𝑡) + 𝐾𝐼 ∫ 𝑒(𝜆)𝑑𝜆 + 𝐾 𝐷
𝑑𝑒(𝑡)
𝑑𝑡
𝑡
0
(3)
where 𝑢(𝑡) is the input signal, 𝑒(𝑡) = 𝑢(𝑡) − 𝜏(𝑡) is the error signal, 𝐾𝑃, 𝐾𝐼, 𝐾 𝐷 are the proportional, integral,
and derivative controller gains, respectively.
 ISSN: 1693-6930
TELKOMNIKA Telecommun Comput El Control, Vol. 18, No. 5, October 2020: 2674 - 2681
2676
Figure 1. The structure of quadrotor UAVs adopted from [21]
3. DESIGN OF CONTROL SYSTEM FOR QUADROTOR UAV
For the UAV design, the original UAV weight is estimated to be 550 grams with the battery. The weight
of the additional battery, LoRa wireless, GPS modules, and Arduino Mega microcontroller are counted as
the payload, which is estimated to be around 250 grams. Total weight is estimated to be around 800 grams. For
the design of a wireless module, there are several characteristics required, such as low data rate, longer range, and
very low power consumption. The high data rate is not required due to the nature of the commands being sent or the
data being received. In our research, we just transmit and receive GPS locations from the UAV to the ground station.
If image or video was required to be transmitted, then a higher data rate will be necessary. For long-range control
and data transmission, wireless communication should have long-range with relatively high fidelity. Moreover,
power consumption needs to be minimal to conserve limited battery power at UAV.
In this research, the long-range wireless module is used to obtain a continuous reading from the GPS sensor,
and the communication range should be between 5 to 10 km. The wireless module should be capable of self-standing
in terms of communication infrastructure and power supply since standard communication systems could have
collapsed during unpredictable events and emergencies. For this purpose, the wireless module used in this research
is Semtech Lora 868 MHz 915 MHz SX1272 Libelium radio frequency module [25], as shown in Figure 2 (a).
It has a dual-frequency band, i.e., 863-870 MHz (Europe) and 902-928 MHz (US). The transmission power is
14 dBm. The sensitivity is -134 dBm. Moreover, the communication distance can cover more than 22 km.
The SX1272 module uses the SPI protocol (Serial peripheral Interface) pins for communication.
The SPI port allows faster communication and frees up the Waspmote’s UART (Universal Asynchronous
Receiver/Transmitter) for other purposes. The SX1272 module does not implement any security method. Encryption
is provided through the Waspmote Encryption library. Specifically, through the AES algorithm with the symmetric
key, with a length of 128, 192, or 256 bits. Programming the microcontroller is a simple three steps process: write
the code, compile the code, and upload the code into the microcontroller.
The GPS module selected in this research is Ublox Neo-6M, as shown in Figure 2 (b). It produces outputs
of the current position and timing data in the format of NMEA 0183 and has a positioning accuracy of 10 meters
without and 5 meters with WAAS (Wide Area Augmentation System). It provides augmentation information to GPS
receivers to enhance the accuracy and reliability of position estimates and also expand the GPS, with the goal of
improving its accuracy, integrity, and availability. GPS U-Blox Neo 6M modules give different approaches for
geo-tagging and stitching images based on GNSS (global navigation systems).
The power supply required for this GPS module is 3.6 V suitable for Arduino. The DC current through any
digital I/O pin is around ten mA. The antenna gain is 50 dB, and the UART timing has a maximum bandwidth of
100 kbit/s. Many researchers have used this GPS U-Blox because of its usability and data accuracy. Currently, there
are 32 GPS satellites orbiting the Earth, in which ten satellites was enough to provide high accuracy data, while four
satellite will be the minimum. GPS satellite send course acquisition (C/A) code to GPS receiver on earth station and
give the accurate positioning to the user on Earth. The GPS user on Earth can even get the distance from one point
to another point according to GPS tracking.
For the payload at the UAV, Arduino Mega will be used and connected to GPS and LoRA wireless
modules [26, 27]. Multiprotocol radio shield, as shown in Figure 2 (c), is used to connect Arduino Mega and the
Wireless Libelium LoRa module. For the ground station, Arduino Uno and LoRa receiver are used and connected
to the computer to obtain the transmitted data from UAV. The specification of the UAV is a quadcopter with six
axes of movement, as shown in Figure 3. The controller is a 2.4 GHz transmitter. The length and width of the
quadcopter are 500 mm with a height of 190 mm. LiPo battery has a capacity of 7.4 V/2200 mA and power of
16.3 W. The payload for the UAV is including the GPS receiver, LoRa wireless module, and an HD camera for First
person view (FPV). However, to minimize battery usage for a longer flight, the HD camera captured the images and
saved it in the SD card, rather than real-time transmitting it to the ground station.
This UAV is controlled by a microcontroller such as Arduino and other sensors. Both of them have great
importance for increasing the efficiency of the UAV and can increase the performance of the aircraft system.
The payload prototype is made from plastic material for the cover of the body. A hierarchical control system is
TELKOMNIKA Telecommun Comput El Control 
Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan)
2677
designed where a high-level controller is responsible for GPS location and positioning and also controlling
long-range radio frequency modules.
The platform of the controller has a total of 4 actuators that are responsible for orienting and translating
the craft according to the outputs of the controller. The actuator lines are made up of the electronic speed controller
(ESC), the motors, and the propellers. The ESC obtains power from the 7.4 V main battery and an input signal in
the form of a pulse-width-modulation (PWM) command from the Arduino mega. The ESC then translates these
PWM commands into the appropriate rotating magnetic field used to control the speed of the motors.
(a) (b) (c)
Figure 2. Hardware design for control system of quadrotor UAV;
(a) LoRa SX1272, (b) GPS Ublox Neo-6m, (c) arduino multiprotocol shield
(a) (b)
Figure 3. Front and top view of the quadcopter; (a) front view and (b) top view
4. EXPERIMENTAL RESULTS AND DISCUSSION
This section describes the quadrotor Matlab simulation, experimental setup, and experiments on
the LoRa wireless communication and GPS accuracy. Matlab simulation confirmed that the PID controller
provided a good control system performance. Moreover, the next experiments evaluated the GPS accuracy of
the pre-determined UAV flight path using GPS GeoPlanner.
4.1. Matlab simulation
Matlab simulation of the aerodynamic design was used for prototyping and flight control system design of
a quadrotor UAV model. Additionally, the GeoMapping Matlab toolbox is utilized for a comprehensive GPS
calculation and validation. With the time calculation utilities, we can compute Julian dates, decimal year, and leap
year. Aerospace toolbox provides three options for visualizing flight data. First, the interface to flight gear flight
simulator lets us visualize vehicle dynamics in a sophisticated 3-D simulation framework. The flight simulator can
playback flight-test data through flight gear and effectively reconstruct behavioral anomalies in the flight-test results.
Matlab Aerospace Toolbox includes functions for controlling the position and altitude of a vehicle in the flight-gear
simulator by using double-precision values of longitude, latitude, altitude, roll, pitch, and yaw. Second, the interface
to simulink 3D animation lets us use the flight data to control vehicle position and attitude in a virtual-reality scene.
The dynamics of the quadrotor are taken from [28] with some slight modification, e.g., the weight of UAV is set to
0.8kg, the length of the quadrotor is set to 0.27 m, etc. Figure 4 shows the Simulink model, while Figure 5 shows
the simulation results, in which the designed PID controller has achieved a good performance. It simulates UAV to
move up from the ground until a pre-defined hight (modify 𝑧). After that, the desired 𝑥 and 𝑦 are set to become
increasing sinusoidal from 0 to 90 seconds and kept constant afterward. The simulation results show the desired
position in 3D versus the actual position, forming an up and spiral movement of the UAV.
 ISSN: 1693-6930
TELKOMNIKA Telecommun Comput El Control, Vol. 18, No. 5, October 2020: 2674 - 2681
2678
Figure 4. Simulink model of the quadrotor UAV
(a) (b)
Figure 5. Quadrotor UAV simulation results; (a) desired and actual position X, Y, Z and
(b) desired and actual position in 3D
4.2. Experimental setup
The experimental setup is shown in Figure 6. We have divided the experiments into static and dynamic
points measurements. For static points measurement, the ground control station is placed at one static location,
and the GPS coordinates of that location are measured using the GPS Ublox NEO, in which we obtained
Point A. We then moved the GPS receiver to another location, and the GPS coordinates at that location were
transmitted using LoRa to the ground station and recorded to obtain Point B. The distance between point A and
point B then can be calculated.
For dynamic points measurement, the ground station GPS location has been recorded earlier (from
static measurement). The LoRa transmitter is attached to the quadrotor UAV. The UAV is then flown to any
locations, and its positions were transmitted to the ground station and recorded. For analysis purposes,
the recorded GPS locations were then plotted using the GeoMapping tool in Matlab, in which we can further
analyze the dynamic flight path.
4.3. Experiment on LoRa
Figure 7 shows an example of LoRa wireless receiver output at the Ground Station during a clear day
and rainy day. The SNR value and packet length during the rainy day were found to be (-31, 129), (-31, 129),
(-31, 127), and (3, 255), in four consecutive readings. It showed that during rain, the wireless signal is
attenuated, and the SNR fluctuates to -31 dB as it experiences disturbances and noises. From this experiment,
the LoRa module was found to be working as expected.
TELKOMNIKA Telecommun Comput El Control 
Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan)
2679
Figure 6. Experimental setup between ground station and quadrotor UAV
(a)
(b)
Figure 7. LoRa receiver output during a clear and rainy day; (a) clear day and (b) rainy day
4.4. Experiment on GPS accuracy and GeoMapping using Matlab and Geoplanner
As described in the previous section, the dynamic measurement was used to evaluate GPS accuracy.
Point A is located at the Petanque area of Female Sport Complex, IIUM, while Point B is located at Female
Sport Complex Gym, IIUM. This experiment was repeated eight times, and the result is shown in Table 1.
In conclusion, the GPS receiver module is working as intended. Figures 8 and 9 showed the GeoMapping result
using Matlab and GPS Planner, respectively. The distance traveled during the dynamic GPS measurement is
around 10.23 km. In our experiment, the quadrotor UAV was controlled using manual remote control.
The GPS coordinates are then recorded and transmitted to the ground station using LoRa. For the autonomous
flight, we could create a flight plan based on locations in which the UAV could fly on its own following
 ISSN: 1693-6930
TELKOMNIKA Telecommun Comput El Control, Vol. 18, No. 5, October 2020: 2674 - 2681
2680
the flight path. This can be used later on, along with the image or video recording, for various purposes, such
as geospatial mapping, precision agriculture, disaster area mapping, etc.
Table 1. Latitude, longitude, and distance between two points
Delta
(latitude)
longitude
(B-A)
Mean
latitude
Point A Point B Lat2 Long2 Distance (m)
Altitude
Difference
-0.0007 -0.0008 3.25365 63.3 148.2 4.9E-07 0.999993225 117.6 84.9
-0.0007 -0.00048 3.25365 63.3 165.7 4.9E-07 0.999994813 117.61 102.4
-0.0007 101.6716 3.25365 0 165.7 4.9E-07 0.999994813 117.61 165.7
-0.00062 101.6715 3.25369 0 171.1 3.84E-07 0.999995931 117.61 171.1
-0.0015 -0.00078 3.25413 72.1 171.1 2.25E-06 0.999976174 187 99
-0.00152 -0.00078 3.25414 72.2 171.1 2.31E-06 0.999975534 188 98.9
-0.00176 -0.00077 3.25434 99.2 204 3.1E-06 0.999967195 212 104.8
-0.00186 -0.00083 3.25429 99.2 172.1 3.46E-06 0.999963349 134 72.9
Average: 148.93 112.46
Figure 8. Sample of GPS route that was traveled in real flight experiment using GeoMapping
Figure 9. Sample of GPS route that was traveled in real flight experiment using GPS GeoPlanner
5. CONCLUSIONS
This paper has presented the design of the control system of quadrotor UAV using LoRa wireless
communication and GPS modules. Matlab simulation was conducted to obtain an optimum PID gains controller.
Next, the suitability of the LoRa wireless module to be used for telemetry data was evaluated during a clear and rainy
day. The GPS telemetry data was validated and optimized using static and dynamic points measurements. Lastly,
GeoMapping in Matlab and Google GPS GeoPlanner were used to analyze the real flight path. Future works include
improved simulation of the quadrotor UAV using the available open-source drone, the use of various sensors and
images for telemetry data, and autonomous flight using a pre-determined flight plan.
TELKOMNIKA Telecommun Comput El Control 
Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan)
2681
ACKNOWLEDGMENTS
The author would like to express their gratitude to the Malaysian Ministry of Education (MOE), which
has provided research funding through the Fundamental Research Grant, FRGS19-076-0684. The authors
would also like to thank International Islamic University Malaysia (IIUM), Universitas Potensi Utama, and
Universiti Teknologi MARA (UiTM) Shah Alam for providing facilities to support the research work.
REFERENCES
[1] S. Norouzi Ghazbi, Y. Aghli, M. Alimohammadi, and A. Akbari, "Quadrotors Unmanned Aerial Vehicle: A Review,"
International Journal on Smart Sensing & Intelligent Systems, vol. 9, no. 1, pp. 309-333, 2016.
[2] R. L. Finn, D. J. C. L. Wright, and S. Review, "Unmanned aircraft systems: Surveillance, ethics and privacy in civil
applications," Computer Law & Security Review, vol. 28, no. 2, pp. 184-194, 2012.
[3] H. Kim and J. Ben-Othman, "A Collision-Free Surveillance System Using Smart UAVs in Multi Domain IoT," IEEE
Communications Letters, vol. 22, no. 12, pp. 2587-2590, 2018.
[4] M. Silvagni, A. Tonoli, E. Zenerino, and M. Chiaberge, "Multipurpose UAV for search and rescue operations in
mountain avalanche events," Geomatics, Natural Hazards and Risk, vol. 8, pp. 18-33, 2017.
[5] J. Qi, D. Song, H. Shang, N. Wang, C. Hua, C. Wu, X. Qi, and J. Han, "Search and rescue rotary‐wing uav and its
application to the lushan ms 7.0 earthquake," Journal of Field Robotics, vol. 33, no. 3, pp. 290-321, 2016.
[6] N. H. Motlagh, T. Taleb, and O. Arouk, "Low-altitude unmanned aerial vehicles-based internet of things services:
Comprehensive survey and future perspectives," IEEE Internet of Things Journal, vol. 3, no. 6, pp. 899-922, 2016.
[7] C. Kanellakis and G. Nikolakopoulos, "Survey on computer vision for UAVs: Current developments and trends,"
Journal of Intelligent & Robotic Systems, vol. 87, pp. 141-168, 2017.
[8] V. Puri, A. Nayyar, and L. Raja, "Agriculture drones: A modern breakthrough in precision agriculture," Journal of
Statistics and Management Systems, vol. 20, no. 4, pp. 507-518, 2017.
[9] U. R. Mogili and B. Deepak, "Review on application of drone systems in precision agriculture," Procedia computer
science, vol. 133, pp. 502-509, 2018.
[10] P. Liu, A. Y. Chen, Y. N. Huang, J. Y. Han, J. S. Lai, S. C. Kang, T. H. Wu, M. C. Wen, and M. H. Tsai, "A review
of rotorcraft unmanned aerial vehicle (UAV) developments and applications in civil engineering," Smart Structures
and Systems, vol. 13, no. 6, pp. 1065-1094, 2014.
[11] S. Bouabdallah and R. Siegwart, "Full control of a quadrotor," 2007 IEEE/RSJ International Conference on Intelligent
Robots and Systems, pp. 153-158, 2007.
[12] A. L. Salih, M. Moghavvemi, et al., "Modelling and PID controller design for a quadrotor unmanned air vehicle,"
2010 IEEE International Conference on Automation, Quality and Testing, Robotics (AQTR), pp. 1-5, 2010.
[13] F. Chen, R. Jiang, K. Zhang, B. Jiang, and G. Tao, "Robust backstepping sliding-mode control and observer-based fault
estimation for a quadrotor UAV," IEEE Transactions on Industrial Electronics, vol. 63, no. 6, pp. 5044-5056, 2016.
[14] F. Chen, W. Lei, K. Zhang, G. Tao, and B. Jiang, "A novel nonlinear resilient control for a quadrotor UAV via
backstepping control and nonlinear disturbance observer," Nonlinear Dynamics, vol. 85, no. 2, pp. 1281-1295, 2016.
[15] J.-J. Xiong and G.-B. Zhang, "Global fast dynamic terminal sliding mode control for a quadrotor UAV," ISA
transactions, vol. 66, pp. 233-240, 2017.
[16] O. Mofid and S. Mobayen, "Adaptive sliding mode control for finite-time stability of quadrotor UAVs with parametric
uncertainties," ISA transactions, vol. 72, pp. 1-14, 2018.
[17] Z. T. Dydek, A. M. Annaswamy, and E. Lavretsky, "Adaptive control of quadrotor UAVs: A design trade study with
flight evaluations," IEEE Transactions on Control Systems Technology, vol. 21, no. 4, pp. 1400-1406, 2012.
[18] M. Santos, V. Lopez, and F. Morata, "Intelligent fuzzy controller of a quadrotor," 2010 IEEE international conference
on intelligent systems and knowledge engineering, pp. 141-146, 2010.
[19] B. Erginer and E. Altuğ, "Design and implementation of a hybrid fuzzy logic controller for a quadrotor VTOL vehicle,"
International Journal of Control, Automation and Systems, vol. 10, no. 1, pp. 61-70, 2012.
[20] A. M. Hairon, H. Mansor, T. Gunawan, and S. Khan, "Travel angle control of quanser bench-top helicopter based on
Quantitative Feedback Theory technique," Indonesian Journal of Electrical Engineering and Computer Science,
vol. 1, no. 2, pp. 310-318, 2016.
[21] X. Lin, Y. Yu, and C. Sun, "Supplementary Reinforcement Learning Controller Designed for Quadrotor UAVs," IEEE
Access, vol. 7, pp. 26422-26431, 2019.
[22] A. Zulu and S. John, "A review of control algorithms for autonomous quadrotors," Open Journal of Applied Science,
vol. 4, pp. 547-556, 2014.
[23] C. Trasviña-Moreno, R. Blasco, Á. Marco, R. Casas, and A. Trasviña-Castro, "Unmanned aerial vehicle based wireless
sensor network for marine-coastal environment monitoring," Sensors, vol. 04, no. 17, pp. 460, 2017.
[24] M. Bangura, "Aerodynamics and Control of Quadrotors," PhD Thesis, Australian National University, 2017.
[25] Libelium, "Waspmote LoRa 868 MHz 915 MHz SX1272 Networking Guide," 2015.
[26] T. S. Gunawan, I. Rahmithul, H. Yaldi, M. Kartiwi, and N. Ismail, "Prototype design of smart home system using internet of
things," Indonesian Journal of Electrical Engineering and Computer Science, vol. 7, no.1, pp. 107-115, 2017.
[27] T. S. Gunawan, I. R. H. Yaldi, M. Kartiwi, and H. Mansor, "Performance Evaluation of Smart Home System using
Internet of Things," International Journal of Electrical and Computer Engineering, vol. 8, no. 1, pp. 400, 2018.
[28] T. Bresciani, "Modelling, Identification and Control of a Quadrotor Helicopter," MSc Thesis, Lund Unversity, 2008.

More Related Content

What's hot

Quadcopter final report anand
Quadcopter final report anandQuadcopter final report anand
Quadcopter final report anand
Anand kumar
 
Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...
Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...
Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...
IJPEDS-IAES
 
Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...
Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...
Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...
International Journal of Power Electronics and Drive Systems
 
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Mustefa Jibril
 
Report of quadcopter
Report of quadcopterReport of quadcopter
Report of quadcopter
Ashish Patel
 
Fabrication of drone
Fabrication of droneFabrication of drone
Fabrication of drone
Rajnish Kumar
 
Design of an autonomous ornithopter with live video
Design of an autonomous ornithopter with live videoDesign of an autonomous ornithopter with live video
Design of an autonomous ornithopter with live video
eSAT Publishing House
 
A survey of quadrotor unmanned aerial vehicles
A survey of quadrotor unmanned aerial vehiclesA survey of quadrotor unmanned aerial vehicles
A survey of quadrotor unmanned aerial vehicles
Calculadoras Online
 
Pwm
PwmPwm
Making of Drone
Making of  DroneMaking of  Drone
Making of Drone
mohanchandrakanth swarna
 
Real time tracking based on gsm and ir module for running train
Real time tracking based on gsm and ir module for running trainReal time tracking based on gsm and ir module for running train
Real time tracking based on gsm and ir module for running train
eSAT Journals
 
Air Ambulance Drone (UAV)
 	  Air Ambulance Drone (UAV) 	  Air Ambulance Drone (UAV)
Air Ambulance Drone (UAV)
IRJET Journal
 
Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...
Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...
Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...
International Journal of Power Electronics and Drive Systems
 
Ad4101172176
Ad4101172176Ad4101172176
Ad4101172176
IJERA Editor
 
Anti collision device
Anti collision deviceAnti collision device
Anti collision device
svsanthoshkumar
 
Drone Building 101
Drone Building 101Drone Building 101
Drone Building 101
Aaron Buma
 
IJSRED-V2I2P31
IJSRED-V2I2P31IJSRED-V2I2P31
IJSRED-V2I2P31
IJSRED
 
IRJET- Smart Accident Detection and Emergency Notification System using IoT a...
IRJET- Smart Accident Detection and Emergency Notification System using IoT a...IRJET- Smart Accident Detection and Emergency Notification System using IoT a...
IRJET- Smart Accident Detection and Emergency Notification System using IoT a...
IRJET Journal
 
A Flexible Closed Loop PMDC Motor Speed Control System for Precise Positioning
A Flexible Closed Loop PMDC Motor Speed Control System for Precise PositioningA Flexible Closed Loop PMDC Motor Speed Control System for Precise Positioning
A Flexible Closed Loop PMDC Motor Speed Control System for Precise Positioning
Waqas Tariq
 
Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...
IJECEIAES
 

What's hot (20)

Quadcopter final report anand
Quadcopter final report anandQuadcopter final report anand
Quadcopter final report anand
 
Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...
Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...
Speed Tracking of Field Oriented Control Permanent Magnet Synchronous Motor U...
 
Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...
Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...
Speed Control of 3-phase Induction Motors under Fault Conditions Supplied by ...
 
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...Design and control of ems magnetic levitation train using fuzzy mras and pid ...
Design and control of ems magnetic levitation train using fuzzy mras and pid ...
 
Report of quadcopter
Report of quadcopterReport of quadcopter
Report of quadcopter
 
Fabrication of drone
Fabrication of droneFabrication of drone
Fabrication of drone
 
Design of an autonomous ornithopter with live video
Design of an autonomous ornithopter with live videoDesign of an autonomous ornithopter with live video
Design of an autonomous ornithopter with live video
 
A survey of quadrotor unmanned aerial vehicles
A survey of quadrotor unmanned aerial vehiclesA survey of quadrotor unmanned aerial vehicles
A survey of quadrotor unmanned aerial vehicles
 
Pwm
PwmPwm
Pwm
 
Making of Drone
Making of  DroneMaking of  Drone
Making of Drone
 
Real time tracking based on gsm and ir module for running train
Real time tracking based on gsm and ir module for running trainReal time tracking based on gsm and ir module for running train
Real time tracking based on gsm and ir module for running train
 
Air Ambulance Drone (UAV)
 	  Air Ambulance Drone (UAV) 	  Air Ambulance Drone (UAV)
Air Ambulance Drone (UAV)
 
Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...
Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...
Speed and Position Estimator of Dual-PMSM for Independent Control Drives usin...
 
Ad4101172176
Ad4101172176Ad4101172176
Ad4101172176
 
Anti collision device
Anti collision deviceAnti collision device
Anti collision device
 
Drone Building 101
Drone Building 101Drone Building 101
Drone Building 101
 
IJSRED-V2I2P31
IJSRED-V2I2P31IJSRED-V2I2P31
IJSRED-V2I2P31
 
IRJET- Smart Accident Detection and Emergency Notification System using IoT a...
IRJET- Smart Accident Detection and Emergency Notification System using IoT a...IRJET- Smart Accident Detection and Emergency Notification System using IoT a...
IRJET- Smart Accident Detection and Emergency Notification System using IoT a...
 
A Flexible Closed Loop PMDC Motor Speed Control System for Precise Positioning
A Flexible Closed Loop PMDC Motor Speed Control System for Precise PositioningA Flexible Closed Loop PMDC Motor Speed Control System for Precise Positioning
A Flexible Closed Loop PMDC Motor Speed Control System for Precise Positioning
 
Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...
 

Similar to Development of control system for quadrotor unmanned aerial vehicle using LoRa wireless and GPS tracking

Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
IOSR Journals
 
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
IOSR Journals
 
Drone’s node placement algorithm with routing protocols to enhance surveillance
Drone’s node placement algorithm with routing protocols to  enhance surveillanceDrone’s node placement algorithm with routing protocols to  enhance surveillance
Drone’s node placement algorithm with routing protocols to enhance surveillance
IJECEIAES
 
40120130405009
4012013040500940120130405009
40120130405009
IAEME Publication
 
Waypoint Flight Parameter Comparison of an Autonomous Uav
Waypoint  Flight  Parameter  Comparison  of an Autonomous UavWaypoint  Flight  Parameter  Comparison  of an Autonomous Uav
Waypoint Flight Parameter Comparison of an Autonomous Uav
ijaia
 
IRJET- Surveillance Drone
IRJET-  	  Surveillance DroneIRJET-  	  Surveillance Drone
IRJET- Surveillance Drone
IRJET Journal
 
Quadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui systemQuadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui system
eSAT Journals
 
Quadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui systemQuadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui system
eSAT Publishing House
 
FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...
FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...
FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...
IJECEIAES
 
Smart missile navigation in defence system using rc4 algorithm to detect target
Smart missile navigation in defence system using rc4 algorithm to detect targetSmart missile navigation in defence system using rc4 algorithm to detect target
Smart missile navigation in defence system using rc4 algorithm to detect target
eSAT Publishing House
 
IRJET- Radiosonde Payload for Weather Balloons
IRJET-  	  Radiosonde Payload for Weather BalloonsIRJET-  	  Radiosonde Payload for Weather Balloons
IRJET- Radiosonde Payload for Weather Balloons
IRJET Journal
 
Low-cost quadrotor hardware design with PID control system as flight controller
Low-cost quadrotor hardware design with PID control system as flight controllerLow-cost quadrotor hardware design with PID control system as flight controller
Low-cost quadrotor hardware design with PID control system as flight controller
TELKOMNIKA JOURNAL
 
Secrecy performance analysis on spatial modeling of wireless communications w...
Secrecy performance analysis on spatial modeling of wireless communications w...Secrecy performance analysis on spatial modeling of wireless communications w...
Secrecy performance analysis on spatial modeling of wireless communications w...
IJECEIAES
 
Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...
Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...
Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...
IRJET Journal
 
A Review on Longitudinal Control Law Design for a Small Fixed-Wing UAV
A Review on Longitudinal Control Law Design for a Small Fixed-Wing UAVA Review on Longitudinal Control Law Design for a Small Fixed-Wing UAV
A Review on Longitudinal Control Law Design for a Small Fixed-Wing UAV
IRJET Journal
 
Smart aerosonde UAV longitudinal flight control system based on genetic algor...
Smart aerosonde UAV longitudinal flight control system based on genetic algor...Smart aerosonde UAV longitudinal flight control system based on genetic algor...
Smart aerosonde UAV longitudinal flight control system based on genetic algor...
journalBEEI
 
Remote Monitoring and Control of Boat Using Lora Technology
Remote Monitoring and Control of Boat Using Lora TechnologyRemote Monitoring and Control of Boat Using Lora Technology
Remote Monitoring and Control of Boat Using Lora Technology
IJAEMSJORNAL
 
Final
FinalFinal
Final
Jay Vala
 
Crane monitoring system based on internet of things using long range
Crane monitoring system based on internet of things using long range Crane monitoring system based on internet of things using long range
Crane monitoring system based on internet of things using long range
IJECEIAES
 
IRJET - PRS Nano UAV System
IRJET - PRS Nano UAV SystemIRJET - PRS Nano UAV System
IRJET - PRS Nano UAV System
IRJET Journal
 

Similar to Development of control system for quadrotor unmanned aerial vehicle using LoRa wireless and GPS tracking (20)

Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
 
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
Design and Structural Analysis for an Autonomous UAV System Consisting of Sla...
 
Drone’s node placement algorithm with routing protocols to enhance surveillance
Drone’s node placement algorithm with routing protocols to  enhance surveillanceDrone’s node placement algorithm with routing protocols to  enhance surveillance
Drone’s node placement algorithm with routing protocols to enhance surveillance
 
40120130405009
4012013040500940120130405009
40120130405009
 
Waypoint Flight Parameter Comparison of an Autonomous Uav
Waypoint  Flight  Parameter  Comparison  of an Autonomous UavWaypoint  Flight  Parameter  Comparison  of an Autonomous Uav
Waypoint Flight Parameter Comparison of an Autonomous Uav
 
IRJET- Surveillance Drone
IRJET-  	  Surveillance DroneIRJET-  	  Surveillance Drone
IRJET- Surveillance Drone
 
Quadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui systemQuadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui system
 
Quadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui systemQuadcopter (uavs) for border security with gui system
Quadcopter (uavs) for border security with gui system
 
FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...
FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...
FIToplankton: Wireless Controlled Remotely-operated Underwater Vehicle (ROV) ...
 
Smart missile navigation in defence system using rc4 algorithm to detect target
Smart missile navigation in defence system using rc4 algorithm to detect targetSmart missile navigation in defence system using rc4 algorithm to detect target
Smart missile navigation in defence system using rc4 algorithm to detect target
 
IRJET- Radiosonde Payload for Weather Balloons
IRJET-  	  Radiosonde Payload for Weather BalloonsIRJET-  	  Radiosonde Payload for Weather Balloons
IRJET- Radiosonde Payload for Weather Balloons
 
Low-cost quadrotor hardware design with PID control system as flight controller
Low-cost quadrotor hardware design with PID control system as flight controllerLow-cost quadrotor hardware design with PID control system as flight controller
Low-cost quadrotor hardware design with PID control system as flight controller
 
Secrecy performance analysis on spatial modeling of wireless communications w...
Secrecy performance analysis on spatial modeling of wireless communications w...Secrecy performance analysis on spatial modeling of wireless communications w...
Secrecy performance analysis on spatial modeling of wireless communications w...
 
Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...
Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...
Advanced Anti Accidental Solution by Pre Analyzing, Tracking and Detection of...
 
A Review on Longitudinal Control Law Design for a Small Fixed-Wing UAV
A Review on Longitudinal Control Law Design for a Small Fixed-Wing UAVA Review on Longitudinal Control Law Design for a Small Fixed-Wing UAV
A Review on Longitudinal Control Law Design for a Small Fixed-Wing UAV
 
Smart aerosonde UAV longitudinal flight control system based on genetic algor...
Smart aerosonde UAV longitudinal flight control system based on genetic algor...Smart aerosonde UAV longitudinal flight control system based on genetic algor...
Smart aerosonde UAV longitudinal flight control system based on genetic algor...
 
Remote Monitoring and Control of Boat Using Lora Technology
Remote Monitoring and Control of Boat Using Lora TechnologyRemote Monitoring and Control of Boat Using Lora Technology
Remote Monitoring and Control of Boat Using Lora Technology
 
Final
FinalFinal
Final
 
Crane monitoring system based on internet of things using long range
Crane monitoring system based on internet of things using long range Crane monitoring system based on internet of things using long range
Crane monitoring system based on internet of things using long range
 
IRJET - PRS Nano UAV System
IRJET - PRS Nano UAV SystemIRJET - PRS Nano UAV System
IRJET - PRS Nano UAV System
 

More from TELKOMNIKA JOURNAL

Amazon products reviews classification based on machine learning, deep learni...
Amazon products reviews classification based on machine learning, deep learni...Amazon products reviews classification based on machine learning, deep learni...
Amazon products reviews classification based on machine learning, deep learni...
TELKOMNIKA JOURNAL
 
Design, simulation, and analysis of microstrip patch antenna for wireless app...
Design, simulation, and analysis of microstrip patch antenna for wireless app...Design, simulation, and analysis of microstrip patch antenna for wireless app...
Design, simulation, and analysis of microstrip patch antenna for wireless app...
TELKOMNIKA JOURNAL
 
Design and simulation an optimal enhanced PI controller for congestion avoida...
Design and simulation an optimal enhanced PI controller for congestion avoida...Design and simulation an optimal enhanced PI controller for congestion avoida...
Design and simulation an optimal enhanced PI controller for congestion avoida...
TELKOMNIKA JOURNAL
 
Improving the detection of intrusion in vehicular ad-hoc networks with modifi...
Improving the detection of intrusion in vehicular ad-hoc networks with modifi...Improving the detection of intrusion in vehicular ad-hoc networks with modifi...
Improving the detection of intrusion in vehicular ad-hoc networks with modifi...
TELKOMNIKA JOURNAL
 
Conceptual model of internet banking adoption with perceived risk and trust f...
Conceptual model of internet banking adoption with perceived risk and trust f...Conceptual model of internet banking adoption with perceived risk and trust f...
Conceptual model of internet banking adoption with perceived risk and trust f...
TELKOMNIKA JOURNAL
 
Efficient combined fuzzy logic and LMS algorithm for smart antenna
Efficient combined fuzzy logic and LMS algorithm for smart antennaEfficient combined fuzzy logic and LMS algorithm for smart antenna
Efficient combined fuzzy logic and LMS algorithm for smart antenna
TELKOMNIKA JOURNAL
 
Design and implementation of a LoRa-based system for warning of forest fire
Design and implementation of a LoRa-based system for warning of forest fireDesign and implementation of a LoRa-based system for warning of forest fire
Design and implementation of a LoRa-based system for warning of forest fire
TELKOMNIKA JOURNAL
 
Wavelet-based sensing technique in cognitive radio network
Wavelet-based sensing technique in cognitive radio networkWavelet-based sensing technique in cognitive radio network
Wavelet-based sensing technique in cognitive radio network
TELKOMNIKA JOURNAL
 
A novel compact dual-band bandstop filter with enhanced rejection bands
A novel compact dual-band bandstop filter with enhanced rejection bandsA novel compact dual-band bandstop filter with enhanced rejection bands
A novel compact dual-band bandstop filter with enhanced rejection bands
TELKOMNIKA JOURNAL
 
Deep learning approach to DDoS attack with imbalanced data at the application...
Deep learning approach to DDoS attack with imbalanced data at the application...Deep learning approach to DDoS attack with imbalanced data at the application...
Deep learning approach to DDoS attack with imbalanced data at the application...
TELKOMNIKA JOURNAL
 
Brief note on match and miss-match uncertainties
Brief note on match and miss-match uncertaintiesBrief note on match and miss-match uncertainties
Brief note on match and miss-match uncertainties
TELKOMNIKA JOURNAL
 
Implementation of FinFET technology based low power 4×4 Wallace tree multipli...
Implementation of FinFET technology based low power 4×4 Wallace tree multipli...Implementation of FinFET technology based low power 4×4 Wallace tree multipli...
Implementation of FinFET technology based low power 4×4 Wallace tree multipli...
TELKOMNIKA JOURNAL
 
Evaluation of the weighted-overlap add model with massive MIMO in a 5G system
Evaluation of the weighted-overlap add model with massive MIMO in a 5G systemEvaluation of the weighted-overlap add model with massive MIMO in a 5G system
Evaluation of the weighted-overlap add model with massive MIMO in a 5G system
TELKOMNIKA JOURNAL
 
Reflector antenna design in different frequencies using frequency selective s...
Reflector antenna design in different frequencies using frequency selective s...Reflector antenna design in different frequencies using frequency selective s...
Reflector antenna design in different frequencies using frequency selective s...
TELKOMNIKA JOURNAL
 
Reagentless iron detection in water based on unclad fiber optical sensor
Reagentless iron detection in water based on unclad fiber optical sensorReagentless iron detection in water based on unclad fiber optical sensor
Reagentless iron detection in water based on unclad fiber optical sensor
TELKOMNIKA JOURNAL
 
Impact of CuS counter electrode calcination temperature on quantum dot sensit...
Impact of CuS counter electrode calcination temperature on quantum dot sensit...Impact of CuS counter electrode calcination temperature on quantum dot sensit...
Impact of CuS counter electrode calcination temperature on quantum dot sensit...
TELKOMNIKA JOURNAL
 
A progressive learning for structural tolerance online sequential extreme lea...
A progressive learning for structural tolerance online sequential extreme lea...A progressive learning for structural tolerance online sequential extreme lea...
A progressive learning for structural tolerance online sequential extreme lea...
TELKOMNIKA JOURNAL
 
Electroencephalography-based brain-computer interface using neural networks
Electroencephalography-based brain-computer interface using neural networksElectroencephalography-based brain-computer interface using neural networks
Electroencephalography-based brain-computer interface using neural networks
TELKOMNIKA JOURNAL
 
Adaptive segmentation algorithm based on level set model in medical imaging
Adaptive segmentation algorithm based on level set model in medical imagingAdaptive segmentation algorithm based on level set model in medical imaging
Adaptive segmentation algorithm based on level set model in medical imaging
TELKOMNIKA JOURNAL
 
Automatic channel selection using shuffled frog leaping algorithm for EEG bas...
Automatic channel selection using shuffled frog leaping algorithm for EEG bas...Automatic channel selection using shuffled frog leaping algorithm for EEG bas...
Automatic channel selection using shuffled frog leaping algorithm for EEG bas...
TELKOMNIKA JOURNAL
 

More from TELKOMNIKA JOURNAL (20)

Amazon products reviews classification based on machine learning, deep learni...
Amazon products reviews classification based on machine learning, deep learni...Amazon products reviews classification based on machine learning, deep learni...
Amazon products reviews classification based on machine learning, deep learni...
 
Design, simulation, and analysis of microstrip patch antenna for wireless app...
Design, simulation, and analysis of microstrip patch antenna for wireless app...Design, simulation, and analysis of microstrip patch antenna for wireless app...
Design, simulation, and analysis of microstrip patch antenna for wireless app...
 
Design and simulation an optimal enhanced PI controller for congestion avoida...
Design and simulation an optimal enhanced PI controller for congestion avoida...Design and simulation an optimal enhanced PI controller for congestion avoida...
Design and simulation an optimal enhanced PI controller for congestion avoida...
 
Improving the detection of intrusion in vehicular ad-hoc networks with modifi...
Improving the detection of intrusion in vehicular ad-hoc networks with modifi...Improving the detection of intrusion in vehicular ad-hoc networks with modifi...
Improving the detection of intrusion in vehicular ad-hoc networks with modifi...
 
Conceptual model of internet banking adoption with perceived risk and trust f...
Conceptual model of internet banking adoption with perceived risk and trust f...Conceptual model of internet banking adoption with perceived risk and trust f...
Conceptual model of internet banking adoption with perceived risk and trust f...
 
Efficient combined fuzzy logic and LMS algorithm for smart antenna
Efficient combined fuzzy logic and LMS algorithm for smart antennaEfficient combined fuzzy logic and LMS algorithm for smart antenna
Efficient combined fuzzy logic and LMS algorithm for smart antenna
 
Design and implementation of a LoRa-based system for warning of forest fire
Design and implementation of a LoRa-based system for warning of forest fireDesign and implementation of a LoRa-based system for warning of forest fire
Design and implementation of a LoRa-based system for warning of forest fire
 
Wavelet-based sensing technique in cognitive radio network
Wavelet-based sensing technique in cognitive radio networkWavelet-based sensing technique in cognitive radio network
Wavelet-based sensing technique in cognitive radio network
 
A novel compact dual-band bandstop filter with enhanced rejection bands
A novel compact dual-band bandstop filter with enhanced rejection bandsA novel compact dual-band bandstop filter with enhanced rejection bands
A novel compact dual-band bandstop filter with enhanced rejection bands
 
Deep learning approach to DDoS attack with imbalanced data at the application...
Deep learning approach to DDoS attack with imbalanced data at the application...Deep learning approach to DDoS attack with imbalanced data at the application...
Deep learning approach to DDoS attack with imbalanced data at the application...
 
Brief note on match and miss-match uncertainties
Brief note on match and miss-match uncertaintiesBrief note on match and miss-match uncertainties
Brief note on match and miss-match uncertainties
 
Implementation of FinFET technology based low power 4×4 Wallace tree multipli...
Implementation of FinFET technology based low power 4×4 Wallace tree multipli...Implementation of FinFET technology based low power 4×4 Wallace tree multipli...
Implementation of FinFET technology based low power 4×4 Wallace tree multipli...
 
Evaluation of the weighted-overlap add model with massive MIMO in a 5G system
Evaluation of the weighted-overlap add model with massive MIMO in a 5G systemEvaluation of the weighted-overlap add model with massive MIMO in a 5G system
Evaluation of the weighted-overlap add model with massive MIMO in a 5G system
 
Reflector antenna design in different frequencies using frequency selective s...
Reflector antenna design in different frequencies using frequency selective s...Reflector antenna design in different frequencies using frequency selective s...
Reflector antenna design in different frequencies using frequency selective s...
 
Reagentless iron detection in water based on unclad fiber optical sensor
Reagentless iron detection in water based on unclad fiber optical sensorReagentless iron detection in water based on unclad fiber optical sensor
Reagentless iron detection in water based on unclad fiber optical sensor
 
Impact of CuS counter electrode calcination temperature on quantum dot sensit...
Impact of CuS counter electrode calcination temperature on quantum dot sensit...Impact of CuS counter electrode calcination temperature on quantum dot sensit...
Impact of CuS counter electrode calcination temperature on quantum dot sensit...
 
A progressive learning for structural tolerance online sequential extreme lea...
A progressive learning for structural tolerance online sequential extreme lea...A progressive learning for structural tolerance online sequential extreme lea...
A progressive learning for structural tolerance online sequential extreme lea...
 
Electroencephalography-based brain-computer interface using neural networks
Electroencephalography-based brain-computer interface using neural networksElectroencephalography-based brain-computer interface using neural networks
Electroencephalography-based brain-computer interface using neural networks
 
Adaptive segmentation algorithm based on level set model in medical imaging
Adaptive segmentation algorithm based on level set model in medical imagingAdaptive segmentation algorithm based on level set model in medical imaging
Adaptive segmentation algorithm based on level set model in medical imaging
 
Automatic channel selection using shuffled frog leaping algorithm for EEG bas...
Automatic channel selection using shuffled frog leaping algorithm for EEG bas...Automatic channel selection using shuffled frog leaping algorithm for EEG bas...
Automatic channel selection using shuffled frog leaping algorithm for EEG bas...
 

Recently uploaded

Mechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdfMechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdf
21UME003TUSHARDEB
 
1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf
1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf
1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf
MadhavJungKarki
 
Call For Paper -3rd International Conference on Artificial Intelligence Advan...
Call For Paper -3rd International Conference on Artificial Intelligence Advan...Call For Paper -3rd International Conference on Artificial Intelligence Advan...
Call For Paper -3rd International Conference on Artificial Intelligence Advan...
ijseajournal
 
AN INTRODUCTION OF AI & SEARCHING TECHIQUES
AN INTRODUCTION OF AI & SEARCHING TECHIQUESAN INTRODUCTION OF AI & SEARCHING TECHIQUES
AN INTRODUCTION OF AI & SEARCHING TECHIQUES
drshikhapandey2022
 
一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理
一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理
一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理
nedcocy
 
SENTIMENT ANALYSIS ON PPT AND Project template_.pptx
SENTIMENT ANALYSIS ON PPT AND Project template_.pptxSENTIMENT ANALYSIS ON PPT AND Project template_.pptx
SENTIMENT ANALYSIS ON PPT AND Project template_.pptx
b0754201
 
Supermarket Management System Project Report.pdf
Supermarket Management System Project Report.pdfSupermarket Management System Project Report.pdf
Supermarket Management System Project Report.pdf
Kamal Acharya
 
Height and depth gauge linear metrology.pdf
Height and depth gauge linear metrology.pdfHeight and depth gauge linear metrology.pdf
Height and depth gauge linear metrology.pdf
q30122000
 
Ericsson LTE Throughput Troubleshooting Techniques.ppt
Ericsson LTE Throughput Troubleshooting Techniques.pptEricsson LTE Throughput Troubleshooting Techniques.ppt
Ericsson LTE Throughput Troubleshooting Techniques.ppt
wafawafa52
 
Digital Twins Computer Networking Paper Presentation.pptx
Digital Twins Computer Networking Paper Presentation.pptxDigital Twins Computer Networking Paper Presentation.pptx
Digital Twins Computer Networking Paper Presentation.pptx
aryanpankaj78
 
ITSM Integration with MuleSoft.pptx
ITSM  Integration with MuleSoft.pptxITSM  Integration with MuleSoft.pptx
ITSM Integration with MuleSoft.pptx
VANDANAMOHANGOUDA
 
一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理
一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理
一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理
sydezfe
 
Blood finder application project report (1).pdf
Blood finder application project report (1).pdfBlood finder application project report (1).pdf
Blood finder application project report (1).pdf
Kamal Acharya
 
Presentation on Food Delivery Systems
Presentation on Food Delivery SystemsPresentation on Food Delivery Systems
Presentation on Food Delivery Systems
Abdullah Al Noman
 
Accident detection system project report.pdf
Accident detection system project report.pdfAccident detection system project report.pdf
Accident detection system project report.pdf
Kamal Acharya
 
OOPS_Lab_Manual - programs using C++ programming language
OOPS_Lab_Manual - programs using C++ programming languageOOPS_Lab_Manual - programs using C++ programming language
OOPS_Lab_Manual - programs using C++ programming language
PreethaV16
 
Call Girls Chennai +91-8824825030 Vip Call Girls Chennai
Call Girls Chennai +91-8824825030 Vip Call Girls ChennaiCall Girls Chennai +91-8824825030 Vip Call Girls Chennai
Call Girls Chennai +91-8824825030 Vip Call Girls Chennai
paraasingh12 #V08
 
原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样
原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样
原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样
ydzowc
 
AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...
AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...
AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...
Paris Salesforce Developer Group
 
openshift technical overview - Flow of openshift containerisatoin
openshift technical overview - Flow of openshift containerisatoinopenshift technical overview - Flow of openshift containerisatoin
openshift technical overview - Flow of openshift containerisatoin
snaprevwdev
 

Recently uploaded (20)

Mechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdfMechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdf
 
1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf
1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf
1FIDIC-CONSTRUCTION-CONTRACT-2ND-ED-2017-RED-BOOK.pdf
 
Call For Paper -3rd International Conference on Artificial Intelligence Advan...
Call For Paper -3rd International Conference on Artificial Intelligence Advan...Call For Paper -3rd International Conference on Artificial Intelligence Advan...
Call For Paper -3rd International Conference on Artificial Intelligence Advan...
 
AN INTRODUCTION OF AI & SEARCHING TECHIQUES
AN INTRODUCTION OF AI & SEARCHING TECHIQUESAN INTRODUCTION OF AI & SEARCHING TECHIQUES
AN INTRODUCTION OF AI & SEARCHING TECHIQUES
 
一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理
一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理
一比一原版(爱大毕业证书)爱荷华大学毕业证如何办理
 
SENTIMENT ANALYSIS ON PPT AND Project template_.pptx
SENTIMENT ANALYSIS ON PPT AND Project template_.pptxSENTIMENT ANALYSIS ON PPT AND Project template_.pptx
SENTIMENT ANALYSIS ON PPT AND Project template_.pptx
 
Supermarket Management System Project Report.pdf
Supermarket Management System Project Report.pdfSupermarket Management System Project Report.pdf
Supermarket Management System Project Report.pdf
 
Height and depth gauge linear metrology.pdf
Height and depth gauge linear metrology.pdfHeight and depth gauge linear metrology.pdf
Height and depth gauge linear metrology.pdf
 
Ericsson LTE Throughput Troubleshooting Techniques.ppt
Ericsson LTE Throughput Troubleshooting Techniques.pptEricsson LTE Throughput Troubleshooting Techniques.ppt
Ericsson LTE Throughput Troubleshooting Techniques.ppt
 
Digital Twins Computer Networking Paper Presentation.pptx
Digital Twins Computer Networking Paper Presentation.pptxDigital Twins Computer Networking Paper Presentation.pptx
Digital Twins Computer Networking Paper Presentation.pptx
 
ITSM Integration with MuleSoft.pptx
ITSM  Integration with MuleSoft.pptxITSM  Integration with MuleSoft.pptx
ITSM Integration with MuleSoft.pptx
 
一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理
一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理
一比一原版(uoft毕业证书)加拿大多伦多大学毕业证如何办理
 
Blood finder application project report (1).pdf
Blood finder application project report (1).pdfBlood finder application project report (1).pdf
Blood finder application project report (1).pdf
 
Presentation on Food Delivery Systems
Presentation on Food Delivery SystemsPresentation on Food Delivery Systems
Presentation on Food Delivery Systems
 
Accident detection system project report.pdf
Accident detection system project report.pdfAccident detection system project report.pdf
Accident detection system project report.pdf
 
OOPS_Lab_Manual - programs using C++ programming language
OOPS_Lab_Manual - programs using C++ programming languageOOPS_Lab_Manual - programs using C++ programming language
OOPS_Lab_Manual - programs using C++ programming language
 
Call Girls Chennai +91-8824825030 Vip Call Girls Chennai
Call Girls Chennai +91-8824825030 Vip Call Girls ChennaiCall Girls Chennai +91-8824825030 Vip Call Girls Chennai
Call Girls Chennai +91-8824825030 Vip Call Girls Chennai
 
原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样
原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样
原版制作(Humboldt毕业证书)柏林大学毕业证学位证一模一样
 
AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...
AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...
AI + Data Community Tour - Build the Next Generation of Apps with the Einstei...
 
openshift technical overview - Flow of openshift containerisatoin
openshift technical overview - Flow of openshift containerisatoinopenshift technical overview - Flow of openshift containerisatoin
openshift technical overview - Flow of openshift containerisatoin
 

Development of control system for quadrotor unmanned aerial vehicle using LoRa wireless and GPS tracking

  • 1. TELKOMNIKA Telecommunication, Computing, Electronics and Control Vol. 18, No. 5, October 2020, pp. 2674~2681 ISSN: 1693-6930, accredited First Grade by Kemenristekdikti, Decree No: 21/E/KPT/2018 DOI: 10.12928/TELKOMNIKA.v18i5.16716  2674 Journal homepage: http://journal.uad.ac.id/index.php/TELKOMNIKA Development of control system for quadrotor unmanned aerial vehicle using LoRa wireless and GPS tracking Teddy Surya Gunawan1 , Wan Atheerah Yahya2 , Erwin Sulaeman3 , Mira Kartiwi4 , Zuriati Janin5 1,2 Department of Electrical and Computer Engineering, International Islamic University Malaysia, Malaysia 1 Fakultas Teknik dan Ilmu Komputer, Universitas Potensi Utama, Indonesia 3 Department of Mechanical Engineering, International Islamic University Malaysia, Malaysia 4 Departement of Information Systems, International Islamic University Malaysia, Malaysia 5 Faculty of Electrical Engineering, Universiti Teknologi MARA, Malaysia Article Info ABSTRACT Article history: Received Jan 17, 2020 Revised Apr 29, 2020 Accepted May 11, 2020 In the past decades, there has been a growing interest in unmanned aerial vehicles (UAVs) for educational, research, business, and military purposes. The most critical data for a flight system is the telemetry data from the GPS and wireless transmitter and also from the gyroscope and accelerometer. The objective of this paper is to develop a control system for UAV using long-range wireless communication and GPS. First, Matlab simulation was conducted to obtain an optimum PID gains controller. Then LoRa wireless was evaluated during clear and rainy days. Static and dynamic points measurement was conducted to validate and optimize GPS accuracy. GeoMapping in Matlab and Google GPS GeoPlanner were then used to analyze the traveled UAV flight path. Keywords: GPS LoRa PID controller Quadrotor UAV Telemetry data This is an open access article under the CC BY-SA license. Corresponding Author: Teddy Surya Gunawan, Department of Electrical and Computer Engineering, International Islamic University Malaysia, Malaysia. Email: tsgunawan@iium.edu.my 1. INTRODUCTION In the past few years, the quadrotor unmanned aerial vehicle (UAV) has gained interest due to its compact size, agility, and autonomous flight [1]. UAV is an aircraft without a pilot on board and can be flown by a remote controller from a ground control station. UAVs can fly autonomously and also manually by remote controller. There are many types of UAV across the world, and they have specific task and mission that depends on the person who built the UAV. A quadrotor system can be used for surveillance [2, 3], rescue [4, 5], aerial photography [6, 7], precision agriculture [8, 9], and other works that are dangerous or space limited for human beings [10]. At first, UAV was not autonomously controlled. It was controlled by remote control and by manual radio, just like a typical aircraft. The control systems of quadrotor UAV has been conducted by many researchers.In [11, 12], the rigid body dynamics of a quadrotor UAV and several effects of aerodynamics were investigated. Several controller can be implemented, including the PID controller [12], backstepping controller [13, 14], sliding-mode controller [15, 16], adaptive control [17], fuzzy logic [18, 19], quantitative feedback [20], reinforcement learning [21], etc. A review of various control systems' performance can be found in [22].
  • 2. TELKOMNIKA Telecommun Comput El Control  Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan) 2675 Despite a sophisticated digital avionic system installed on the present aircraft, which defines aircraft altitude, speed, and continuous position, we still need the UAV in various emergency situations. In this paper, we introduce the use of long-range (LoRa) wireless module and also the GPS tracking to enable the Quadrotor UAV to obtain telemetry data, for example, a continuous GPS position. The dynamics and control system of the quadrotor UAV was modeled and simulated in Matlab. In order to get precise and continuous data telemetry from the UAV to the ground control station (GCS), we use the long-range (LoRa) wireless communication system [23]. 2. QUADROTOR UNMANNED AERIAL VEHICLE (UAV) MODELLING The majority of commercial quadrotors are marketed with the aim of doing aerial photography, e.g., Aeryon scout, Microdrones md4-1000, Quanser Qball, Parrot AR. Drone 2.0, DJI Phantom 3, AscTec, Mikrokopter, etc. In addition, there are many communities and university-based open-source projects for quadrotors development, e.g., STARMAC X4, ANU X4-Flyer, Arduino ATmega based, Mikrokopter based, STM32 based, etc [24]. The structure of the quadrotor UAVs investigated in this paper is as shown in Figure 1. There are two key states of the quadrotor UAV, i.e., position (𝑋, 𝑌, 𝑍) and attitude (roll, pitch, yaw). The position describes the translation between the world frame and body frame. The attitude describes rotation between the world and body frames. Roll describes how the right and left sides are elevated with respect to each other (if the left side pushed down, and the right side is pushed up, the UAV will move to the left). Pitch describes how the front and back are elevated with respect to each other (if the front is moved down, and the back is up, it will move forward). And yaw describes the rotation of the drone (if the front, back, and both sides are leveled, it can turn around the yaw axis without shifting position). The dynamic of quadrotor UAVs can be formulated as described in [12, 17]. The position 𝑝 𝑥, 𝑝 𝑦, 𝑝𝑧 and attitude (roll, pitch, yaw) 𝜑, 𝜃, 𝜓, can be formulated as: 𝑝̈ 𝑥 = (cos 𝜑 sin 𝜃 cos 𝜓 + sin 𝜑 sin 𝜓) 𝜏4 𝑚 + 𝑑1 𝑝̈ 𝑦 = (cos 𝜑 sin 𝜃 sin 𝜓 − sin 𝜑 cos 𝜓) 𝜏4 𝑚 + 𝑑2 𝑝̈ 𝑧 = cos 𝜑 cos 𝜑 𝜏4 𝑚 − 𝑔 + 𝑑3 𝜑̈ = 𝜑̇ 𝜓̇ ( 𝐽𝑧𝑧 − 𝐽𝑥𝑥 𝐽 𝑦𝑦 ) + 𝐽 𝑅 𝐽 𝑦𝑦 𝜑̇ Ω 𝑅 + 𝐿 𝐽 𝑦𝑦 𝜏1 + 𝑑4 𝜃̈ = 𝜃̇ 𝜓̇ ( 𝐽 𝑦𝑦 − 𝐽𝑧𝑧 𝐽𝑥𝑥 ) − 𝐽 𝑅 𝐽𝑥𝑥 𝜃̇Ω 𝑅 + 𝐿 𝐽𝑥𝑥 𝜏2 + 𝑑5 𝜓̈ = 𝜑̇ 𝜃̇ ( 𝐽𝑥𝑥 − 𝐽 𝑦𝑦 𝐽𝑧𝑧 ) + 1 𝐽𝑧𝑧 𝜏3 + 𝑑6 (1) where 𝑚 is the mass of the quadrotor and its payload, 𝐽𝑥𝑥, 𝐽 𝑦𝑦, 𝐽𝑧𝑧 are the moments of inertia of the quadrotor, 𝐿 is he length from the barycentre to the center of each rotor, 𝐽 𝑅 and Ω 𝑅 provide the moments of inertia and angular velocity of the propeller blades, 𝑑1, ⋯ , 𝑑6 are bounded disturbances. 𝜏1, 𝜏2, 𝜏3 are thrusts in the direction of roll, pitch, yaw and 𝜏4 is the collective thrust. The relationships between the thrust [𝜏1, 𝜏2, 𝜏3, 𝜏4] 𝑇 and control signals [𝑢1, 𝑢2, 𝑢3, 𝑢4] 𝑇 for motors are shown as: 𝜏1 = 𝑐 𝑇(𝑢2 − 𝑢4) 𝜏2 = 𝑐 𝑇(𝑢1 − 𝑢3) 𝜏3 = 𝑐 𝑀(𝑢1 − 𝑢2 + 𝑢3 − 𝑢4) 𝜏4 = 𝑐 𝑇(𝑢1 + 𝑢2 + 𝑢3 + 𝑢4) (2) where [𝑢1, 𝑢2, 𝑢3, 𝑢4] 𝑇 are control signals that range from 0 to 1, 𝐶 𝑇 and 𝐶 𝑀 are the parameters which translate control signals to thrusts and torque. The proportional integral derivative (PID) controller can be used due to its relatively simple structure, which can be easily understood and implemented in practice. 𝑢(𝑡) = 𝐾𝑃 𝑒(𝑡) + 𝐾𝐼 ∫ 𝑒(𝜆)𝑑𝜆 + 𝐾 𝐷 𝑑𝑒(𝑡) 𝑑𝑡 𝑡 0 (3) where 𝑢(𝑡) is the input signal, 𝑒(𝑡) = 𝑢(𝑡) − 𝜏(𝑡) is the error signal, 𝐾𝑃, 𝐾𝐼, 𝐾 𝐷 are the proportional, integral, and derivative controller gains, respectively.
  • 3.  ISSN: 1693-6930 TELKOMNIKA Telecommun Comput El Control, Vol. 18, No. 5, October 2020: 2674 - 2681 2676 Figure 1. The structure of quadrotor UAVs adopted from [21] 3. DESIGN OF CONTROL SYSTEM FOR QUADROTOR UAV For the UAV design, the original UAV weight is estimated to be 550 grams with the battery. The weight of the additional battery, LoRa wireless, GPS modules, and Arduino Mega microcontroller are counted as the payload, which is estimated to be around 250 grams. Total weight is estimated to be around 800 grams. For the design of a wireless module, there are several characteristics required, such as low data rate, longer range, and very low power consumption. The high data rate is not required due to the nature of the commands being sent or the data being received. In our research, we just transmit and receive GPS locations from the UAV to the ground station. If image or video was required to be transmitted, then a higher data rate will be necessary. For long-range control and data transmission, wireless communication should have long-range with relatively high fidelity. Moreover, power consumption needs to be minimal to conserve limited battery power at UAV. In this research, the long-range wireless module is used to obtain a continuous reading from the GPS sensor, and the communication range should be between 5 to 10 km. The wireless module should be capable of self-standing in terms of communication infrastructure and power supply since standard communication systems could have collapsed during unpredictable events and emergencies. For this purpose, the wireless module used in this research is Semtech Lora 868 MHz 915 MHz SX1272 Libelium radio frequency module [25], as shown in Figure 2 (a). It has a dual-frequency band, i.e., 863-870 MHz (Europe) and 902-928 MHz (US). The transmission power is 14 dBm. The sensitivity is -134 dBm. Moreover, the communication distance can cover more than 22 km. The SX1272 module uses the SPI protocol (Serial peripheral Interface) pins for communication. The SPI port allows faster communication and frees up the Waspmote’s UART (Universal Asynchronous Receiver/Transmitter) for other purposes. The SX1272 module does not implement any security method. Encryption is provided through the Waspmote Encryption library. Specifically, through the AES algorithm with the symmetric key, with a length of 128, 192, or 256 bits. Programming the microcontroller is a simple three steps process: write the code, compile the code, and upload the code into the microcontroller. The GPS module selected in this research is Ublox Neo-6M, as shown in Figure 2 (b). It produces outputs of the current position and timing data in the format of NMEA 0183 and has a positioning accuracy of 10 meters without and 5 meters with WAAS (Wide Area Augmentation System). It provides augmentation information to GPS receivers to enhance the accuracy and reliability of position estimates and also expand the GPS, with the goal of improving its accuracy, integrity, and availability. GPS U-Blox Neo 6M modules give different approaches for geo-tagging and stitching images based on GNSS (global navigation systems). The power supply required for this GPS module is 3.6 V suitable for Arduino. The DC current through any digital I/O pin is around ten mA. The antenna gain is 50 dB, and the UART timing has a maximum bandwidth of 100 kbit/s. Many researchers have used this GPS U-Blox because of its usability and data accuracy. Currently, there are 32 GPS satellites orbiting the Earth, in which ten satellites was enough to provide high accuracy data, while four satellite will be the minimum. GPS satellite send course acquisition (C/A) code to GPS receiver on earth station and give the accurate positioning to the user on Earth. The GPS user on Earth can even get the distance from one point to another point according to GPS tracking. For the payload at the UAV, Arduino Mega will be used and connected to GPS and LoRA wireless modules [26, 27]. Multiprotocol radio shield, as shown in Figure 2 (c), is used to connect Arduino Mega and the Wireless Libelium LoRa module. For the ground station, Arduino Uno and LoRa receiver are used and connected to the computer to obtain the transmitted data from UAV. The specification of the UAV is a quadcopter with six axes of movement, as shown in Figure 3. The controller is a 2.4 GHz transmitter. The length and width of the quadcopter are 500 mm with a height of 190 mm. LiPo battery has a capacity of 7.4 V/2200 mA and power of 16.3 W. The payload for the UAV is including the GPS receiver, LoRa wireless module, and an HD camera for First person view (FPV). However, to minimize battery usage for a longer flight, the HD camera captured the images and saved it in the SD card, rather than real-time transmitting it to the ground station. This UAV is controlled by a microcontroller such as Arduino and other sensors. Both of them have great importance for increasing the efficiency of the UAV and can increase the performance of the aircraft system. The payload prototype is made from plastic material for the cover of the body. A hierarchical control system is
  • 4. TELKOMNIKA Telecommun Comput El Control  Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan) 2677 designed where a high-level controller is responsible for GPS location and positioning and also controlling long-range radio frequency modules. The platform of the controller has a total of 4 actuators that are responsible for orienting and translating the craft according to the outputs of the controller. The actuator lines are made up of the electronic speed controller (ESC), the motors, and the propellers. The ESC obtains power from the 7.4 V main battery and an input signal in the form of a pulse-width-modulation (PWM) command from the Arduino mega. The ESC then translates these PWM commands into the appropriate rotating magnetic field used to control the speed of the motors. (a) (b) (c) Figure 2. Hardware design for control system of quadrotor UAV; (a) LoRa SX1272, (b) GPS Ublox Neo-6m, (c) arduino multiprotocol shield (a) (b) Figure 3. Front and top view of the quadcopter; (a) front view and (b) top view 4. EXPERIMENTAL RESULTS AND DISCUSSION This section describes the quadrotor Matlab simulation, experimental setup, and experiments on the LoRa wireless communication and GPS accuracy. Matlab simulation confirmed that the PID controller provided a good control system performance. Moreover, the next experiments evaluated the GPS accuracy of the pre-determined UAV flight path using GPS GeoPlanner. 4.1. Matlab simulation Matlab simulation of the aerodynamic design was used for prototyping and flight control system design of a quadrotor UAV model. Additionally, the GeoMapping Matlab toolbox is utilized for a comprehensive GPS calculation and validation. With the time calculation utilities, we can compute Julian dates, decimal year, and leap year. Aerospace toolbox provides three options for visualizing flight data. First, the interface to flight gear flight simulator lets us visualize vehicle dynamics in a sophisticated 3-D simulation framework. The flight simulator can playback flight-test data through flight gear and effectively reconstruct behavioral anomalies in the flight-test results. Matlab Aerospace Toolbox includes functions for controlling the position and altitude of a vehicle in the flight-gear simulator by using double-precision values of longitude, latitude, altitude, roll, pitch, and yaw. Second, the interface to simulink 3D animation lets us use the flight data to control vehicle position and attitude in a virtual-reality scene. The dynamics of the quadrotor are taken from [28] with some slight modification, e.g., the weight of UAV is set to 0.8kg, the length of the quadrotor is set to 0.27 m, etc. Figure 4 shows the Simulink model, while Figure 5 shows the simulation results, in which the designed PID controller has achieved a good performance. It simulates UAV to move up from the ground until a pre-defined hight (modify 𝑧). After that, the desired 𝑥 and 𝑦 are set to become increasing sinusoidal from 0 to 90 seconds and kept constant afterward. The simulation results show the desired position in 3D versus the actual position, forming an up and spiral movement of the UAV.
  • 5.  ISSN: 1693-6930 TELKOMNIKA Telecommun Comput El Control, Vol. 18, No. 5, October 2020: 2674 - 2681 2678 Figure 4. Simulink model of the quadrotor UAV (a) (b) Figure 5. Quadrotor UAV simulation results; (a) desired and actual position X, Y, Z and (b) desired and actual position in 3D 4.2. Experimental setup The experimental setup is shown in Figure 6. We have divided the experiments into static and dynamic points measurements. For static points measurement, the ground control station is placed at one static location, and the GPS coordinates of that location are measured using the GPS Ublox NEO, in which we obtained Point A. We then moved the GPS receiver to another location, and the GPS coordinates at that location were transmitted using LoRa to the ground station and recorded to obtain Point B. The distance between point A and point B then can be calculated. For dynamic points measurement, the ground station GPS location has been recorded earlier (from static measurement). The LoRa transmitter is attached to the quadrotor UAV. The UAV is then flown to any locations, and its positions were transmitted to the ground station and recorded. For analysis purposes, the recorded GPS locations were then plotted using the GeoMapping tool in Matlab, in which we can further analyze the dynamic flight path. 4.3. Experiment on LoRa Figure 7 shows an example of LoRa wireless receiver output at the Ground Station during a clear day and rainy day. The SNR value and packet length during the rainy day were found to be (-31, 129), (-31, 129), (-31, 127), and (3, 255), in four consecutive readings. It showed that during rain, the wireless signal is attenuated, and the SNR fluctuates to -31 dB as it experiences disturbances and noises. From this experiment, the LoRa module was found to be working as expected.
  • 6. TELKOMNIKA Telecommun Comput El Control  Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan) 2679 Figure 6. Experimental setup between ground station and quadrotor UAV (a) (b) Figure 7. LoRa receiver output during a clear and rainy day; (a) clear day and (b) rainy day 4.4. Experiment on GPS accuracy and GeoMapping using Matlab and Geoplanner As described in the previous section, the dynamic measurement was used to evaluate GPS accuracy. Point A is located at the Petanque area of Female Sport Complex, IIUM, while Point B is located at Female Sport Complex Gym, IIUM. This experiment was repeated eight times, and the result is shown in Table 1. In conclusion, the GPS receiver module is working as intended. Figures 8 and 9 showed the GeoMapping result using Matlab and GPS Planner, respectively. The distance traveled during the dynamic GPS measurement is around 10.23 km. In our experiment, the quadrotor UAV was controlled using manual remote control. The GPS coordinates are then recorded and transmitted to the ground station using LoRa. For the autonomous flight, we could create a flight plan based on locations in which the UAV could fly on its own following
  • 7.  ISSN: 1693-6930 TELKOMNIKA Telecommun Comput El Control, Vol. 18, No. 5, October 2020: 2674 - 2681 2680 the flight path. This can be used later on, along with the image or video recording, for various purposes, such as geospatial mapping, precision agriculture, disaster area mapping, etc. Table 1. Latitude, longitude, and distance between two points Delta (latitude) longitude (B-A) Mean latitude Point A Point B Lat2 Long2 Distance (m) Altitude Difference -0.0007 -0.0008 3.25365 63.3 148.2 4.9E-07 0.999993225 117.6 84.9 -0.0007 -0.00048 3.25365 63.3 165.7 4.9E-07 0.999994813 117.61 102.4 -0.0007 101.6716 3.25365 0 165.7 4.9E-07 0.999994813 117.61 165.7 -0.00062 101.6715 3.25369 0 171.1 3.84E-07 0.999995931 117.61 171.1 -0.0015 -0.00078 3.25413 72.1 171.1 2.25E-06 0.999976174 187 99 -0.00152 -0.00078 3.25414 72.2 171.1 2.31E-06 0.999975534 188 98.9 -0.00176 -0.00077 3.25434 99.2 204 3.1E-06 0.999967195 212 104.8 -0.00186 -0.00083 3.25429 99.2 172.1 3.46E-06 0.999963349 134 72.9 Average: 148.93 112.46 Figure 8. Sample of GPS route that was traveled in real flight experiment using GeoMapping Figure 9. Sample of GPS route that was traveled in real flight experiment using GPS GeoPlanner 5. CONCLUSIONS This paper has presented the design of the control system of quadrotor UAV using LoRa wireless communication and GPS modules. Matlab simulation was conducted to obtain an optimum PID gains controller. Next, the suitability of the LoRa wireless module to be used for telemetry data was evaluated during a clear and rainy day. The GPS telemetry data was validated and optimized using static and dynamic points measurements. Lastly, GeoMapping in Matlab and Google GPS GeoPlanner were used to analyze the real flight path. Future works include improved simulation of the quadrotor UAV using the available open-source drone, the use of various sensors and images for telemetry data, and autonomous flight using a pre-determined flight plan.
  • 8. TELKOMNIKA Telecommun Comput El Control  Development of control system for quadrotor unmanned aerial vehicle using… (Teddy Surya Gunawan) 2681 ACKNOWLEDGMENTS The author would like to express their gratitude to the Malaysian Ministry of Education (MOE), which has provided research funding through the Fundamental Research Grant, FRGS19-076-0684. The authors would also like to thank International Islamic University Malaysia (IIUM), Universitas Potensi Utama, and Universiti Teknologi MARA (UiTM) Shah Alam for providing facilities to support the research work. REFERENCES [1] S. Norouzi Ghazbi, Y. Aghli, M. Alimohammadi, and A. Akbari, "Quadrotors Unmanned Aerial Vehicle: A Review," International Journal on Smart Sensing & Intelligent Systems, vol. 9, no. 1, pp. 309-333, 2016. [2] R. L. Finn, D. J. C. L. Wright, and S. Review, "Unmanned aircraft systems: Surveillance, ethics and privacy in civil applications," Computer Law & Security Review, vol. 28, no. 2, pp. 184-194, 2012. [3] H. Kim and J. Ben-Othman, "A Collision-Free Surveillance System Using Smart UAVs in Multi Domain IoT," IEEE Communications Letters, vol. 22, no. 12, pp. 2587-2590, 2018. [4] M. Silvagni, A. Tonoli, E. Zenerino, and M. Chiaberge, "Multipurpose UAV for search and rescue operations in mountain avalanche events," Geomatics, Natural Hazards and Risk, vol. 8, pp. 18-33, 2017. [5] J. Qi, D. Song, H. Shang, N. Wang, C. Hua, C. Wu, X. Qi, and J. Han, "Search and rescue rotary‐wing uav and its application to the lushan ms 7.0 earthquake," Journal of Field Robotics, vol. 33, no. 3, pp. 290-321, 2016. [6] N. H. Motlagh, T. Taleb, and O. Arouk, "Low-altitude unmanned aerial vehicles-based internet of things services: Comprehensive survey and future perspectives," IEEE Internet of Things Journal, vol. 3, no. 6, pp. 899-922, 2016. [7] C. Kanellakis and G. Nikolakopoulos, "Survey on computer vision for UAVs: Current developments and trends," Journal of Intelligent & Robotic Systems, vol. 87, pp. 141-168, 2017. [8] V. Puri, A. Nayyar, and L. Raja, "Agriculture drones: A modern breakthrough in precision agriculture," Journal of Statistics and Management Systems, vol. 20, no. 4, pp. 507-518, 2017. [9] U. R. Mogili and B. Deepak, "Review on application of drone systems in precision agriculture," Procedia computer science, vol. 133, pp. 502-509, 2018. [10] P. Liu, A. Y. Chen, Y. N. Huang, J. Y. Han, J. S. Lai, S. C. Kang, T. H. Wu, M. C. Wen, and M. H. Tsai, "A review of rotorcraft unmanned aerial vehicle (UAV) developments and applications in civil engineering," Smart Structures and Systems, vol. 13, no. 6, pp. 1065-1094, 2014. [11] S. Bouabdallah and R. Siegwart, "Full control of a quadrotor," 2007 IEEE/RSJ International Conference on Intelligent Robots and Systems, pp. 153-158, 2007. [12] A. L. Salih, M. Moghavvemi, et al., "Modelling and PID controller design for a quadrotor unmanned air vehicle," 2010 IEEE International Conference on Automation, Quality and Testing, Robotics (AQTR), pp. 1-5, 2010. [13] F. Chen, R. Jiang, K. Zhang, B. Jiang, and G. Tao, "Robust backstepping sliding-mode control and observer-based fault estimation for a quadrotor UAV," IEEE Transactions on Industrial Electronics, vol. 63, no. 6, pp. 5044-5056, 2016. [14] F. Chen, W. Lei, K. Zhang, G. Tao, and B. Jiang, "A novel nonlinear resilient control for a quadrotor UAV via backstepping control and nonlinear disturbance observer," Nonlinear Dynamics, vol. 85, no. 2, pp. 1281-1295, 2016. [15] J.-J. Xiong and G.-B. Zhang, "Global fast dynamic terminal sliding mode control for a quadrotor UAV," ISA transactions, vol. 66, pp. 233-240, 2017. [16] O. Mofid and S. Mobayen, "Adaptive sliding mode control for finite-time stability of quadrotor UAVs with parametric uncertainties," ISA transactions, vol. 72, pp. 1-14, 2018. [17] Z. T. Dydek, A. M. Annaswamy, and E. Lavretsky, "Adaptive control of quadrotor UAVs: A design trade study with flight evaluations," IEEE Transactions on Control Systems Technology, vol. 21, no. 4, pp. 1400-1406, 2012. [18] M. Santos, V. Lopez, and F. Morata, "Intelligent fuzzy controller of a quadrotor," 2010 IEEE international conference on intelligent systems and knowledge engineering, pp. 141-146, 2010. [19] B. Erginer and E. Altuğ, "Design and implementation of a hybrid fuzzy logic controller for a quadrotor VTOL vehicle," International Journal of Control, Automation and Systems, vol. 10, no. 1, pp. 61-70, 2012. [20] A. M. Hairon, H. Mansor, T. Gunawan, and S. Khan, "Travel angle control of quanser bench-top helicopter based on Quantitative Feedback Theory technique," Indonesian Journal of Electrical Engineering and Computer Science, vol. 1, no. 2, pp. 310-318, 2016. [21] X. Lin, Y. Yu, and C. Sun, "Supplementary Reinforcement Learning Controller Designed for Quadrotor UAVs," IEEE Access, vol. 7, pp. 26422-26431, 2019. [22] A. Zulu and S. John, "A review of control algorithms for autonomous quadrotors," Open Journal of Applied Science, vol. 4, pp. 547-556, 2014. [23] C. Trasviña-Moreno, R. Blasco, Á. Marco, R. Casas, and A. Trasviña-Castro, "Unmanned aerial vehicle based wireless sensor network for marine-coastal environment monitoring," Sensors, vol. 04, no. 17, pp. 460, 2017. [24] M. Bangura, "Aerodynamics and Control of Quadrotors," PhD Thesis, Australian National University, 2017. [25] Libelium, "Waspmote LoRa 868 MHz 915 MHz SX1272 Networking Guide," 2015. [26] T. S. Gunawan, I. Rahmithul, H. Yaldi, M. Kartiwi, and N. Ismail, "Prototype design of smart home system using internet of things," Indonesian Journal of Electrical Engineering and Computer Science, vol. 7, no.1, pp. 107-115, 2017. [27] T. S. Gunawan, I. R. H. Yaldi, M. Kartiwi, and H. Mansor, "Performance Evaluation of Smart Home System using Internet of Things," International Journal of Electrical and Computer Engineering, vol. 8, no. 1, pp. 400, 2018. [28] T. Bresciani, "Modelling, Identification and Control of a Quadrotor Helicopter," MSc Thesis, Lund Unversity, 2008.