Sensors: Pose Estimation of A Mobile Robot Based On Fusion of IMU Data and Vision Data Using An Extended Kalman Filter
Sensors: Pose Estimation of A Mobile Robot Based On Fusion of IMU Data and Vision Data Using An Extended Kalman Filter
Sensors: Pose Estimation of A Mobile Robot Based On Fusion of IMU Data and Vision Data Using An Extended Kalman Filter
Article
Pose Estimation of a Mobile Robot Based on Fusion
of IMU Data and Vision Data Using an Extended
Kalman Filter
Mary B. Alatise 1, * ID
and Gerhard P. Hancke 1,2
1 Department of Electrical, Electronic and Computer Engineering, University of Pretoria, Pretoria 0028,
South Africa; [email protected] or [email protected]
2 Department of Computer Science, City University of Hong Kong, Hong Kong, China
* Correspondence: [email protected]; Tel.: +27-83-757-3830
Abstract: Using a single sensor to determine the pose estimation of a device cannot give accurate
results. This paper presents a fusion of an inertial sensor of six degrees of freedom (6-DoF) which
comprises the 3-axis of an accelerometer and the 3-axis of a gyroscope, and a vision to determine a
low-cost and accurate position for an autonomous mobile robot. For vision, a monocular vision-based
object detection algorithm speeded-up robust feature (SURF) and random sample consensus
(RANSAC) algorithms were integrated and used to recognize a sample object in several images
taken. As against the conventional method that depend on point-tracking, RANSAC uses an iterative
method to estimate the parameters of a mathematical model from a set of captured data which
contains outliers. With SURF and RANSAC, improved accuracy is certain; this is because of their
ability to find interest points (features) under different viewing conditions using a Hessain matrix.
This approach is proposed because of its simple implementation, low cost, and improved accuracy.
With an extended Kalman filter (EKF), data from inertial sensors and a camera were fused to estimate
the position and orientation of the mobile robot. All these sensors were mounted on the mobile robot
to obtain an accurate localization. An indoor experiment was carried out to validate and evaluate the
performance. Experimental results show that the proposed method is fast in computation, reliable
and robust, and can be considered for practical applications. The performance of the experiments
was verified by the ground truth data and root mean square errors (RMSEs).
Keywords: pose estimation; mobile robot; inertial sensors; vision; object; extended Kalman filter
1. Introduction
Localization is identified as a problem of estimating the pose estimation (i.e., position and
orientation) of a device or object such as aircraft, humans and robots, relative to a reference frame,
based on sensor input. Other related problems of localization are path planning [1,2], indoor
localization/navigation and tracking activities [3]. Several methods are used to determine localization:
inertial sensors [4], odometry [4], GPS [4], and laser and sonar ranging sensors [5–7]. The use of relatively
cheap sensors is important from a practical point of view; however, low-cost sensors seldom provide good
performance due to measurement inaccuracies in various environments. Recently, augmented reality
(AR) has been widely deployed to facilitate a new method for users to interact with their surroundings.
Areas of applications of AR are tourism, education, entertainment, etc. [6–10]. Despite research carried
out on current technologies for indoor environments to estimate the position and orientation of mobile
devices, the high cost of deployment to achieve accuracy is still a major challenge. In recent times,
with the Internet-of-things and mobile devices enabling sensing [11,12] for a variety of consumer,
environmental and industrial applications [13–17], sensors and embedded intelligence have become
cheaper and easier to integrate into systems [15]. The main contribution of this work is the use of SURF
and RANSAC algorithms to acquire data from vision and integrate it with inertial sensors to estimate
the position and orientation of the mobile robot. The inertial measurement unit (IMU) used for this
practical work is the new Arduino 101 microcontroller which has both accelerometer and gyroscope
compacted into the same device to give accurate results. The fusion of inertial sensors and vision-based
techniques are used to provide a robust tracking experience and thus overcome the inadequacies
associated with individual component-based tracking. The main advantages of this method lie in its
ease of implementation, low cost, fast computation and improved accuracy. Currently, it has been
proven that vision could be a promising navigation sensor that provides accurate information about
position and orientation [18]. Cameras have the advantage of providing an extensive amount of
information while having a low weight, limited power consumption, low cost and reasonable size.
However, the use of vision methods has it shortcomings, such as illumination change and distortion
due to fast movement. Inertial sensors offer good signals with high rate during fast motions but
are sensitive to accumulated drift due to double integration during estimation of position. On the
other hand, visual sensors provide precise ego-motion estimation with a low rate in the long term,
but suffer from blurred features under fast and unpredicted motions. The aim of inertial and vision
sensor integration is to overcome some fundamental limitations of vision-only tracking and IMU-only
tracking using their complementary properties. Tracking of object in an environment is usually
predefined with specific landmarks or markers. More discussion on markers will be presented in
Section 2. The fusion methods, such as the Kalman filter or extended Kalman filter, usually adopt
iterative algorithms to deal with linear and non-linear models, and hence convergence is not always
assured [19,20]. For an autonomous mobile robot to localize and determine its precise orientation and
position, some techniques are required to tackle this problem. Generally, the techniques are split into
two categories [21–24]:
Relative localization techniques (local): Estimating the position and orientation of the robot
by combining information produced by different sensors through the integration of information
provided by diverse sensors, usually encoder or inertial sensors. The integration starts from the initial
position and continuously update in time. The relative positioning alone can be used only for a short
period of time.
Absolute localization techniques (global): This method allows the robot to search its location
directly from the mobile system domain. There numerous methods usually depend on navigation
beacons, active or passive landmarks, maps matching or satellite-based signals such as the global
positioning system (GPS). For absolute localization, the error growth is mitigated when measurements
are available. The position of the robot is externally determined and its accuracy is usually time and
location-independent. In other words, integration of noisy data is not required and thus there is no
accumulation of error with time or distance travelled. The limitation is that one cannot keep track
of the robot for small distances (barring exceptionally accurate GPS estimates); in addition, GPS is
not appropriate for indoor localization. This paper proposed to implement a hybrid method (inertial
and vision) such that the weakness of one technique is complemented by the other. We conducted an
indoor experiment using low-cost devices and a simple methodology to determine the pose estimation
of a mobile robot in an environment in real-time. The two major components used are IMU (6-DoF)
and a single camera. The system is based on the data collected from IMU and camera fused together
using extended kalman filter (EKF) to determine the pose estimation of a mobile robot in reference
to an object in the environment. Object identification from the image captured by the camera will
be simulated and analysed using the computer toolbox in MATLAB with the speeded-up robust
feature (SURF) algorithm, which is the most recent and efficient detector and descriptor for object
recognition. The random sample consensus (RANSAC) algorithm will be used for the feature matching.
This algorithm was used to estimate the homograph matrix of images captured. The combination of
SURF and RANSAC gives robust, fast computation and accurate results for vision tracking scenarios.
The accuracy of the proposed method will be shown as a result of real experiments performed and pose
Sensors 2017, 17, 2164 3 of 22
estimation method proposed which will be evaluated by the root mean square error model (RMSE).
The RMSE shows that the pose estimation method has low error values in both position and orientation.
Therefore, this approach can be implemented for practical applications used in indoor environments.
In our previous work [25], we proposed a six degree of freedom pose estimation that integrates data
from IMU and monocular vision. Detected natural landmarks (also known as markerless method)
from image captured were used as data input for vision. Experimental results showed an improved
performance of accuracy. This article is based on using a recognized object (marker-based method)
captured by the camera with IMU data to determine the pose estimation of a mobile robot. The rest of
the paper is organized as follows: in Section 2, a review of previous work done is presented. Section 3
discusses the proposed method for pose estimation which includes the IMU and camera mathematical
expressions. The experimental setup is presented in Section 4. This is followed by Section 5, which
presents the results and a discussion of the proposed method. Finally, Section 6 concludes the work
and gives future directions.
2. Related Work
Pose estimation has been studied in past and recent times for applications in object positioning [7],
robotics, and augmented reality (AR) tracking [26]. This section will discuss the existing technologies
used for pose estimation in our environment these days. These methods are categorised into inertial
sensor-based methods, vision sensor-based methods and fusion based methods.
and RANSAC algorithm [36,37,43]. RANSAC is used here because of its ability to estimate parameter
with a high degree of accuracy even when a substantial number of outliers are present in the data set.
SURF was first introduced by Bay et al. [36]. SURF outperforms the formerly proposed scheme
SIFT with respect to repeatability (reliability of a detector for finding the same physical interest
points under different viewing conditions), distinctiveness, and robustness, yet can be computed and
compared much faster. The descriptors are used to find correspondent features in the image. SURF
detect interest points (such as blob) using Hessian matrix because of it high level of accuracy. This is
achieved by relying on integral images for image convolutions; by building on the strengths of the
leading existing detectors and descriptors (specifically, using a Hessian matrix-based measure for the
detector, and a distribution-based descriptor); and by simplifying these methods to the essential. This
leads to a combination of novel detection, description, and matching steps. SURF is used to detect
key points and to generate its descriptors. Its feature vector is based on the Haar Wavelet response
around the interested features [38]. SURF is scale-and rotation-invariant, which means that, even with
variations of the size and rotation of an image, SURF can find key points.
Random sample consensus (RANSAC) is feature matcher which works well with SURF to match
objects detected by SURF in images. RANSAC was first published by Fischler and Bolles [43] in 1981
which is also often used in computer vision. For example, to simultaneously unravel correspondence
problems such as fundamental matrices related to a pair of cameras, homograph estimation, motion
estimation and image registration [44–49]. It is an iterative method to estimate parameters of a
mathematical model from a set of observed data which contains outliers. Standard RANSAC algorithm
of this method is presented as follows:
Assuming a 2D image corresponds to a 3D scene points (xi , wXi ), let us assume that some
matches are wrong in the data. RANSAC uses the smallest set of possible correspondence and proceed
iteratively to increase this set with consistent data.
The correspondences that partake of the consensus obtained from S* are the inliers. The outliers
are the rest. It has to be noted that the number of iterations, which ensures a probability p that at least
one sample with only inliers is drawn can be calculated. Let p be the probability that the RANSAC
algorithm selects only inliers from the input data set in some iteration. The number of iterations is
denoted as [50–52]:
log(1 − p)
k= ,
log(1 − (1 − w)n )
where w is the proportion of inliers and n is the size of the minimal subset from which the model
parameters are estimated.
Steps to detect and recognise object (marker) in a scene are as follows:
3.3.Proposed
ProposedModeling
ModelingMethod
Method
Whenworking
When workingwith
witha asensor
sensorunit
unitcontaining
containinga acamera
cameraand
andananIMU,
IMU,several
severalreference
referencecoordinate
coordinate
systems have to be presented. The four major coordinate systems are depicted in
systems have to be presented. The four major coordinate systems are depicted in Figure 1:Figure 1:
(a) World frame (b) Object frame (c) Camera frame (d) Body frame
Figure 1. Reference coordinate system.
Figure 1. Reference coordinate system.
• Camera frame {c}: This frame is attached to the camera on the mobile robot with the x-axis
pointing to the image plane in the right direction and z-axis pointing along the optical axis and
origin located at the camera optical center.
• The IMU method provides orientation of the body {b} with respect to (wrt) world frame {w} Rwb
and vision method provides orientation of the object {o} wrt to camera frame {c} Rco [26,60].
Sensors 2017, 17, 2164 7 of 22
3.1. IMU-Based Pose Estimation
3.1. IMU-Based Pose Estimation
Figure 2 shows the block diagram of the inertial sensors which used a Kalman filter to estimate the
Figure 2 shows the block diagram of the inertial sensors which used a Kalman filter to estimate
current pose and to reduce drifts and errors [61] of the sensors. This filter is also capable of estimating
the current pose and to reduce drifts and errors [61] of the sensors. This filter is also capable of
an accurate orientation of the system, but is basically used for linear systems.
estimating an accurate orientation of the system, but is basically used for linear systems.
where g denotes the gravity and the subscripts b and w represents the body frame and world
gw = Rwb gb , (1)
frame, respectively. To obtain the rotation matrix from the world frame {w} to the body frame {b},
where(R ) , the Euler
gwbdenotes the angles,
gravityroll andφ the
, pitch θ , and yaw
subscripts b andψw can be obtained
represents the as:
body frame and world frame,
respectively. To obtain the rotation matrix from the world frame {w} to the body frame {b}, ( Rwb ),
cφ cθ −cψ sθ + sψ sφ cθ sψ sθ + cψ sφ cθ
the Euler angles, roll φ, pitch θ, and yaw ψ can be obtained as:
( Rwb ) = cφ sθ cψ cθ + sψ sφ sθ − sψ cθ + cψ sφ sθ , (2)
− sφ cφcθ −cψsθsφ+cψsψsφcθ sψsθ + cψsφcθcφ cθ
The 3-axis accelerometer gives the components of the gravitational accelerations expressed in the
object reference frame ( gb = [ gbx gby gbz ] T ), where the superscript T represents the transpose matrix.
Hence, substituting the gravity vector is related through a rotation matrix, the relation is given as:
gbx 0 − g sin θ
gb = gby = Rwb gw = Rwb 0 = g cos ϕ sin φ , (4)
gbz g g cos ϕ cos θ
From Equation (4) pitch and roll angles can be deduced from the gravity vectors as:
!
gby
θ = arctan p , (5)
( gbx 2 + gbz 2 )
gbx
φ = arctan − , (6)
gbz
Equations to calculate position and velocity are given as:
where ab , Vb , Sb , k, k + 1 and ∆t are acceleration, velocity, position, time intervals and sampling time.
To calculate the angular rate we used the methods adopted in [63]. The angular rate is integrated to
determine the orientation from gyroscope.
1
w
1
u X w
w
Y
=camera’s
M( Rwc twc ) , (10)
The projection matrix depends onv the
λ
intrinsic
Zw and extrinsic parameters. The five
1
intrinsic parameters are: focal length f , principal point u10 , v0 and the scaling in the image x and
au and au = fuon
av .depends v = f v . The axes skew coefficient γ is often zero.
, athe
The projection
y directions, matrix camera’s intrinsic and extrinsic parameters. The five intrinsic
parameters are: focal length f , principal point u0 , v0 and the scaling in the image x and y directions, au
au
and av . au = f u , av = f v . The axes skew coefficient γγis oftenuzero.
0
M = 0 av u0 v0 ,
au γ (11)
M =0 0 a0v v0 1, (11)
0 0 1
Extrinsic parameters: R, T , define the position of the camera center and the camera’s heading
Extrinsic parameters: R, T, define the position of the camera center and the camera’s heading in
in world
world coordinates.
coordinates. Camera
Camera calibration
calibration isistotoobtain
obtainthe
theintrinsic
intrinsicand
andextrinsic
extrinsic parameters.
parameters. Therefore,
Therefore,
the projection matrix of a world point in the image is expressed
the projection matrix of a world point in the image is expressed as: as:
C
C= − RR−−11TT == −
=− − RRTTT,
T, (12)
(12)
xk is the state vector, uk denotes a known control input, wk denote the process noise, and vk is the
measurement noise. yk is the measurement vector, hk is the observation matrix all at time k. The process
noise wk has a covariance matrix Q and measurement noise vk has a covariance matrix R, are assumed
to be zero-mean white Gaussian noise processes independent of each other. EKF is a special case
of Kalman filter that is used for nonlinear systems. EKF is used to estimate the robot position and
orientation by employing the prediction and correction of a nonlinear system model. Time prediction
update equation is given as:
x̂k− = A x̂k−1 + Buk , (15)
−1
Kk = Pk− H T k ( Hk Pk− Hk + Rk ) , (19)
The Jacobian matrix Hk with partial derivatives of the measurement function h(·) with respect to
the state x is evaluated at the prior state estimate x̂k− , the equation is given as:
∂h
H= | X = x k −1 , (20)
∂X
For the fused filter method used in this work, we adopted one of the models used in [27]. We used
accelerometer data as a control input, while gyroscope data and vision data were used as measurements.
This model is extensively explained in reference above, but the process noise and covariance noise are
suitably tuned. The state vector is given as:
x = [p v q ω ]T , (21)
Sensors 2017, 17, 2164 11 of 22
where p and v stand for the state variables corresponding to the 3D position and velocity of the IMU
in the world frame, q denotes the orientation quaternion corresponding to the rotation matrix R and ω
is the angular velocity from gyroscope. The fused transition matrix used here is given as:
" #
F1 O6x7
F11 = , (22)
O7x6 F1
∆t ∆t2
1 0 0 2 0 0 2
∆t
0 1 0 0 2 0 0
∆t
0 0 1 0 0 cos2 t
1 2
F = , (24)
0 0 0 1 0 0 0
sin2 t
0 0 0 0 1 0
0 0 0 0 0 1 0
where ∆t is the sampling time between images captured. F1 and F1 is the state transition matrix for
inertial sensor and vision respectively. The process noise covariance is taken from the accelerometer
and is given as: " #
1 Q1 O6x3
Q1 = , (25)
O7x3 Q1
" #
q1 O3x3
Q1 = , (26)
O3x3 q1
1 0 0 0 0 ∆t2 0
Q1 = 0 1 0 0 0 0 ∆t , (27)
0 0 1 0 0 0 0
Q1 and Q1 are the process noise covariance from accelerometer and vision respectively.
q1 = I3 σa 2 and 1 q1 = I3 σa 2 , are the process noise taken from accelerometer while the measurement
noise is taken from the gyroscope and vision where In is the identity matrix dimension of n. R is the
key matrix for sensor fusion, R1 and R1 are the covariance from gyroscope and vision.
" #
R1 O4x3
R11 = , R1 = I4 σg 2 , R1 = I3 σv2 T,
O3x4 R1
is the observation matrix from vision. The parameters used for filter tuning and experiments are given
in Table 1.
Variables Meanings
Sampling interval of IMU sensor 100 Hz
Gyroscope measurement noise variance, σg 0.001 rad2 /s2
Accelerometer measurement noise variance, σa 0.001 m/s2
Camera measurement noise variance, σv 0.9
Sampling interval between image frames 25 Hz
(a) (b)
(c) (d)
(e) (f)
(g) (h)
Figure 5. A box detected from two different images but in similar scenes. (a) Query image; (b) Training
Figure 5. A box detected from two different images but in similar scenes. (a) Query image; (b) Training
image; (c) Conversion of RGB to grayscale; (d) Removal of lens distortion; (e) Image including
image; (c) Conversion of RGB to grayscale; (d) Removal of lens distortion; (e) Image including outliers;
outliers; (f) Image with inliers only; (g,h) Images with display box around the recognised object.
(f) Image with inliers only; (g,h) Images with display box around the recognised object.
and inliers. For the simulation, 50 of the strongest feature points were extracted from the query image
to match with the training image in other to have sufficient points when matching the images. The
matching of images was done by RANSAC algorithm. With RANSAC algorithm, the inliers were
computed in such that if the inliers points are more than the threshold then homograph transform
will be estimated. This is shown in Figure 5f. The last step is for a bounding box to be designated and
Sensors 2017, 17, 2164 15 of 22
displayed around the recognised object as shown in Figure 5g,h.
Figure 6. Euler
Figure 6. Euler angles
angles from
from IMU. Roll: red;
IMU. Roll: red; pitch:
pitch: green;
green; yaw:
yaw: blue.
blue.
Figure 7a–c shows the orientation result of the fused data from inertial sensor and vision. The
Figure 7a–c shows the orientation result of the fused data from inertial sensor and vision. The IMU
IMU was able to abruptly determine the direction of mobile, but the vision slowly captured the
was able to abruptly determine the direction of mobile, but the vision slowly captured the images
images to determine the orientation of the mobile robot. With different sampling frequencies,
to determine the orientation of the mobile robot. With different sampling frequencies, computation
computation time did not allow both estimates to run at the same time. The IMU was able to
time did not allow both estimates to run at the same time. The IMU was able to determine the
determine the direction of the robot within a specific path, but with the camera, the rotational axis
direction of the robot within a specific path, but with the camera, the rotational axis was extended
was extended to capture more views; therefore, the range of direction was widened and areas which
to capture more views; therefore, the range of direction was widened and areas which could not be
could not be covered by IMU were captured by the camera, although vision-based tracking is more
covered by IMU were captured by the camera, although vision-based tracking is more accurate for
accurate for slow movement than IMU. However, using only computer vision, tracking is lost almost
slow movement than IMU. However, using only computer vision, tracking is lost almost immediately;
immediately; it is therefore obvious that the addition of IMU is beneficial. EKF is used to fuse the
it is therefore obvious that the addition of IMU is beneficial. EKF is used to fuse the inertial and visual
inertial and visual measurement to estimate the state of the mobile robot. With EKF, corrections for
measurement to estimate the state of the mobile robot. With EKF, corrections for pose estimation were
made; this shows that the filter is efficient, specifically when fusing two or more sensors together.
Equations (10)–(12) from Section 3 were used to calculate the camera pose in reference to the image
plane. From the equations, the intrinsic and extrinsic parameters were estimated through the camera
calibration. It should be noted that the described system is very sensitive to calibration parameters. Errors
in parameters used for calibration could deteriorate the tracking of the system. Hence, the design of
Sensors 2017, 17, 2164 16 of 22
pose estimation were made; this shows that the filter is efficient, specifically when fusing two or more
sensors together. Equations (10)–(12) from Section 3 were used to calculate the camera pose in
reference
Sensors 2017, to the image plane. From the equations, the intrinsic and extrinsic parameters16were
17, 2164 of 22
estimated through the camera calibration. It should be noted that the described system is very
sensitive to calibration parameters. Errors in parameters used for calibration could deteriorate the
accurate
tracking ofcalibration
the system. methods
Hence, isthevital for of
design proper operation.
accurate As methods
calibration observedisfrom
vitalthe figures,operation.
for proper there is a
slight difference between the data obtained from inertial sensor to that of vision.
As observed from the figures, there is a slight difference between the data obtained from inertialAt the point where
the robot
sensor made
to that of avision.
90 degrees
At theright
pointturn,
where thethe
yaw value
robot foraIMU
made was 91.25
90 degrees rightdegrees,
turn, theand
yaw88value
degrees
for
for vision. Pitch and roll angles both have values of 1.2 degrees and 4 degrees.
IMU was 91.25 degrees, and 88 degrees for vision. Pitch and roll angles both have values of 1.2 With the proposed
method,
degrees andthrough the use
4 degrees. of EKF,
With accumulated
the proposed errorsthrough
method, and drifts
thewere reduced
use of and improvement
EKF, accumulated errors was
and
thereby achieved.
drifts were reduced and improvement was thereby achieved.
80
inertial
vision
60 fused
40
20
-20
-40
-60
0 20 40 60 80 100 120
Time (sec)
(a) (b)
Yaw angles (deg)
(c)
Figure 7. Orientation results for fused sensors. (a) Roll angles; (b) Pitch angles; (c) Yaw angles.
Figure 7. Orientation results for fused sensors. (a) Roll angles; (b) Pitch angles; (c) Yaw angles.
Figure 8 shows a comparison of the three directions of the mobile robot taken from vision only.
Figure shows
The figure 8 shows a comparison
a distinctive of the three
estimation directions
of position of of
thethe mobile
mobile robotThe
robot. taken from vision
position only.
estimation
The
basedfigure shows
on the a distinctive
reference object in estimation
the image isofrelative
position of the
to the mobile
position of robot. The robot
the mobile position
andestimation
the world
based on the reference object in the image is relative to the position of the mobile robot
coordinate, with the median vector of the planar object for Z-axis close to 1 and −1. This shows and the world
that
coordinate, with the median vector of the planar object for Z-axis close to
the feature selection method used is effective. Therefore, SURF and RANSAC algorithms 1 and − 1. This shows that
the feature selection
combination method
can be used used is effective.
to determine Therefore,
the accurate SURF
position ofand RANSAC
an object algorithms
through vision. combination
can be used to determine the accurate position of an object through vision.
Sensors 2017, 17, 2164 17 of 22
Sensors 2017, 17, 2164 17 of 22
Sensors 2017, 17, 2164 17 of 22
Figure
Figure 8.
8. Experimental
Experimental position
position in
in XYZ
XYZ directions from vision
directions from vision data.
data.
Figure 8. Experimental position in XYZ directions from vision data.
5.3. Performance: Accuracy
5.3. Performance: Accuracy
5.3. Performance: Accuracy
The ground truth data was collected with the use of external camera placed in the environment
The
The ground
ground truth
truth data
data was
was collected
collected with
with the
the use
use of external
ofit’s
external camera
camera placed
placed in
in the
the environment
environment
of experiment. The external camera was used because less expensive, available and reliable to
of
of experiment.
experiment. The
The external
external camera
camera was
was used
used because
because it’s
it’s less
less expensive,
expensive, available
available and
and reliable
reliable to
determine 6-DoF of position. The camera was placed on a flat terrain with the mobile robot withto a
determine
determine 6-DoF of of position. TheThe camera was was placed
placed on on aa flat
flat terrain with the
the mobile robot with
with aa
distance of 6-DoF
4.90 m inposition.
between; the camerascenario is shown in Figure terrain
9. Since with
the camera mobile
usedrobot
was neither
distance
distance of
of 4.90
4.90 m inin between; the
the scenario is
is shown in Figure 9.
9. Since the
the camera used was neither
360 degrees nor m between;
a motion camera, scenario
it was ensured shownthatinthe
Figure
camera Since
was able camera
to cover used
the was neither
experiment
360
360 degrees
degrees nor
nor a
a motion
motion camera,
camera, it
it was
was ensured
ensured that
that the
the camera
camera was
was able
able to
to cover
cover the
the experiment
experiment
area. It can be observed from the figure that our method exhibits good performance, as it is close to
area. It
It can
can be
area.ground be observed
observed from
fromthe the figure that our
figureimprovement
that method
our method exhibits
exhibitsgood performance,
good performance, as itasisitclose to the
is close to
the truth. However, further of the proposed method is encouraged. For
ground
the ground truth. However,
truth. further
However, improvement
further improvementof the proposed
of the cameramethod
proposed is encouraged. For accurate
accurate ground truth data to be obtained, a motion capture or amethod is encouraged.
laser ranging sensor is also For
ground
accurate truth
grounddatatruth
to bedata
obtained,
to be a motion capture
obtained, a motion camera
capture or camera
a laser ranging
or a lasersensor is also
ranging suggested.
sensor is also
suggested. The sensors are expensive, but an accurate result is guaranteed. Figure 10a shows the
The sensorsThe
suggested. are expensive, but an accurate result is guaranteed. Figure 10a shows the trajectory of
trajectory of thesensors
mobile arerobotexpensive,
projectedbut an accurate
in the XY planeresult is guaranteed.
and Figure 10b shows Figure 10a shows the
the corresponding
the mobile
trajectory of robot
ofthe projected
themobile
mobilerobot in the XY
robottrajectory. plane and Figure 10b shows the corresponding
projected in the XY plane and Figure 10b shows the corresponding positions of the
positions
mobile
positions robot trajectory.
of the mobile robot trajectory.
These error values are still reasonable for indoor localization. In Table 2, RMSE position and orientation
are further
Sensors stated
2017, 17, for specific periods. It can be observed from the table that the position error slightly
2164 18 of 22
Sensors 2017, 17, 2164 18 of 22
increases with increase in time. For RMSE orientation, both pitch and yaw error angles decreases
angles
as timedecreases
increasesas time for
while increases whilewas
roll, error for roll, error was gradually increasing
the start from theabout
start time
angles decreases as time increases while forgradually
roll, error increasing from
was gradually increasing time
from to 80 s
the start time
to
and about
later80 s and later
decreases. decreases.
The accuracy The
of accuracy
the proposed of the proposed
method was method was
improved and improved
better and better
performances
to about 80 s and later decreases. The accuracy of the proposed method was improved and better
performances
were achieved.were achieved.
performances were achieved.
(m)(m)
Y (m)
Position
Y (m)
Position
(a) (b)
(a) (b)
Figure 10. Comparing the proposed method with the ground truth. (a) Robot trajectory in the XY
Figure
Figure 10. Comparing the
10. Comparing the proposed
proposed method
method withwith the
the ground
ground truth. (a) Robot
truth. (a) Robot trajectory
trajectory in
in the
the XY
XY
plane; (b) Position corresponding to the trajectory.
plane;
plane; (b)
(b) Position
Position corresponding
corresponding to
to the
the trajectory.
trajectory.
0.16
0.16 X
YX
0.14 Y
0.14
[°] [°]
(m)(m)
0.12
RMSE
0.12
RMSE
RMSE
RMSE
0.1
Orientation
Position
0.1
Orientation
Position
0.08
0.08
0.06
0.06
0.04
0.040 20 40 60 80 100 120
0 20 40 60 80 100 120
(a) (b)
(a) (b)
Figure 11. Results of RMSE for position and orientation. (a) Position; (b) Orientation.
Figure 11. Results of RMSE for position and orientation. (a) Position; (b) Orientation.
Figure 11. Results of RMSE for position and orientation. (a) Position; (b) Orientation.
Table 2. RMSE of position and orientation.
Table 2. RMSE of position and orientation.
Table 2. RMSE of position and orientation.
Time (s) Position Error (m) Orientation Error (Degree)
Time (s) Position Error (m) Orientation Error (Degree)
Time (s) x
Position Error y
(m) Roll Pitch
Orientation Yaw
Error (Degree)
x y Roll Pitch Yaw
20 0.05 0.08 0.78 0.62 0.62
20 x
0.05 y
0.08 Roll
0.78 Pitch
0.62 Yaw
0.62
40 0.05 0.08 0.81 0.60 0.56
40
20 0.05
0.05 0.08
0.08 0.81
0.78 0.60
0.62 0.56
0.62
60
40
0.07
0.05
0.09
0.08
0.85
0.81
0.56
0.60
0.55
0.56
60 0.07 0.09 0.85 0.56 0.55
80
60 0.06
0.07 0.09
0.09 0.90
0.85 0.56
0.56 0.54
0.55
80 0.06 0.09 0.90 0.56 0.54
100
80 0.07
0.06 0.09
0.09 0.62
0.90 0.50
0.56 0.53
0.54
100
100 0.07
0.07 0.09
0.09 0.62
0.62 0.50
0.50 0.53
0.53
120 0.14 0.09 0.75 0.18 0.18
120
120 0.14
0.14 0.09
0.09 0.75
0.75 0.18
0.18 0.18
0.18
6. Conclusions
6. Conclusions
In this paper, a novel fusion of computer vision and inertial measurements to obtain robust and
In this paper, a novel fusion of computer vision and inertial measurements to obtain robust and
accurate autonomous mobile robot pose estimation was presented for an indoor environment. The
accurate autonomous mobile robot pose estimation was presented for an indoor environment. The
inertial sensor used is the 6-DoF, which was used to determine the linear velocity, angular velocity,
inertial sensor used is the 6-DoF, which was used to determine the linear velocity, angular velocity,
position and orientation. For the computer vision, a single forward-looking camera was used to
position and orientation. For the computer vision, a single forward-looking camera was used to
Sensors 2017, 17, 2164 19 of 22
6. Conclusions
In this paper, a novel fusion of computer vision and inertial measurements to obtain robust
and accurate autonomous mobile robot pose estimation was presented for an indoor environment.
The inertial sensor used is the 6-DoF, which was used to determine the linear velocity, angular velocity,
position and orientation. For the computer vision, a single forward-looking camera was used to
generate 2D/3D correspondences. The purpose of data fusion is to produce reliable data that is not
influenced by accelerometer noise and gyroscope drift. In respect to this, vision was proposed as the
best fit to complement the weaknesses of inertial sensors. The inertial sensors and the camera were
both mounted on the robot to give excellent performance of the robot estimate.
For object recognition, SURF and RANSAC algorithms were used to detect and match features
in images. SURF is used to detect key points and to generate its descriptors. It is scale-and
rotation-invariant, which means that, even with differences on the size and on the rotation of an
image, SURF can find key points. In addition, RANSAC is an algorithm to estimate the homograph
matrix of an image; therefore, the combination of SURF and RANSAC gives robust, fast computation
and accurate results for vision tracking scenarios.
The experimental results have shown that a hybrid approach of using inertial sensors and vision
is far better than using a single sensor. An extended Kalman filter was designed to correct each sensor
hitches by fusing the inertial and vision data together to obtain accurate orientation and position.
RMSE values for position and orientation were determined to evaluate the accuracy of the technique.
As a result, the method shows reliable performance with high accuracy. This type of system proposed
further improves the accuracy with respect to localization. The weakness of this method is that it may
not be a good approach to be used in a large environment, because the field of view is limited and
not all areas can be covered. It is therefore important to consider the use of stereo vision (i.e., the use
of two cameras). Again, another limitation is the single type of object (marker) that was used as a
reference to determine the pose estimation of the mobile robot. The use of two or more mobile objects
to estimate the robot’s position and orientation in other to give better and accurate results should also
be considered. Further research work is to determine the robot’s pose estimation by tracking a mobile
object in a real-time video in a large scale environment.
Acknowledgments: The authors would like to appreciate the anonymous reviewers for their valuable comments
that contributed to improving this paper. This work was supported by National Researcher Foundation grant
funded by the South African government in collaboration with the University of Pretoria.
Author Contributions: M.B.A. designed the experiments, performed the experiments and analyzed the results.
G.P.H. supervised her work, advising on possible approaches and supplying equipment and analysis tools.
Conflicts of Interest: The authors declare no conflict of interest.
References
1. Röwekämper, J.; Sprunk, C.; Tipaldi, G.D.; Stachniss, C.; Pfaff, P.; Burgard, W. On the position accuracy of
mobile robot localization based on particle filters combined with scan matching. In Proceedings of the 2012
IEEE/RSJ International Conference on Intelligent Robots and Systems, Vilamoura, Portugal, 7–12 October
2012; pp. 3158–3164.
2. Alomari, A.; Phillips, W.; Aslam, N.; Comeau, F. Dynamic fuzzy-logic based path planning for mobility-assisted
localization in wireless sensor networks. Sensors 2017, 17, 1904. [CrossRef] [PubMed]
3. Mohamed, H.; Moussa, A.; Elhabiby, M.; El-Sheimy, N.; Sesay, A. A novel real-time reference key frame scan
matching method. Sensors 2017, 17, 1060. [CrossRef] [PubMed]
4. Gregory Dudek, M.J. Inertial sensors, GPS and odometry. In Springer Handbook of Robotics; Springer:
Berlin/Heidelberg, Germany, 2008; pp. 446–490.
5. Jinglin, S.; Tick, D.; Gans, N. Localization through fusion of discrete and continuous epipolar geometry with
wheel and imu odometry. In Proceedings of the American Control Conference (ACC), San Francisco, CA,
USA, 29 June–1 July 2010.
Sensors 2017, 17, 2164 20 of 22
6. Weng, E.N.G.; Khan, R.U.; Adruce, S.A.Z.; Bee, O.Y. Objects tracking from natural features in mobile
augmented reality. Procedia Soc. Behav. Sci. 2013, 97, 753–760. [CrossRef]
7. Li, J.; Besada, J.A.; Bernardos, A.M.; Tarrío, P.; Casar, J.R. A novel system for object pose estimation using
fused vision and inertial data. Inf. Fusion 2017, 33, 15–28. [CrossRef]
8. Chen, P.; Peng, Z.; Li, D.; Yang, L. An improved augmented reality system based on andar. J. Vis. Commun.
Image Represent. 2016, 37, 63–69. [CrossRef]
9. Daponte, P.; De Vito, L.; Picariello, F.; Riccio, M. State of the art and future developments of the augmented
reality for measurement applications. Measurement 2014, 57, 53–70. [CrossRef]
10. Khandelwal, P.; Swarnalatha, P.; Bisht, N.; Prabu, S. Detection of features to track objects and segmentation using
grabcut for application in marker-less augmented reality. Procedia Comput. Sci. 2015, 58, 698–705. [CrossRef]
11. Potter, C.H.; Hancke, G.P.; Silva, B.J. Machine-to-machine: Possible applications in industrial networks.
In Proceedings of the 2013 IEEE International Conference on Industrial Technology (ICIT), Cape Town,
South Africa, 25–28 February 2013; pp. 1321–1326.
12. Opperman, C.A.; Hancke, G.P. Using NFC-enabled phones for remote data acquisition and digital control.
In Proceedings of the AFRICON, 2011, Livingstone, Zambia, 13–15 September 2011; pp. 1–6.
13. Kumar, A.; Hancke, G.P. An energy-efficient smart comfort sensing system based on the IEEE 1451 standard
for green buildings. IEEE Sens. J. 2014, 14, 4245–4252. [CrossRef]
14. Silva, B.; Fisher, R.M.; Kumar, A.; Hancke, G.P. Experimental link quality characterization of wireless sensor
networks for underground monitoring. IEEE Trans. Ind. Inform. 2015, 11, 1099–1110. [CrossRef]
15. Kruger, C.P.; Abu-Mahfouz, A.M.; Hancke, G.P. Rapid prototyping of a wireless sensor network gateway
for the internet of things using off-the-shelf components. In Proceedings of the 2015 IEEE International
Conference on Industrial Technology (ICIT), Seville, Spain, 17–19 March 2015; pp. 1926–1931.
16. Phala, K.S.E.; Kumar, A.; Hancke, G.P. Air quality monitoring system based on ISO/IEC/IEEE 21451
standards. IEEE Sens. J. 2016, 16, 5037–5045. [CrossRef]
17. Cheng, B.; Cui, L.; Jia, W.; Zhao, W.; Hancke, G.P. Multiple region of interest coverage in camera sensor
networks for tele-intensive care units. IEEE Trans. Ind. Inform. 2016, 12, 2331–2341. [CrossRef]
18. Ben-Afia, A.; Deambrogio, D.; Escher, C.; Macabiau, C.; Soulier, L.; Gay-Bellile, V. Review and classification of
vision-based localization technoques in unknown environments. IET Radar Sonar Navig. 2014, 8, 1059–1072.
[CrossRef]
19. Lee, T.J.; Bahn, W.; Jang, B.M.; Song, H.J.; Cho, D.I.D. A new localization method for mobile robot by
data fusion of vision sensor data and motion sensor data. In Proceedings of the 2012 IEEE International
Conference on Robotics and Biomimetics (ROBIO), Guangzhou, China, 11–14 December 2012; pp. 723–728.
20. Tian, Y.; Jie, Z.; Tan, J. Adaptive-frame-rate monocular vision and imu fusion for robust indoor positioning.
In Proceedings of the 2013 IEEE International Conference on Robotics and Automation (ICRA), Karlsruhe,
Germany, 6–10 May 2013; pp. 2257–2262.
21. Borenstein, J.; Everett, H.R.; Feng, L.; Wehe, D. Navigating mobile robots: Systems and techniques.
J. Robot. Syst. 1997, 14, 231–249. [CrossRef]
22. Persa, S.; Jonker, P. Real-time computer vision system for mobile robot. In SPIE, Intelligent Robots and
Computer Vision XX: Algorithms, Techniques, and Active Vision; David, P.C., Ernest, L.H., Eds.; SPIE: Bellingham,
WA, USA, 2001; pp. 105–114.
23. Goel, P.; Roumeliotis, S.I.; Sukhatme, G.S. Robust localization using relative and absolute position estimates.
In Proceedings of the 1999 IEEE/RSJ International Conference on Intelligent Robots and Systems, IROS ‘99,
Kyongju, Korea, 17–21 October 1999; pp. 1134–1140.
24. Fantian, K.; Youping, C.; Jingming, X.; Gang, Z.; Zude, Z. Mobile robot localization based on extended
kalman filter. In Proceedings of the 2006 6th World Congress on Intelligent Control and Automation, Dalian,
China, 21–23 June 2006; pp. 9242–9246.
25. Alatise, M.; Hancke, G.P. Pose estimation of a mobile robot using monocular vision and inertial sensors data.
In Proceedings of the IEEE AFRICON 2017, Cape Town, South Africa, 18–20 September 2017.
26. Kumar, K.; Reddy, P.K.; Narendra, N.; Swamy, P.; Varghese, A.; Chandra, M.G.; Balamuralidhar, P.
An improved tracking using IMU and vision fusion for mobile augemented reality applications. Int. J.
Multimed. Appl. (IJMA) 2014, 6, 13–29.
27. Erdem, A.T.; Ercan, A.O. Fusing inertial sensor data in an extended kalman filter for 3D camera tracking.
IEEE Trans. Image Process. 2015, 24, 538–548. [CrossRef] [PubMed]
Sensors 2017, 17, 2164 21 of 22
28. Azuma, R.T. A survey of augmented reality. Presence Teleoper. Virtual Environ. 1997, 6, 355–385. [CrossRef]
29. Nasir, A.K.; Hille, C.; Roth, H. Data fusion of stereo vision and gyroscope for estimation of indoor mobile
robot orientation. IFAC Proc. Vol. 2012, 45, 163–168. [CrossRef]
30. Bird, J.; Arden, D. Indoor navigation with foot-mounted strapdown inertial navigation and magnetic sensors
[emerging opportunities for localization and tracking]. IEEE Wirel. Commun. 2011, 18, 28–35. [CrossRef]
31. Sibai, F.N.; Trigui, H.; Zanini, P.C.; Al-Odail, A.R. Evaluation of indoor mobile robot localization techniques.
In Proceedings of the 2012 International Conference on Computer Systems and Industrial Informatics,
Sharjah, UAE, 18–20 December 2012; pp. 1–6.
32. Aggarwal, P.; Syed, Z.; Niu, X.; El-Sheimy, N. A standard testing and calibration procedure for low cost
mems inertial sensors and units. J. Navig. 2008, 61, 323–336. [CrossRef]
33. Genc, Y.; Riedel, S.; Souvannavong, F.; Akınlar, C.; Navab, N. Marker-less tracking for AR: A learning-based
approach. In Proceedings of the 2002 International Symposium on Mixed and Augmented Reality,
ISMAR 2002, Darmstadt, Germany, 1 October 2002. [CrossRef]
34. Ozuysal, M.; Fua, P.; Lepetit, V. Fast keypoint recognition in ten lines of code. In Proceedings of the IEEE
International Conference on Computer Visionand Pattern Recognition, Minneapolis, MN, USA, 17–22 June
2007; pp. 1–8.
35. Lowe, D.G. Distinctive image features from scale-invariant keypoints. Int. J. Comput. Vis. 2004, 60, 91–110.
[CrossRef]
36. Bay, H.; Ess, A.; Tuytelaars, T.; Van Gool, L. Speeded-up robust features (surf). Comput. Vis. Image Underst.
2008, 110, 346–359. [CrossRef]
37. Loncomilla, P.; Ruiz-del-Solar, J.; Martínez, L. Object recognition using local invariant features for robotic
applications: A survey. Pattern Recognit. 2016, 60, 499–514. [CrossRef]
38. Farooq, J. Object detection and identification using surf and bow model. In Proceedings of the 2016
International Conference on Computing, Electronic and Electrical Engineering (ICE Cube), Quetta, Pakistan,
11–12 April 2016; pp. 318–323.
39. Hol, J.; Schön, T.; Gustafsson, F. Modeling and calibration of inertial and vision sensors. Int. J. Robot. Res.
2010, 2, 25. [CrossRef]
40. Harris, C.; Stephens, M.C. A combined corner and edge detector. Proc. Alvey Vis. Conf. 1988, 15, 147–151.
41. Tomasi, C.; Kanade, T. Shape and Motion from Image Streams: A Factorization Method—Part 3: Detection and Tracking
of Point Features; Technical Report CMU-CS-91-132; Carnegie Mellon University: Pittsburgh, PA, USA, 1991.
42. Mikolajczyk, K.; Schmid, C. Scale & affine invariant interest point detectors. Int. J. Comput. Vis. 2004, 60, 63–86.
43. Fischler, M.; Bolles, R. Random sample consensus: A paradigm for model fitting with applications to image
analysis and automated cartography. Commun. ACM 1981, 24, 381–395. [CrossRef]
44. Serradell, E.; Ozuysal, M.; Lepetit, V.; Fua, P.; Moreno-Noquer, F. Combining geometric and appearance
prioris for robust homography estimation. In Proceedings of the 11th European Conference on Computer
Vision, Crete, Greece, 5–11 September 2010; pp. 58–72.
45. Zhai, M.; Shan, F.; Jing, Z. Homography estimation from planar contours in image sequence. Opt. Eng. 2010,
49, 037202.
46. Cheng, C.-M.; Lai, S.-H. A consensus sampling technique for fast and robust model fitting. Pattern Recognit.
2009, 42, 1318–1329. [CrossRef]
47. Torr, P.H.; Murray, D.W. The development and comparison of robust methods for estimating the fundamental
matrix. Int.J. Comput. Vis. 1997, 24, 271–300. [CrossRef]
48. Chen, C.-S.; Hung, Y.-P.; Cheng, J.-B. Ransac-based darces: A new approach to fast automatic registration of
partially range images. IEEE Trans. Pattern Anal. Mach. Intell. 1999, 21, 1229–1234. [CrossRef]
49. Gonzalez-Ahuilera, D.; Rodriguez-Gonzalvez, P.; Hernandez-Lopez, D.; Lerma, J.L. A robust and hierchical
approach for the automatic co-resgistration of intensity and visible images. Opt. Laser Technol. 2012, 44,
1915–1923. [CrossRef]
50. Lv, Y.; Feng, J.; Li, Z.; Liu, W.; Cao, J. A new robust 2D camera calibration method using ransac. Opt. Int. J.
Light Electron Opt. 2015, 126, 4910–4915. [CrossRef]
51. Zhou, F.; Cui, Y.; Wang, Y.; Liu, L.; Gao, H. Accurate and robust estimation of camera parameters using
ransac. Opt. Lasers Eng. 2013, 51, 197–212. [CrossRef]
52. Marchand, E.; Uchiyama, H.; Spindler, F. Pose estimation for augmented reality: A hands-on survey.
IEEE Trans. Vis. Comput. Graph. 2016, 22, 2633–2651. [CrossRef] [PubMed]
Sensors 2017, 17, 2164 22 of 22
53. Tao, Y.; Hu, H.; Zhou, H. Integration of vision and inertial sensors for 3D arm motion tracking in home-based
rehabilitation. Int. J. Robot. Res. 2007, 26, 607–624. [CrossRef]
54. Suya, Y.; Neumann, U.; Azuma, R. Hybrid inertial and vision tracking for augmented reality registration.
In Proceedings of the IEEE Virtual Reality (Cat. No. 99CB36316), Houston, TX, USA, 13–17 March 1999;
pp. 260–267.
55. You, S.; Neumann, U. Fusion of vision and gyro tracking for robust augmented reality registration.
In Proceedings of the IEEE Virtual Reality 2001, Yokohama, Japan, 13–17 March 2001; pp. 71–78.
56. Nilsson, J.; Fredriksson, J.; Ödblom, A.C. Reliable vehicle pose estimation using vision and a single-track
model. IEEE Trans. Intell. Transp. Syst. 2014, 15, 14. [CrossRef]
57. Fox, D.; Thrun, S.; Burgard, W.; Dellaert, F. Particle filters for mobile robot localization. In Sequential Monte
Carlo Methods in Practice; Springer: New York, NY, USA, 2001. Available online: http://citeseer.nj.nec.com/
fox01particle.html (accessed on 15 September 2016).
58. Wan, E.A.; Merwe, R.V.D. The unscented kalman filter for nonlinear estimation. In Proceedings of the
Adaptive Systems for Signal Processing, Communications, and Control Symposium 2000 (AS-SPCC),
Lake Louise, AB, Canada, 4 October 2000; pp. 153–158.
59. Jing, C.; Wei, L.; Yongtian, W.; Junwei, G. Fusion of inertial and vision data for accurate tracking. Proc. SPIE
2012, 8349, 83491D.
60. Ligorio, G.; Sabatini, A. Extended kalman filter-based methods for pose estimation using visual, inertial
and magnetic sensors: Comparative analysis and performance evaluation. Sensors 2013, 13, 1919–1941.
[CrossRef] [PubMed]
61. Ahmad, N.; Ghazilla, R.A.R.; Khairi, N.M.; Kasi, V. Reviews on various inertial measurement unit (IMU)
sensor applications. Int. J. Signal Process. Syst. 2013, 1, 256–262. [CrossRef]
62. Diebel, J. Representing attitude: Euler angles, unit quaternions, and rotation vectors. Matrix 2006, 58, 1–35.
63. Zhao, H.; Wang, Z. Motion measurement using inertial sensors, ultrasonic sensors, and magnetometers with
extended kalman filter for data fusion. IEEE Sens. J. 2012, 12, 943–953. [CrossRef]
64. Choi, S.; Joung, J.H.; Yu, W.; Cho, J.I. What does ground tell us? Monocular visual odometry under planar
motion constraint. In Proceedings of the 2011 11th International Conference on Control, Automation and
Systems (ICCAS), Gyeonggi-do, Korea, 26–29 October 2011; pp. 1480–1485.
65. Caballero, F.; Merino, L.; Ferruz, J.; Ollero, A. Unmanned aerial vehicle localization based on monocular
vision and online mosaicking. J. Intell. Robot. Syst. 2009, 55, 323–343. [CrossRef]
66. Chaolei, W.; Tianmiao, W.; Jianhong, L.; Yang, C.; Yongliang, W. Monocular vision and IMU based navigation
for a small unmanned helicopter. In Proceedings of the 2012 7th IEEE Conference on Industrial Electronics
and Applications (ICIEA), Singapore, 18–20 July 2012; pp. 1694–1699.
67. Dementhon, D.F.; Davis, L.S. Model-based object pose in lines of code. Int. J. Comput. Vis. 1995, 15, 123–141.
[CrossRef]
68. Zhengyou, Z. Flexible camera calibration by viewing a plane from unknown orientations. In Proceedings of
the Seventh IEEE International Conference on Computer Vision, Kerkyra, Greece, 20–27 September 1999;
pp. 666–673.
69. Park, J.; Hwang, W.; Kwon, H.I.; Kim, J.H.; Lee, C.H.; Anjum, M.L.; Kim, K.S.; Cho, D.I. High performance
vision tracking system for mobile robot using sensor data fusion with kalman filter. In Proceedings of
the 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Taipei, Taiwan,
18–22 October 2010; pp. 3778–3783.
70. Delaune, J.; Le Besnerais, G.; Voirin, T.; Farges, J.L.; Bourdarias, C. Visual–inertial navigation for pinpoint
planetary landing using scale-based landmark matching. Robot. Auton. Syst. 2016, 78, 63–82. [CrossRef]
71. Bleser, G.; Stricker, D. Advanced tracking through efficient image processing and visual–inertial sensor
fusion. Comput. Graph. 2009, 33, 59–72. [CrossRef]
72. Linksprite Technologies, Inc. Linksprite JPEG Color Camera Serial UART Interface. Available online:
www.linksprite.com (accessed on 12 October 2016).
© 2017 by the authors. Licensee MDPI, Basel, Switzerland. This article is an open access
article distributed under the terms and conditions of the Creative Commons Attribution
(CC BY) license (http://creativecommons.org/licenses/by/4.0/).