1,631
Views
1
CrossRef citations to date
0
Altmetric
Research Article

UKF-based enhancement and ROS implementation of 4-WDDMR localization with advanced control system

& | (Reviewing editor)
Article: 1481561 | Received 28 Mar 2018, Accepted 23 May 2018, Published online: 09 Jul 2018

Abstract

This article exhibits integration of nonholonomic four-wheeled differential drive mobile robot platform (4-WDDMR) implemented using an Arduino Mega 2560 microcontroller and robot operating system. Particularly, estimating the current situation of the robot navigation system is complex thanks to uncertainty exerted by the robot incorporated with actuators complexities and nonlinearities. An efficient and accurate estimation technique which applies probabilistic algorithm based Unscented Kalman Filter is proposed. The stability of 4-WDDMR Control-Navigation system has been tested and improved based on Lyapunov criterion. The proposed techniques are implemented and evaluated using MATLAB/SIMULINK®. Both practical and simulation results demonstrate the vitality of the proposed Control-Navigation approach. It is believed that the proposed approaches will help to build an autonomous robotics system that can assist humans with their works in daily life basis.

PUBLIC INTEREST STATEMENT

The popularity of using robots as alternatives to human beings in the real world is becoming more common nowadays, especially in industry, medicine, entertainment, and military. These robots need means to think and to mimic the natural behavior of people. In this article, an artificial intelligence method is proposed to give robots thinking ability to find their way in buildings. The method presented is based on the Bees Algorithm which simulates foraging behavior of real honey bees. The proposed method is implemented as a computer program designed to find the shortest path in a building. This path is planned in a way to avoid collision with stationary barriers and moving objects such as other robots.

1. Introduction

Mobile Robot Localization is a key issue in which high dynamic performance control becomes a vital requirement to ensure correct trajectory tracking with high degree of belief (DoB). One of the most efficient technique used to correct the robot localization is the Extended Kalman the Filter (EKF) (Klančar, Teslić, & Škrjanc, Citation2013; Panich & Afzulpurkar, Citation2011). The important drawback of EKF is that, it uses a linearized dynamic model, which leads to bias correction and ignoring the robot uncertainty. However, vision sensor is proposed in (Negenborn, Citation2003), it is aimed to assist the system to be localized correctly at a predefined location, (Al-Araji, Abbod, & Al-Raweshidy, Citation2012; Zhao et al., Citation2012) consider robot proprioceptive sensors with as pure measured signals as possible, which enable to determine correctly the robot posture. Small signal stability analysis is taken into consideration to investigate the robot stability when the system uncertainty is exhibited. Higher uncertainty degree in the dynamic and kinematic model prone on the robot, the EKF-Localization system failed to define the real posture and the robot DoB is not more trusted (Thrun, Fox, & Burgard, Citation2005). To overcome this limitation, Unscented Kalman Filter (UKF) based on Unscented Transform (UT) has been developed as a method to estimate the robot posture (Houshangi & Azizi, Citation2005). This article introduces a novel 4-WDDMR Control-Navigation approach using UKF-assisted Adaptive Optimal Controller (Adaptive-Linear Quadratic Regulator, Adaptive-LQR). The system stability has been tested and improved based on Lyapunov criterion. The fusion sensors consisted of a gyroscope and noisy odometry sensors were used. It is assumed also, that the 4-WDDMR model is considered highly uncertain. Intensive results have shown that the estimated robot posture based on UKF are more precise than those obtained from EKF in spite of huge uncertainty imposed to the 4-WDDMR. Finally, a practical system implementation based on ROS, the most trending and popular robotic framework in the world (O’Kane, Citation2014) and Arduino board has been developed. The practical results were coincided with those obtained from MATLAB models and C augmented programs for Adaptive-LQR control technique as well as for UKF. The remaining sections of the paper are as follows: Section II provides details about hardware overview of the mobile robot platform and explains the model of the mobile robot combining the actuators dynamics; Section III discusses mobile robot localization based on UKF as a probabilistic inference solution; Section IV provides the stability of the proposed controller for the kinematic and dynamic systems; Section V exhibits intensive simulation results of UKF performance with high uncertainty of system’s parameters; Section VI explains the system implementation and practical results based ROS system and Arduino board, and section VII provides a conclusion for the presented work.

2. 4-WDDMR modeling

The diagram of the 4-WDDMR, shown in Figure , consists of a wheeled robot with four driving wheels mounted with 4-DC geared motors and two channels Hall Effect incremental encoders. The 4-WDDMR platform is implemented with an Arduino Mega 2560 board for low-level robot control.

Figure 1. Diagram of the 4-WDDMR.

Figure 1. Diagram of the 4-WDDMR.

The orientation of the robot is determined using the angular velocities of left and right wheels “that is” differential drive system. The wheels in the same side are operated together using (L298N H-Bridge Module). To measure the robot’s orientation angle θ around the Z-axis, a three-axis gyroscope sensor communicated with Arduino via I2C Bus is used. The Onboard robot system is connected with PC-based Offboard robot system via RF 433 MHz. The parameters of 4-WDDMR and actuators are listed in Table .

Table 1. 4-WDDMR model parameters

As seen from Figure , the robot’s location is determined in its environment based on two coordinated frames; namely, Global Frame and Local Frame (Dhaouadi & Abu Hatab, Citation2013). C is the center of mass of the 4-WDDMR’s and A is the middle point between the two back wheels. Let PL=XALYALθT is the robot posture represented in {L} frame and PG=XAGYAGθT is the robot posture represented in {G} frame. It is considered that the wheels do not slide “that is” nonholonomic constraint (Siegwart & Noubakhsh, Citation2004).

Figure 2. 4-WDDMR coordinates systems.

Figure 2. 4-WDDMR coordinates systems.

xA & yA are the coordinates of point A, and θ is the robot’s orientation angle sensed between the moving direction of XG (Dhaouadi & Abu Hatab, Citation2013). The Kinematic of 4-WDDMR can be described as (1):

(1) x˙CGy˙CGθ˙CG=cos(θ)dsin(θ)sin(θ)dcos(θ)01νω=Gνω(1)

The dynamic model of a nonholonomic 4-WDDMR is given in (2) as follows (Dhaouadi & Abu Hatab, Citation2013):

(2) M(q)q¨+V(q,q˙)q˙+G(q)+F(q˙)+τd=B(q)τΛT(q)λ(2)

Where M(q)n×n is an inertia matrix, must be definite, V(q,q˙)n is the Centripetal and Coriolis matrix, G(q)n is the Gravitational vector, F(q˙)n is the Friction Surface matrix, τd is the bounded unknown disturbance vector, B(q)n×r is the Input Transformation matrix, τ=τRτLTr is the Input Actuator’s Torques vector which act on the right and left wheels, ΛT(q)m×n is the Kinematic Constraints Associated matrix, λm is the Constraint Forces vector, n is the robot coordinates number, r is the inputs number and mis the constraints number. G(q) is equal to zero since the robot base constrained the horizontal plane. For a real 4-WDDMR, the torque vector τ is produced by electromechanical actuators. A common and simplified dynamic model of a permanent magnet DC motor with gear train is given as follows (3), (Kelly, Santibanez, & Loria, Citation2006):

(3) τ=N2CmφNRauJmq¨fm+Cmφ2Raq˙(3)

Where q[rad] is the angular position of the wheel.

Thus, the integrated dynamic model of a 4-WDDMR considering friction in the wheels and having its actuators is obtained by substituting τ from (3) in (2):

(4) (NM(q)+J)q¨+N(V(q,q˙)+B)q˙+NG(q)+NF(q˙)+τd=K(q)uΛT(q)λ(4)

However, the information of the robot location obtained from the Odometry-based Onboard sensors is subject to different types of accumulated errors and uncertainties over time due to the nature of process. There are two main errors categories: Deterministic and Non-Deterministic (Siegwart & Noubakhsh, Citation2004). The major position error sources that cannot be detected by Odometry are misalignment of the wheels, unequal wheel diameter, limited resolution during integration and other random errors affected by the environment, this errors represented by σp. Thus, the real increment posture of 4-WDDMR Pk=xkykθkT becomes (5):

(5) Pk=Pk1+ΔP+σP(5)

For this propose, UKF was implemented based on the kinematic model of the robot to determine the real posture precisely (Houshangi & Azizi, Citation2005).

3. Perception and localization-based UKF

In the present section, a novel approach for localization-based UKF-fusion sensors have been investigated successfully. The problem of navigation can be summarized into answering four questions (Liu, Citation2010): “Where am I?” which is the Localization problem, “What does the word look like?,” “Where am I going?,” and “How should I get there?”

Accurate Localization is regarded as fulfilling a major precondition of trusty autonomous robots (Thrun et al., Citation2005). Whenever the robot acts in real world, it needs to be able to deal with errors and uncertainty. In literature, researchers have developed a variety of localization techniques depending on the robot’s perception system “that is” sensors (Thrun et al., Citation2005).

Probabilistic Inference or Bayesian rule are a common way to deal with this problem by representing the robot’s posture xk at sample time k with probability distributions p(xk) (Negenborn, Citation2003).

Being able to estimate the posterior probability distributions of the 4-WDDMR’s posture is useful for many robotics problem (Negenborn, Citation2003). For this purpose, Kalman Filter Framework (KF)-based Gaussian approximate solution was implemented as a practically implementable Optimal Recursive State Estimator for a known 4-WDDMR kinematic model (Houshangi & Azizi, Citation2005). It is proposed that the robot is equipped with encoders and exteroceptive sensors as shown in Figure .

Figure 3. Block diagram of fusion sensors.

Figure 3. Block diagram of fusion sensors.

Nonlinearity errors can lead to poor EKF performance or to divergence (Kandepu, Foss, & Imsland, Citation2008; Sarkka, Citation2011). Jacobians does not allow correct state and measurements Covariance matrices propagation in presence of significant dynamic conditions (Rhudy, Gu, & Napolitano, Citation2013). To overcome such limitations, UKF Algorithm has been developed and verified with the present of uncertainties.

UKF is derived based on UT to capture the posterior mean Xˉ and covariance P to the third order of nonlinear system (Sarkka, Citation2011). First, a set of Sigma points are voted to express the probability distribution. The nonlinear function is then applied to each Sigma point. Hence, the results provide a set of transformed points with the mean and covariance (Merwe, Citation2004).

UKF is computationally more costly than EKF, but it reduces estimation errors. One of the advantages of UKF over EKF is that it does not need to drive the Jacobian matrices (Rhudy et al., Citation2013). In order to apply UKF as a localization algorithm (Sarkka, Citation2011), a discrete time model for the 4-WDDMR navigation with sampling time Ts is given by (6):

(6) xkykθk=Tsrω2cos(θk)cos(θk)sin(θk)sin(θk)1L1LωRkωLk+xk1yk1θk1(6)

Where the robot posture x=xkykθkT is the state vector and the input vector is the angular velocities of the right and left wheelsu=ωRkωLkT. The UKF algorithm includes three main stages as shown in Figure (Merwe, Citation2004).

  • Initialize the State Space vector and Covariance matrix (7):

(7) χ0=[x000]TPk1=P0000Q000R(7)
  • Action (or Prediction) update:

Figure 4. UKF recursive algorithm.

Figure 4. UKF recursive algorithm.

The following operations are performed on each time (k):

  1. Form (2n+1) weighed Sigma points as follows (8):

(8) χk1=[xk1xk1+γPk1xk1γPk1]T(8)

Where γ is a scalar parameter.

  • (2) Transfer the Sigma points over the 4-WDDMR Kinematic Model (9):

(9) χk=Ad(xk1)χk1+Bd(xk1)uk(9)
  • (3) Calculate the predicted Mean χˆk and Covariance Pχχ (10):

(10) χˆk=i=02nωm[i]χk[i]Pχχ=i=02nωc[i]χk[i]χˆkχk[i]χˆkT(10)

Where the weighs ωm[i],ωc[i] defined by the algorithm.

  • (4) Propagate Sigma points through the Measurements Model and calculate the predicted Mean zˆk, the predicted Covariance of the measurement Pzz, and the Cross-Covariance of the state and measurement Pχz(11):

(11) zˆk=i=02nωm[i]zk[i]Pzz=i=02nωc[i]zk[i]zˆkzk[i]zˆkTPχz=i=02nωc[i]χk[i]χˆkzk[i]zˆkT(11)
  • Perception update:

The 4-WDDMR corrects its posture by merging its belief with the probability of making exactly that observation (Kandepu et al., Citation2008). The UKF gain Kk is chosen to minimize the estimation errors and updated the Mean χˆk and Covariance Pχχ as follows (12):

(12) Kk=PχzPzz1χˆk=χˆk+Kk(zkzˆk)Pχχ=PχχKkPzzKkT(12)

4. System stability analysis

In the presence of uncertainties and disturbances, which increase the complexity of the control study, it is not always possible to obtain a control law ensuring the stability of the system with respect to precalculated trajectories (Kühne, Lages, & DaSilva, Citation2005).

Also due to its high nonlinearity and nonholonomic constrains, the control of a 4-WDDMR is very challenging. The state of the art of mobile robot control strategies employed can be found (Wang, Qu, Obeng, & Wu, Citation2007; Zhao et al., Citation2012). A complex analytically derived control law, which has significantly high computational accuracy and lead to minimum tracking error of mobile robot for different types of trajectories is proposed in (Al-Araji et al., Citation2012).

The authors’ previous work (Kass Hanna & Joukhadar, Citation2015), proposed a simple adaptive quadratic optimal predictive control approach for 4-WDDMR Kinematic Model. A LQR is implemented for the low-level control, which tracks the velocities commends given by the high-level controller. It has been shown that the dynamic control performance is high and robust to system uncertainty (Kass Hanna & Joukhadar, Citation2015). This section, the stability of the proposed control system studied in (Kass Hanna & Joukhadar, Citation2015) has been validated mathematically based on Lyapunov Criterion. As seen in Figure , the objective is to track a pre-calculated trajectory reference signal xdydθdT with the desired linear and angular velocities νdωdT by the robot platform. Therefore, the dynamic equations of tracking error based on the Kinematic Model (1) are as follows (13):

(13) e˙x=ydeθ+νdcos(θ)νcos(θd)e˙y=xdeθνdsin(θ)νsin(θd)e˙θ=eω=ωdω(13)

Where exeyeθT is the posture error vector of 4-WDDMR with respect to the global frame. The proposed velocities control low is given by (14):

(14) ν=Kxexcos(θd)+Kyeysin(θd)+νdω=Kθeθ+ωd(14)

Kx > 0,Ky > 0,Kθ > 0 are the optimal control gains. It should be noted that the control law was adapted along a desired orientation to avoid losing information about the 4-WDDMR motion (Kass Hanna & Joukhadar, Citation2015). Considering the following positive Lyapunov function (15):

(15) E=12ex2+ey2+eθ2(15)

The time derivative of E is given by (16):

(16) E˙=exe˙x+eye˙y+eθe˙θ(16)

Using the proposed control law (14), the time derivative of the Lyapunov function become (17):

(17) E˙=Kxex2cos2(θd)Kyey2sin2(θd)Kθeθ2(17)

The time derivative E˙is negative, then, using Lyapunov Criterion, the 4-WDDMR control system is stable (Gutierrez-Arias, Flores-Mena, Morin-Castillo, & Suarez-Ramier, Citation2011). The aforementioned velocities control law (14) is based on the Kinematic Model. It is necessary to design torque controllers for the 4-WDDMR based on the Dynamic Model. The Dynamic Model (4) can be formulated as follow (18) where x=νωT

(18) Mˉx˙+Cxˉ=uˉ(18)

Mˉ is the Inertia Mass Matrix and Cˉis the Coriolis Matrix satisfies the following skew-symmetric property (Wang, Citation2012):

(19) xT(Mˉ2Cˉ)x=0   xn(19)

The Control vector uˉopt has to be determined to minimize a selected cost function as follow (20):

(20) uˉopt=Koptxˉ(20)

To enhance the dynamic system behavior an integral LQR-based controller is proposed (Kass Hanna & Joukhadar, Citation2015).

The designed system has a configuration with inherent stability characteristics based Lyapunov approach (Gutierrez-Arias et al., Citation2011).

If the state vector xˉˆ was estimated then it needed to close the feedback loop of the nonlinear control system. UKF is proposed to compensate the uncertainty in the plant dynamic under control as shown in equation (21).

(21) .^x=(AKUKFCBKopt)x¯^(21)

Equ. (21) explains the existing of both the adaptive optimal controller gain vector and the UKF correction gain vector. Both have significant effect of the dynamic control performance in case they were not suitably tuned.

This results in precise state estimation of the nonlinear system and enables for high dynamic performance control

5. Simulation results

To demonstrate the effectiveness of the proposed Control-Navigation system, simulation has been performed for a 4-WDDMR using MATLAB/SIMULINK® and C code. The simulation validated by tracking 3DoFs desired flower shape path with 2m of diameter. The angular velocities at joint space level and using LQR controller and Cartesian space posture adaptive optimal controller were augmented with the proposed UKF-based localization system have been implemented. The system was tested with high degree of parametric uncertainty.

Figure shows the proposed system’s dynamic performance supported with EKF-Localization system. Figure -a was obtained assuming the presence of nondeterministic errors affected by the environment on 4-WDDMR as nonsmooth floor (bumps and holes), as seen the 4-WDDMR tracks the desired path with low DoB. Figure -b was conducted with the presence of deterministic errors in 4-WDDMR’s Dynamic and Kinematic parameter, as seen the divergence is very high and the DoB is null (the desired trajectory “blue,” the actual trajectory “red” and the ellipsoids is represent the uncertainty). The same system was reevaluated assuming the similar uncertainties in the 4-WDDMR model but using UKF-Localization system.

Figure 5. EKF-based path correction.

Figure 5. EKF-based path correction.

The results in Figure showed that the UKF decreased the drift in 4-WDDMR path and the Control-Navigation system enhanced the 4-WDDMR’s DoB along the trajectory.

Figure 6. UKF-based path correction.

Figure 6. UKF-based path correction.

6. Software architecture-based ROS

A software framework for a 4-WDDMR based on ROS is described in this section. ROS is a meta-open source operating system, which is designed for robots and runs on Linux (Quigley et al., Citation2008). ROS distribution used in this article is ROS Indigo which was released in 22 July 2014.

ROS provides libraries and tools such as hardware abstraction, message passing, device drivers, perception, visualizer, and more to help software developers create robot applications. ROS is built up by stacks, which in turn are built up by packages, every package contains at least one node. ROS-message is a data structure that can be sent between nodes. Both the Adaptive Optimal Control and UKF algorithm are implemented in C++ using ROS.

A diagram of the 4-WDDMR-ROS software architecture is shown in Figure . The perception and High Level Control tasks shown (left), the main real time optimal control loop, which communicate via Arduino board with sensors and actuators shown (right). Arduino board communicates with PC-master via ROS serial topic. Figure shows the time response of the wheels angular velocities. It is observed that the low level dynamic system is exponentially converged and shows high dynamic response. The spikes shown at sample instants 220 and 240 s are due to applying sudden breaking signals to examine the robustness of the developed controller.

Figure 7. Schematic of ROS software architecture for 4-WDDMR.

Figure 7. Schematic of ROS software architecture for 4-WDDMR.

Figure 8. Time response for right and left wheels.

Figure 8. Time response for right and left wheels.

Figure shows high level control dynamic performance and UKF navigation system with an arbitrary predetermined trajectory generated via ROS topic, as seen the robot true orientation angle is coincided with UKF and the gyroscope sensor one, where the odometry one is out of synchronization and not accurate.

Figure 9. 4-WDDMR orientation tracking.

Figure 9. 4-WDDMR orientation tracking.

7. Conclusion

This article has presented an ultimate integrated robotics system-based ROS as an advanced robot software environment. The proposed Adaptive Optimal Controller has been shown to be capable to overcome the robot dynamic parameters uncertainties and robustness against parameters mismatch.

The implemented UKF-based system state estimation has proven to be robust against the uncertainties exhibited by robot kinematic parameters. It has been noted that the proposed approach has provided high DoB for the robot localization. The conducted practical results obtained from the proposed approach, which were implemented on ROS were coincided with the simulation results obtained from the developed model built in MATLAB/SIMULINK® and C language. This work will be further developed with UKF and D-SLAM techniques to obtain an autonomous robotic system (Kerl, Sturm, & Cremers, Citation2013).

Additional information

Funding

The authors received no direct funding for this research.

Notes on contributors

Abdulkader Joukhadar

Abdulkader Joukhadar was born in 1968. He received his Ph.D. degree from Aberdeen University, UK in 2004. Currently, he is an associate professor of Intelligent Control System at the Dept. Mechatronics Engineering, Faculty of Electrical and Electronic Engineering, University of Aleppo. The central theme of his research is in the field of Robotics, Robot Control, Probabilistic Robotics and Intelligent Control Systems, Kalman Filtering, Adaptive Control.

Dalia Kass Hanna

Dalia Kass Hanna was born in 1987. She studied Control Engineering and Automation at the University of Aleppo, Syria. She received her MSc degree in 2016. Since 2011, she is a teacher at the Dept. Mechatronics Engineering, Laboratory of Integrated Mechatronics Systems. Her research interests lie in the fields of Intelligent Mechatronics Systems, Embedded Systems, Robot Localization, SLAM and Intelligent Motion approaches.

References

  • Al-Araji, A. , Abbod, M. , & Al-Raweshidy, H. (2012). Design of an adaptive neural predictive nonlinear controller for nonholonomic mobile robot system based on posture identifier in the presence of disturbance. International Journal of Simulation--Systems, Science & Technology, 12(3), 17–28.
  • Dhaouadi, R. , & Abu Hatab, A. (2013). Dynamic modelling of differential drive mobile robots using lagrange and Newton-Euler methodologies. Advance in Robotics & Automation , 2, 107. doi:10.4172/2168-9695.1000107
  • Gutierrez-Arias, E. M. , Flores-Mena, J. E. , Morin-Castillo, M. M. , & Suarez-Ramier, H. (2011). Design of an optimal control for an autonomous mobile robot. Revista Mexicana De Fi Sic , 57(1), 75–83.
  • Houshangi, N. , & Azizi, F. (2005). Accurate mobile robot position determination using unscented Kalman filter, 846–851. doi:10.1109/CCECE.2005.1557061
  • Kandepu, R. , Foss, B. , & Imsland, L. (2008). Applying the unscented Kalman filter for nonlinear state estimation. Journal of Process Control, 18(7–8), 753–768.
  • Kass Hanna, D. , & Joukhadar, A. (2015). A novel control-navigation system-based adaptive optimal controller & EKF localization of DDMR. International Journal of Advanced Research in Artificial Intelligence , 4(25), 29–37.
  • Kelly, R. , Santibanez, V. , & Loria, A. (2006). Control of robot manipulators in joint space . London: Springer Science & Business Media.
  • Kerl, C. , Sturm, J. , & Cremers, D. (2013). Dense visual SLAM for RGB-D cameras . Intelligent Robots and Systems (IROS), 2013 IEEE/RSJ International Conference on. IEEE.
  • Klančar, G., Teslić, L., & Škrjanc, I. (2014). Mobile-robot pose estimation and environment mapping using an extended Kalman filter. International Journal of Systems Science, 45(12), 2603–2618.
  • Kühne, F. , Lages, W. F. , & DaSilva, G. (2005, September). Model predictive control of a mobile robot using linearization . IEEE Latin-American Robotics Symposium,  São Luis (pp. 525–530).
  • Liu, Y. (2010). Navigation and control of mobile robot using sensor fusion. In A. Ude (Ed.), Robot vision (pp. 129–142).  InTech. ISBN: 978-953-307-077-3.
  • Merwe, R. (2004). Sigma-point Kalman filters for probabilistic inference in dynamic state-space models. Scholar Archive. Faculty of the OGI School of Science & Engineering at Oregon Health & Science University, USA.
  • Negenborn, R. (2003). Robot localization and Kalman filters on finding your position in a noisy word ( MSc thesis).
  • O’Kane, J. M. (2014). A gentle introduction to ROS . Department of Computer Science and Engineering, University of South California, USA, ISBN 978-14-92143-23-9.
  • Panich, S. , & Afzulpurkar, N. (2011). Mobile robot integrated with gyroscope by using IKF. International Journal of Advanced Rbotic Systems , 8,(2), 122–136.
  • Quigley, M. , Conley, B. K. , Faust, J. , Foote, T. , Leibs, J. , Berger, E. , & Wheeler, A. (2008). ROS: An open source robot operating system . Stanford University.
  • Rhudy, M. , Gu, Y. , & Napolitano, M. R. (2013). An analytical approach for comparing linearization methods in EKF and UKF. International Journal of Advanced Robotic Systems , InTech 10, 208. doi:10.5772/56370
  • Sarkka, S. (2011). Bayesian filtering and smoothing (Vol. 3). Cambridge, UK: Cambridge University Press.
  • Siegwart, R. , & Noubakhsh, I. R. (2004). Introductoin to autonomous mobile robots . Cambridge, MA: The MIT Press.
  • Thrun, S. , Fox, D. , & Burgard, W. (2005). Probabilistic robotics. Massachusttes Institute of Technology .
  • Wang, J. , Qu, Z. , Obeng, M. , & Wu, X. (2007). Approximation based adaptive tracking control of uncertain nonholonomic mechanical system . Proceedings of the World Congress on Engineering and Computer Science, USA.
  • Wang, K. (2012). Near-optimal tracking control of a nonholonomic mobile robot with uncertainties. International Journal of Advanced Robotic Systems, InTech , 9, 66. doi:10.5772/51189
  • Zhao, P. , Chen, J. , Song, Y. , Tao, X. , Xu, T. , & Mei, T. (2012). Design of a control system for an autonomous vehicle based on Adaptive-PID. International Journal of Advanced Robotic Systems , 9, 44. doi:10.5772/51314