You are on page 1of 12

IEEE SENSORS JOURNAL, VOL. XX, NO.

XX, XXXX 2017 1

An Informational Approach for Fault Tolerant


Data Fusion Applied to a UAV’s Attitude, Altitude
and Position Estimation
M. Saied, A. Tabikh, C. Francis, H. Hamadi and B. Lussier .

Abstract— This paper presents a fault tolerance architecture for data fusion mechanisms that tolerates sensor faults in
a multirotor Unmanned Aerial Vehicle (UAV). The developed approach is based on the traditional duplication/comparison
method and is carried out via error detection and system recovery to both detect and isolate the faulty sensors. It is applied
on an informational framework using extended Informational Kalman Filters (IKF) for state estimation with prediction
models based on available sensors measurements. Error detection is realized through residuals comparisons using the
Bhattacharyya Distance (BD), an informational measure that estimates the similarity of two probability distributions. An
optimal thresholding based on Bhattacharyya criterion is applied. In order to identify the faulty sensor, the Bhattacharyya
distance between the a priori and a posteriori distributions of each IKF is also computed. The system recovery is done
by substituting the erroneous state by an error-free state. The proposed architecture alleviates the assumption of a fault-
free prediction model using the information surprise concept instead of hardware redundancy.The performance of the
proposed framework is shown through offline validation using real measurements from navigation sensors of a multirotor
UAV with fault injection.
Index Terms— Sensor Fusion, Fault Tolerance, Information Theory, Unmanned Aerial Vehicle

I. I NTRODUCTION • The difficulty of predicting and designing the behavior


of fusion algorithms by formal techniques such as proof
M ULTISENSOR data fusion finds wide application in
many robotic fields such as localization, sensor net-
works, environment mapping and object recognition [1]. It •
checking and formal model.
The near-infinite execution context generated by the open
consists of combining information from various sensors and environment of the robotic systems where conditions may
knowledge sources to better describe the process or phe- vary at any moment and in many different ways. The
nomenon of interest and achieve more precise reasoning than validation of UAV systems for example needs multiple
could be accomplished by the usage of only one sensor [2]. long flights to encounter all the possible situations, which
Data fusion is considered as a research field involving multiple makes it a costly, difficult and long process.
fields including artificial intelligence, statistical estimation, As an alternative to this validation, some works developed fault
information theory and signal processing [3]. Performing data tolerance mechanisms for data fusion to remove or reduce the
fusion can improve reliability, confidence and consistency of effects of faults on the system or process operation [8], [9].
the data. Fault Tolerance is defined as one of the four means to attain
Despite the evident potential benefit of these techniques, dependability [10] and aims to allow the system to deliver a
there are a number of issues and limitations that make data correct service even after the occurrence of errors [11], [12].
fusion approaches a challenging task. First, their implemen- Fault tolerance methods are generally implemented via error
tation requires redundant, diverse and complementary sensors detection and system recovery:
which increases the risks of hardware faults. Other issues are • Error detection aims to detect the erroneous state of the
related to the data used in the fusion process, diversity and system before errors are propagated and cause system
imperfection of the used sensors and the type of the application failures. It can be achieved by duplication–comparison,
[2], [4], [5], [6]. temporal watchdog and likelihood checks.
In addition, the validation of data fusion approaches faces • System recovery allows the system to recover to an
two major problems [7]: operational mode after fault occurrence. It is mainly
M. Saied is with the School of Engineering, Department of Electrical achieved by error handling through recovery, pursuit or
and Electronics Engineering, Lebanese International University (LIU), compensation.
Bekaa, Lebanon (e-mail: majd.saied@liu.edu.lb).
A. Tabikh and C. Francis are with the Scientific Research Center Fault tolerant data fusion has been in use for over 50 years
in Engineering, Lebanese University, Faculty of Engineering, Hadath, especially in aircraft navigation systems [13]. The existing ap-
Lebanon (e-mail: cfrancis@ul.edu.lb). proaches in the literature are mainly based on the duplication-
H. Hamadi is with Altran, France
B. Lussier is with the Heudiasyc Laboratory, University of Technology comparison techniques that consist in comparing results from
of Compi ‘egne, France (e-mail: benjamin.lussier@hds.utc.fr). at least two redundant units that are independent of the faults to
2 IEEE SENSORS JOURNAL, VOL. XX, NO. XX, XXXX 2017

tolerate and provide the same service. The duplication design approaches were considered also in [34] with a comparison
methods incorporate two redundancy strategies: analytical between different forms of Kalman filters applied for data
redundancy and hardware redundancy. fusion of Inertial Measurement Unit (IMU), Global Positioning
System (GPS) receiver, and magnetometer sensors data. The
• Duplication based on analytical models: In this first
work in [35] proposed a fault tolerance architecture based
category, an analytical model is used as a diversification
on duplication-comparison technique for perception targeting
of physical sensors. Generally the data fusion mechanism
sensors and software faults on an outdoor quadrotor UAV. The
applied in this type of approaches is the Kalman filter that
architecture uses extended Kalman filers for data fusion and
uses the model of the system to estimate a measurement
a weighted average voting system with an added analytical
redundant to that delivered by a real sensor. Then the
redundancy using the dynamic model of the quadrotor.
residue resulting from the combination of the measure-
In most of the works considering these approaches, the fault
ments estimated by the model and delivered by the sensor
indicators were obtained as a difference between deterministic
is used as a fault indicator. Examples of duplication based
values corresponding to the nominal estimations and the
on an analytical model of the fusion process are found in
observations collected from the sensors. However, more robust
[14]–[18].
indicators could be derived from the comparison of the proba-
• Duplication based on hardware redundancy: These ap-
bility distributions of the prediction and the observations using
proaches combine multiple data sources. Unlike tech-
informational metrics such as α divergences [36], Kullback-
niques based on the analytical model of the system, they
Leibler divergence [37] and Bhattacharyya distance [38].
use the analysis of some internal parameters to ensure
These informational measures give more accurate information
fault tolerance. In [19], malfunction is detected based
about sensor observations and estimations such as volume,
on the temporal analysis of conflict resulting from the
orientation and uncertainties in distributions, which leads to
fusion of data sources using the Smets’s Transferable
more robust fault indicators [39].
Belief Model (TBM). The works in [20], [21] proposed
Among the metrics cited before, the Bhattacharyya distance
the analysis of the static and dynamic reliability of data
was used in fault detection and isolation techniques in different
sources to detect the defective source. Other similar
applications such as analog circuits [40], [41], multi-robot
examples of fault tolerance in data fusion are mentioned
systems [42], rolling element bearings [43] and many other
in [22], [23].
applications. In [42], the Bhattacharyya distance was applied
With the growing applications of autonomous unmanned with the Informational Kalman Filter (IF), that deals with the
aerial vehicles, fault tolerant data fusion is becoming a critical information matrix and vector, for diagnosis of sensor faults
requirement for safe and reliable operation. In fact, UAVs in wheeled mobile robots. The informational filter presents
are capable of achieving different missions under unknown several advantages over the covariance form of the Kalman
circumstances, where human involvement is unsafe or im- filter for multi-sensor systems. Its computational requirement
possible [24]. Their operation depends on sensors that are is less than that of the covariance form since it requires the
subjected to some types of faults and failures [25], [26]. inversion of the information matrix which is of the dimension
Therefore, it is fundamental for the UAVs to diagnose any of the state vector instead of the inversion of the composite
sensors faults to ensure an accurate estimate of their states. innovation covariance matrix which is of the dimension of
In the literature, multi-sensor data fusion architectures applied the observation vector. In addition, it performs better than the
on UAVs were investigated in different works for position, Kalman Filter in the correction step since it requires only
velocity and attitude estimation [27], [28], for estimation additions at this stage. It allows also for a distributed or
of unknown ship positions during landing operations using decentralized data fusion architecture [44], and is therefore
Extended Kalman Filters (EKF) [29], and diagnosis of the considered in this work.
safety distance between drones and high-voltage overhead This paper proposes a global informational approach for
transmission lines [30]. A real analysis of sensor fusion tested fault tolerant data fusion applied to UAV attitude, altitude
on real UAV platforms was discussed in [31]. and position estimation in absence of a dynamic model. The
The fault tolerance (FT) in data fusion applied to UAVs developed approach is based on the duplication/comparison
was also considered in some studies. In [32], the authors traditional method. An informational framework is proposed
proposed an architecture for integrated navigation systems of and designed using extended Informational Kalman Filters for
UAVs with application to height sensors measurements fusion. state estimation with prediction models based on available
The FT scheme included a main Kalman filter with three sub- sensors measurements. For the diagnosis layer, fault indicators
filters (radar altimeter/barometric altimeter/GPS). The Chi- are generated and evaluated using the statistical Bhattacharyya
Square test with test propagators used normally to test the metric. The system recovers from a fault by switching from
consistency between a signal and its reference in a stochastic the erroneous state into an error free state. Compared to the
dynamic system was employed for fault isolation. A fault work presented in [35], the architecture in this paper does
tolerant multi-sensor fusion for UAV attitude estimation was not make use of an estimation of the dynamic model of the
developed in [33] using the Unscented Information Filter UAV to isolate the faulty sensors since this estimation may
(UIF). The proposed scheme, validated using real flight data, introduce errors due to the model imperfections, the uncer-
enables the on-line calibration of sensors which leads to an im- tainties in the system or the unusual environmental conditions.
proved interpretation of the sensor health conditions. Similar The evaluation of the information surprise provided by the
SAIED et al.: AN INFORMATIONAL APPROACH FOR FAULT TOLERANT DATA FUSION APPLIED TO AN UAV’S ATTITUDE, ALTITUDE AND POSITION ESTIMATION
3

T T
sensors measurements is adopted instead for fault diagnosis. Yk/k−1 = [Fk−1 Yk−1/k−1 Fk−1 + Bk−1 Qk Bk−1
−1 (4)
The concept of surprise appeared remarkable for its simplicity +Qk−1 ]
and generality which resulted in its applicability to areas as yk/k−1 = Yk/k−1 f (xk−1/k−1 , uk−1 ) (5)
diverse as learning, data mining [45], fault detection [44], etc.
Based on the above review, the novel contributions of this • Update Step:
w
work are summarized as below: X
Yk/k = Yk/k−1 + Il (k) (6)
• The proposition of a stochastic fault tolerant multi-sensor
l=1
data fusion architecture for a multirotor UAV that alle-
w
viates the assumption of a fault-free prediction model X
yk/k = yk/k−1 + il (k) (7)
and reduces the number of redundant sensors needed for
l=1
fault isolation. This is achieved by developing an algo-
rithm based on the concept of the information surprise w is the number of sensor blocks. Il (k) is the information
evaluated using the Bhattacharyya distance between the matrix contribution of the sensor l written as:
predicted and the corrected distributions of the extended Il (k) = (Hkl )T (Rkl )−1 Hkl (8)
Information filters;
• A thresholds optimization process using the Bhat- and il (k) is the information state associated to the measure-
tacharyya criterion developed first in [42] to maximize the ment from sensor l at time k, zkl , expressed by:
information surprise between the prior and the posterior
il (k) = (Hkl )T (Rkl )−1 [(zkl − hlk/k−1 ) + (Hkl xlk/k−1 )] (9)
distributions;
The rest of the paper is organized as follows: in Section with hlk/k−1 = hl (xk/k−1 ), Hkl ∈ Rm×n and Rkl being
2, some preliminaries about the information filter and the respectively the non linear measurement equation, its Jacobian
Bhattacharyya distance are presented. The proposed fault and the covariance matrix related to the sensor l. The Jacobians
tolerant data fusion architecture is detailed in Section 3. Fk , Hk and Bk are given as:
Then, offline real experimental data validation results are ∂f ∂h ∂f
presented in Section 4. Finally a conclusion and a discussion Fk = |x=xk/k , Hk = |x=xk/k , Bk = |u=uk (10)
∂x ∂x ∂u
are provided in Section 5.
B. Bhattacharyya Distance (BD)
II. P RELIMINARIES
The Bhattacharyya Distance (BD) is a measure of dissimi-
Consider the nonlinear system represented as: larity between two probability distributions p(x) and q(x). It
xk = f (xk−1 , uk−1 ) + ωk−1 is based on the Bhattacharyya coefficient that estimates the
(1) overlap between two statistical populations [38]:
zk = h(xk ) + vk
where, at a given instant k, xk ∈ Rn is the state vector, zk ∈ BD(p, q) = −log[BC(p, q)] (11)
Rm is the measurement vector, uk ∈ Rr is the input vector, with:
ωk ∈ Rn and vk ∈ Rm are white Gaussian noises associated Xp Z p
respectively to the state model with a covariance matrix Qk ∈ BC(p, q) = p(x).q(x) or p(x).q(x) (12)
Rn×n and to the measurement model with a covariance matrix x∈X x∈X
Rk ∈ Rm×m , and f : (xk−1 , uk−1 ) 7−→ xk , and h : xk 7−→ being the Bhattacharyya coefficient for discrete and continuous
zk are two defined mapping. probability distributions respectively. Considering two nor-
mally distributed classes p and q, with µp , µq , σp and σq being
A. Extended Information Filter their means and variances respectively, the Bhattacharyya
An Extended Information Filter (EIF) is applied to estimate distance can be formulated as:
the altitude, attitude and position of a multirotor UAV. It 1 1 σp2 σq2 1 (µp − µq )2
BD(p, q) = log( ( 2 + 2 + 2)) + ( 2 ) (13)
consists of two phases: (a) the prediction phase that uses the 4 4 σq σp 4 σq + σp2
evolution model which is a representation of the theoretical
operation of the UAV, (b) the update phase where sensors out- For multivariate normal distributions, BD is expressed as:
puts are needed to correct the prediction. The information form 1 1 |detσ|
BD = (µp − µq )T σ −1 (µp − µq ) + log( )
of the Kalman filter is obtained by replacing the representation 8 2 |detσp |.|detσq |
of the state estimate x̂k and covariance Pk in the EKF with (14)
σ +σ
the information state vector yk and information matrix Yk : with σ = p 2 q .
From the equation above, one can notice that the Bhat-
yk/k = Yk/k xk/k (2) tacharyya distance can be divided into two terms:
1 T −1
Yk/k = Pk−1 (3) • 8 (µp − µq ) σ (µp − µq ) representing the Mahalanobis
distance (MD) between the two distributions;
The EIF equations are formulated as in [44]: 1 |detσ|
• 2 log( |detσ |.|detσ | ) representing the mutual information
p q
• Prediction Step: between p(x) and q(x) and the one with covariance σ;
4 IEEE SENSORS JOURNAL, VOL. XX, NO. XX, XXXX 2017

Sensor Specifications
Bhattacharyya distance has been already used to measure class • IMU modules:
separability in classification problems and it was shown to be − Gyroscope − Nonlinearity: up to ±0.05%
better than the Mahalanobis distance. When two classes have − Cross-Axis Sensitivity: up tp ±1%
− Full-scale range: ±2000◦ /s
different variances and similar means, MD will be zero, while − Accelerometer − Nonlinearity: ±0.5%
BD increases with the difference between the variances. It is − Cross-Axis Sensitivity: up to ±1%
also preferred over the Kullback-Leibler divergence because − Full-scale range: ±16g
it does not require a reference distribution and is therefore • GPS module − Velocity accuracy: 0.05m/s
symmetrical. However, the online computation of this distance − Heading accuracy: 0.3◦
between moving normal distributions may introduce some − Horizontal position accuracy: 2.5m
latency and detection delay that should be studied as we • Magnetometer module − Sensitivity: 330LSB/G
propose in our perspectives. − Dynamic range: 16(X and Y)/25(Z) G
− Accuracy: up to 1.5◦

III. C OMPARISON /D UPLICATION FAULT TOLERANCE • Lidar Lite-V3 − Range: 40m


A RCHITECTURE − Accuracy (< 5m): ±2.5cm
− Resolution: ±1cm
The fault tolerant data fusion architecture using compari-
TABLE I
son/duplication is presented in this section . It is based on the
S ENSORS S PECIFICATIONS
approach proposed in [7] and its general principle is illustrated
in Fig. 1.
The duplication/comparison approach in data fusion consists
of using at least two redundant units performing fusion of data gyroscope (Gyro1), a 3-axis accelerometer(Acc1), and a
collected from diversified or redundant sensors to estimate Digital Motion Processor TM (DMP).
the system states and then comparing them to detect an • Sensor block S2: It consists of one low cost Ublox NEO-

abnormal behavior of the system. Once an error is detected, the M8N GPS module (GPS1) used to measure the absolute
outputs of the fusion blocks and the sensors measurements are position of the UAV, one IST8310 magnetometer (Mag1)
analysed for error identification and for estimating the correct based on the anisotropic magneto resistance (AMR) tech-
output. Under the assumption of a single fault, this approach nology to estimate the heading (yaw) of the UAV, and one
can deal with one hardware sensor fault. LIDAR-Lite v3 Lidar (Lidar1) to measure the altitude of
As shown in Fig. 1, the architecture consists of two parallel the UAV.
data fusion units DF1 and DF2 resulting from (S1,S2) and • Sensor block S3: It consists of a Bosch BMI055 Inertial

(S3,S4) sensor blocks respectively. S1 and S3 are supposed Measurement Unit (IMU2) that includes a digital, tri-axial
to be functionally similar (i.e. either redundant sensors or 12-bit acceleration sensor (Acc2) and a triaxial 16-bit
diversified sensors providing the same information), the same gyroscope (Gyro2).
holds for S2 and S4. The outputs of the duplicated and • Sensor Block S4: It consists of one low cost Ublox NEO-

diversified components are compared and are used as follows: M8N GPS module (GPS2), one IST8310 magnetometer
(Mag2) in addition to one Lidar (Lidar2).
• The outputs of EIKF1 and EIKF2 are compared using the
Bhattacharyya metric to detect the presence of an error. In addition to these sensors, a Real-time kinematic (RTK) GPS
• The outputs of the sensor blocks (S1,S3) and (S2,S4) are providing measurements with an accuracy of 1cm is installed
compared to identify the type of the fault. and will be used as ground truth. Note that in this architecture
the sensors are not diversified, which means that we will not be
– If the outputs of the functionally similar sensors
able to tolerate common cause failures, such as GPS rebounds
are different, then a sensor fault is diagnosed. The
or absence of data due to being in a tunnel.
erroneous branch and the defective sensor can be
The specifications of the different used sensors are summa-
identified by residual analysis and the fault is toler-
rized in Table I.
ated using the outputs of the error free branch.
– If the sensors outputs are identical, then a software
fault is diagnosed. B. Data Fusion Component
Each component of the architecture is detailed in Fig. 2, and The first Extended Information Kalman Filter (EIKF1) of
in the following sections. the architecture uses data from the Inertial Measurement Unit
system (IMU1) with the sensors GPS1, Mag1 and Lidar1. The
sensor block S1 is used in the evolution model, and the sensor
A. Sensor Component
block S2 is used in the update step. The second fusion block
In our work, the data fusion fault tolerant architecture is has a similar construction.
implemented on a multirotor UAV to provide real flight data We define the two coordinate frames: a body-fixed coordi-
for experimental validation using fault injection. This UAV nate system (B), with its origin located at the accelerometer
is equipped with various redundant and diversified sensors triad and aligned to the casing, and a local North-East-Down
grouped in sensor blocks. (NED) navigation cartesian frame (N ). For most applications
• Sensor block S1: It consists of an InvenSense ICM-20689 this frame is defined stationary with respect to the earth if the
Inertial Measurement Unit (IMU1) that combines a 3-axis UAV is not expected to move over large distances. The rotation
SAIED et al.: AN INFORMATIONAL APPROACH FOR FAULT TOLERANT DATA FUSION APPLIED TO AN UAV’S ATTITUDE, ALTITUDE AND POSITION ESTIMATION
5

Fig. 1. Duplication–comparison architecture for fault tolerant data fusion [7]

Fig. 2. Fault Tolerance architecture implementation on the UAV system


6 IEEE SENSORS JOURNAL, VOL. XX, NO. XX, XXXX 2017

between the two frames is given by the three Euler angles: roll with αk = (rk cφk + qk sφk )(tan θk2 + 1), βk = (qk cφk −
(φ), pitch (θ) and yaw (ψ), and the rotating Direction Cosine rk sφk )/cθk , γk = s(θk (rk cφk + qk sφk ))/cθk2 .
Matrix is defined as:
B B
k =
R
N =  0 0 1 0 −żbk ẏbk

cψcθ −sψcφ + cψsθsφ sψsφ + cψsθcφ  0 1 0 żbk 0 −ẋbk 
 sψcθ cψcφ + sψsθsφ −cψsφ + sψsθcφ   0

0 1 −ẏbk ẋbk 0

 (24)
−sθ cθsφ cθcφ  0 0 0 1 sφk tan θk cφk tan θk
 

(15)  0 0 0 0 cφk −sφk 
1) Prediction Step: The prediction equations are expressed 0 0 0 0 sφk /cθk cφk /cθk
in terms of the accelerometer and gyroscope measurements.
The prediction is then achieved as detailed in (4) and (5).
A each instant k, the quadrotor state and input vectors are
defined as: 2) Update Step: To deal with the accelerometer and gy-
Xk = [ẋbk ẏbk żbk φk θk ψk ]T (16) roscope inaccuracies, correction measurements are obtained
from the GPS, magnetometer and lidar sensors. The measure-
uk = [axk ayk azk pk qk rk ]T (17) ment vector is given by:
where ẋb , ẏb , żb and p, q, r are the body-axis velocity
zk = [vxk vyk vzk Mxk Myk Mzk żLk ]T (25)
components and angular rates respectively.
The accelerations ax , ay and az are measured with respect where vxk , vyk , vzk are the GPS velocity measurements, Mxk ,
to the fixed gravity vector such as: Myk , Mzk are the magnetometer measurements in the body
     
ax ẋ 0 frame and zLk is the lidar altitude measurement.
 ay  = d  ẏ  + RB  0 
N (18) The nonlinear observation equations of the magnetometer
dt
az ż -g are given below:
d
with dt [ẋ ẏ ż]T being the time derivative of the velocity vector 
Mx
 
M ex

observed from the fixed frame and expressed as:  My  = R B  M ey 
N. (26)
        Mz M ez
ẋ ẋb p ẋb
d  d 
ẏ  = ẏb  +  q  ×  ẏb  (19) where [Mex Mey Mez ]T is the local magnetic vector expressed
dt dt in the navigation frame. The same transformation is needed
ż żb r żb
for the GPS measurements. The observation model is thus
Combining the equations (18) and (19) lead to the dynamics
nonlinear and given by:
of the velocity states as below:
   
ẋ rẏb − q żb + ax − g sin θ h(x
 k) =
d  b   
ẏb = pżb − rẋb + ay + g sin φ cos θ  (20) cψk cθk ẋbk + δxθk ẏbk + δxψk żbk
dt sψk cθk ẋbk + δyθk ẏbk + δyψk żbk
żb q ẋb − pẏb + az + g cos φ cos θ 



 −sθ k ẋbk + cθk sφk ẏbk + cθk cφk żbk 
Similarly, using the rotation matrix derived above, the 
 cψk cθk Mex + δxθk Mey + δxψk Mez

 (27)
relationship between the angular rates and the time derivatives  k k
 sψk cθk Mex + δyθk Mey + δyψk Mez
k 

of the Euler angles are given by:  k k
 −sθk Mex + cθk sφk Mey + cθk cφk Mez
k 

    k k k
φ p + q sin φ tan θ + r cos φ tan θ żbk
d 
θ  =  q cos φ − r sin φ  (21)
dt
ψ (q sin φ + r cos φ) sec θ with δxθk = −sψk cφk + cψk sθk sφk , δxψk = sψk sφk +
cψk sθk cφk , δyθk = cψk cφk +sψk sθk sφk , δyψk = −cψk sφk +
Based on (20), (21) and assuming that the bias parameters
sψk sθk cφk , and the update step is achieved according to (6)-
follow a first-order Gauss-Markov noise model, the state
(9).
dynamic equations can be written as:
For the implementation of the information filter on the UAV
Xk+1/k = f (Xk/k , uk ) + wk (22) system, the parameter w in (6) and (7) will be equal to 3 and
the vector zkl in (9) corresponds to [vxk vyk vzk 0 0 0 0]T for
with Xk+1/k being the estimated state vector at time k + 1
the GPS sensor, [0 0 0 Mxk Mxy Mxz 0]T for the magnetometer
given observations up to time k. The system is nonlinear and
and [0 0 0 0 0 0 zLk ]T for the lidar.
the jacobians should be calculated as in (10):
Fk =
−qk −g cθk
 
0 rk 0 0
 −rk −pk 0 −g cθk sφk −g cφk sθk 0  C. Fault Tolerant Component
 qk −pk 0 −g cθk sφk −g cφk sθk 0
 
 In this section, we present how sensors faults are detected
 0 0 0 qk cφk tan θk αk 0 
 and the system recovers using the fault tolerant component.
 
 0 0 0 −rk cφk − qk sφk 0 0
0 0 0 βk γk 0 We first detail the Error Detection Module, and then the Error
(23) Identification and Recovery Module.
SAIED et al.: AN INFORMATIONAL APPROACH FOR FAULT TOLERANT DATA FUSION APPLIED TO AN UAV’S ATTITUDE, ALTITUDE AND POSITION ESTIMATION
7

Pn
1) Error Detection Module: As described above and illus- hi
Estimate P̂0 : P̂0 = 1 − i=1
n
trated in Fig. 2, the first step in the fault tolerant component Initialize Bcmin = 0
is the error detection module EDM. It compares the estimated
states of the two Information Kalman filters (position, attitude
and altitude). For this purpose we calculate the Bhattacharyya Consider a threshold T hDet(i) from
Distance BD(DF 1,DF 2) between the outputs of the two data the set T hDet(min) to T hDet(max)
fusion blocks DF1 and DF2. At each time instant k, the models
estimated from the data fusion blocks DF1 and DF2 are de-
[DF 1] [DF 2]
scribed by their means qk and qk and their covariance i
[DF 1] [DF 2] Find the corresponding PD and PFi
matrices σk and σk respectively, the residual is then
expressed by:
[DF 1] [DF 2] [DF 1]
BD(DF 1,DF 2) = 18 (qk − qk )T σ −1 (qk Compute Bci
[DF 2] |σ| (28)
−qk ) + 12 log( [DF 1] [DF 2] )
|σk |.|σk |

Then this residual is compared to a certain threshold to detect If Bci < Bcmin =⇒ Bcmin = Bci
the existence of faulty sensors. The decision is taken among T hDet(opt) = T hDeti
two hypotheses: H1 , the hypothesis of existence of sensors PDopt
= PDi
faults in the UAV system and H0 , the hypothesis of absence opt
PF = PFi
of faults.
Let us define the following probabilities: Fig. 3. Residual threshold optimization
R∞
• PD = p(u1 /H1 ) = p(x/H1 )dx: Detection prob-
T hDet
ability, it is the probability of selecting H1 when H1 is
true, Knowing that:
R∞
• PF = p(u1 /H0 ) = p(x/H0 )dx: False alarm
T hDet P (u0 ) = P0 (1 − PF ) + (1 − P0 )(1 − PD )
probability, it is the probability of selecting H1 when (31)
P (u1 ) = P0 PF + (1 − P0 )PD
H0 is true,
• P0 = P (H0 ) and P (H1 ) = 1 − P0 : Prior probabilities, The Bhattacharyya criterion can be expressed as:
with ui being defined as the action of choosing the hypothesis 1

Bc = − log[α  0 + β0 ] + log[α1 + β1 ] − 2 log[γ0 ]
Hi , and p(x/Hi ) is the probability density function of the 1 (32)
− 2 log[γ1 ]
variable x, which corresponds to the Bhattacharyya distance
BD(DF 1,DF 2) in our case. with:
√ √
Different techniques were proposed and applied in the α0 = P0 √1 − PF , β0 = (1 − P0 )√1 − PD
literature to fix and choose the thresholds. In Bayesian op- α1 = P0 PF , β1 = (1 − P0 ) PD (33)
timisation, the threshold selection followed the minimization α2 β02 α2 β12
γ0 = P00 + 1−P , γ1 = P01 + 1−P
of a mean risk function. Using the Neyman-Pearson criterion, 0 0

it consists of optimizing the probability of detection while According to (32), the Bhattacharyya criterion depends on
minimizing the false alarm probability [46]. Other techniques the detection and false alarm probabilities PD and PF , and
consider the optimisation problem in terms of quantity of consequently depends on the choice of the detection threshold
information by minimizing the conditional entropy of the T hDet .
decision hypothesis or maximizing the mutual information The main objective is to determine the threshold that
[47], [48]. The technique adopted in this work is based on the maximizes the information surprise which corresponds to the
Bhattacharyya criterion developed in [42]. The optimisation minimization of the Bhattacharyya criterion. The algorithm is
problem is formulated using the information surprise that based on the exhaustive search problem-solving technique. It
evaluates the variation between the prior and the posterior starts by defining a threshold search interval, and then calculat-
distributions [45]. ing the Bc value across this interval to find the threshold that
The Bhattacharyya criterion is defined as: leads to the minimum Bc . To estimate the a priori probability
! P0 , we assume having random samples of hypotheses hi :
X Xq h = (h1 , h2 , ..., hn ), where hi = 0 if the hypothesis H0 is
Bc = − log p(Hi /uj )p(Hi ) (29)
selected, and hi = 1 if the hypothesis H1 is selected. The
j i
probability P0 is estimated as [44]:
Using Bayes theorem, it can be formulated as: Pn
hi
P̂0 = 1 − i=1 (34)
h h q q i n
Bc = − log p(H0 ) p(up(u 0 /H0 )
0)
+ p(H1 ) p(up(u 0 /H1 )
0)
h q q ii Fig. 3 summarizes the threshold optimization algorithm
+log p(H0 ) p(up(u
1 /H0 )
1)
+ p(H 1 ) p(u1 /H1 )
p(u1 ) where T hDet(min) and T hDet(max) are fixed arbitrary based
(30) on the residuals sizes. Fixing these margins is simpler than
8 IEEE SENSORS JOURNAL, VOL. XX, NO. XX, XXXX 2017

fixing empirically the optimal threshold in traditional tech- The diagnosis and fault-tolerant algorithm is detailed in
niques as a better choice of these two values decreases the Algorithm 1.
convergence time to the optimal threshold but do not change
this optimal value given by the algorithm when theses values
are big enough. Algorithm 1 Fault-Tolerant Algorithm
The choice of the probability P0 should be suitable to the Data: T hDet , T hDF 1 , T hDF 2 , T h13 , T h24a , T h24b , T h24c
application and to the frequency of occurrence of defects. It begin
is normally estimated based on the historical system behavior Calculate BD(DF 1,DF 2) , BDDF 1 , BDDF 2 Calcu-
as a priori knowledge of the probable fault cases is needed to late D(S1,S3) , D(S2,S4)a , D(S2,S4)b , D(S2,S4)c if
guarantee their detection. Note that this is also the case when (BD(DF 1,DF 2) > T hDet ) then
dealing with traditional techniques based on fixing thresholds /* A fault is detected */ if (BDDF 1 > T hDF 1 ) then
empirically. /* The fault is in the first branch */ if (D(S1,S3) >
2) Error Identification and Recovery Module: Once an error T h13 ) then
is detected, the faulty component should be isolated and S1 is faulty, Isolate EIKF 1
then the correct output of the system estimated. The pro- else
cedure starts by comparing the probability distributions of if (D(S2,S4)a > T h24a )||(D(S2,S4)b >
the prediction and correction steps of each data fusion block T h24b )||(D(S2,S4)c > T h24c ) then
S2 is faulty, Isolate EIKF 1
to evaluate the information surprise [45] provided by the
else
correction measurements. This is done by computing the two /* cannot identify the faulty sensor, keep
Bhattacharyya distances as described in the equations below: running without modifications */
[DF 1] [DF 1] [DF 1] [DF 1] end
BDDF 1 = 81 (qk/k−1 − qk/k )T σ −1 (qk/k−1 − qk/k )
|σ|
+ 21 log( q [DF 1] [DF 1]
) end
|σk/k−1 |.|σk/k |
else
(35)
if (DBDF 2 > T hDF 2 ) then
/* The fault is in the second branch */
[DF 2] [DF 2] [DF 2] [DF 2]
BDDF 2 = 81 (qk/k−1 − qk/k )T σ −1 (qk/k−1 − qk/k ) else
|σ| /* cannot identify the faulty branch, keep run-
+ 21 log( q )
[DF 2] [DF 2]
|σk/k−1 |.|σk/k | ning without modifications */ if (D(S1,S3) >
(36) T h13 ) then
If no fault exists, the a priori (k/k −1) and a posteriori (k/k) S3 is faulty, Isolate EIKF 2
distributions should be convergent, and the information sur- else
prise must not exceed a predetermined threshold that depends if (D(S2,S4)a > T h24a )||(D(S2,S4)b >
on the number of observations, the size of the state vector, etc. T h24b )||(D(S2,S4)c > T h24c ) then
On the other hand, if the residual BDDF 1 exceeds a threshold S4 is faulty, Isolate EIKF 2
T hDF 1 , an error is detected in the first branch (in the block else
/* cannot identify the faulty sensor,
sensors S1 or S2). If the residual BDDF 2 exceeds a threshold
keep running without modifications */
T hDF 2 , an error is detected in the second branch (in the block
end
sensors S3 or S4).
Then we proceed by comparing the outputs of similar end
sensors. We first compare the output of the sensor block S1 end
with that of the sensor block S3 by comparing the distance end
D(S1,S3) to a threshold T h13 . D(S1,S3) is defined as: else
p /* No fault is detected */
DS1,S3 = (φ1 − φ2 )2 + (θ1 − θ2 )2 + (ψ1 − ψ2 )2 (37) end
with φi , θi and ψi being the Euler angles measured by the end
Inertial Measurement Unit IM Ui .
Second, we compare the output of sensor block S2 with that
of the sensor block S4 by comparing the distances D(S2,S4)a ,
D(S2,S4)b and D(S2,S3)c to thresholds T h24a , T h24b and IV. E XPERIMENTAL VALIDATION
T h24c . D(S2,S4)a , D(S2,S4)b and D(S2,S4)c are defined as: In this section we present the experimental validation of
p the proposed fault tolerant architecture using real data and
D(S2,S4)a = (x1 − x2 )2 + (y1 − y2 )2
fault injection. We start first by describing the experimental
D(S2,S4)b = |z1 − z2 | (38)
environment followed by the obtained results.
D(S2,S4)c = |ψ1 − ψ2 |
The data acquisition was conducted outdoor using a
with xi and yi being the position measured by the GP Si , Tarot650 quadrotor built at the Heudiasyc Laboratory and
zi the altitude measured by the Lidari and ψi the yaw angle shown in Fig. 4. The UAV is equipped with the different
measured by the Magnetometer Magi . sensors detailed in Section 3. The experimental data included
SAIED et al.: AN INFORMATIONAL APPROACH FOR FAULT TOLERANT DATA FUSION APPLIED TO AN UAV’S ATTITUDE, ALTITUDE AND POSITION ESTIMATION
9

Fig. 4. Experimental quadrotor

online fault injection, then was processed offline using a


Matlab environment. We consider in this section the results of Fig. 5. Real and estimated trajectories after an additive fault on GPS1
two fault injections: an additive fault on the first GPS sensor
GPS1, and an additive fault on Lidar1. The covariance matrices
of the state and measurement models are selected based on
empirical tuning as:
10−4 × I3×3
 
03×3
Qk = , Rk = 0.5 × I7×7
03×3 10−6 × I3×3

A. Additive fault on GPS1


First, an additive fault on GPS1 output is considered. This
type of fault emulates a typical jump in the GPS position
resulting from satellite signal rebounds. Note that using redun-
dant GPS sensors of the same type would usually not tolerate
this fault as it has a common cause. Between the instants
t1 = 7.26s and t2 = 15.8s, a jump of 1m is added in the
x1 and y1 direction and the new measurements x01 and y10 are
then given below as:
x01 (tk ) = x1 (tk ) + 1
t1 ≤tk ≤t2
(39)
y10 (tk ) = y1 (tk ) + 1 Fig. 6. The BD(DF 1,DF 2) for the fault detection after GPS1 fault
t1 ≤tk ≤t2

The UAV followed a given U-shape reference trajectory,


presented in green by the RTK measurement (considered as the BD(DF 1,DF 2) test is done for both BDDF 1 and BDDF 2 .
ground truth) in Fig. 5. The trajectories estimated by the first Fig 8 shows how that a posteriori distributions of the second
and second Information filters in presence of faults on GPS1 data fusion block are convergent and the residual BDDF 1
data are presented respectively in blue and red in Fig. 5. It is exceeds its threshold value after the fault has been detected,
clear how the position estimated from the first filter deviates indicating an error in the first branch. Similar reasoning on
significantly from all the other systems. residual D(S1,S3) shown in Fig. 9 enables to decide that the
Fig. 6 gives the Bhattacharyya distance BD(DF 1,DF 2) used GPS1 is the faulty sensor. It should be noted that in Fig. 8,
for the fault detection. It presents a jump at the fault injection the fault is injected at time t = 7.26s. Before this instant, the
time indicating a drift between the outputs of the data fusion high values of the distances BDDF 1 and BDDF 2 are due to
blocks. It should be compared to the threshold presented in the time needed for the filters to converge. Practically, enough
black in Fig. 6 that corresponds to the minimum Bhattacharyya time should be provided to initialize the filter and ensure its
criterion obtained at the value 0.2 when P0 = 0.6154 (Fig. 7). convergence before launching the diagnosis algorithm. The
It is shown that the system detects an error at time tDet = black curve in Fig. 5 presents the output of the data fusion
7.29s. mechanism of the UAV. From an average of the outputs of
Once an error is detected, the faulty sensor should be IEKF1 and IEKF2, it goes to the output of IEKF2 after
isolated by applying Algorithm 1. Therefore, the set of resid- the exclusion of the first Information filter. To evaluate the
uals BDDF 1 , BDDF 2 , D(S1,S3) , D(S2,S4)a , D(S2,S4)b and accuracy of the fault tolerant controller, the position errors
D(S2,S4)c must be compared (Fig. 8 and 9). To fix the thresh- along the x and y axes are shown in Fig. 10. Note that the parts
olds, an identical procedure to the one followed previously for of the plots circled with red are outliers (false measurement
10 IEEE SENSORS JOURNAL, VOL. XX, NO. XX, XXXX 2017

Fig. 7. Optimal threshold value T h12 using the Bhattacharyya Criterion


for P0 = 0.6154. Fig. 9. The different residual tests after GPS1 fault

Fig. 8. The residual test to isolate the failed branch after GPS1 fault

acquired from real time operating GPSs).

B. Additive fault on Lidar2


During this experiment, the UAV is requested to perform a
hovering flight at a 3m altitude. At time t1 = 67s, an additive
fault of 1m is added to the Lidar2 output as below:
z20 (tk ) = z2 (tk ) + 1 (40)
tk ≥t1

There is no need for an additional ground truth in this case


since the precision of the Lidar installed on the UAV is below
15cm, thus it is considered as a ground truth. The estimated
Fig. 10. The position errors along the x and y axes
altitudes by the two Information filters in the case of faults on
the Lidar2 data are presented respectively in blue and red in
SAIED et al.: AN INFORMATIONAL APPROACH FOR FAULT TOLERANT DATA FUSION APPLIED TO AN UAV’S ATTITUDE, ALTITUDE AND POSITION ESTIMATION
11

However, they are expensive and they can result in a


significant increase in mass.
• Compared with [33], [34], the fault-tolerant aspect of the
sensor fusion algorithm is validated with sensor failures
injected during real flight and not by superimposing
simulated sensor failures on the actual flight data.

V. C ONCLUSION
In this work, a fault tolerant multi-sensor fusion architecture
based on the informational form of the Kalman filter and
the information theory concept is developed and applied to
a UAV system. The fault detection and isolation steps were
formulated using the Bhattacharyya distances between the
outputs of the Information filters and between the predicted
and the updated distributions of each IF respectively. The
BD used in residual tests presents many advantages when
compared to other metrics such as the Mahalanobis distance
or the Kullback–Leibler metric since it increases with the
difference between the variances of the distributions under
study and is symmetrical. However, the latency introduced
by the inertia of this distance when applied to measurement
streams and its effect on the detection delay have not been
considered and should be evaluated in future studies.
An optimal thresholding method using the Bhattacharyya
criterion Bc is adopted instead of the traditional techniques
based on heuristic methods to fix the false alarm probability.
The computed threshold is affected by the historical system
behavior and the prior probability of the hypothesis.
Fig. 11. Estimated altitudes after an additive fault on Lidar2 In future work, this architecture should be developed and
extended to have the ability to tolerate more than one sensor
fault, in addition to actuators faults. Its performance in case
Fig. 11. We can clearly see that the altitude estimated from the of small additive and drift faults should be further evaluated
first filter deviates significantly from the one estimated from and could be improved by comparing the outputs of redundant
the second filter. The black curve presents the altitude of the sensors.
UAV given as output of the data fusion mechanism. It goes
from an average of the altitudes of IEKF1 and IEKF2 to the ACKNOWLEDGEMENTS
value of IEKF1 once IEKF2 has been excluded as a system
recovery. The authors would like to thank the Heudiasyc Laboratory
This architecture could be easily adapted to detect and iso- for providing real data used for validation.
late software fault as already considered in [7]. The software
faults that are generally introduced during the development R EFERENCES
stage are of human origin. Note however that software faults [1] H. Durrant-Whyte and T. Henderson, Multisensor Data Fusion. Springer
detection problem is out of scope of this paper. Handbook of Robotics, 2016, pp. 867–896.
When compared to similar architectures applied on un- [2] B. Khaleghi, A. Khamis, F. O. Karray and S. N. Razavi, “Multisensor
data fusion: A review of the state-of-the-art,” Information Fusion, vol. 14,
manned aerial vehicles, the one presented in this paper presents no. 1, pp. 28–44, Jan, 2013.
the following advantages: [3] D. Hall and J. Llinas, “An introduction to multisensor data fusion,”
Proceedings of the IEEE, vol. 85, no. 1, pp. 6–23, Jan. 1997.
• Compared with [35], the proposed architecture overcomes [4] M. Kumar, D. Garg and R. Zachery, “A Generalized Approach for
the disadvantages of using a dynamic model to isolate Inconsistency Detection in Data Fusion from Multiple Sensors,” American
the faulty sensor which requires to identify and tune the Control Conference (ACC), Minneapolis, MN, USA, 2006, pp. 2078–2083.
[5] P. Smets, “Analyzing the combination of conflicting belief functions,”
model parameters after each failure occurrence to avoid Information fusion, vol. 8, no. 4, pp. 387–412, Oct. 2007.
model drift. [6] Y. Zhu, E. Song, J. Zhou and Z. You, “Optimal Dimensionality Reduction
• Compared with [32], less redundant sensors and Kalman of Sensor Data in Multisensor Estimation Fusion,” IEEE Transactions on
Signal Processing, vol. 53, no. 5, pp. 1631–1639, May 2005.
filter blocks are needed in this architecture. The fault [7] K. Bader, B. Lussier and W. Schon, “A fault tolerant architecture for data
tolerant methods based on majority-voting methods or fusion: A real application of Kalman filters for mobile robot localization,”
weighted-mean methods requiring at least three similar Robotics and Autonomous Systems, vol. 88, pp. 11–23, Feb. 2017.
[8] B. Du, Z. Shi, J. Song, H. Wang and L. Han, “A Fault-Tolerant Data
or diversified sensors measuring a certain state variable Fusion Method of MEMS Redundant Gyro System Based on Weighted
as in [32] are still used in many existing avionic systems. Distributed Kalman Filtering,” Micromachines, vol. 5, no. 10, Apr. 2019.
12 IEEE SENSORS JOURNAL, VOL. XX, NO. XX, XXXX 2017

[9] L. Shu-qing and Z. Sheng-xiu, “A Congeneric Multi-Sensor Data Fusion [31] J. Garcia, J.M. Molina and J. Trincado, “Real evaluation for designing
Algorithm and Its Fault-Tolerance,” International Conference on Computer sensor fusion in UAV platforms.” Information Fusion, vol. 63, pp. 136–
Application and System Modeling, Taiyuan, China, 2010, pp. 339–342. 152, Dec. 2020.
[10] A. Avizienis, J.-C. Laprie, B. Randell and C. Landwehr, “Basic Concepts [32] K. Geng and N.A. Chulin, “Applications of multi-height sensors data
and Taxonomy of Dependable and Secure Computing,” IEEE Transactions fusion and fault-tolerant Kalman filter in integrated navigation system of
on Dependable And Secure Computing, vol. 1, no. 1, pp. 11–33, March UAV,” Procedia Computer Science, vol. 103, pp. 231–238, 2017.
2004. [33] Y. Gu, J. N. Gross, M. B. Rhudy and K. Lassak, “A Fault-Tolerant
[11] H. Darvishi, D. Ciuonzo, E.R. Eide and P. Salvo Rossi, “Sensor-Fault Multiple Sensor Fusion Approach Applied to UAV Attitude Estimation,”
Detection, Isolation and Accommodation for Digital Twins via Modular International Journal of Aerospace Engineering, 2016.
Data-Driven Architecture,” IEEE Sensors Journal, 2021. [34] J. Gross, Sensor Fusion Based Fault-Tolerant Attitude Estimation So-
[12] L. Liu, G. Han, Y. He, and J. Jiang, “Fault-Tolerant Event Region lutions for Small Unmanned Aerial Vehicles, PhD Thesis, West Virginia
Detection on Trajectory Pattern Extraction for Industrial Wireless Sensor University, 2011.
Networks,” IEEE Transactions on Industrial Informatics, vol. 16, no. 3, pp. [35] H. Hamadi, Fault-tolerant control of a multirotor unmanned aerial
2072–2080, March 2020. vehicle under hardware and software failures, PhD Thesis, University of
[13] D.J. Allerton and H. Jia, “A Review of Multisensor Fusion Methodolo- Technology of Compiegne, 2020.
gies for Aircraft Navigation Systems,” Journal of Navigation, vol. 58, no. [36] S. Amari, “α-Divergence Is Unique, Belonging to Both f - Divergence
3, pp. 405–417, 2005. and Bregman Divergence Classes,” IEEE Trans. Inf. Theory, vol. 55, no.
11, pp. 4925–4931, Oct. 2009.
[14] J. Simanek, V. Kubelka and M. Reinstein, “Improving multi-modal data
[37] A. Zeroual, F. Harrou, Y. Sun and N. Messai, “Integrating Model Based
fusion by anomaly detection”, Autonomous Robots, vol. 39, pp. 139–154,
Observer and Kullback–Leibler Metric for Estimating and Detecting Road
2015.
Traffic Congestion,” IEEE Sens. J., vol. 18, no. 20, pp. 8605—8616, Aug.
[15] L. Hachemi, M. Guiatni and A. Nemra, “Fault Diagnosis and Recon- 2018.
figuration for Mobile Robot Localization Based on Multi-Sensors Data [38] A. Bhattacharyya, “On a measure of divergence between two statistical
Fusion,” Unmanned Systems, 2021. populations defined by thew probability distributions,” Bull. Calcutta Math.
[16] B. Kellalib, N. Achour, V. Coelen and A. Nemra, “Towards simultaneous Soc., vol. 35, pp. 99–109, 1943.
localization and mapping tolerant to sensors and software faults: Appli- [39] B. Abci, M. El Badaoui El Najjar, V. Cocquempot and G. Dherbomez,
cation to omnidirectional mobile robot,” Proceedings of the Institution of “An informational approach for sensor and actuator fault diagnosis for
Mechanical Engineers, Part I: Journal of Systems and Control Engineering, autonomous mobile robots,” Journal of Intelligent & Robotic Systems, vol.
2021. 99, pp. 387–406, Aug. 2020.
[17] V. Kubelka, L. Oswald, F. Pomerleau, F. Colas, T. Svoboda and M. [40] S. Srimani, K. Ghosh and H. Rahaman, “Parametric Fault Detection in
Reinstein, “Robust Data Fusion of Multimodal Sensory Information for Analog Circuits: A Statistical Approach,” Asian Test Symposium (ATS),
Mobile Robots,” Journal of Field Robotics, vol. 32, no. 4, pp. 447-–473, Hiroshima, Japan, pp. 275–280, 2016.
2014. [41] S. Srimani, M.K. Parai, K. Ghosh and H. Rahaman, “Parametric fault
[18] N. Sadeghzadeh-Nokhodberiz and J. Poshtan, “Distributed Interacting detection of analog circuits based on Bhattacharyya measure,” Analog
Multiple Filters for Fault Diagnosis of Navigation Sensors in a Robotic Integrated Circuits and Signal Processing, vol. 93, vol. 477–488, Dec.
System,” IEEE Transactions on Systems, Man, and Cybernetics: Systems, 2017.
vol. 47, no. 7, pp. 1383–1393, 2017. [42] B. Abci, J. Nader, M. El Badaoui El Najjar and V. Cocquempot, “Fault-
[19] V. Ricquebourg, M. Delafosse, L. Delahoche, B. Marhic, A. Jolly-Desodt tolerant multi-sensor fusion and thresholding based on the Bahattachryya
and D. Menga, “Fault detection by combining redundant sensors: a conflict distance with application to a multi-robot system,” European Workshop on
approach within the TBM framework,” Cognitive Systems with Interactive Advanced Control and Diagnosis, Bologna, Italy, 2019.
Sensors, COGIS, 2007. [43] J. Harmouche, C. Delpha and D. Diallo, “Improved Fault Diagnosis of
[20] F. Delmotte and G. Gacquer, “Detection of defective sources with Ball Bearings Based on the Global Spectrum of Vibration Signals,” IEEE
belief functions,” International Conference on Information Processing and Transactions on Energy Conversion, vol. 30, no. 1, pp. 376–383, March
Management of Uncertainty in Knowledge-Based Systems, Malaga, Spain, 2015.
2008, pp. 337—344. [44] J. Al Hage, M El Badaoui El Najjar and D. Pomorski, “Multi-
[21] F. Delmotte, “Detection of defective sources in the setting of possibility sensor fusion approach with fault detection and exclusion based on the
theory,” Fuzzy Sets Syst., vol. 158, no. 5, pp. 555—571, 2007. Kullback–Leibler Divergence: Application on collaborative multi-robot
[22] L. Shu-qing and Z. Sheng-xiu, “A congeneric multi-sensor data fusion system,” Information Fusion, vol. 37, pp. 61–76, Sep. 2017.
algorithm and its fault-tolerance,” International Conference on Computer [45] P. Baldi and L. Itti, “Of bits and wows: A Bayesian theory of surprise
Application and System Modeling, ICCASM, 2010. with applications to attention,” Neural Networks, vol. 23, no. 5, pp. 649–
[23] D.J. Allerton and H. Jia, “Distributed data fusion algorithms for inertial 666, Jun. 2010.
network systems,” Radar Sonar Navig. IET, vol. 2, no. 1, pp. 51–62, 2008. [46] D.A. Pados, P. Papantoni-Kazakos, D. Kazakos and A. G. Koyiantis,
[24] M. Silvagni, A. Tonoli, E. Zenerino and M. Chiaberge, “Multipurpose “On-line threshold learning for Neyman-Pearson distributed detection,”
UAV for search and rescue operations in mountain avalanche events,” IEEE Transactions on Systems, Man, and Cybernetics, vol. 24, no. 10,
Geomatics, Natural Hazards and Risk, vol. 8, no. 1, pp. 18–33, May 2017. pp. 1519–1531, Oct. 1994.
[47] I.Y. Hoballah and P.K. Varshney, “An information theoretic approach
[25] M Saied, T. Mahairy, C. Francis, H. Shraim, H. Mazeh and M. El Rafei,
to the distributed detection problem,” IEEE Transactions on Information
“Differential Flatness-Based Approach for Sensors and Actuators Fault
Theory, vol. 35, no. 5, pp. 988–994, Sep. 1989.
Diagnosis of a Multirotor UAV,” IFAC-PapersOnLine, vol. 52, no. 16, pp.
[48] D. Pomorski, “Entropy-based optimisation for binary detection net-
831-836, 2019.
works,” Proceedings of the Third International Conference on Information
[26] R. Avram, X. Zhang and J. Muse, “Quadrotor Sensor Fault Diagnosis Fusion, Paris, France, 2000.
with Experimental Results,” Journal of Intelligent & Robotic Systems, vol.
86, pp. 115–137, April 2017.
[27] R. Sabatini, S. Ramasamy and A. Gradi, “Multisensor data fusion for
unmanned aerial vehicles navigation and guidance,” International Confer-
ence and Exhibition Mechanical & Aerospace Engineering, Philadelphia,
USA, 2014.
[28] R. Sabatini, S. Ramasamy, A. Gardi and L. R. Salazar, “Low-cost
Sensors Data Fusion for Small Size Unmanned Aerial Vehicles Navigation
and Guidance,” International Journal of Unmanned Systems Engineering,
vol. 1, no. 3, 2013.
[29] X. Yang, L. Mejias and M. Garratt, “Multi-Sensor Data Fusion for
UAV Navigation during Landing Operations,” Australian Conference on
Robotics and Automation, Melbourne, Australia, pp. 1–10, 2011.
[30] W. Zhang, Y. Ning and C. Suo, “A Method Based on Multi-Sensor Data
Fusion for UAV Safety Distance Diagnosis,” Electronics, vol. 8, no. 12,
Dec. 2019.

You might also like