Next Article in Journal
Initial Results Obtained with the First TWIN VLBI Radio Telescope at the Geodetic Observatory Wettzell
Next Article in Special Issue
A Neural Network-Based Gait Phase Classification Method Using Sensors Equipped on Lower Limb Exoskeleton Robots
Previous Article in Journal
Diazonium Chemistry for the Bio-Functionalization of Glassy Nanostring Resonator Arrays
Previous Article in Special Issue
A Cross Structured Light Sensor and Stripe Segmentation Method for Visual Tracking of a Wall Climbing Robot
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

RGB-D SLAM Combining Visual Odometry and Extended Information Filter

1
School of Information Engineering, East China Jiaotong University, Nanchang 330013, China
2
Department of Mechanical, Aerospace and Biomedical Engineering, University of Tennessee, Knoxville, TN 37996, USA
3
School of Computer Science, Colorado Technical University, Colorado Springs, CO 80907, USA
*
Author to whom correspondence should be addressed.
Sensors 2015, 15(8), 18742-18766; https://doi.org/10.3390/s150818742
Submission received: 21 May 2015 / Revised: 20 July 2015 / Accepted: 27 July 2015 / Published: 30 July 2015
(This article belongs to the Special Issue Sensors for Robots)

Abstract

:
In this paper, we present a novel RGB-D SLAM system based on visual odometry and an extended information filter, which does not require any other sensors or odometry. In contrast to the graph optimization approaches, this is more suitable for online applications. A visual dead reckoning algorithm based on visual residuals is devised, which is used to estimate motion control input. In addition, we use a novel descriptor called binary robust appearance and normals descriptor (BRAND) to extract features from the RGB-D frame and use them as landmarks. Furthermore, considering both the 3D positions and the BRAND descriptors of the landmarks, our observation model avoids explicit data association between the observations and the map by marginalizing the observation likelihood over all possible associations. Experimental validation is provided, which compares the proposed RGB-D SLAM algorithm with just RGB-D visual odometry and a graph-based RGB-D SLAM algorithm using the publicly-available RGB-D dataset. The results of the experiments demonstrate that our system is quicker than the graph-based RGB-D SLAM algorithm.

1. Introduction

Self-localization is widely recognized as one of the most basic problems for an autonomous robot with respect to navigation. This task can be performed pretty well when the environment is known a priori, but when a map of the environment is not available beforehand, robot localization becomes very difficult. This may be due to a lack of information of the environment that the robot moves in or to the excessive cost of manually building a map on purpose. In these cases, the robot must simultaneously build a map of the environment and localize itself within it. This problem, known as simultaneous localization and map building (SLAM), has been extensively studied over the last two decades. The solutions to the SLAM problem presented so far differ mainly for the environment description adopted and for the estimation technique employed. There are two main estimation forms: filter-based SLAM and graph-based SLAM.
Filter-based SLAM involves estimating the posterior by means of Bayes’ rule [1]:
p ( ξ t , m | z 1 : t , u 1 : t )
where ξ t is the pose of the robot at time t, m is the map, z 1 : t is the observation sequence and u 1 : t is the odometry information (or motion control input). Filter-based SLAM is also called online SLAM, since it is incremental; past measurements and controls are discarded once they have been processed. According to different ways of addressing the posterior probability, there are many filter-based methods like the extended Kalman filter (EKF) method [2], the extended information filter (EIF) method [3], the particle filter (PF) method [4], etc.
Instead of estimating only current pose ξ t in filter-based SLAM, the graph-based SLAM estimates a complete trajectory ξ 1 : t and map m by all observed information. The method is considered time-consuming and cannot satisfy real-time requirements. However, by means of efficient solving methods, the graph-based SLAM has received more attention [5,6,7].
The initial studies on the SLAM problem focused on two-dimensional environments, so they were usually applied to mobile robots. Recently, a variety of 3D SLAM algorithms have supported 6-DOF (degree-of-freedom) pose optimization [8]; therefore, the SLAM technique is employed in various platforms, such as quadrotors [9], underwater robots [10], etc. In the early 3D SLAM studies, expensive sensors, like 2D and 3D-LRFs (laser range finders), were mainly used. However, recently, with the advent of inexpensive Kinect-style sensors [11], which are called RGB-D (red-green-blue depth) cameras, since they give the color image and the depth data concurrently, the robotics and computer vision communities have focused on 3D SLAM techniques using the RGB-D camera data; we call these techniques RGB-D SLAM.
The current RGB-D SLAM techniques, which are reviewed in detail in the following section, are mostly based on graph-based SLAM. They need loop detection and loop correction to refine the graph, and sometimes, they are not real time. For most RGB-D SLAM systems, there are three major problems. (1) The hyper-high dimensional problem: In two-dimensional space, the pose is represented as ξ t = ( x t , y t , θ t ) T , and the environmental map is denoted as Θ = { θ 1 , θ 2 , , θ N } , which contains N characteristics, where θ i = ( x i , y i ) . The dimension of the state vector is 2 N + 3 . For the three-dimensional space, the pose is represented as ξ t = ( x t , y t , z t , α t , β t , γ t ) T , and the dimension of the state vector is 3 N + 6 . Since the number of features in the actual environment may reach tens of thousands, the SLAM problem is a hyper-high dimensional problem; (2) The data association problem: This problem means that the extracted feature is judged as to whether it is a new or pre-existing feature. Assume at time step t, m extracted features match n features in the map with computation complexity O ( n m ) irrespective of the independence between features. The time complexity is very high for a real-time environment; (3) The selection and design of visual odometry: Frame-to-frame alignment based on feature matching should not be selected to avoid over-estimation. It is caused by re-applying the feature measurements that are used both as motion information and as measurement information in the SLAM process.
In this paper, we propose a new RGB-D SLAM method based on visual odometry (VO) and the extended information filter (EIF), referred to as VO-EIF RGB-D SLAM. As with current graph-based RGB-D SLAM algorithms, our filter-based RGB-D SLAM in this paper does not depend on other sensors (such as gyroscope, encoder, etc.). Our contribution consists of providing an appropriate observation model and motion model for the SLAM for a robot. More concretely, this paper has the following contributions: (1) we adopt the method based on the extended information filter to decrease the dimensions for a high-dimensional state space; (2) inspired by the related works [12,13,14], we employ the binary feature descriptor for feature matching to reduce the complexity effectively; (3) we build an RGB-D feature observation model that combines the 3D positions and the binary descriptors of the landmarks and that avoids explicit data association between the observations and map; and (4) we devise a visual dead reckoning algorithm based on visual residuals, which is used to estimate motion control input, to avoid over-estimation. Moreover, this is more robust and accurate than feature-based visual odometry methods.
The rest of the paper is organized as follows: Section 2 refers to the related work. Section 3 provides the principle of the extended information filter SLAM. Section 4 describes the binary robust appearance and normals descriptor (BRAND) descriptor. The RGB-D feature observation model and the motion model in this work are introduced in Section 5 and Section 6, respectively. Section 7 shows the experimental results, and Section 8 sets out the conclusions and presents lines for future work.

2. Related Research

Currently, most robot SLAM is carried out with the sensor, which provides a 2D scene. The main reason is that acquiring high-quality 3D data is very expensive. However, with the advent of the low-cost Microsoft Kinect sensor, there has been great interest in capturing and reconstructing 3D environments using a movable RGB-D sensor [7,15,16]. It provides dense, high-resolution depth information at a low price and small size.
Fioraio et al. [17] developed a SLAM application using Kinect. They used the bundle-adjustment framework to ingrate ICP (iterative closest point) [18] with visual feature matches. In their research, the graph is optimized using a g 2 o (general graph optimization) framework [5] to obtain global alignment. They adopted the ICP algorithm [18] for pairwise alignment between sequential frames and recovering the rigid transformation between point clouds. The alignment accuracy of ICP significantly depends on the scene content.Po-Chang et al. [19] use color feature descriptors to improve depth data correspondences. Lee et al. [20] proposed an RGB-D SLAM method that handles low dynamic situations using a pose-graph structure, in which nodes are grouped based on their covariance values. Any false constraints are pruned based on an error metric related to the node groups.
Henry et al. [15,16] studied highly efficient pose graph optimization, such as TORO (tree-based network optimizer) in 2010. In 2012, Henry et al. [16] improved this algorithm. They combined FAST (features from accelerated segment test) and Calonder descriptors [21] to estimate pose, utilized the RE-RANSAC (re-projection error random sample consensus) method for frame-to-frame alignment and incorporated ICP constraints into SBA [22] (sparse bundle adjustment) for global optimization. The core of their algorithm is RGB-D ICP, a novel ICP variant that makes use of the rich information included in RGB-D data. In 2013, Henry et al. [23] presented patch volumes to create globally-consistent maps. The approach combines GPU-accelerated volumetric representations with global consistency, which shows the great effect for indoor map building.
Audras et al. [24] presented ab RGB-D SLAM methodology that is very efficient for a complex indoor environment. In the algorithm, the trajectory estimation is integrated into a single global process, which does not rely on intermediate-level features. Moreover, using the accurate pose measurement with the localization techniques, a compact photometric model of the environment is acquired. In [25], the rigid body motion of a handheld RGB-D camera is estimated by an energy-based approach. They combined visual odometry technology with an RGB-D sensor for autonomous flight experimental analysis. The experimental system is able to plan a complex 3D path in a cluttered environment. The work in [24,25] do not extract sparse features and warp the pixel for one frame to another using a depth map and a photometric error minimization method for frame-to-frame alignment. The work in [26] presents a new dense visual odometry system, in which the geometric error is parameterized by the inverse depth instead of the depth, as used in most VO systems.
The work in [27] puts forward a novel GPU implementation based on an RGB-D visual odometry algorithm. They used a 6-DOF camera odometry estimation methods to track and integrate RGB color information into the KinectFusion [28] reconstruction process to allow a high-quality map. The experiment shows that there is no need for the use of keyframes, and the method results in real-time colored volumetric surface reconstructions. Many RGB-D SLAM techniques are limited to office-type and geometrically-structured environments. Hu et al. [29] proposed a switching-based algorithm that heuristically choose between RGB-D bundle adjustment and RGB-D bundle adjustment-based local map building. RGB-D SLAM maps are created by applying sparse bundle adjustment on an included two-step re-projection RANSAC and ICP approach. By a heuristic switching algorithm, they dealt with various failure modes associated with RGB-D-BA (RGB-D bundle adjustment). The map connection strategy significantly reduces the computational cost, and the algorithm has great potential to be applied in a larger scale environment.
Similar to [15,16], Endres et al. [30] used the ICP algorithm only when there were few or no matching keypoints in order to reduce the time complexity. They used the g 2 o framework [5] to optimize the 3D pose graph and created a stereo 3D map for robot localization, navigation and path planning. The work in [31] uses RGB-D data to provide a complete benchmark for evaluating visual SLAM and odometry systems and proposes two evaluation metrics and automatic evaluation tools.
Kerl et al. [32] proposed a dense visual SLAM method for RGB-D cameras and an entropy-based similarity measure for keyframe selection and loop closure detection. In contrast to sparse, feature-based methods [15,30], the approach significantly decreases the drift and is real time. Compared to the work by Tykkala et al. [33], the keyframe and pose graph optimization are obtained simultaneously without manual intervention. Since traditional loop closures have a high time complexity, the work in [34] presents a novel SLAM system that takes advantage of non-rigid map deformations for map correction during loop closures.
Felix Endres et al. [35] extracted keypoints from the color images and used the depth images to localize them in 3D. RANSAC is used to estimate the transformations between associated keypoints and to optimize the pose graph using nonlinear optimization. In contrast to other RGB-D SLAM system, they performed a detailed experimental evaluation on benchmark dataset [31] and discussed many parameters, such as the choice of the feature descriptor, the number of visual features, etc. The system is robust for scenarios such as fast camera motions and feature-poor environments.
Most RGB-D SLAM algorithms [15,24,25,27,36,37,38] combine texture with geometric features to deal with the problem and regard the scene as a set of points. The work in [39] exploits the structure of the scene and incorporates both point and plane features to implement the SLAM algorithm. The algorithm explains how to find point and plane correspondences using camera motion prediction and uses both points and planes to relocate and bundle adjustment, aiming at refining camera pose estimates.
Figure 1. Flow diagram of the visual odometry-extended information filter (VO-EIF) RGB-D SLAM system. Through the data association test, the landmark is added to the landmark descriptor database for the feature matching. The core of the system is the EIF SLAM. Section 3 introduces the extended information filter approach. The binary descriptor is demonstrated in Section 4. The observation model and the motion model are presented in Section 5 and Section 6, respectively.
Figure 1. Flow diagram of the visual odometry-extended information filter (VO-EIF) RGB-D SLAM system. Through the data association test, the landmark is added to the landmark descriptor database for the feature matching. The core of the system is the EIF SLAM. Section 3 introduces the extended information filter approach. The binary descriptor is demonstrated in Section 4. The observation model and the motion model are presented in Section 5 and Section 6, respectively.
Sensors 15 18742 g001
We put forward the RGB-D SLAM algorithm based on the traditional filter-based SLAM algorithm in the paper. Firstly, we apply the unsupervised learning algorithm without human intervention [40] to correct depth distortion. Then, the BRISK (Binary Robust Invariant Scalable Keypoints) keypoint detector [13] is adopted to extract feature points, and next, we use the BRAND [12] descriptor to increase the credibility of data association in SLAM. Finally, We develop the RGB-D SLAM system integrating EIF SLAM with dense visual odometry (DVO). The flow diagram of the algorithm is illustrated in Figure 1. The descriptor and the VO-EIF RGB-D SLAM algorithm will be described in detail in the following sections.

3. Extended Information Filter Approach to SLAM

In the SLAM algorithm, the state vector s t consists of RGB-D camera pose ξ t and the set of n map landmarks, i.e., s t = [ ξ t , p m 1 , p m 2 , p m n ] T , where p m j is the 3D position coordinate of the j-th landmark in the world coordinate system at time step t. We use a first-order linearization of the motion and measurement models. Assume posterior p ( s t | z t , u t ) obeys a Gaussian probability distribution, traditionally parameterized by the mean μ t and the covariance matrix Σ t .
p ( s t | z t , u t ) = N ( μ t , Σ t ) exp 1 2 ( ξ t μ t ) T Σ t 1 ( ξ t μ t ) = exp 1 2 ( ξ t T Σ t 1 ξ t 2 μ t T Σ t 1 ξ t + μ t T Σ t 1 μ t ) exp 1 2 ξ t T Σ t 1 ξ t + μ t T Σ t 1 ξ t = exp 1 2 ξ t T Λ t ξ t + η t T ξ t N 1 ( η t , Λ t )
where z t = { z 0 , z 1 , , z t } denotes the history of observational data, z t = { z t i | i = 1 , 2 , , N t } denotes the observational data of the RGB-D camera and z t i denotes the observational data of the i-th landmark at time step t. u t = { u 1 , , u t } is the history of motion control inputs; u t = ( Δ x t , Δ y t , Δ z t , Δ α t , Δ β t , Δ γ t ) T is the motion control inputs of the RGB-D camera at time step t. Gaussian probability distribution Equation (2) is parameterized by the information vector η t and the information matrix Λ t .
Λ t = Σ t 1
η t = Λ t μ t = Σ t 1 μ t
Extended information filtering is similar to the extended Kalman filter. The algorithm is divided into two phases: measurement update and state prediction [3].
Measurement update: The key of landmark observation is to reduce the uncertainty in the estimates for the camera pose and the map. The general measurement model Equation (5) is a nonlinear state function with added white Gaussian noise, v t N ( 0 , R ) . Equation (6) is the first-order linearization related to the mean of the robot pose and observed features with the Jacobian.
z t = h ( s t ) + v t
h ( μ ¯ t ) + H ( s t μ ¯ t ) + v t
Use p ( s t | z t 1 , u t ) = N 1 ( η ¯ t , Λ ¯ t ) to update the current distribution and applying Bayes’ rule to infer a new observation.
p ( s t | z t , u t ) p ( z t | s t ) p ( s t | z t 1 , u t )
State prediction: The prediction stage predicts the distribution over the new camera pose as two steps. First, we predict robot pose ξ t + 1 and get the state vector that includes the new camera pose, s ^ t + 1 = [ ξ t , ξ t + 1 , M ] T . Second, we marginalizing ξ t from the posterior to achieve the desired distribution s t + 1 = [ ξ t + 1 M ] T . This is exemplified in Figure 2.
Figure 2. A graphical explanation of EIF’s methodology in the information matrix. A circle indicates the position of a feature; a triangle indicates the camera pose. Darker shades in the matrix imply stronger relevance; white indicates no relevance. (a) m + = { p m 1 , p m 2 , p m 3 , p m 5 } represents features associated with the camera pose; m = { p m 4 } represents features irrelevant to the camera pose; (b) new camera pose ξ t + 1 is added to the state vector s ^ t + 1 = [ ξ t , ξ t + 1 , M ] T ; (c) marginalized distribution with the old pose ξ t . The constraints between ξ t and each map element in m + are eliminated. New constraints between ξ t + 1 and m + are created. We see from the shading that many constraints between features are weakened.
Figure 2. A graphical explanation of EIF’s methodology in the information matrix. A circle indicates the position of a feature; a triangle indicates the camera pose. Darker shades in the matrix imply stronger relevance; white indicates no relevance. (a) m + = { p m 1 , p m 2 , p m 3 , p m 5 } represents features associated with the camera pose; m = { p m 4 } represents features irrelevant to the camera pose; (b) new camera pose ξ t + 1 is added to the state vector s ^ t + 1 = [ ξ t , ξ t + 1 , M ] T ; (c) marginalized distribution with the old pose ξ t . The constraints between ξ t and each map element in m + are eliminated. New constraints between ξ t + 1 and m + are created. We see from the shading that many constraints between features are weakened.
Sensors 15 18742 g002
In this work we estimate the camera motion between RGB-D images through the visual odometry algorithm, explained in detail in Section 6. The observation model, based on 3D landmarks with binary descriptors, will be shown in Section 5.

4. RGB-D Image Feature Descriptor

There are many feature descriptor methods, which are divided into two categories: gradient histogram-based feature descriptors, like SIFT [41] and SURF [42], and binary feature descriptors, like BRISK [13], ORB (Oriented Fast and Rotated BRIEF) [43], BRIEF (Binary Robust Independent Elementary Features) [14]. The evaluation criteria of the descriptor include invariance to image noise, scale, translation and rotation transformations. The traditional SIFT and SURF methods are very robust, but the computation time is not practicable for real-time scenes. Binary feature descriptors are described with a binary string. These descriptors are computed by pairwise intensity comparison tests, using simple intensity difference tests, which have the characteristics of less memory consumption, faster processing in creation and a matching process. The distance between two binary strings can be measured using the Hamming distance. The Hamming distance equation is given in equation:
Δ h a m m i n g ( x , y ) = i = 1 n x i y i = i = 1 n b ( x i , y i )
where b ( x , y ) represents bit inequality and x i and y i are the i-th bits in the descriptors x and y, respectively.
b ( x , y ) = 1 x y 0 x = y
In this work, we adopt BRAND [12], which combines appearance and geometric shape information from RGB-D images. Compared to other descriptors based on texture, geometry and a combination of both pieces of information, BRAND has advantages in accuracy, processing time and memory consumption, since it combines intensity and geometric information to improve the ability of fast and accurate matching. It is invariant to rotation and scale transform and suitable for applications with low memory consumption and high speed. The algorithm is composed of three main steps:
Step 1. 
We use the depth information from the RGB-D image to compute the scale factor, which is used in Step 2, and analysis the feature in the keypoint’s neighborhood.
Step 2. 
We extract a patch in the RGB domain to estimate the feature angular direction of the keypoint’s vicinity.
Step 3. 
We combine both appearance and geometric information to bring forth keypoint descriptors with a binary string.
The steps performed to build the binary string are illustrated in Figure 3. The pair ( I , D ) represents the output of an RGB-D system, where I ( x ) and D ( x ) denote color and depth information of a pixel x. In the BRAND algorithm, each pair ( x i , y i ) P is evaluated:
f ( x i , y i ) = 1 i f ( p i ( x i ) < p i ( y i ) ) τ g ( x i , y i ) 0 o t h e r w i s e
where p i ( x ) denotes the pixel intensity of a pixel x and p i ( x i ) < p i ( y i ) represents the characteristic gradient changes in the keypoint neighborhood. τ g ( x i , y i ) evaluates the geometric pattern on its surface. The analysis of the geometric pattern using τ ( . ) is based on two invariant geometric measurements: the normal displacement and the surface’s convexity. Figure 4 shows the construction process of the bit string.
Figure 3. Flow diagram of binary robust appearance and normals descriptor (BRAND) descriptor. s is the scale factor, and θ is the dominant direction of the keypoint.
Figure 3. Flow diagram of binary robust appearance and normals descriptor (BRAND) descriptor. s is the scale factor, and θ is the dominant direction of the keypoint.
Sensors 15 18742 g003
Figure 4. The construction process of the bit string. The red circle represents the patch of size W × W ( 9 W 48 ) centered at the keypoint location. For sampled pair ( x , y ) in a patch P , the changes in the intensity and geometry are evaluated.
Figure 4. The construction process of the bit string. The red circle represents the patch of size W × W ( 9 W 48 ) centered at the keypoint location. For sampled pair ( x , y ) in a patch P , the changes in the intensity and geometry are evaluated.
Sensors 15 18742 g004
We evaluate changes in the intensity and geometry of the sampled pair ( x , y ) in a patch p and encode the descriptor extracted from a patch p associated with a keypoint k. It is represented as a binary string:
b ( k ) = i = 1 256 2 i 1 f ( x i , y i )
The BRAND descriptor takes into account appearance and geometry from RGB-D images. Appearance is an object property invariant to any geometric transformation, and geometric measurements are invariant to rotation, translation and scaling. Different from descriptors that use either appearance information or geometric information, the BRAND descriptor spends little memory space and little processing time without losing accuracy, which presents invariance to rotation, translation, scale transform and robustness to different illumination conditions.

5. RGB-D Feature Observation Model

5.1. The Overall RGB-D Observation Model

The probabilistic observation model is p ( z t | ξ t ) . Assuming conditional independency in the observation of the individual landmark z t i of the same frame, we get p ( z t | ξ t ) = i p ( z t i | ξ t ) . In order to avoid explicit data correlation between features in the current frame and map, we employ the full probability method to calculate the marginal distribution of the observation likelihood with individual landmark:
p ( z t i | ξ t ) = ψ = 1 , 2 , , M , φ p ( z t i | ξ t , k i = ψ ) P ( k i = ψ | ξ t )
where k i is a discrete variable, which represents the correspondence of the i-th observed landmark. k i = φ indicates no correspondence. Since P ( k i = ψ | ξ t ) relies on the observation z t i , we assume P ( k i = ψ | ξ t ) = ς , where ς is constant. Equation (12) is equivalent to p ( z t i | ξ t ) = ς ψ = 1 , 2 , , M , φ p ( z t i | ξ t , k i = ψ ) , where p ( z t i | ξ t , k i = ψ ) is the probability of the observed landmark z t i and its corresponding landmark m ψ to coincide in both the 3D space of the position and the space of the brand descriptors. It is represented as a Gaussian distribution:
p ( z t i | ξ t , k i = ψ ) = N 0 ; z ¯ t i m ¯ ψ μ , Σ z t i + Σ m ψ Σ = ς ' exp 1 2 z ¯ t i m ¯ ψ T Σ z t i + Σ m ψ 1 z ¯ t i m ¯ ψ
where ς ' = 2 π Σ z t i + Σ m ψ 1 2 .
The exponential term in Equation (13) can be divided into two factors related to the position and descriptor dimensions of the random variable separately:
N 0 ; μ , Σ = ς ' exp 1 2 μ p T μ F T Σ p 0 0 T Σ F 1 μ p μ F = ς ' exp 1 2 μ p T Σ p 1 μ p + μ F T Σ F 1 μ F = ς ' exp 1 2 μ p T Σ p 1 μ p exp 1 2 μ F T Σ F 1 μ F
where Σ p and Σ F are related to the position and the descriptor dimensions, respectively. The latter part of Equation (14) is taken for the Euclidean distance between feature descriptors. If the Euclidean distance is used to measure data correlation between features, the data association problem can be resolved well and be integrated into the observation model. However, in challenging scenarios, such as fast camera motions and environments with many similar objects, the feature matching speed is very low. Therefore, we adopt the binary feature descriptor and computer Hamming distance in order to improve the speed of feature matching and to reduce the size of the feature description database.

5.2. RGB-D Correlation Model of Observation

In this work, we assume that the i-th feature is described as a vector f i = ( p i , Σ i , b i ) T . p i = ( x i , y i , z i ) T is the 3D location of feature i in the world coordinate system; Σ i is the 3 × 3 covariance matrix of p i ; and b i is binary description of feature i. The observation z t is:
z t = { z t i | i = 1 , 2 , , N t } w h e r e z t i = p t i , f t i
where p t i is the 3D location of the i-th landmark in the camera coordinate system at time step t and f t i is the feature descriptor of the landmark. Assuming that position uncertainty in 3D is represented as mean μ and 3 × 3 covariance matrix Σ:
p t i N ( μ t i , Σ t i )
The map m is defined as { m j | j = 1 , 2 , , M } , where m j = p m j , f m j , p m j is the 3D location of the j-th landmark in the camera coordinate system and f m j is the feature descriptor of the landmark. Assuming the position in the map is a normal distribution:
p m j N ( μ m j , Σ m j )
All bits of the binary descriptor are independent and identically distributed binary random variables, i.e., p ( 0 ) = p ( 1 ) 0 . 5 . The binary descriptor F is:
F B ( 1 , 0 . 5 ) the first bit , , B ( 1 , 0 . 5 ) the L-th bit
Every bit value of the feature descriptor is not important, but we need to know the similarity between the two feature descriptors, i.e., the distribution of the Hamming distance H = f i , f j .
Let l k is the probability of a successful match for the k-th bit; L is the length of the descriptor. Obviously, l k obeys the binomial distribution, and for the large sample data, the expectations of l k are equal to 0.5. Therefore, the Hamming distance H is the sum of L variables that obey identical binomial distribution B ( 1 , 0 . 5 ) , and H obeys binomial distribution B ( L , 0 . 5 ) .
H B ( L , 0 . 5 )
In order to describe the uncertainty of data correlation and geometric measurement in the observation model, we approximate the binomial distribution as the following normal distribution.
H N ( 0 . 5 L , 0 . 25 L )
That is, Σ F in Equation (14) is set as 0 . 25 L .

6. Motion Model: Dense Visual Odometry

Visual odometry [37,44] is an estimation process of the movement information of an intelligent body only using the input information of a single or multiple cameras. In this paper, we use the DVO proposed by Kerl et al. [37] to estimate the ego-motion of RGB-D sensor, which is used as the motion model of EIF. DVO estimates camera motion by aligning two consecutive RGB-D images.
A 3D point p in the scene observed by two cameras is assumed to yield the same brightness in both images, i.e., I 1 ( x ) = I 2 ( τ ( u , x ) ) . This assumption is based on the photo-consistency theory. τ ( u , x ) is the warping function; u R 6 is the camera motion; τ ( u , x ) maps a pixel coordinate x R 2 in the first image ( I 1 ) to a coordinate in the second image( I 2 ) . In the following, we will give a detailed derivation of the warping function, calculate the error function based on all of the pixels and minimize the difference between the estimated and the real depth measurements.

6.1. Camera Model

We reconstruct a 3D point p from its pixel coordinates x = ( u x , v x ) T and a corresponding depth measurement D 1 ( x ) using the inverse projection function π 1 , i.e.,
p = π 1 ( x , D 1 ( x ) ) = D 1 ( x ) ( u x + u 0 α , v x + v 0 β , 1 ) T
where α, β are the focal length and u 0 , v 0 are the center coordinates of the pinhole camera model.

6.2. Warping Function

In the coordinate frame of the second camera, the point p is rotated and translated according to the rigid body motion g ( g S E ( 3 ) , which is the special Euclidean group). A rigid body motion comprises a rotation matrix R ( R S O ( 3 ) , which is the rotation group) and a translation vector t ( t R 3 ). The transformation matrix T is given as:
T 4 × 4 = R 3 × 3 t 3 × 1 0 1
The transformation of the 3D point p with g is g ( p ) = Tp . T has twelve parameters, while g has six degrees of freedom. Therefore, we use twist coordinates u; u is a six-vector, i.e., u = ( v 1 , v 2 , v 3 , w 1 , w 2 , w 3 ) T . v 1 , v 2 , v 3 are called the linear velocity and w 1 , w 2 , w 3 are the angular velocity of the motion. The transformation matrix T can be calculated from u using the matrix exponential T = exp ( u ^ ) relating Lie algebra s e ( 3 ) to Lie group S E ( 3 ) .
When the transformed point T ( p ) = ( x , y , z ) T is observed by the second camera, we calculate warped pixel coordinates as:
π ( T ( p ) ) = ( α x z u 0 , β y z v 0 ) T
We summarize Equation (21)–(23); the full warping function is:
τ ( x , T ) = π ( T p ) = π ( T ( π 1 ( x , D 1 ( x ) ) )

6.3. Probabilistic Estimation

The difference in brightness between the first and the warped second image is defined as:
r i ( u ) = I 2 ( τ ( x i , T ) ) I 1 ( x i )
By assuming that all n pixels x i ( i = 1 , , n ) in the image are equal, the probability of whole residual image r = ( r 1 , , r n ) T is p ( r | u ) = i p ( r i | u ) . After applying Bayes’ rule, the posterior probability of a camera motion u given a residual image r is:
p ( u | r ) = p ( r | u ) p ( u ) p ( r )
We seek for u M A P by maximizing the posterior probability, i.e.,
u M A P = arg max u p ( u | r )
By integrating Equation (26) with Equation (27) and removing the term p ( r ) , which does not depend on u, we obtain:
u M A P = arg max u i p ( r i | u ) p ( u )
Assuming all residuals r i ( i = 1 , , n ) are independent and identically distributed, by minimizing instead the negative log likelihood, we get:
u M A P = arg min u i log p ( r i | u ) log p ( u )
The minimum is found when the derivative of the log likelihood is set to zero. To simplify Equation (29), we drop the motion prior log p ( u ) and obtain:
i log p ( r i | u ) u = i log p ( r i ) r i r i u = 0
We define w ( r i ) = log p ( r i ) / r i · 1 / r i and get r i u w ( r i ) r i = 0 . The photometric error follows a t-distribution [45] p t ( 0 , σ 2 , v ) . In the distribution, mean μ = 0 , and variance = σ 2 ; degree of freedom = v. In Equation (29), we assume that all residuals are equal. It is very difficult to satisfy. Really, large errors covering the outliers get low weights. On the contrary, small errors with large variance get higher probability. The t-distribution is fit for this model. If p ( r i | u ) is defined as a t-distribution, the weighted least squares problem is:
u M A P = arg min u i w ( r i ) ( r i ( u ) ) 2
The function w ( r i ) is called the weighting function and is defined as:
w ( r i ) = log p ( r i ) / r i · 1 / r i
In this paper, the residual r i follows a bivariate t-distribution. Based on the t-distribution p t ( 0 , Σ , v ) , the weights w ( r i ) are:
w ( r i ) = v + 1 v + r i T 1 r i
The weight w ( r i ) termed by ∑ is automatically adapted.

6.4. Optimization of Motion Estimation

This optimization problem is a non-linear least squares problem. The residuals r i ( u ) are non-linear in u; we use a first order Taylor expansion to linearize it. We obtain normal equations of this non-linear least squares problem:
A Δ u = b i n w i J i T 1 J i Δ u = i n w i J i T Σ 1 r i
where J i R 2 × 6 is the Jacobian matrix, which contains the derivatives of r i concerning u. The normal equation for increments Δ u is iteratively calculated. At each iteration, the scale matrix ∑ and the weights w i are re-estimated. A is the Hessian matrix of nonlinear least squares problems. Assuming parameters u are normally distributed, A 1 is a lower bound for the variance of the estimated parameters u, i.e., u = A 1 .

7. Experimental Results

The experiments were implemented with the Robot Operating System (ROS) framework. All of the experiments were done using the same notebook computer, which has an Intel Core i7-4700HQ CPU and 8.0 GB RAM with Ubuntu 14.04 64-bit operation system. In the experiments, we compared three methods: the VO-EIF RGB-D SLAM, the DVO algorithm and a type of graph-based RGB-D SLAM implemented in the RTAB-Map system [46]. In the graph-based RGB-D SLAM, the TORO (tree-based network optimizer) [47] is selected to optimize the pose graph, and FAST/BRAND is selected as the detector/descriptor [48]. The other parameter settings of the graph-based RGB-D SLAM are the same as in [48], except that time limit T is not set. In our VO-EIF RGB-D SLAM, we set two update thresholds t 1 and t 2 . When any of the following two conditions are satisfied, the filter update will execute: the accumulated changes of x, y or z of the visual odometry are greater than t 1 , or any of the accumulated changes of r o l l , p i t c h or y a w of the visual odometry are greater than t 2 . In the following experiments, t 1 is set to 0.1 m and t 2 is set to 0.1 rad.
In order to test the validity of our algorithm, we implemented two different experiments. The first experiment was conducted online in our lab environment, which focused on the effectiveness and timeliness of all parts of our algorithm, as well as qualitatively verifying the accuracy. The second was accomplished off-line by utilizing the RGB-D benchmark provided by the Technical University of Munich [31]. The advantage of using this benchmark is that each dataset of the benchmark accompanies an accurate ground truth trajectory obtained with an external motion capture system, and it can be used to quantitatively evaluate the accuracy of the algorithm. Benchmark data were taken with a Microsoft Kinect sensor, providing 640 × 480 RGB and depth frames at a 30-Hz rate; the ground truth data were taken with a highly accurate motion capture system, composed of eight 100-Hz cameras.

7.1. Lab Environment Results

Figure 5 shows landmark observation in the process of the camera motion. Figure 5a demonstrates the observation of the first frame. Seen from the view of x z (the red arrow represents the x-axis and the blue arrow represents the z-axis), no landmark is observed in the first frame (the blue oval represents the landmark). In Figure 5b–f, white lines represent landmark re-observation. The number of keypoints for observation is limited to 10 for the purpose of improving the speed of SLAM. From Figure 5b–f, we can see that the landmarks number gradually increased and the uncertainties of re-observed landmarks gradually decreased.
Figure 5. The map building process of VO-EIF RGB-D SLAM: (a) The first frame; (b) The eighth frame; (c) The thirty-first frame; (d) The fifty-second frame; (e) The sixty-first frame; (f) The seventy-third frame.
Figure 5. The map building process of VO-EIF RGB-D SLAM: (a) The first frame; (b) The eighth frame; (c) The thirty-first frame; (d) The fifty-second frame; (e) The sixty-first frame; (f) The seventy-third frame.
Sensors 15 18742 g005
Figure 6 demonstrates a comparison between two trajectories of the two methods. The red curve stands for the motion trajectory with the VO-EIF RGB-D SLAM algorithm, and the green curve stands for the motion trajectory with traditional visual odometry. In Figure 6b–f, the yellow circles represent the camera position estimated with the VO-EIF RGB-D SLAM method, and the white square represents the camera position estimated with the DVO method. Seen from Figure 6, the difference between the two methods is not obvious in the first 30 frames of the motion. In the later stage of the motion, when the camera moves toward the original position, the red trajectory is close to the original position, but the green trajectory deviates from the original position. Without the observation model, accumulative error with the DVO method increased with time and affected proper trajectory estimation. In each step of the observation of the VO-EIF RGB-D SLAM method, the error is very small, and accumulative error can be corrected. Therefore, the algorithm of VO-EIF RGB-D SLAM can properly estimate camera motion.
Figure 6. Comparison of two trajectories: (a) The first frame; (b) The eighth frame; (c) The thirty-first frame; (d) The fifty-second frame; (e) The sixty-first frame; (f) The seventy-third frame.
Figure 6. Comparison of two trajectories: (a) The first frame; (b) The eighth frame; (c) The thirty-first frame; (d) The fifty-second frame; (e) The sixty-first frame; (f) The seventy-third frame.
Sensors 15 18742 g006
These results show that VO-EIF RGB-D SLAM has the advantage of smaller accumulative error. We acquire the trajectory closer to the real trajectory with the VO-EIF RGB-D SLAM. Especially, when the camera comes back to the original position, the trajectory with the traditional method deviates from the original position, but the trajectory with the VO-EIF RGB-D SLAM is very close to the original position (as can bee seen in Figure 6f).

7.2. Benchmark Results

The results of the benchmark experiments were calculated using the absolute trajectory error (ATE) evaluation tool provided with the benchmark. This evaluation method directly compares the difference between poses in the ground truth and measured trajectory, and the end result of it is the root mean squared error (RMSE) of the per pose errors summed over the entire trajectory.
In this paper, we evaluated two datasets using our proposed algorithm, the DVO algorithm and the above graph-based RGB-D SLAM separately. The two datasets are sequences “freiburg1_room” and “freiburg3_long_office_household”. Their durations are 48.90 s and 87.09 s, respectively. The statistical results are shown in Table 1 and Table 2. Figure 7 shows in four different perspectives the trajectory results of the sequence “freiburg1_room”: the ground truth trajectory and the three trajectories, which are respectively generated by the three algorithms. Similar to Figure 7, Figure 8 is the trajectory results of the sequence “freiburg3_long_office_household”. The measured trajectory errors are shown in Figure 9 and Figure 10. From these experimental results, we can see that the VO-EIF RGB-D SLAM can successfully complete the large loop closing, while the DVO cannot (as can be seen in Figure 10a). This is because in VO-EIF RGB-D SLAM, the re-observed features can greatly improve the sensor localization accuracy. The localization precision of our algorithm is nearly the equivalent of the graph-based algorithm. It should be pointed out that the trajectory of the graph-based algorithm is nearly fully updated at every update time, but in our filter-based algorithm, only the current camera pose is updated, and the poses of the passed time are not saved and updated in the filter. In other words, in the filter-based algorithm, the estimation of the camera pose at time t is only based on the information by time t, which has no post updating.
Table 1. Comparison results of processing the sequence “freiburg1_room”. DVO, dense visual odometry.
Table 1. Comparison results of processing the sequence “freiburg1_room”. DVO, dense visual odometry.
Comparison Index TermsMethod
DVOVO-EIF RGB-D SLAMGraph RGB-D SLAM
RMSE0.4475350.1147600.093479
TrajectoryMean0.4182950.1093730.083075
errorMedian0.4126220.1122260.072460
indicatorsSTD0.1591120.0347470.042859
(m)Min0.0928790.0247640.025987
Max0.7943120.3094300.211681
Total processing time (s)15.732724.6747105.8131
Table 2. Comparison results of processing the sequence “freiburg3_long_office_household”.
Table 2. Comparison results of processing the sequence “freiburg3_long_office_household”.
Comparison Index TermsMethod
DVOVO-EIF RGB-D SLAMGraph RGB-D SLAM
RMSE0.5351520.0676320.053803
TrajectoryMean0.4288540.0612550.051310
errorMedian0.2711390.0535490.050743
indicatorsSTD0.3201130.0286690.016189
(m)Min0.0905210.0105770.023585
Max1.1247030.1305010.124373
Total processing time (s)29.934763.4500184.4862
Figure 11 and Figure 12 show the processing time for each frame of the two sequences by different algorithms. It can be seen that the update time of our algorithm is smaller than the processing time of the graph-based algorithm for the keyframe at a similar moment.
Figure 7. Comparison of the four trajectories for the sequence “freiburg1_room”. The blue, red and black trajectories are generated by our algorithm, the DVO algorithm and the graph-based algorithm, respectively. The green trajectory is the ground truth. (ad) The views in four different perspectives.
Figure 7. Comparison of the four trajectories for the sequence “freiburg1_room”. The blue, red and black trajectories are generated by our algorithm, the DVO algorithm and the graph-based algorithm, respectively. The green trajectory is the ground truth. (ad) The views in four different perspectives.
Sensors 15 18742 g007
Figure 8. Comparison of the four trajectories for the sequence “freiburg3_long_office_household”. The blue, red and black trajectories are generated by our algorithm, the DVO algorithm and the graph-based algorithm, respectively. The green trajectory is the ground truth. (ad) The views in four different perspectives.
Figure 8. Comparison of the four trajectories for the sequence “freiburg3_long_office_household”. The blue, red and black trajectories are generated by our algorithm, the DVO algorithm and the graph-based algorithm, respectively. The green trajectory is the ground truth. (ad) The views in four different perspectives.
Sensors 15 18742 g008
Figure 9. Comparing absolute trajectory errors (ATEs) for the sequence “freiburg_1room”: (a) ATE using the graph-based RGB-D SLAM; (b) ATE using the VO-EIF RGB-D SLAM.
Figure 9. Comparing absolute trajectory errors (ATEs) for the sequence “freiburg_1room”: (a) ATE using the graph-based RGB-D SLAM; (b) ATE using the VO-EIF RGB-D SLAM.
Sensors 15 18742 g009
Figure 10. Comparing ATEs for the sequence “freiburg3_long_office_household”: (a) ATE using the graph-based RGB-D SLAM; (b) ATE using the VO-EIF RGB-D SLAM.
Figure 10. Comparing ATEs for the sequence “freiburg3_long_office_household”: (a) ATE using the graph-based RGB-D SLAM; (b) ATE using the VO-EIF RGB-D SLAM.
Sensors 15 18742 g010
Figure 11. Total processing time of every frame of the sequence “freiburg1_room” by different algorithms.
Figure 11. Total processing time of every frame of the sequence “freiburg1_room” by different algorithms.
Sensors 15 18742 g011
Figure 12. Total processing time of every frame of the sequence “freiburg3_long_office_household” by different algorithms.
Figure 12. Total processing time of every frame of the sequence “freiburg3_long_office_household” by different algorithms.
Sensors 15 18742 g012

8. Conclusions

In this paper, we put forward a novel RGB-D SLAM algorithm. Our RGB-D observation model is based on the binary descriptor, which effectively reduces the time complexity of the data association. Visual odometry is estimated for the movement of the camera by aligning two consecutive intensity images I 1 and I 2 and incorporating the weight and motion prior. We evaluated our approach quantitatively on a publicly-available RGB-D dataset and compare our approach to a graph-based RGB-D SLAM algorithm. The experimental results illustrate that VO-EIF RGB-D SLAM can successfully complete large loop closing, and the localization precision of our algorithm is nearly the equivalent of the graph-based algorithm; moreover, our algorithm is quicker than the graph-based algorithm.
As a next step, we plan to extend the VO-EIF RGB-D SLAM algorithm to the map with a 3D color point cloud. The VO-EIF RGB-D SLAM algorithm based on the keyframe [32] will be studied. For example, if there are many (at least three) feature points in the observation of the camera at time t, the frame can be used as a candidate keyframe. After the corresponding landmark of the features is updated, the pose of the keyframe is updated by reverse-measurement. Furthermore, a more sophisticated technique could be used to extract image features for a more robust and efficient system.

Acknowledgments

This work is supported by the National Natural Science Foundation of China (No. 61165007), the Natural Science Foundation of Jiangxi Province, China (No. 20132BAB211036), the Science and Technology Research Foundation of Jiangxi Provincial Education Department (No. GJJ14367), and the Program of Study Abroad for Young Scholar Sponsored by Jiangxi Provincial Education Department.

Author Contributions

The work presented in this paper corresponds to a collaborative development by all authors. Heng Zhang and Jindong Tan defined the research line. Yanli Liu and Heng Zhang designed and implemented the feature observation model and motion model. Heng Zhang and Naixue Xiong performed the experiments.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Thrun, S.; Burgard, W.; Fox, D. Probabilistic Robotics; The MIT Press: Cambridge, MA, USA, 2005. [Google Scholar]
  2. Leonard, J.J.; Feder, H.J.S. Decoupled stochastic mapping. IEEE J. Ocean. Eng. 2001, 26, 561–571. [Google Scholar] [CrossRef]
  3. Thrun, S.; Liu, Y.; Koller, D.; Ng, A.; Ghahramani, Z.; Durrant-Whyte, H. Simultaneous localization and mapping with sparse extended information filters. Int. J. Robot. Res. 2004, 23, 693–716. [Google Scholar] [CrossRef]
  4. Moreno, F.A.; Blanco, J.L.; Gonzalez, J. Stereo vision-specific models for particle filter-based SLAM. Robot. Auton. Syst. 2008, 57, 955–970. [Google Scholar] [CrossRef]
  5. Kummerle, R.; Grisetti, G.; Strasdat, H.; Konolige, K.; Burgard, W. G2o: A general framework for graph optimization. In Proceedings of 2011 IEEE International Conference on Robotics and Automation, Shanghai, China, 9–13 May 2011; pp. 3607–3613.
  6. Johannsson, H.; Kaess, M.; Fallon, M.; Leonard, J.J. Temporally scalable visual SLAM using a reduced pose graph. In Proceedings of 2013 IEEE International Conference on Robotics and Automation, Karlsruhe, Germany, 6–10 May 2013; pp. 54–61.
  7. Sun, F.; Hu, D.; Liu, H.; Lin, R.; Wang, Y.; Yang, S. RGBD SLAM for indoor environment. In Foundations and Practical Applications of Cognitive Systems and Information Processing; Sun, F., Hu, D., Liu, H., Eds.; Springer Heidelberg: Berlin, Germany, 2014; pp. 161–175. [Google Scholar]
  8. Jun, L.; Pan, T.; Tseng, K.; Pan, J. Design of a monocular simultaneous localisation and mapping system with ORB feature. In Proceedings of 2013 IEEE International Conference Multimedia and Expo, San Jose, CA, USA, 15–19 July 2013; pp. 1–4.
  9. Valenti, R.G.; Dryanovski, I.; Jaramillo, C.; Strom, D.P.; Xiao, J. Autonomous quadrotor flight using onboard RGB-D visual odometry. In Proceedings of 2014 IEEE International Conference Robotics and Automation, Hong Kong, China, 31 May–7 Jun 2014; pp. 5233–5238.
  10. Hildebrandt, M.; Gaudig, C.; Christensen, L.; Natarajan, S.; Carrio, J.H.; Paranhos, P.M.; Kirchner, F. A validation process for underwater localization algorithms. Int. J. Adv. Robot. Syst. 2014, 11. [Google Scholar] [CrossRef]
  11. Han, J.; Shao, L.; Xu, D.; Shotton, J. Enhanced computer vision with microsoft Kinect sensor: A review. IEEE Trans. Cyber. 2013, 43, 1318–1334. [Google Scholar]
  12. Nascimento, E.R.; Oliveira, G.L.; Campos, M.F.M.; Vieira, A.W.; Schwartz, W.R. BRAND: A robust appearance and depth descriptor for RGB-D images. In Proceedings of the 2012 IEEE/RSJ International Conference on Intelligent Robots and Systems, Vilamoura, Portugal, 7–12 October 2012; pp. 1720–1726.
  13. Leutenegger, S.; Chli, M.; Siegwart, R.Y. BRISK: Binary robust invariant scalable keypoints. In Proceedings of the 2011 IEEE International Conference on Computer Vision (ICCV), Barcelona, Spain, 6–13 November 2011; pp. 2548–2555.
  14. Calonder, M.; Lepetit, V.; Strecha, C.; Fua, P. BRIEF: Binary robust independent elementary features. In Computer Vision—ECCV 2010; Daniilidis, K., Maragos, P., Paragios, N., Eds.; Springer Heidelberg: Berlin, Germany, 2010; Volume 6314, pp. 778–792. [Google Scholar]
  15. Henry, P.; Krainin, M.; Herbst, E.; Ren, X.; Fox, D. RGB-D mapping: Using kinect-style depth cameras for dense 3D modeling of indoor environments. Int. J. Robot. Res. 2012, 31, 647–663. [Google Scholar] [CrossRef]
  16. Khatib, O.; Kumar, V.; Sukhatme, G.; Henry, P.; Krainin, M.; Herbst, E.; Ren, X.; Fox, D. RGB-D mapping: Using depth cameras for dense 3D modeling of indoor environments. In Experimental Robotics; Khatib, O., Kumar, V., Sukhatme, G., Eds.; Springer Heidelberg: Berlin, Germany, 2014; pp. 477–491. [Google Scholar]
  17. Fioraio, N.; Konolige, K. Realtime visual and point cloud slam. In Proceedings of the RGB-D Workshop on Advanced Reasoning with Depth Cameras at Robotics: Science and Systems Conference, Los Angeles, CA, USA, 27 Jun 2011.
  18. Besl, P.J.; McKay, N.D. A method for registration of 3-D shapes. IEEE Trans. Pattern Anal. Mach. Intell. 1992, 14, 239–256. [Google Scholar] [CrossRef]
  19. Po-Chang, S.; Ju, S.; Cheung, S.C.S. A robust RGB-D SLAM system for 3D environment with planar surfaces. In Proceedings of the 2013 20th IEEE International Conference on Image Processing (ICIP), Melbourne, Australia, 15–18 September 2013; pp. 275–279.
  20. Lee, D.; Myung, H. Solution to the SLAM problem in low dynamic environments using a pose graph and an RGB-D sensor. Sensors 2014, 14, 12467–12496. [Google Scholar] [CrossRef] [PubMed]
  21. Calonder, M.; Lepetit, V.; Fua, P. Keypoint signatures for fast learning and recognition. In Proceedings of the 10th European Conference on Computer Vision: Part I, Marseille, France, 12–18 October 2008; pp. 58–71.
  22. Lourakis, M.I.A.; Argyros, A.A. SBA: A software package for generic sparse bundle adjustment. ACM Trans. Math. Soft. 2009, 36, 1–30. [Google Scholar] [CrossRef]
  23. Henry, P.; Fox, D.; Bhowmik, A.; Mongia, R. Patch volumes: Segmentation-based consistent mapping with RGB-D cameras. In Proceedings of 2013 International Conference on 3D Vision, Seattle, WA, USA, 29 June–1 July 2013; pp. 398–405.
  24. Audras, C.; Comport, A.; Meilland, M.; Rives, P. Real-time dense appearance-based SLAM for RGB-D sensors. In Proceedings of the 2011 Australasian Conference on Robotics and Automation, Melbourne, Australia, 7–9 December 2011; pp. 100–109.
  25. Steinbrucker, F.; Sturm, J.; Cremers, D. Real-time visual odometry from dense RGB-D images. In Proceedings of 2011 IEEE International Conference on Computer Vision Workshops, Barcelona, Spain, 6–13 November 2011; pp. 719–722.
  26. Gutiérrez-Gómez, D.; Mayol-Cuevas, W.; Guerrero, J.J. Inverse depth for accurate photometric and geometric error minimisation in RGB-D dense visual odometry. In Proceedings of the 2015 IEEE International Conference on Robotics and Automation (ICRA), Seattle, WA, USA, 26–30 May 2015.
  27. Whelan, T.; Johannsson, H.; Kaess, M.; Leonard, J.J.; McDonald, J. Robust real-time visual odometry for dense RGB-D mapping. In Proceedings of the 2013 IEEE International Conference on Robotics and Automation, Karlsruhe, Germany, 6–10 May 2013; pp. 5724–5731.
  28. Whelan, T.; Kaess, M.; Fallon, M.; Johannsson, H.; Leonard, J.; McDonald, J. Kintinuous: Spatially extended kinectfusion. In Proceedings of the RSS Workshop on RGB-D: Advanced Reasoning with Depth Cameras, Sydney, Australia, 9–10 July 2012.
  29. Hu, G.; Huang, S.; Zhao, L.; Alempijevic, A.; Dissanayake, G. A robust RGB-D SLAM algorithm. In Proceedings of the 2012 IEEE/RSJ International Conference on Intelligent Robots and Systems, Vilamoura, Portugal, 7–12 October 2012; pp. 1714–1719.
  30. Endres, F.; Hess, J.; Engelhard, N.; Sturm, J.; Cremers, D.; Burgard, W. An evaluation of the RGB-D SLAM system. In Proceedings of the 2012 IEEE International Conference on Robotics and Automation, Saint Paul, MN, USA, 14–18 May 2012; pp. 1691–1696.
  31. Sturm, J.; Engelhard, N.; Endres, F.; Burgard, W.; Cremers, D. A benchmark for the evaluation of RGB-D SLAM systems. In Proceedings of the 2012 IEEE/RSJ International Conference on Intelligent Robots and Systems, Vilamoura, Portugal, 7–12 October 2012; pp. 573–580.
  32. Kerl, C.; Sturm, J.; Cremers, D. Dense visual SLAM for RGB-D cameras. In Proceedings of the 2013 IEEE/RSJ International Conference on Intelligent Robots and Systems, Tokyo, Japan, 3–7 November 2013; pp. 2100–2106.
  33. Tykkälä, T.; Comportb, A.I.; Kämäräinenc, J.; Hartikainen, H. Live RGB-D camera tracking for television production studios. J. Vis. Commu. Image Repr. 2014, 14, 207–217. [Google Scholar] [CrossRef]
  34. Whelan, T.; Kaess, M.; Leonard, J.J.; McDonald, J.B. Deformation-based loop closure for large scale dense RGB-D SLAM. In Proceedings of the 2013 IEEE/RSJ International Conference on Intelligent Robots and Systems, Tokyo, Japan, 3–7 November 2013; pp. 548–555.
  35. Endres, F.; Hess, J.; Sturm, J.; Cremers, D.; Burgard, W. 3-D mapping with an RGB-D camera. IEEE Trans. Robot. 2014, 30, 177–187. [Google Scholar] [CrossRef]
  36. Huang, A.S.; Bachrach, A.; Henry, P.; Krainin, M.; Maturana, D.; Fox, D.; Roy, N. Visual odometry and mapping for autonomous flight using an RGB-D camera. In Proceedings of the International symposium on Robotics Research, Flagstaff, AZ, USA, 28 August–1 September 2011; pp. 1–16.
  37. Kerl, C.; Sturm, J.; Cremers, D. Robust odometry estimation for RGB-D cameras. In Proceedings of the 2013 IEEE International Conference on Robotics and Automation, Karlsruhe, Germany, 6–10 May 2013; pp. 3748–3754.
  38. Tykkala, T.; Audras, C.; Comport, A.I. Direct iterative closest point for real-time visual odometry. In Proceedings of the 2011 IEEE International Conference on Computer Vision Workshops, Barcelona, Spain, 6–13 November 2011; pp. 2050–2056.
  39. Ataer-Cansizoglu, E.; Taguchi, Y.; Ramalingam, S.; Garaas, T. Tracking an RGB-D camera using points and planes. In Proceedings of the 2013 IEEE International Conference on Computer Vision Workshops, Sydney, Australia, 2–8 December 2013; pp. 51–58.
  40. Teichman, A.; Miller, S.; Thrun, S. Unsupervised intrinsic calibration of depth sensors via SLAM. In Proceedings of the Robotics: Science and Systems, Berlin, Germany, 24–28 June 2013.
  41. Lowe, D.G. Distinctive image features from scale-invariant keypoints. Int. J. Comput. Vis. 2004, 60, 91–110. [Google Scholar] [CrossRef]
  42. Bay, H.; Ess, A.; Tuytelaars, T.; van Gool, L. Speeded-up robust features (SURF). Comput. Vis. Image Underst. 2008, 110, 346–359. [Google Scholar] [CrossRef]
  43. Rublee, E.; Rabaud, V.; Konolige, K.; Bradski, G. ORB: An efficient alternative to SIFT or SURF. In Proceedings of the 2011 IEEE International Conference on Computer Vision (ICCV), Barcelona, Spain, 6–13 November 2011; pp. 2564–2571.
  44. Engel, J.; Sturm, J.; Cremers, D. Camera-based navigation of a low-cost quadrocopter. In Proceedings of the 2012 IEEE/RSJ International Conference on Intelligent Robots and Systems, Vilamoura, Portugal, 7–12 October 2012; pp. 2815–2821.
  45. Lange, K.L.; Little, R.J.A.; Taylor, J.M.G. Robust statistical modeling using the t distribution. J. Am Stat. Assoc. 1989, 84, 881–896. [Google Scholar] [CrossRef]
  46. Labbe, M.; Michaud, F. Appearance-based loop closure detection for online large-scale and long-term operation. IEEE Trans. Robot. 2013, 29, 734–745. [Google Scholar] [CrossRef]
  47. Grisetti, G.; Stachniss, C.; Burgard, W. Nonlinear constraint network optimization for efficient map learning. IEEE Trans. Intell. Transp. Syst. 2009, 10, 428–439. [Google Scholar] [CrossRef]
  48. Zhang, H.; Liu, Y.; Tan, J. Loop closing detection in RGB-D SLAM combining appearance and geometric constraints. Sensors 2015, 15, 14639–14660. [Google Scholar] [CrossRef] [PubMed]

Share and Cite

MDPI and ACS Style

Zhang, H.; Liu, Y.; Tan, J.; Xiong, N. RGB-D SLAM Combining Visual Odometry and Extended Information Filter. Sensors 2015, 15, 18742-18766. https://doi.org/10.3390/s150818742

AMA Style

Zhang H, Liu Y, Tan J, Xiong N. RGB-D SLAM Combining Visual Odometry and Extended Information Filter. Sensors. 2015; 15(8):18742-18766. https://doi.org/10.3390/s150818742

Chicago/Turabian Style

Zhang, Heng, Yanli Liu, Jindong Tan, and Naixue Xiong. 2015. "RGB-D SLAM Combining Visual Odometry and Extended Information Filter" Sensors 15, no. 8: 18742-18766. https://doi.org/10.3390/s150818742

Article Metrics

Back to TopTop