Next Article in Journal
Robot-Assisted Eccentric Contraction Training of the Tibialis Anterior Muscle Based on Position and Force Sensing
Next Article in Special Issue
Intelligent Positioning for a Commercial Mobile Platform in Seamless Indoor/Outdoor Scenes based on Multi-sensor Fusion
Previous Article in Journal
Multiplexed Paper Microfluidics for Titration and Detection of Ingredients in Beverages
Previous Article in Special Issue
Real-Time Monitoring of Jet Trajectory during Jetting Based on Near-Field Computer Vision
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Continuous Driver’s Gaze Zone Estimation Using RGB-D Camera

1
Information Science and Technology College, Dalian Maritime University, Dalian 116026, China
2
School of Microelectronics, Dalian University of Technology, Dalian 116024, China
*
Author to whom correspondence should be addressed.
Sensors 2019, 19(6), 1287; https://doi.org/10.3390/s19061287
Submission received: 9 January 2019 / Revised: 22 February 2019 / Accepted: 24 February 2019 / Published: 14 March 2019

Abstract

:
The driver gaze zone is an indicator of a driver’s attention and plays an important role in the driver’s activity monitoring. Due to the bad initialization of point-cloud transformation, gaze zone systems using RGB-D cameras and ICP (Iterative Closet Points) algorithm do not work well under long-time head motion. In this work, a solution for a continuous driver gaze zone estimation system in real-world driving situations is proposed, combining multi-zone ICP-based head pose tracking and appearance-based gaze estimation. To initiate and update the coarse transformation of ICP, a particle filter with auxiliary sampling is employed for head state tracking, which accelerates the iterative convergence of ICP. Multiple templates for different gaze zone are applied to balance the templates revision of ICP under large head movement. For the RGB information, an appearance-based gaze estimation method with two-stage neighbor selection is utilized, which treats the gaze prediction as the combination of neighbor query (in head pose and eye image feature space) and linear regression (between eye image feature space and gaze angle space). The experimental results show that the proposed method outperforms the baseline methods on gaze estimation, and can provide a stable head pose tracking for driver behavior analysis in real-world driving scenarios.

1. Introduction

Driver distraction and inattention are the key factors that cause traffic accidents. Distracted driving increases the probability of crashes as the drivers shift their attention from driving. To recognize and prevent these types of potential dangers, driving behavior monitoring plays an increasingly significant role in Advanced Driver Assistance Systems (ADAS), and high level ADAS can provide higher forms of automation, in which drivers are even expected to glance away from the primary operational task and be guided to get through some critical situation.
Human-centric driving monitor technologies can be divided into two categories, intrusive-sensing technologies and remote-sensing technologies. While the intrusive-sensing technologies [1] detect head motion from attached head orientation sensors, some biomedical sensing technologies [2,3] measure the signals from the driver immediately and intuitively, but disturb the driver in the process, leading to inconvenience complaints. Vision-based applications usually mount the remote cameras inside the vehicle, and are capable of monitoring the driver in a non-contact and non-invasive way. These applications benefit from the advance in information technologies, and can present computer vision algorithms based on low-cost sensors. Figure 1 shows the typical RGB-D camera and the corresponding RGB-D data.
In the driver context, the dynamics of a driver’s head and eye are potential to present where or what he/she is looking at. The allocation of a driver’s gaze is linked to a driver’s current attention. Therefore, studying a driver’s gaze direction and fixation has been extensively applied for visual distraction detection and understanding driver activities, and in natural driving, many drivers move both their heads and eyes when looking at the target. Many gaze tracking systems have been proposed for monitoring driver’s attention state [5]. Detailed surveys of gaze estimation and head pose estimation can be seen in Refs. [6,7].
Coarse gaze direction based on a driver’s head orientation is usually acceptable in vision-based driver behavior monitoring systems. The probability of driver gaze is often generated by a gaze zone estimator. The discrete gaze zones are defined as the in-vehicle components where drivers are looking at, such as windshields, rear-view mirrors, side mirrors, etc. Since head pose contributes to gaze direction, many gaze zone estimation methods consider head orientation as the indicator of the gaze zone in a convenient manner, and parts of many studies treat the gaze zone estimation as a combination of head pose estimation (head pose value) and gaze estimation (gaze angle value of eyeball) in three degree of freedom (Euler angle), yaw, pitch and roll. This is consistent with real driving behavior in natural driving, resulting in many drivers moving both their heads and eyes when they are looking at the target.
From the perspective of sensor information, driver gaze zone estimation systems fall into one of two categories: systems using RGB/Grayscale cameras, and RGB-D cameras.
RGB or Grayscale Cameras: Most systems that use RGB or Grayscale cameras are largely relying on precise localization of facial features. Constrained Local Model (CLM) is one of the Facial Landmark Detection (FLD) methods, and has been commonly employed to extract and analyze the head pose and its dynamic in single [8] or multiple camera systems [9,10]. The driver’s face is detected in an unpredicted environment and further location of the frontal facial landmark points under model constraints (typical instances are various feature points annotated around face contour, eyes, eyebrows, nose and mouth). In order to provide robust representation against illumination and accelerate the detection speed, Vicente et al. [11] expressed face shape by Supervised Descent Method (SDM) using an SIFT descriptor and analyzed the geometric configurations of facial landmark points to estimate the head pose. After FLD process, head pose vector or facial feature landmarks are extracted as training features for gaze zone estimation.
Besides, FLD uses eye alignment to locate the eye region for eye pose estimation. By assuming the human eyeball as a spherical 3D eye model with a constant radius, there are only several parameters needed. One of important parameter is pupil center. As the pupil is darker than other parts of the eye region, Fridman et al. [12] used an adaptive threshold of the histogram of the eye image to segment the pupil blob, but it does not work well in the non-uniform varying lighting conditions. On the low resolution eye image, Trawari et al. [10] detected the iris center (same as the eyeball center) using the HoG descriptor. This method trained the local patches of the eye image under different light, but to a great extent, needed some image processing steps to ensure its detection quality. Vicente et al. [11] used SDM tracker to detect eye landmarks including six eye contour points and the pupil. The eye estimation followed a 3D eye model-based approach in their work.
However, it is still critical for the above systems to obtain depth information, especially when solving the 3D head pose from the 2D images depending on the detected landmarks and their relative 3D configurations with a weak perspective projection model. To address the varying changes of head position and head rotation, Ultrasonic sensors [13,14] or dual cameras [15] are used as extra devices for generating more information to compensate for head movement.
RGB-D Cameras: Standard RGB cameras can take advantage of color information, but lack depth information due to inherent hardware restrictions. The great challenges for such works are the illumination vulnerability under poor environmental conditions where light and shade bring negative effects. To overcome some of these difficulties, RGB-D cameras are applied to obtain both RGB images and more information using point-cloud-based sensors. RGB-D cameras can synchronously capture RGB images and depth images. Different RGB-D cameras are implemented by stereo cameras, structured light, time-of-flight or laser scanners. The more expensive the sensors are, the more accurate point-cloud they achieve. RGB-D cameras benefit from the depth appearance or point-clouds that generated by themselves to build gaze zone estimation systems.
To handle the point-clouds, ICP (Iterative Closet Points) algorithm [16,17] that is used for iterative registration between the free-form three-dimensional rigid point-cloud surfaces, has been applied to calculate the rotation matrix and offset vector between source face template and target face templates. Peláez C. et al. [18] presented a gaze zone estimation system to estimate head pose by analyzing the projection of three-dimensional point-cloud based on ICP. With continuous iterative correction, ICP can minimize the distance from the source point-cloud to the target point-cloud within a given three-dimensional space. However, when the point-cloud level grows larger, the time cost increases dramatically.
Therefore, Bär et al. [19] used Newton method to optimize the ICP solution process. A Newton method is favorable for a faster convergence than a gradient descent method. Multi-templates were used in point-cloud alignment to compute the head pose, subsequently, driver’s gaze angle was analyzed on the eye gaze model. Experimental results show that their system can obtain robust estimation of head pose than single-template system, but the Newton method requires more strict initial value, thus, their system suffers from the problem of falling into a local solution. More studies show that in the process of ICP alignment, adding a filter (such as temporal filter [20], Kalman Filter [21], etc.) to track and learn its state at the next timeframe can solve ICP anisotropic conversion more effectively and stably. Particle Swarm Optimization (PSO) algorithm [22] can solve this through the cooperative behavior of a generation of evolutionary particles. Although PSO has achieved better results, its response is too slow.
Based on depth image appearances, the training regression model for head pose estimation can be constructed by labelling a large number of training sample. Fanelli et al. [23,24] built a random forest regression model and tested depth image appearances with different scanning accuracy. Random forest regression was used to map the depth images to the continuous head pose space by probabilistic voting, in which random sampling samples were adopted to avoid over-fitting. Their results are sensitive to the depth image acquisition and preprocessing, and poor solutions will result in the case of online testing. Breitenstein et al. [25] used the depth appearance of the nose region to predict the head pose, collected reference appearance during the offline stage, and then calculated the errors between the candidate depth and the current input. However, these methods have not been applied in driver gaze zone estimation systems. One of the most important reasons is that the depth appearances maybe incomplete in real driving environments, due to the illumination changes and occlusions.
For gaze estimation or head pose estimation using RGB-D cameras [26,27,28], RGB and depth images can also be used in different processing events. Usually, a depth image is used for foreground segmentation, head localization and object tracking, while the RGB image is used for eye localization and feature extraction. For example, Cazzato et al. [29] located the facial landmark points and position of pupil center in RGB images, and predicted head pose by ICP alignment. The human line of gaze was estimated by oriented feature points surrounding the eye. Mora et al. [30,31] also provided gaze system combining of head pose estimation and gaze estimation, but they used appearance-based gaze estimation methods instead of model-based methods. However, these methods only have better estimation accuracy in the case of a frontal face; the errors increase on low-resolution eye images under free movement.
This work focuses on the applicable gaze zone estimation system with RGB-D cameras performance in a real-world driving environment, and adapts for variants of ICP to align a driver’s face templates. The highlights of the paper are shown below:
  • An application-oriented ICP-based point-clouds alignment solution for continuous driver gaze zone estimation using RGB-D camera is proposed, applying multi-zone templates for target face templates revision, and particle filter tracking with auxiliary sampling for initializing and updating the best transformation of source face template; at the same time, the head state is tracked and learned to cope with high rotation velocities under natural head turns, providing reliable head pose value in both yaw, pitch and roll.
  • A novel appearance-based eye gaze estimation with two-stage neighbor selection is utilized, avoiding the inaccurate pupil center localization in a real remote driving environment and the vulnerable eye gaze model under very large head rotation. The proposed eye gaze estimation method treats gaze prediction as a combination of cascaded nearest neighbor query and local feature regression.
A summary of driver gaze zone estimation using an RGB-D camera is provided in Table 1. Compared with the previous gaze zone detection systems using RGB-D cameras, the proposed system presents continuous resolution not only for the gaze zone estimation, but also for the head pose estimation and gaze estimation. Unlike the multi-template ICP in Ref. [19], they ensured the transformation of the point-clouds by averaging the results of multiple templates. However, the target templates will be changed due to the varying illumination changes and large head rotations and presence of partial occlusion of eye glasses or light source. We revise multi-zone ICP for balancing the templates’ revision in the real driving scenario. Furthermore, particle filter tracking is used for initialize and update the best transformation of ICP. Unlike model-based gaze estimation methods, which have disadvantages due to the vulnerability under large head movement, the appearance-based gaze estimation method is a better alternative. Furthermore, we conduct the gaze estimation as a two-stage nearest neighbor selection from both head pose space and image feature space. This structure makes it more efficient. The proposed system outputs the final gaze zone index by classifying the gaze angle with head pose compensation.
The rest of this paper is organized as follows. Section 2 introduces our driver gaze zone estimation system that combines the head pose tracking and gaze estimation. The details of implementing multi-zone ICP-based head pose estimation appear in Section 2.1. Section 2.2 presents head state tracking by auxiliary particle filter. Section 2.3 shows the proposed appearance-based gaze estimation with neighbor selection. In Section 3, the proposed system is evaluated and some practical issues regarding the implementation are considered. Finally, Section 4 gives a brief conclusion.

2. Proposed System

This paper presents a combination of multi-zone ICP-based head pose tracking, and appearance-based gaze estimation to build a continuous driver gaze zone detection system (as shown in Figure 2). These two parts have been handled in Depth image and RGB image, respectively.
On the depth image, the scene depth information can be easily obtained. Therefore, as shown in Figure 3, the face region in the foreground is segmented from the driving environment with adaptive minimum distance restrictions. Simultaneously, face detection using Viola–Jones method [32] is used to judge whether a driver’s face has been searched and further shrink the face region. At this point, the three-dimensional point-cloud data of face templates has been extracted more precisely and can basically meet the needs of subsequent operations. Some pre-processing is applied to remove outliers, reduce noises, and preserve the geometric characteristics of point-cloud at the same time. After smooth filtering on the depth image, its corresponding three-dimensional point-cloud is generated for rigid transformation. This point-cloud is called the source template.
To estimate head pose under large head rotation, a multi-zone ICP-based method is proposed. By taking advantage of the least squares techniques, source point-cloud and corresponding reference point-cloud templates are aligned under iterative operation, alignment, comparing, adjusting, re-alignment, re-comparing, and re-adjusting. Proper templates at different gaze zones can reduce the templates accumulative error under large head motion. In order to solve the problem that the iteration result does not converge, the head state is tracked and learned by auxiliary particle filtering. The ICP-based point-cloud alignment is then initialized by the prediction value of head state. Head pose in Euler angle will output by the recent head transformation. It should be noted that the reference templates for a multi-zone can be captured when a driver sits down and glances at the labeled center of the pre-defined self-centered gaze zone.
On the RGB image, an eye region is localized in the face region. Due to the scale of a driver’s face region not changing dramatically, the eye region is easier to be captured in the constraint of face detection. The normalized eye images have been mapped into the image feature space, while head pose that is generated in the head poses estimation have been mapped into the head pose space. Appearance-based gaze estimation using neighbor selection is utilized, in which both head pose and eye image features contribute to gaze prediction. By two-stage nearest neighbor searching in both head pose and image feature space, more relevant image features can be found for building the mapping relationship between image feature space and gaze angle space. Final gaze direction is obtained as the gaze angle with head pose compensation. Then, gaze zone estimation is a classification of final gaze direction by k-Nearest Neighbor.
Detailed information about head pose estimation, head state tracking and gaze estimation is described in the following chapters.

2.1. Multi-Zone ICP-Based Head Pose Estimation

The human face region is considered as rigid surface of three-dimensional model without deformation. Regardless of the perspective transformation and scale factor, only takes into account the linear transformation and translation transformation of the coordinate system, the rigid transformation between two human face point-cloud set data is defined as:
T = R t 0 1
where, T is a 4 × 4 matrix, R is a 3 × 3 rotation matrix, t is a 3 × 1 translation vector. The rotation matrix of cloud point alignment is a continuous right multiplication process of three orthogonal rotation matrix with a determinant of 1.
R = R x R y R z , t = t x t y t z T
R x = 1 0 0 0 cos α sin α 0 sin α cos α R y = cos β 0 sin β 0 1 0 sin β 0 cos β R z = cos γ sin γ 0 sin γ cos γ 0 0 0 1
To solve the transformation matrix T , ICP algorithm is applied for aligning different point-clouds [33]. During data acquisition and rigid transformation, unavoidable data noise always exists, and causes the alignment of target point-cloud and source point-cloud not to achieve accurate results. Therefore, in order to improve the accuracy of calculation, it is necessary to find as many effective corresponding point pairs as possible, to constrain the transformation matrix.
The main steps of the basic ICP algorithm for point-cloud alignment are: (1) search the nearest neighbor point pairs between two point-cloud using the correspondence estimation; (2) calculate the transformation matrix by the least squares method in an iterative way with all the valid point pairs, until it meets the convergence conditions.

2.1.1. Nearest Neighbor Search

In a given point-cloud set P and Q , a set of nearest neighbor point pairs ( q i , p j ) can be extracted, where q i Q and p j P . Thus, q i Q , at least one closest point p j P exists. In order to reduce the computational complexity of the rapid search, the corresponding point pairs are computed by the normal under the minimum distance constraints, and the obtained nearest neighbor at this time is an approximated nearest point, rather than the ground-truth nearest point. Figure 4 shows a schematic diagram of nearest neighbor search process based on the Point-to-Plane method [34]. Firstly, based on the normal of reference point p j at the point-cloud P , the intersection q i of the normal at the point-cloud Q can be found. Then, make the tangent plane of q i , and draw the vertical line between the point p j and the tangent plane. Finally, compute the intersection point q i at the point-cloud Q . Thus far, a point pair ( q i , p j ) is extracted.
Through the Point-to-Plane nearest neighbor search, the found neighbor point pairs are not strictly constrained one by one correspondence. That means the different points on the source point-cloud maybe have built a pair relationship with the same point on the reference point could. Moreover, because of the influence of data noise, partial outliers are produced, and confuse the related point pairs. Furthermore, to eliminate the interference of outliers and build a stable point pairs relationship, the reciprocal correspondence point pairs are selected after the filtering method smooth the noise in the space. The reciprocal correspondence point pairs are intersection of two sets of nearest neighbor points pairs, exchange the reference point-cloud source and the reference point-cloud source.
In summary, reciprocal correspondence nearest neighbor point pairs search strategy is utilized in the proposed point-cloud alignment method, which accelerates the search speed and reduces index complexity, generating effective point-cloud pairs for further transformation computation of point-cloud alignment.

2.1.2. Iterative Computing of Transformation

The calculation process of transform matrix is as follows. Firstly, the space mapping reconstruction error function is defined by least square method using the generated nearest neighbor point pairs. Then, a coarse transformation matrix is optimized and solved by minimizing the error function. By projecting the source point-cloud to the coordinate system of the reference point-cloud, the new source point-cloud for next repeat is gotten. Each repeat process is a combination of the optimization of transformation matrix and nearest neighbor point pairs searches for the new source point-cloud. The fine transform matrix will be gotten until it satisfies the convergence condition.
When the final transformation matrix is solved, the rotation angle of head pose in Euclidean space can be calculated using the right-hand Cartesian coordinate system (as shown in Figure 5).
α = arctan ( R 32 R 33 ) , β = arctan ( R 31 R 32 2 + R 33 2 ) , γ = arctan ( R 21 R 11 )
where, R i j denotes the element of R at i row j column. α , β and γ denotes the yaw, pitch and roll of driver’s head pose, respectively.
In general, there are large rotations of a driver’s head in the real driving condition, but the vast majority of the related head poses are concentrated on several gaze regions, such as the left mirror, right mirror, rear-view mirror, windshield, etc. All these areas are known as the gaze zone.
To reduce the cumulative error of ICP iteration, a multi-zone ICP-based head pose estimation method is proposed by applying templates of different gaze zones in continuous tracking. To accelerate the iterative process of ICP, particle filtering is used in tracking the head pose, initializing the coarse transformation matrix. Detailed descriptions of particle filtering are in Section 2.2. All reference templates are collected with ground-truth head pose values and represent different gaze zones. The head pose estimation system first initializes the reference template with zero angle in head pose Euclidean space, then calculates the Euclidean distance of the estimated head pose and the corresponding head pose of the reference templates, and determines the current template index by choosing the 1-Nearest Neighbor. Typically, a driver’s head pose will vary depending on the driving behavior.
The steps of the proposed head pose estimation method are shown in the Algorithm 1.
Algorithm 1: Multi-zone ICP-based Driver’s Head Pose Estimation.
1:
Initialize multiple cloud point templates for different driver gaze zone
P = { P 1 , P 2 , · · · , P m } .
2:
For each new cloud point Q , calculate the predicted head state by Particle Filter tracking, and get the initial value of ( R , t ) : ( R ^ , t ^ ) .
3:
Update the coarse head pose value ( α , β , γ ) based on Equation (4) with ( R ^ , t ^ ) .
4:
Update the current gaze zone index m of templates using k-NN method.
5:
Search the nearest point pairs between Q and P m using Nearest Neighbor Search algorithm:
p j P m , q i = arg min q i Q nnsp ( p j , q i )
where, nnsp ( · ) is a Point-to-Plane Nearest Neighbor Search function with correspondence strategy.  
6:
Calculate the optimal transformation ( R b e s t , t b e s t ) via minimize the reconstruction error between  Q  and P m by:
( R b e s t , t b e s t ) = arg min R ^ , t ^ e ( R ^ , t ^ ) = arg min R ^ , t ^ N P R ^ P m + t ^ Q
( R b e s t , t b e s t ) is computed in a iterative process, until the reconstruction error is below the given threshold τ .
7:
According to the Right-hand Cartesian Coordinate system, update the fine head pose value ( α , β , γ ) based on Equation (4) with ( R b e s t , t b e s t ) .
8:
Tracking the head state by particle filter and goto Step 2

2.2. Head State Tracking by Particle Filter

Particle filter is a nonlinear filtering algorithm based on Bayesian estimation, and has unique advantages in dealing with parameter estimation and state tracking. In this chapter, it is assumed that the driver’s face is a rigid mesh, and we treat the alignment of the 3D point-cloud between source and templates as motion variant of head pose state. Therefore, the driver’s head state dynamic model is established based on particle filter, and the translation and rotation of a head in a given state space is tracked and learned by particle filters. In order to solve the particle impoverish and weight assignation problem of particle filter, an auxiliary sampling method is used in Sequential Importance Sampling (SIS). Figure 6 shows the overall framework of head state tracking by particle filter.

2.2.1. State Space Model

In state space, an unobservable driver’s head state is part of time series dynamics, and defined as X 1 : t = { X 1 , X 2 , · · · , X t } . At the same time, some observations Y 1 : t = { Y 1 , Y 2 , · · · , Y t } are made at continuous time points; it is assumed that all the state sequence is a Markov chain. In this case, similar to [35], the driver state space model can represent the process of the time series, the main composition of which is:
X t = F t ( X t 1 , U t ) f t ( X t | X t 1 ) Transition Density Y t = G t ( X t , V t ) g t ( Y t | X t ) Observation Density
where, X t = ( A t , v t ) is the driver’s head state. v t is a two-dimensional vector consisting of line velocity and angular velocity. The driver’s head state X t and data Y t are assumed to be generated by nonlinear functions F t and G t , respectively, of the state and noise disturbances U t and V t , and A t = ( t x , t y , t z , α , β , γ ) is a six-dimensional vector, which is consisting of head displacements of the axis t x , t y , t z , and head rotation α , β , γ . Based on Equation (4), A t can be convert into ICP initial value R and t of the rigid transformation.
Generally, the driver’s typical head motions can be divided into two parts. One is static state that focuses on the straight ahead direction without offset. The other motion is the linear dynamics that moves from one position to another. These situations can be modeled as mixed driver’s head state [36]: X t * = ( X t , τ t ) , where X t = ( 1 τ t ) X t ( 1 ) + τ t X t ( 2 ) , and τ t is a binary sign of velocity, with a value of 0 or 1. X t ( 1 ) = 1 0 0 0 X t 1 ( 1 ) + u t ( 1 ) 0 denotes the state with a speed of almost zero, while X t ( 2 ) = 1 1 0 1 X t 1 ( 2 ) + u t ( 2 ) 0 denotes the state of constant velocity. u t ( 1 ) and u t ( 2 ) are random variables that account for changes of the head state from different i.i.d. stochastic sequences.
The driver’s head state observation model is defined as Y t = T X t + V t , where T is conversion matrix between two space, and V t is the noise at time t. The distribution of τ t is based on the rotational speed of the driver head. When τ t = 1 , d ( Y t , Y t 1 ) > ε 1 , d ( A t , A t 1 ) > ε 2 , where ε 1 , ε 2 are the threshold of rotation speed, it means that the movement of head exceeds the range. Otherwise, when τ t = 0 , the head is stay still.

2.2.2. Particle Filter Tracking

On the basis of the above driver’s head state space model, auxiliary particle filter method is applied to improve the probability distribution of the driver’s head state at the new time point. Relying on the probability inference of posterior probability density, the joint probability density of driver’s head state and observed state is given as:
p 0 : T , 0 : T ( X 0 : T , Y 0 : T ) = p 0 ( X 0 ) g ( Y 0 | X 0 ) × t = 1 T f ( X t | X t 1 ) g ( Y t | X t )
where, p 0 is the initial probability density of X 0 . According to the driver’s head state conversion model and observation model, the states and the data are from randomly sampling process. Their sample pathes ( x ˜ 0 , x ˜ 1 , , x ˜ T ) take the initial value x ˜ 0 p 0 ( X 0 ) , and otherwise x ˜ t f t ( x t | X t = x ˜ t 1 ) . The corresponding y ˜ 0 g ( Y 0 | X 0 ) with a initial value y ˜ 0 g ( Y 0 | X 0 ) , and otherwise y t ˜ g t ( y t | X t = x ˜ t ) .
Since it is not possible to accurately obtain the current driver’s head state distribution trend p ( X ) , the standardized distribution of importance q ( X ) is utilized as an alternative, and the weight of current state sample data is updated by the previous observed driver’s head state. For the i-th sample weight w t ( i ) , w t ( i ) = p t ( x t ( 1 ) ) q t ( x t ( i ) ) . By p ( X t = x t | Y 1 : t = y 1 : t ) = p ( y t | x t ) p ( x t | y 1 : t 1 ) p ( y t | y 1 : t 1 ) , and set σ t | 0 : t 1 = N x g t ( Y t = y t ) p t | 0 : t 1 ( X t = x | y 0 : t 1 ) d x , therefore the joint probability density can be computed by
p 0 : t | 0 : t ( X 0 : t = x 0 : t | Y 0 : t = y 0 : t ) = g t ( x t | Y t ) p 0 : t | 0 : t 1 ( x 0 : t | y 0 : t ) σ t | 0 : t 1 ( y t | y t 1 )
Since it is impossible to sample according to the density function p 0 : t | 0 : t ( X 0 : t | Y 0 : t ) , the N samples x ˜ 0 : t ( i ) , i = 1 , 2 , , N are selected based on the probability density q 0 : t | 0 : t ( X 0 : t | Y 0 : t ) , and the sampling importance weights are computed by
w ˜ t ( i ) = p 0 : t | 0 : t ( x ˜ 0 : t | y 0 : t ) q 0 : t ( x 0 : t | y 0 : t )
All these weights are standardized and mapped to the interval [0, 1].
The weights will gradually probably fail after a long time of running, so the importance re-sampling is added after each weight calculation. In order to facilitate the survival of particles in the next moment, auxiliary sampling is used in the standard re-sampling process of the probability distribution of the driver’s head state. It is assumed that the joint posterior probability function at the time point can be well approximated using the Dirac measure of that time point.
A rough approximation function f ( d x t | x t 1 ( i ) ) δ μ t ( i ) ( d x t ) is used in the re-sampling, then the joint probability density can be approximated by
p 0 : t | 0 : t ( d x 0 : t 1 | y 0 : t ) i = 1 N g ( y t | μ t ( i ) ) w t 1 ( i ) δ x 0 : t 1 ( i ) ( d x 0 : t 1 )
At this point, the generalized importance ratio of particles is given as
w ˜ t ( i ) = w ˜ t 1 ( i ) v ˜ t 1 ( i ) × g ( y t | x t ( i ) ) f ( x t ( i ) | x t 1 ( i ) ) q t ( x t ( i ) | x t 1 ( i ) , y t )
Compared with the standard sequential importance sampling, the sampling in this chapter revises the important weights by 1 v t 1 ( i ) , and the weight ratios by w t 1 ( i ) v t 1 ( i ) . In this way, during the re-sampling process before sampling, the particles predicted at the previous moment are extended to increase particle diversity at the current moment and to reduce the variance of the importance weights, producing a more accurate estimate.
At this point, the driver’s head state transition density f t ( X t | X t 1 ) can be estimated based on the observation density g t ( Y t | X t ) 1 B e x p ( λ d ( Y t , T X t + V t ) ) , where B is a standardized constant. Therefore, the current driver’s head state X t is computed by the weighted average of the samples X t ^ = n = 1 N w t ( n ) x ˜ t ( n ) .

2.3. Appearance-Based Gaze Estimation Using Neighbor Selection

The proposed appearance-based gaze estimation is modeled in a local neighbor-based regression way, which contains three steps: feature extraction, two-stage neighbor selection and PLSR for gaze regression. The facial landmark detection and eye region localization contribute in extracting the eye images and head pose for gaze prediction. Neighbor selection seeks the neighbor of test sample in a training dataset. The nearest neighbors have similar properties in head pose and image feature. Gaze regression based on PLSR (Partial Least Squares Regression) is then employed to model using these neighbor samples.
The driver’s face always appears fully in the field of view. After the face region, which takes the bounding box, is localized, it is easy to obtain the eye region according to the landmarks, and head angle values are computed through trigonometry operations using elements from a rotation matrix. The head vector is converted from the rotation matrix to its axis-magnitude representation by Rodrigues Transform, which can also be used to transform three basic vectors to a rotation matrix.
The success of neighbor selection is highly depent on the appropriate construction of neighbor feature space. However, finding the proper neighbors from large scale eye image dataset is still a challenging problem. Because eye appearance is sensitive to head movement, head pose feature is significant for appearance-based gaze estimation with free head movement. Similar gaze direction under the same head pose for the same subject has a closet pupil center.
Here, gaze directions are regressed under similar head pose and image feature using the local manifold.
As shown in Figure 7, the proposed neighbor selection method consists of a double k-NN query in different feature spaces. This work provides a simple version of our previous work [37]. Here, Raw features are used as the appearance descriptor. A training dataset with query table has been built, in which each item of table contains index, eye image and its corresponding features (head pose and image feature). Image features with less nearest neighbors are found in the scope of the test data. The found image features are used as neighbor samples appearance for gaze local regression.
Previous local regression method based on k-NN usually estimates gaze angle using the mean of selected neighbors, which ignores the correlation between samples and gaze angles. To handle this, PLSR is utilized to reduce the dimensionality and project the gaze angle data onto components of maximum covariance with the image feature data. It is a combination of two methods: partial least squares (PLS) analysis and multiple linear regression. Furthermore, the statistically inspired modification of the PLS method (SIMPLS) algorithm is used in the gaze local regression for its competitiveness on large scale dataset [38].
Given eye appearances X f e a t u r e R k × n and gaze directions Y g a z e R 3 × n , then the gaze regression can be modeled as [39] by
X f e a t u r e = T f e a t u r e P f e a t u r e T + E
Y g a z e = U g a z e G g a z e T + F
where, T f e a t u r e and U g a z e are the scores of X and Y , respectively. P f e a t u r e and G g a z e are the loadings of X f e a t u r e and Y g a z e , respectively. E and F are the residual matrixs.
PLS matrices T f e a t u r e and U g a z e contain latent variables which are calculated as the linear combination of X f e a t u r e and Y g a z e . Assume T f e a t u r e = X f e a t u r e W and U g a z e = Y g a z e N . Thus, according to Ref. [39], PLSR model is reformulated as follows:
Y g a z e = X f e a t u r e B + F
where, B = W ( P f e a t u r e T W ) 1 N . The covariance between score vectors is maximized in each iteration of PLS, the i-th components of W and N can be computed by
w ( i ) , n ( i ) = arg max w , n n T ( Y g a z e , 0 T X f e a t u r e , 0 ) w s . t . | w | = 1 , | n | = 1 , t f e a t u r e ( i ) t f e a t u r e ( j ) j < i
where, t f e a t u r e ( i ) is i-th score vector of X f e a t u r e . Y g a z e , 0 and X f e a t u r e , 0 are the refined value of Y g a z e and X f e a t u r e , that have subtracted the mean vector of themselves. When the regression coefficients B is obtained, the predicted gaze angle can be determined by Y t e s t = X t e s t B , where X t e s t is the image feature of test sample.

3. Experimental Results and Discussion

This section evaluates the accuracy of the proposed system in different tasks on natural driving data. First, we report the performance of our head pose estimation in different gaze zones. Second, we compare our gaze estimation with head pose compensation to other baseline methods. Finally, we evaluate the driver’s gaze point and analyze the driver’s attention transfer probability between different gaze zones.

3.1. Experiment Setup and Data Sources

Evaluation is performed on a collection of video sequences of driving subjects with depth measurements. All image data (RGB images and Depth images) are collected from natural and on-road driving using the Kinect v1. For the Kinect’s installation in the real driving environment, it needs to be placed at the position that neither interfere the driver’s operation, nor occlude the effective field of view of the depth sensor, and the Kinect is designed for indoor applications with a range of detection at 0.8–4.0 m and with a field of view at 57 ( H o r i z o n t a l ) × 43 ( V e r t i c a l ) .
Therefore, in the evaluation, the Kinect is mounted facing the driver with the placement above the instrument board and in front of the windshield (as shown in Figure 8). It captures both depth and RGB video stream of the face view at 30 frames/s. The resolution of the Depth image is 320 × 240 , while the RGB image resolution is 640 × 480 . After image interpolation, they are of the same resolution. Afterwards, all images in which the face images are out of camera range or the eyes blink are discarded automatically. In this manner, the image dataset delivers almost 50,000 RGB data and Depth data from single driver in natural driving. For each frame, a depth image, a color image, the ground truth head pose, and gaze zone index are provided.
To provide the precise ground truth head pose value, the IMU (Inertial Motion Units), consists of three MPU6050 sensors, and is attached on the driver’s head to track its respective motion. IMU sensor outputs continuous head rotation angle by interior gyroscope with Kalman filter at 50 frames/s. To balance the sampling frequency of the IMU and the Kinect, IMU data is sub-sampled after data acquisition. The Kinect and the IMU are connected to a laptop via the USB interface and serial port, respectively. The whole system is powered by a 220-V portable power bank, and runs on one laptop with 2.30 GHz Intel Core i5 CPU and 8 GB RAM.
To evaluate the gaze direction, particular regions of interest are annotated as gaze zones in our dataset. All gaze zones are partitioned in the front of driver seat and contain most normal driving behavior movements. The considered gaze zones are left mirror, right mirror, rear-view mirror, instrument board, steering wheel, navigation system, glove box and several regions of the windshield, as shown in Figure 8.
Head pose estimation needs to be initialized under a condition in which the zero point of yaw, pitch and roll represents straight-ahead head direction as gaze zone 3. Due to each driver having his or her distinct head behavior when he/she turns face to the fixed gaze zone, we calibrate the head pose in one time when the driver looks the windshield region at a specific direction. There are some error degrees about 0.7 to + 0.6 in yaw, 0.3 to + 0.3 in pitch and 0.4 to + 0.3 in roll. This initialization is performed using the first 100 frames, and the center point is determined by a weighted average of estimated head pose. Typically, the personalized head pose values for each gaze zone are stabilized. The nine calibrated head poses and their corresponding gaze zone are shown in Figure 9. The gaze zone index is displayed above the templates, and the head pose angle in Euclidean angle space is shown under the template in Euler angle (yaw, pitch, roll).

3.2. Results of Head Pose Estimation

The head pose template data for each gaze zone is generated with calibrated head pose values. We collected a standard data set of head poses for each gaze zone using a head motion sensor. Our estimated angle degree of head pose was multiplied by an expanded coefficient. The motion-sensor ground-truth data were then used to compare with the head pose computed using our algorithms. Driver head pose referring to our gaze zone are focused on areas which yaw ranges from −60 degree to +60 degree, pitch ranges from −45 degree to +45 degree and roll ranges from −10 degree to +10 degree. Figure 10 shows the tracking errors for randomly selected data segments as an example. This figure indicates that the estimation of yaw has a little large error rate than other two items, because driver rotates large angle in this dimension.
Since we apply it in a real driving environment, therefore, the tolerance error range is considered based on the gaze zone estimation. For different gaze zones, statistical results are counted (See Table 2). In this table, AME means Average Mean Error, VAR represents variance which demonstrates the derivation degree of mean error and SDR is acronyms of Success Detection Rate which is the characterization of acceptance rates in the range of tolerance. The acceptance values of yaw, pitch and roll are the estimation values whose absolute errors do not exceed the corresponding threshold (5, 2, 2 degrees for yaw, pitch and roll respectively). In Table 2, the estimation of gaze zone 1 and gaze zone 2 does not exhibit a greater stability on the edge of yaw and pitch. However, the estimations of gaze zone 6 are surrounded by more gaze zone which takes the advantages of multiple information fusion contributed by estimation of other six gaze zone. Gaze zone 3 with highest frequency is the zone when driver looks straight ahead. So, it has the highest SDR for less change of head pose.
Figure 11 shows the visualization of accuracy rates that have been partitioned into 15 × 15 degrees squared regions in two-dimensional head pose (yaw and pitch). The square’s color denotes total number of frames which falls into the particular region. Since the drivers always put their attention on the road (gaze zone 3), two on-road squared regions have the most amount of frames, other squared regions have less frames. Comparing with Ref. [19], our results have a good accuracy around the zero points of head pose, and a low dynamics range of head pose, due to the multi-zone templates at particular head pose and the driving behaviour in the real-world scenarios.
When drivers turn their head from left to right in yaw, angle velocity of the head movements is really high per second. Table 3 shows the mean absolute error of head pose estimation at different head motions. All head movements that slower than 0.3 radians can be recognized as small rotation, any other measured head angle velocities are large rotation. It can be remarked that our work demonstrates the continuous head pose estimation using RGB-D sensor for natural and on-road driving. Previous works provide short-session or pre-arranged on-road evaluation [18,19]. Although the mean errors presented in these papers are less than our work’s results, it is worth noting that the evaluation performed on a head pose-free natural active driving scenario is a more practical solution to driver’s eye gaze problems. In addition, the particle filter tracking for a driver’s head state can cope with high rotation angle velocities in both yaw, pitch and roll directions.
In the evaluation, our system also has some limitations: under complex light conditions, frequent non-uniform illumination changes may result in the incomplete face region of a three-dimensional point-cloud, so the template registration processing is greatly disturbed and the head pose cannot be accurately estimated. As in Ref. [18], the sunlight sensitivity is common for vision-based systems.

3.3. Results of Gaze Estimation

While the head pose estimation is applied on the 3D point-cloud that derives from the depth data, the gaze estimation is mainly performed on the RGB data. The human eye images are cropped from the whole face images under natural illumination after facial landmark detection and anthropometry computation, and 5000 frames valid data has been retained. The cropped low-resolution human eye image are shown in Figure 12. To test the effectiveness of the proposed appearance-based gaze estimation method, some baseline appearance-based methods and model-based methods are compared on three-fold cross-validation. To be fair, all methods are compensated with the same head pose estimation (See in Section 2.1). Among them, ALR (Adaptive Linear Regression) [40] and CALR (Coupled ALR) [31] are solved using 100 selected images. The methods based on modified RF and SVR are classically trained on all training data. EGM (3D Eye Gaze model) [10] is a model-based method, and computes the gaze angle on the 3D eye model based on detected pupil center and eye center.
Table 4 depicts the results of gaze estimation with head pose compensation, and from it, it is clear that the overall gaze estimation performance for our method is better than that for other baseline methods. As expected, the appearance-based methods have certain tolerance level to non-uniform illumination, but when the light gets low, it is hard to generate discriminated features from the RGB image, due to its all values are tends to be zeros. Actually, if some eye images under dark light are exist in the training data, the performance of the appearance-based methods will be much better. However, it is much harder for model-based method to locate the pupil center or iris center, which makes the model-based method unstable under difference head pose variations and illumination variations.

3.4. Analysis of Gaze Zone Frequency

This part reports the experimental results of gaze zone frequency and transfer probability. Note that in a real car scenario, driver gaze zone frequency represents the state of a driver’s attention off/on the road for visual distraction, and the transfer probability provides the driver’s probable gaze zone in the next frame or motion, depicts the driver’s driving behavior habit in a temporal context. The frequencies of different driver gaze zones during driving is analyzed in Table 5. It can be seen that the gaze zone 3 (bottom left region of windshield) cases have the highest frequencies both on estimation with head pose solely, and with head pose and gaze pose. The other gaze zones with high frequency are gaze zone 2 (right mirror), gaze zone 1 (left mirror) and gaze zone 4 (rear-view mirror), which are in-car components that drivers often look at. This is consistent with the characteristics in real driving conditions. Note that the frequencies of gaze zone 1 and gaze zone 2 are almost the same. In addition, the gaze zone 9 is with the lowest frequency of gaze, because in the case of driving, it is a place that the drivers seldom glance at. In Table 5, it is clear that the gaze zone frequencies are similar between the estimation with gaze pose and without gaze pose. More specifically, the index of gaze zone with highest frequency is the same and other gaze zones’ frequencies are slightly changes. The frequency of gaze zone 3 is too large in estimation without gaze pose, when joint the gaze pose and head pose, the frequencies of its neighbor gaze zone are increased. The main reason for this is that during driving, the driver will use more eye movement while looking ahead. However, the gaze zone estimation systems with only head pose usually ignore this situation and put focus on coarse gaze directions. Therefore, the combination of head pose estimation and gaze estimation for gaze zone classification is more reasonable and accurate.
Figure 13 provides a statistical analysis of the transfer probability between different gaze zones of 50,000 frame data from natural and on-road driving. Here, the transfer probability is defined as the frequencies of gaze zone when driver’s attention convert from current image frame to next image frame. In Figure 13, the directions that those arrows point to, are the probable gaze zone for next frame, and the numbers range in [ 0 , 1 ] are the corresponding probability values. For example, the probability in gaze zone 1 that remains itself is 0.9190, and that transfers to gaze zone is 0.0757, and that goes to gaze zone 7 is 0.0053. Generally, driver will look at each predefined gaze zone during a period of few seconds, resulting in many frames duration of the self transfer. Overall, most of gaze zones have high transfer probability to gaze zone 3 except themselves. This is a quick gaze return to the on-road gaze zone after viewing other gaze zones. It should also be noted that the gaze zone 4 to gaze zone 5 is a single-way transfer, that is, the driver never look at gaze zone 4 after gaze zone 5. When the driver’s gaze stays in a certain gaze zone for a long time, the driving assistance system could alarm the distraction state of the driver by the dynamic transfer probability of the gaze zone.

4. Conclusions

In this paper, we introduce an application-oriented solution for continuous driver gaze zone estimation systems, using multi-zone ICP-based point-cloud alignment for head pose estimation and two-stage neighbor selection for appearance-based eye gaze estimation. To accelerate the convergence speed of the ICP iteration, we utilize multi-zone templates and particle filter tracking to initialize and update the best transformation of source face template. Based on the characteristic features of head pose, and eye images, we apply a cascaded structure for a neighbor selection framework to select the nearest neighbor data that is more similar to the test head pose and eye images. Then, through the local regression of selected nearest neighbor data, a gaze estimation model is built for current gaze angle prediction. With the described solution, head orientation and gaze angle are calculated, and the gaze zone is determined by the gaze angle with head pose compensation. Our system has a reliable performance on head pose tracking and gaze estimation, making it applicable for in-vehicle driver monitoring applications. In the future, we hope to improve the accuracy of appearance-based gaze estimation in real driving environments, and to perform another study on cross-subject gaze zone estimation.

Author Contributions

Y.W., and G.Y. conceived and designed the experiments; Y.W., and Z.M. performed the experiments; X.D., J.P., and Z.L. analyzed the data; Y.W., and X.F. wrote the paper.

Funding

This work was supported in part by the National Natural Science Foundation of China Grant 61802043, Grant 61370142 and Grant 61272368, by the Fundamental Research Funds for the Central Universities Grant 3132016352.

Acknowledgments

The authors sincerely thank the editors and anonymous reviewers for the very helpful and kind comments to assist in improving the presentation of our paper. The authors would like to thank Xueyu Geng, Tianyi Shen for their scientific collaboration in this research work.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Zhao, Y.; Görne, L.; Yuen, I.M.; Cao, D.; Sullman, M.; Auger, D.; Lv, C.; Wang, H.; Matthias, R.; Skrypchuk, L.; et al. An orientation sensor-based head tracking system for driver behaviour monitoring. Sensors 2017, 17, 2692. [Google Scholar] [CrossRef] [PubMed]
  2. Reyes-Mu noz, A.; Domingo, M.; López-Trinidad, M.; Delgado, J. Integration of body sensor networks and vehicular ad-hoc networks for traffic safety. Sensors 2016, 16, 107. [Google Scholar] [CrossRef] [PubMed]
  3. Zhang, X.; Li, J.; Liu, Y.; Zhang, Z.; Wang, Z.; Luo, D.; Zhou, X.; Zhu, M.; Salman, W.; Hu, G.; et al. Design of a fatigue detection system for high-speed trains based on driver vigilance using a wireless wearable EEG. Sensors 2017, 17, 486. [Google Scholar] [CrossRef] [PubMed]
  4. Zhang, Z. Microsoft kinect sensor and its effect. IEEE Multimed. 2012, 19, 4–10. [Google Scholar] [CrossRef]
  5. Dong, Y.; Hu, Z.; Uchimura, K.; Murayama, N. Driver inattention monitoring system for intelligent vehicles: A review. IEEE Trans. Intell. Transp. Syst. 2011, 12, 596–614. [Google Scholar] [CrossRef]
  6. Murphy-Chutorian, E.; Trivedi, M.M. Head pose estimation in computer vision: A survey. IEEE Trans. Pattern Anal. Mach. Intell. 2009, 31, 607–626. [Google Scholar] [CrossRef] [PubMed]
  7. Hansen, D.; Ji, Q. In the eye of the beholder: A survey of models for eyes and gaze. IEEE Trans. Pattern Anal. Mach. Intell. 2010, 32, 478–500. [Google Scholar] [CrossRef] [PubMed]
  8. Vasli, B.; Martin, S.; Trivedi, M.M. On driver gaze estimation: Explorations and fusion of geometric and data driven approaches. In Proceedings of the IEEE 19th International Conference on Intelligent Transportation Systems (ITSC), Rio de Janeiro, Brazil, 1–4 November 2016. [Google Scholar]
  9. Tawari, A.; Martin, S.; Trivedi, M.M. Continuous head movement estimator for driver assistance: Issues, algorithms, and on-road evaluations. IEEE Trans. Intell. Transp. Syst. 2014, 15, 818–830. [Google Scholar] [CrossRef]
  10. Tawari, A.; Chen, K.H.; Trivedi, M.M. Where is the driver looking: Analysis of head, eye and iris for robust gaze zone estimation. In Proceedings of the IEEE 17th International Conference on Intelligent Transportation Systems (ITSC), Qingdao, China, 8–11 October 2014. [Google Scholar]
  11. Vicente, F.; Huang, Z.; Xiong, X.; de la Torre, F.; Zhang, W.; Levi, D. Driver gaze tracking and eyes off the road detection system. IEEE Trans. Intell. Transp. Syst. 2015, 16, 2014–2027. [Google Scholar] [CrossRef]
  12. Fridman, L.; Lee, J.; Reimer, B.; Victor, T. ‘Owl’ and ‘Lizard’: Patterns of head pose and eye pose in driver gaze classification. IET Comput. Vis. 2016, 10, 308–314. [Google Scholar] [CrossRef]
  13. Jung, D.; Lee, J.M.; Gwon, S.Y.; Pan, W.; Lee, H.C.; Park, K.R.; Kim, H.C. Compensation method of natural head movement for gaze tracking system using an ultrasonic sensor for distance measurement. Sensors 2016, 16, 110. [Google Scholar] [CrossRef]
  14. Pan, W.; Jung, D.; Yoon, H.S.; Lee, D.E.; Naqvi, R.A.; Lee, K.W.; Park, K.R. Empirical Study on Designing of Gaze Tracking Camera Based on the Information of User’s Head Movement. Sensors 2016, 16, 1396. [Google Scholar] [CrossRef]
  15. Lee, H.C.; Lee, W.O.; Cho, C.W.; Gwon, S.Y.; Park, R.R.; Lee, H.; Cha, J. Remote gaze tracking system on a large display. Sensors 2013, 13, 13439–13463. [Google Scholar] [CrossRef]
  16. Chen, Y.; Medioni, G. Object modeling by registration of multiple range images. In Proceedings of the IEEE International Conference on Robotics and Automation (ICRA), Sacramento, CA, USA, 9–11 April 1991. [Google Scholar]
  17. Besl, P.J.; McKay, N.D. Method for registration of 3-D shapes. In Sensor Fusion IV: Control Paradigms and Data Structures; SPIE: Bellingham, WA, USA, 1992; pp. 586–607. [Google Scholar]
  18. Peláez, C.G.A.; García, F.; de la Escalera, A.; Armingol, J.M. Driver monitoring based on low-cost 3-D sensors. IEEE Trans. Intell. Transp. Syst. 2014, 15, 1855–1860. [Google Scholar] [CrossRef]
  19. Bär, T.; Reuter, J.F.; Zöllner, J.M. Driver head pose and gaze estimation based on multi-template icp 3-d point-cloud alignment. In Proceedings of the IEEE 15th International Conference on Intelligent Transportation Systems (ITSC), Anchorage, AK, USA, 16–19 September 2012. [Google Scholar]
  20. Funes-Mora, K.A.; Odobez, J. Gaze estimation in the 3d space using rgb-d sensors. Int. J. Comput. Vis. 2016, 118, 194–216. [Google Scholar] [CrossRef]
  21. Li, S.; Ngan, K.N.; Sheng, L. A head pose tracking system using RGB-D camera. In Proceedings of the International Conference on Computer Vision Systems, St. Petersburg, Russia, 16–18 July 2013; pp. 153–162. [Google Scholar]
  22. Padeleris, P.; Zabulis, X.; Argyros, A.A. Head pose estimation on depth data based on particle swarm optimization. In Proceedings of the IEEE Conference on Computer Vision and Pattern Recognition Workshops (CVPRW), Providence, RI, USA, 16–21 June 2012. [Google Scholar]
  23. Fanelli, G.; Gall, J.; Van Gool, L. Real time head pose estimation with random regression forests. In Proceedings of the IEEE Conference on Computer Vision and Pattern Recognition (CVPR), Colorado Springs, CO, USA, 20–25 June 2011. [Google Scholar]
  24. Fanelli, G.; Weise, T.; Gall, J.; Van Gool, L. Real time head pose estimation from consumer depth cameras. In Proceedings of the Joint Pattern Recognition Symposium, Frankfurt, Germany, 31 August–2 September 2011; pp. 101–110. [Google Scholar]
  25. Breitenstein, M.D.; Kuettel, D.; Weise, T.; Van Gool, L.; Pfister, H. Real-time face pose estimation from single range images. In Proceedings of the IEEE Conference on Computer Vision and Pattern Recognition (CVPR), Anchorage, AK, USA, 23–28 June 2008. [Google Scholar]
  26. Saeed, A.; Al-Hamadi, A.; Ghoneim, A. Head pose estimation on top of haar-like face detection: A study using the kinect sensor. Sensors 2015, 15, 20945–20966. [Google Scholar] [CrossRef]
  27. Ghiass, R.S.; Arandjelovic, O. Highly accurate gaze estimation using a consumer RGB-depth sensor. arXiv, 2016; arXiv:1604.01420. [Google Scholar]
  28. Wang, K.; Ji, Q. Real time eye gaze tracking with Kinect. In Proceedings of the IEEE International Conference on Pattern Recognition (ICPR), Cancun, Mexico, 4–8 December 2016. [Google Scholar]
  29. Cazzato, D.; Leo, M.; Distante, C. An investigation on the feasibility of uncalibrated and unconstrained gaze tracking for human assistive applications by using head pose estimation. Sensors 2014, 14, 8363–8379. [Google Scholar] [CrossRef]
  30. Mora, K.A.F.; Odobez, J. Gaze estimation from multimodal kinect data. In Proceedings of the IEEE Conference on Computer Vision and Pattern Recognition Workshops (CVPRW), Providence, RI, USA, 16–21 June 2012. [Google Scholar]
  31. Mora, K.A.F.; Odobez, J. Person independent 3d gaze estimation from remote rgb-d cameras. In Proceedings of the IEEE International Conference on Image Processing (ICIP), Melbourne, Australia, 15–18 September 2013. [Google Scholar]
  32. Viola, P.; Jones, M.J. Robust real-time face detection. Int. J. Comput. Vis. 2004, 57, 137–154. [Google Scholar] [CrossRef]
  33. Rusu, R.B.; Cousins, S. 3d is here: point-cloud library (pcl). In Proceedings of the IEEE International Conference on Robotics and automation (ICRA), Shanghai, China, 9–13 May 2011. [Google Scholar]
  34. Park, S.; Subbarao, M. An accurate and fast point-to-plane registration technique. Pattern Recognit. Lett. 2003, 24, 2967–2976. [Google Scholar] [CrossRef]
  35. Cappé, O.; Godsill, S.J.; Moulines, E. An overview of existing methods and recent advances in sequential Monte Carlo. Proc. IEEE 2007, 95, 899–924. [Google Scholar] [CrossRef]
  36. Murphy-Chutorian, E.; Trivedi, M.M. Head pose estimation and augmented reality tracking: An integrated system and evaluation for monitoring driver awareness. IEEE Trans. Intell. Transp. Syst. 2010, 11, 300–311. [Google Scholar] [CrossRef]
  37. Wang, Y.; Zhao, T.; Ding, X.; Peng, J.; Bian, J.; Fu, X. Learning a gaze estimator with neighbor selection from large-scale synthetic eye images. Knowl.-Based Syst. 2018, 139, 41–49. [Google Scholar] [CrossRef]
  38. Alin, A. Comparison of PLS algorithms when number of objects is much larger than number of variables. Stat. Pap. 2009, 50, 711–720. [Google Scholar] [CrossRef]
  39. Huang, D.Y.; Zhang, Z.; Ge, S.S. Speaker state classification based on fusion of asymmetric simple partial least squares (SIMPLS) and support vector machines. Comput. Speech Lang. 2014, 28, 392–419. [Google Scholar] [CrossRef]
  40. Lu, F.; Sugano, Y.; Okabe, T.; Sato, Y. Adaptive linear regression for appearance-based gaze estimation. IEEE Trans. Pattern Anal. Mach. Intell. 2014, 36, 2033–2046. [Google Scholar] [CrossRef]
  41. Wang, Y.; Shen, T.; Yuan, G.; Bian, J.; Fu, X. Appearance-based gaze estimation using deep features and random forest regression. Knowl.-Based Syst. 2016, 110, 293–301. [Google Scholar] [CrossRef]
  42. Martinez, F.; Carbone, A.; Pissaloux, E. Gaze estimation using local features and non-linear regression. In Proceedings of the 19th IEEE International Conference on Image Processing (ICIP), Orlando, FL, USA, 30 September–3 October 2012. [Google Scholar]
Figure 1. (a) Exterior appearance of RGB-D camera (Kinect v1) [4], and corresponding RGB-D data (b,c) obtained by it.
Figure 1. (a) Exterior appearance of RGB-D camera (Kinect v1) [4], and corresponding RGB-D data (b,c) obtained by it.
Sensors 19 01287 g001
Figure 2. Overview of the proposed system.
Figure 2. Overview of the proposed system.
Sensors 19 01287 g002
Figure 3. Point-cloud at different distance: (a) in-door, (b) in-vehicle.
Figure 3. Point-cloud at different distance: (a) in-door, (b) in-vehicle.
Sensors 19 01287 g003
Figure 4. Point-to-Plane nearest neighbor search for point-cloud alignment.
Figure 4. Point-to-Plane nearest neighbor search for point-cloud alignment.
Sensors 19 01287 g004
Figure 5. Three degrees of freedom of head pose.
Figure 5. Three degrees of freedom of head pose.
Sensors 19 01287 g005
Figure 6. Head state tracking by particle filter.
Figure 6. Head state tracking by particle filter.
Sensors 19 01287 g006
Figure 7. Appearance-based gaze estimation using neighbor selection.
Figure 7. Appearance-based gaze estimation using neighbor selection.
Sensors 19 01287 g007
Figure 8. Driver gaze zone partition in real driving environment.
Figure 8. Driver gaze zone partition in real driving environment.
Sensors 19 01287 g008
Figure 9. Point-cloud templates of different gaze zone.
Figure 9. Point-cloud templates of different gaze zone.
Sensors 19 01287 g009
Figure 10. Comparisons of GT (Ground-truth) and predicted head pose value on (a) yaw, (b) pitch, and (c) roll.
Figure 10. Comparisons of GT (Ground-truth) and predicted head pose value on (a) yaw, (b) pitch, and (c) roll.
Sensors 19 01287 g010
Figure 11. Head pose success classification rate for 5 degrees tolerance.
Figure 11. Head pose success classification rate for 5 degrees tolerance.
Sensors 19 01287 g011
Figure 12. Example eye images.
Figure 12. Example eye images.
Sensors 19 01287 g012
Figure 13. Transfer probability between different driver gaze zone.
Figure 13. Transfer probability between different driver gaze zone.
Sensors 19 01287 g013
Table 1. Review of driver gaze zone Estimation Methods/Systems Using an RGB-D Camera.
Table 1. Review of driver gaze zone Estimation Methods/Systems Using an RGB-D Camera.
Research StudyHead Pose
(HP)
Gaze
(GA)
Gaze Zone
Estimation
Datasets
Resolution
Peláez C. et al.
[18]
Yaw, Pitch, Roll
(ICP + Alignment )
-HPContinuous
Bär et al.
[19]
Yaw, Pitch
(Multi-template ICP + Alignment)
Yaw, Pitch
(Eye Model)
HP + GADiscrete
This studyYaw, Pitch, Roll
(Multi-zone ICP + Alignment)
Yaw, Pitch, Roll
(Appearance)
HP + GAContinuous
Table 2. Statistical Results for Head Pose Estimation.
Table 2. Statistical Results for Head Pose Estimation.
Gaze ZoneYawPitchRoll
AME ( deg . ) VAR SDR ( % ) AME ( deg . ) VAR SDR ( % ) AME ( deg . ) VAR SDR ( % )
15.2723.15988.832.4112.08588.672.4552.33487.16
25.2543.27388.782.6522.38687.352.5462.46287.60
34.3702.58594.541.7901.50492.541.7241.04193.91
44.7722.58292.372.5562.12489.262.4722.42788.34
54.6822.53791.812.4302.42787.852.5272.46087.41
64.5762.18993.222.4751.94589.461.6461.93492.66
74.6212.98291.472.0832.05790.452.3342.43588.63
85.0822.96492.222.5462.02489.702.2342.51689.14
95.1563.02291.872.7232.08388.452.3622.41188.77
AME: Absolute Mean Error, VAR: Variance, SDR: Success Detection Rate of gaze zone.
Table 3. The Mean Absolute Error of head pose estimation at different head motions.
Table 3. The Mean Absolute Error of head pose estimation at different head motions.
Head StateYaw ( deg . ) Pitch ( deg . ) Roll ( deg . )
Small Rotation (Proposed)3.9341.6521.425
Large Rotation (Proposed)5.7972.5622.848
Overall (Proposed)4.4931.9251.852
Peláez C. et al. [18]3.72.12.9
Table 4. The Mean Absolute Error of gaze estimation using head pose and gaze angle.
Table 4. The Mean Absolute Error of gaze estimation using head pose and gaze angle.
Methods AME ( deg . )
Head pose, HOG + Modified RF [41]8.0234
Head pose, HoG + SVR [42]8.7216
Head pose, ALR [40]12.723
Head pose, CALR [31]10.39
Head pose, EGM [10]9.58
Head pose, PLSR (Proposed)7.5682
Table 5. Frequency value of each gaze zone estimation.
Table 5. Frequency value of each gaze zone estimation.
Gaze Zone
No.
Frequency only
with Head Pose (%)
Frequency with both Head
Pose and Gaze Angle (%)
15.24.5
24.94.7
381.274.4
43.54.4
52.14.0
61.62.8
70.51.4
80.93.1
90.10.7

Share and Cite

MDPI and ACS Style

Wang, Y.; Yuan, G.; Mi, Z.; Peng, J.; Ding, X.; Liang, Z.; Fu, X. Continuous Driver’s Gaze Zone Estimation Using RGB-D Camera. Sensors 2019, 19, 1287. https://doi.org/10.3390/s19061287

AMA Style

Wang Y, Yuan G, Mi Z, Peng J, Ding X, Liang Z, Fu X. Continuous Driver’s Gaze Zone Estimation Using RGB-D Camera. Sensors. 2019; 19(6):1287. https://doi.org/10.3390/s19061287

Chicago/Turabian Style

Wang, Yafei, Guoliang Yuan, Zetian Mi, Jinjia Peng, Xueyan Ding, Zheng Liang, and Xianping Fu. 2019. "Continuous Driver’s Gaze Zone Estimation Using RGB-D Camera" Sensors 19, no. 6: 1287. https://doi.org/10.3390/s19061287

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

Article Metrics

Back to TopTop