SlideShare a Scribd company logo
1 of 8
Download to read offline
Intelligent Control and Automation, 2013, 4, 18-25
http://dx.doi.org/10.4236/ica.2013.41003 Published Online February 2013 (http://www.scirp.org/journal/ica)
Wall Follower Autonomous Robot Development Applying
Fuzzy Incremental Controller
Dirman Hanafi, Yousef Moh Abueejela, Mohamad Fauzi Zakaria
Department of Mechatronic and Robotic Engineering, Faculty of Electrical and Electronic Engineering,
Universiti Tun Hussein Onn Malaysia, Parit Raja, Malaysia
Email: dr_dirman@yahoo.com
Received September 18, 2012; revised October 18, 2012; accepted October 25, 2012
ABSTRACT
This paper presents the design of an autonomous robot as a basic development of an intelligent wheeled mobile robot
for air duct or corridor cleaning. The robot navigation is based on wall following algorithm. The robot is controlled us-
ing fuzzy incremental controller (FIC) and embedded in PIC18F4550 microcontroller. FIC guides the robot to move
along a wall in a desired direction by maintaining a constant distance to the wall. Two ultrasonic sensors are installed in
the left side of the robot to sense the wall distance. The signals from these sensors are fed to FIC that then used to de-
termine the speed control of two DC motors. The robot movement is obtained through differentiating the speed of these
two motors. The experimental results show that FIC is successfully controlling the robot to follow the wall as a guid-
ance line and has good performance compare with PID controller.
Keywords: Autonomous Robot; Wall Follower; Fuzzy Incremental Controller; Embedded System
1. Introduction
Wheeled robots are mechanical devices capable of mov-
ing in an environment with a certain degree of autonomy.
Autonomous navigation is associated to the availability
of external sensors that get information of the environ-
ment through visual images or distance or proximity mea-
surements. The most common sensors are distance sen-
sors (ultrasonic, laser, infrared, etc) able to detect obsta-
cles and measure the distance to walls close to the robot
path. When advanced autonomous robots navigate within
indoor environments (industrial or civil buildings), they
have to be endowed the ability to move through corridors,
to follow walls, to turn corners and to enter open areas of
the rooms [1-4]. The degree of a mobile robot ability to
move around autonomously in its environment deter-
mines its best possible application such as tasks that in-
volve transportation, exploration, surveillance, inspection,
etc.
In attempts to formulate approaches that can handle
real world uncertainty, researches are frequently faced
with the necessity of considering tradeoffs between de-
veloping complex cognitive systems that are difficult to
control. Furthermore, they adopt a host of assumptions
that lead to simplified models which are not sufficiently
representative of the system or the real world. The latter
option is a popular one which often enables the formula-
tion of viable control laws. However, these control laws
are typically valid only for systems that comply with im-
posed assumptions, and furthermore, only in neighbor-
hoods of some nominal state. Recent research and appli-
cation employing non-analytical methods of computing
such as fuzzy logic, evolutionary computation, and neu-
ral networks have demonstrated the utility and potential
of these paradigms for intelligent control of complex
systems. In particular, fuzzy logic has proven to be a
convenient tool for handling real world uncertainty and
knowledge representation [3,5-7]. When a mobile robot
is designed, the three key questions that need to be an-
swered by the robot are: (Where am I, Where am I going,
and how do I get there).
So that, to reach these three answers the robot has to
have a model of the environment. After that it needs to
perceive and analyze the environment to find its position
within the environment. The plan and execution of the
movement will then be finally defined by its control me-
thod. Most of the current practical robot technology in
industries is focused on areas such as positioning, teach-
ing-playback, and two-dimensional vision [8].
The first section of this paper gives introduction about
mobile robot development. The second section explains
related work with this paper. The third section gives in-
sight into the methodology to develop a wall follower
mobile robot.
2. Related Work
Voluminous literature exists on the subject of mobile
Copyright © 2013 SciRes. ICA
D. HANAFI ET AL. 19
robotics motion control development. It is a heavily re-
searched area due to both the challenging theoretical na-
ture of the problem and its practical importance. Previous
work in autonomous mobile robot control generally in-
volves line following, wall following, path tracking con-
trol, and so on.
In order to follow a wall and navigate, image process-
ing techniques can be used to detect perspective lines to
guide the robot along the centre axis of the corridor. This
technique requires cameras that can be expensive. Previ-
ous work in autonomous mobile robot control generally
involves path planning and path tracking control. It can
be classified into the following four categories: linear
[9,10], nonlinear [11,12], geometrical [13], and intelli-
gent [3,13] approaches. Using two switches on the left of
the robot to follow left wall and a bumper switch to de-
tect an obstruction in front is suggested in [6,7]. A ge-
netic algorithm using Fuzzy Logic Controller is devel-
oped in [14]. A multivariable control and ultrasonic range
finders for the measurement of a distance are being used
for wall tracking robot in [15]. A Fuzzy Logic Controller
is used to drive a robot parallel to the wall with the help
of ultrasonic sensors in [16]. In this paper fuzzy incre-
mental controller (FIC) is applied to improve the perfor-
mance of wall follower robot with input from ultrasonic
sensors.
3. Methodology
3.1. Robot Movement Principle
The autonomous robot is modeled as a rigid body that
satisfies a nonholonomic constraint, which means the
motion of the system is not completely free. They are in
which the instantaneous velocities of system components
are restricted, thereby limiting the local movement of the
system. This means that the mobile robot cannot move
sideways and based on the principle of a rolling wheel.
Figure 1 shows an idealized rolling wheel [17]. The
wheel is free to rotate about its axis ( wY axis). The robot
exhibits preferential rolling motion in one direction ( wX
axis) and a certain amount of lateral slip. For lower ve-
locities, rolling motion is dominant and slipping can be
neglected.
Where, r = wheel radius, V = wheel linear velocity and
Figure 1. An idealized rolling wheel.
ω = wheel angular velocity.
In this case, some assumptions as below are used.
 No slip occurs in the orthogonal direction of rolling
(non-slipping).
 No translation slip occurs between the wheel and the
floor (pure rolling).
 At most one steering link per wheel with the steering
axis perpendicular to the floor.
3.2. Robot Model
Deriving a model for the whole robot’s motion is a bot-
tom-up process. Each individual wheel contributes to the
robot’s motion and, at the same time, imposes constraints
on robot motion. Wheels are tied together based on robot
chassis geometry, and therefore their constraints combine
to form constraints on the overall motion of the robot
chassis. Other case the forces and each wheel constraints
must be expressed with respect to a clear and consistent
reference frame. The develop robot is a two-wheeled
mobile robot (Differential Drive) whose position is de-
fined by three Coordinates (3 DOF) in a plane  , ,x y  .
Figure 2 below shows a two-wheeled robot, where P is
the motion center of the autonomous robot and the grav-
ity centre of the platform. Where,  ,x y represents li-
near speed or tangential velocity and  is the angular
velocity.
Kinematics is the study of the mathematics of motion
without considering the forces that affect the motion. It
deals with the geometric relationships that govern the
system. It develops a relationship between control para-
meters and the behavior of a system in space. The model
of the robot is as shown in Figure 3. The linear speed of
the right and the left wheel are related to
the angular speed as follows:
 Right Left, 
y
vy vx
 
x
Figure 2. The model of the mobile robot.

d
R
left
v

right
v
R
v
Figure 3. Robot parameters.
Copyright © 2013 SciRes. ICA
D. HANAFI ET AL.20
Right Rightr  
Left Leftr
(1)
   (2)
where, r is the radius of the wheel. Right and Left is
angular velocity of the right and left wheels respectively.
R and R are the velocity and angular velocity of the
robot respectively.
The total linear and angular speed of the robot can be
calculated as Equations (3) and (4). In order to specify
the position of the robot on the plane, a relationship be-
tween the global reference frame of the plane and the
local reference frame of the robot are established as in
Figure 3 [9,10]. The robot in a state of motion must al-
ways rotate about a point that lies somewhere on the
common axis of its two wheels. This point is often called
the Instantaneous Centre of Curvature (ICC).
The robot’s coordinates  ,x y
 
and its orientation
 changed with respect to time can be calculated us-
ing the following equations.
 Right Left 2 R  (3)
 Right Leftt d d dR   (4)
d dx t x cosR   (5)
d dy t sinRy    (6)
R 
  00
(7)
Integrating Equations (5) and (6), and taking the initial
positions to be x x   00and y y with initial
orientation 0 yields:
     
  
ft Right Left
Right Left 0 0
2
sin sint d
 0 Rightx d  Lex t
   

    
     
  
(8)
  
0 Right Left Right Left
0 0
2
cos
y t y d    
Right Leftcos t d   
   
   
cos 0
0
0 1
x
R
 
(9)
From the Equations (5)-(7), the kinematic model of the
mobile robot with two independently driving wheels can
be represented in Cartesian model as Equation (10).
siny
R
x  
y

 

 
     
        


     
      
 
 

(10)
where, x and y are position variables,  is a heading
direction angle (yaw angle), and  , 
 
are the forward
velocity and the rotational velocity (angular velocity) of
the robot, respectively [12].
 
The position and the orientation of the autonomous
robot are determined by a set of differential equations
below:
Right Left
Right Left
cos 0
2
sin 0
0 1
x
y
d
 
 
 
 

                       
(11)
Equations (3) and (11) are extended to be:
Right
Left
1 2cos 1 2cos
1 2sin 1 2sin
0 1
x
y
d
  

  


   
         
       
(12)
3.3. Wall Geometry and Robot Motion Model
In case of a different set of state is considered, it is pos-
sible to use the corridor navigation controller to enable
the robot to follows a wall. This possibility is based on
two tasks and very similar to each other. Where, the state
are defined in relation to the wall as  and D.  is the
angular deviation relative to the wall line and D is the
distance of the robot from an imaginary line at a desired
distance from the wall as represented in Figure 4 [10,18].
Two ultrasonic sensors are mounted in left side of ro-
bot and named as 1 and 2 . Variable D is calculated
through the following equations:
S S
cosD S (13)
 1 21 2S S S  (14)
Using Pythagorean Theorem, relationship between 
and sensors reading  S S1 2
The develop controller is required to be back fed with
the values of
is represented as Figure 5.
 and D at each instant. These values can
be primarily obtained from ultrasonic measurements. For
this case, the following Equations (15) and (16) can use
to calculate the state variables.
 
 
 
  
 
 



D
S
L
Sensor 1
Sensor 2
Figure 4. Wall geometry and sensors model.
L







 21
SS
Figure 5. Pythagorean Theorem.
Copyright © 2013 SciRes. ICA
D. HANAFI ET AL. 21
    2
1 2S S 2
1 2cos S S L   (15) Inference
Mechanism
    
Defuzzification
Fuzzification
2
1 2L S S 2
1 21 2D S S  (16)
Let consider that,  is very small and L is
, the Equations (15) and (16) become: 1S S 
2
2
 1 21 2D S S  (17)
 1 21 L S S 

(18)
The angle error E , distance error d and total
error are evaluated based on the distance be-
tween the robot and the wall which represented by Equa-
tions (19)-(21).
 E
 TotE
 ReE f D d (19)
 1 2E S S  
Tot dE E E
(20)
 
 0
(21)
The right and the left angular velocity of each wheel
are calculated using the following equation respect to the
initial speed of each wheel  .
 0 TotE    
 0 TotE  
Right 0
Left 0 
(22)
(23)
3.4. Fuzzy Logic Controller
Fuzzy logic is based on the principle of human expert
decision making in problem solving mechanism. Where,
the solution is described in a linguistic term or every
spoken language, i.e., fast, slow, high, low, etc. [19,20].
In more complex cases, they include some hedge terms,
i.e., very high, not so low, etc. To represent such terms, a
nonmathematical fuzzy set theory is needed.
Figure 6 shows the block diagram of fuzzy logic that
consist four components: Fuzzification, Fuzzy rule based,
Fuzzy inference and Defuzzification.
The design of fuzzy logic controller generally has the
following step:
1) Design the membership function for fuzzification
input and output variables.
2) Implement the fuzzy inference by a series of IF-
THEN rules.
3) Inference engine derives a conclusion from the facts
and rules contained in the knowledge base using various
human expert techniques.
4) Process to maps a fuzzy set into a crisp set.
Fuzzy Incremental Controller (FIC) has main advan-
tage that is smooth in signal control [21], therefore, it has
been applied in this paper. Fuzzy Incremental Controller
(FIC) as in Figure 7 has been developed to control wall
follower robot. It has two input and two output variables.
error (e)
signal
control (u)
Rule Base
Figure 6. Fuzzy logic block diagram.
Input and output variables of FIC assumed have triangu-
lar membership function. Input variables are S1 and S2
(feedback sensor’s reading) and each of them have been
assigned three linguistic values as Near (N), Desired (D)
and Far (F). The controller output is used to control the
change in angular velocity of the right and left wheel of
the robot. The changes in angular velocities of the two
wheels  , Right Left have linguistic values: Slow (S),
Medium (M) and Fast (F).
The membership functions graphs of FIC develop are
shown in Figures 8-11. The triangular membership func-
tions are used for their simplicity is quite commonly ap-
plied.
Generating the rules for fuzzy control system is often
the most difficult step in the design process. It usually
requires some expert knowledge of the plant dynamics.
This knowledge could be in the form of an intuitive un-
derstanding gained from experimenting, or it could come
from a plant model which is then used in a computer si-
mulation. Rule tabulation of each variable for wall fol-
lower robot is represented as in Tables 1 and 2.
4. Robot Construction
Figure 12 shows the physical construction of the wall
follower robot developed respectively. It has two wheels
on either side of its chassis. Each of these wheels has a
separate DC motor. These motors run independently
from each other with the help of PWM signals generated
by the PIC18F4550 Microcontroller, and a driver IC SN
754410. Moreover, a caster wheel is used in to balance
the entire chassis. The robot measures the distance from
a wall on its left side. Two ultrasonic sensors are instal-
led on the left side to aid in following a wall.
5. Controller Experimental Result
In this paper three kinds of controller have been applied
for wall follower robot, they are fuzzy incremental con-
troller (FIC), proportional differential (PD) controller and
proportional integral and differential (PID) controller.
Four graphs from each of controller responses are com-
pared. First is Cartesian space, second is theta position of
the robot, third is left back sensor response and finally is
Copyright © 2013 SciRes. ICA
D. HANAFI ET AL.
ICA
22
Figure 7. FIC of wall follower robot block diagram.
Figure 10. Membership function of ωRight.
Figure 8. Memberships function of left back sensor (S1).
Figure 11. Membership function of ωLeft.
figures are in time unit (second). The experimental re-
sults are as Figures 13-24:
Figure 9. Memberships function of right back sensor (S2).
Based on graphs above, FIC results give good per-
formance, for angle of orientation, x position, y position
Left front sensor response. The robot sets to follow the
wall with 20 cm distance and it x axis of the response
Copyright © 2013 SciRes.
D. HANAFI ET AL. 23
Table 1. Rule tabulation of right wheel angular velocity.
S1
ωRight
N (Near) D (Desired) F (Far)
S (Slow) S (Slow) S (Slow) S (Slow)
M (Medium) F (Fast) S (Slow) S (Slow)S2
F (Fast) F (Fast) M (Medium) M (Medium)
Table 2. Rule tabulation of left wheel angular velocity.
S1
ωLeft
N (Near) D (Desired) F (Far)
S (Slow) M (Medium) F (Fast) F (Fast)
M (Medium) S (Slow) F (Fast) M (Medium)S2
F (Fast) S (Slow) S (Slow) S (Slow)
Figure 12. Robot physical construction.
Figure 13. (x, y) Cartesian space response under FIC.
Figure 14. Theta position of robot under FIC.
Figure 15. Left back sensor response of robot under FIC.
Figure 16. Left front sensor response of robot under FIC.
Figure 17. (x, y) Cartesian space response under PD.
Figure 18. Theta position of robot under PD.
 ,xand y position as a whole. Besides that, FIC also
produces lower overshoot for the motion and position of
the robot in the orientation curve. Then the robot able to
achieve reference position from the wall in short time
Copyright © 2013 SciRes. ICA
D. HANAFI ET AL.24
Figure 19. Left back sensor response of robot under PD.
Figure 20. Left front sensor response of robot under PD.
Figure 21. (x, y) Cartesian space response under PID.
Figure 22. Theta position of robot under PID.
compared with the other controllers.
The parameters response comparisons of each control-
ler are listed in Table 3.
6. Conclusion
The wall following control of the autonomous robot has
Figure 23. Left back sensor response of robot under PID.
Figure 24. Left front sensor response of robot under PID.
Table 3. Controller response parameters comparison.
Fuzzy logic PD PID
Overshoot 0.24 0.29 0.46
Setting time 0.5 0.9 1
Error 1.2 × 10–13
6.5 × 10–8
4.05 × 10–5
been presented using ultrasonic sensors. The sensor data
are used to measure and obtain the distance and orienta-
tion of the robot. Then, these data are utilized in the
feedback controller. The FIC algorithm has been embed-
ded in PIC18F4550 microcontroller for controlling the
wall follower robot. The FIC responses good perform-
ance compared to PD and PID controller. The experi-
mental results show the FIC controller gives lowest over-
shoot, shortest settling time and smallest error than PD
and PID controller. It means FIC controller more suitable
to be used in controlling wall follower robot.
7. Acknowledgements
This work has been supported by Faculty of Electrical
and Electronic Engineering Universiti Tun Hussein Onn
Malaysia.
REFERENCES
[1] R. Carelli, C. Soria, O. Nasisi and E. O. Freire, “Stable
AVG Corridor Navigation with Fuse Vision-Based Con-
trol Signals,” IEEE Proceeding of Industrial Electronics
Society Conference, Sevilla, 5-8 November 2002, pp.
Copyright © 2013 SciRes. ICA
D. HANAFI ET AL.
Copyright © 2013 SciRes. ICA
25
2433-2438.
[2] R. Carelli and E. Freire, “Stable Corridor Navigation
Controller for Sonar-Based Mobile Robots,” Technical
Report, INAW, Universidad Nacional de San Juan, San
Juan, 2001.
[3] R. Malhotra and A. Sarkar, “Development of a Fuzzy
Logic Based Mobile Robot for Dynamic Obstacle Avoi-
dance and Goal Acquisition in an Unstructured Envi-
roment,” IEEE/ASME Proceeding of International Con-
ference on Advanced Intelligent Mechatronics, Kobe, 20-
24 July 2003, pp. 235-247.
[4] P. M. Peri, “Fuzzy Logic Controller for an Autonomous
Mobile Robot,” Master Thesis, Cleveland State Univer-
sity, Cleveland, 2005.
[5] D. Ratner and P. McKerrow, “Navigation an Outdoor
Robot along Continuous Landmarks with Ultrasonic Sen-
sing,” Robotics and Autonomous Systems, Vol. 45, No. 1,
2003, pp. 73-82. doi:10.1016/S0921-8890(03)00096-4
[6] R. Carelli and E. O. Freire, “Navigation Outdoor and
Wall-Following Stable Control for Sonar-Based Mobile
Robots,” Robotics and Autonomous Systems, Vol. 45, No.
3-4, 2003, pp. 235-247. doi:10.1016/j.robot.2003.09.005
[7] R. Benporad, M. Di Marco and A. Tesi, “Wall-Following
Controller for Sonar-Based Mobile Robots,” Proceeding
of IEEE Conference on Decision and Control, San Diego,
10-12 December 1997, pp. 3063-3068.
[8] Japan Robot Society, “Summary Report on Technology
Strategy for Creating a Robot Society in 21st Century,”
2001. http://www.jara.jp/e/dl/report 0105.pdf
[9] D. Simon, “Analyzing Control System Robustness,” IEEE
Potentials, Vol. 21, No. 1, 2002, pp.16-19.
[10] B. Davies and W. E. R. Davies, “Practical Robotics: Prin-
ciples and Applications,” Prentice Hall, Upper Saddle
River, 1997.
[11] Z. Gao, “From Linear to Nonlinear Control Means: A
Practical Progression,” ISA Transactions, Vol. 41, No. 2,
2002, pp. 177-189. doi:10.1016/S0019-0578(07)60077-9
[12] Z. Gao, Y. Huang and J. Han, “An Alternative Paradigm
for Control System Design,” Proceeding of IEEE Con-
ference on Decision and Control, Orlando, 4-7 December
2001, pp. 4578-4585.
[13] G. McComb and M. Preoko, “The Robot Builder’s Bo-
nanza,” 3rd Edition, McGraw Hill, New York, 2006.
[14] R. Braunsting, J. Mujika and J. P. Uribe, “A Wall Fol-
lowing Robot with a Fuzzy Logic Controller Optimized
by a Genetic Algorithm,” Fuzzy Systems, Vol. 5, 1995, pp.
77-82.
[15] M. Ergezer, “Multivariable Control Method for Wall
Tracking Robot,” Project Paper, Department of Electrical
and Computer Engineering, Cleveland State University,
Cleveland, 2006.
[16] O. J. Sordalen, “Feedback Control of Nonholonomic Mo-
bile Robots,” Ph.D. Thesis, Department of Engineering
Cybernetics, The Norwegian Institute of Technology,
2006.
[17] B. Cai and D. Konik, “Intelligent Vehicle Active Suspen-
sion Control Using Fuzzy Logic,” Proceeding of IFAC
World Congress, Vol. 2, 1993, pp. 231-236.
[18] Z. Yi, H. Y. Khing, C. C. Seng and Z. X. Wei, “Multi-
Ultrasonic Sensor Fusion for Mobile Robots,” IEEE Pro-
ceeding of the Intelligent Vehicle Symposium, Dearborn,
3-5 October 2000, pp. 387-391.
[19] I. Skrjanc and D. Matko, “Predictive Function Control
Based on Fuzzy Model for Heat-Exchanger Pilot Plant,”
IEEE Transaction on Fuzzy Systems, Vol. 8, No. 6, 2000,
pp. 705-712. doi:10.1109/91.890329
[20] D. Hanafi, M. N. M. Than, A. A. A. Emhemed, T. Muly-
ana, A. M. Zaid and A. Johari, “Heat Exchanger’s Shell
and Tube Modeling for Intelligent Control Design,” IEEE
Proceeding of 3rd International Conference on Commu-
nication Software and Networks, Xi’an, 27-29 May 2001,
pp. 37-41.
[21] M. Veerachary and D. Sharma, “Fuzzy Incremental Con-
troller for the 3rd Bulk Converter,” IEEE Proceeding of
International Conference on Power Electronics and Drive
Systems, Bangkok, 27-30 November 2007, pp. 768-771.

More Related Content

What's hot

A Novel Wall Following Algorithm For Mobile Robots
A Novel Wall Following Algorithm For Mobile RobotsA Novel Wall Following Algorithm For Mobile Robots
A Novel Wall Following Algorithm For Mobile RobotsWaqas Tariq
 
Novel Navigation Strategy Study on Autonomous Mobile Robots
Novel Navigation Strategy Study on Autonomous Mobile RobotsNovel Navigation Strategy Study on Autonomous Mobile Robots
Novel Navigation Strategy Study on Autonomous Mobile RobotsWaqas Tariq
 
Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...
Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...
Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...Waqas Tariq
 
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...IJRES Journal
 
Research.Essay_Chien-Chih_Weng_v3_by Prof. Karkoub
Research.Essay_Chien-Chih_Weng_v3_by Prof. KarkoubResearch.Essay_Chien-Chih_Weng_v3_by Prof. Karkoub
Research.Essay_Chien-Chih_Weng_v3_by Prof. KarkoubChien-Chih Weng
 
Based on ant colony algorithm to solve
Based on ant colony algorithm to solveBased on ant colony algorithm to solve
Based on ant colony algorithm to solveijaia
 
Modelling of walking humanoid robot with capability of floor detection and dy...
Modelling of walking humanoid robot with capability of floor detection and dy...Modelling of walking humanoid robot with capability of floor detection and dy...
Modelling of walking humanoid robot with capability of floor detection and dy...ijfcstjournal
 
Trajectory reconstruction for robot programming by demonstration
Trajectory reconstruction for robot programming  by demonstration  Trajectory reconstruction for robot programming  by demonstration
Trajectory reconstruction for robot programming by demonstration IJECEIAES
 
Design and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotDesign and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotIJTET Journal
 
A Simple Integrative Solution For Simultaneous Localization And Mapping
A Simple Integrative Solution For Simultaneous Localization And MappingA Simple Integrative Solution For Simultaneous Localization And Mapping
A Simple Integrative Solution For Simultaneous Localization And MappingWaqas Tariq
 
Mobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimizationMobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimizationeSAT Publishing House
 
Intelligent vision based snake robot
Intelligent vision based snake robotIntelligent vision based snake robot
Intelligent vision based snake roboteSAT Publishing House
 
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerDesign and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerIOSR Journals
 
Trajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial EquationTrajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial Equationgummaavinash7
 

What's hot (20)

A Novel Wall Following Algorithm For Mobile Robots
A Novel Wall Following Algorithm For Mobile RobotsA Novel Wall Following Algorithm For Mobile Robots
A Novel Wall Following Algorithm For Mobile Robots
 
Novel Navigation Strategy Study on Autonomous Mobile Robots
Novel Navigation Strategy Study on Autonomous Mobile RobotsNovel Navigation Strategy Study on Autonomous Mobile Robots
Novel Navigation Strategy Study on Autonomous Mobile Robots
 
Jurnal
JurnalJurnal
Jurnal
 
Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...
Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...
Attitude Estimation And Compensation In Odometric Localization of Mobile Robo...
 
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
Stabilization of Six-Legged Robot on Tilt Surface With 9 DOF IMU Based on Inv...
 
Research.Essay_Chien-Chih_Weng_v3_by Prof. Karkoub
Research.Essay_Chien-Chih_Weng_v3_by Prof. KarkoubResearch.Essay_Chien-Chih_Weng_v3_by Prof. Karkoub
Research.Essay_Chien-Chih_Weng_v3_by Prof. Karkoub
 
Motion Planning
Motion PlanningMotion Planning
Motion Planning
 
Final Paper
Final PaperFinal Paper
Final Paper
 
Based on ant colony algorithm to solve
Based on ant colony algorithm to solveBased on ant colony algorithm to solve
Based on ant colony algorithm to solve
 
Modelling of walking humanoid robot with capability of floor detection and dy...
Modelling of walking humanoid robot with capability of floor detection and dy...Modelling of walking humanoid robot with capability of floor detection and dy...
Modelling of walking humanoid robot with capability of floor detection and dy...
 
Trajectory reconstruction for robot programming by demonstration
Trajectory reconstruction for robot programming  by demonstration  Trajectory reconstruction for robot programming  by demonstration
Trajectory reconstruction for robot programming by demonstration
 
Design and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotDesign and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of Robot
 
A Simple Integrative Solution For Simultaneous Localization And Mapping
A Simple Integrative Solution For Simultaneous Localization And MappingA Simple Integrative Solution For Simultaneous Localization And Mapping
A Simple Integrative Solution For Simultaneous Localization And Mapping
 
Mobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimizationMobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimization
 
Intelligent vision based snake robot
Intelligent vision based snake robotIntelligent vision based snake robot
Intelligent vision based snake robot
 
22 vol64no3
22 vol64no322 vol64no3
22 vol64no3
 
Ijecet 06 10_003
Ijecet 06 10_003Ijecet 06 10_003
Ijecet 06 10_003
 
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerDesign and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
 
Trajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial EquationTrajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial Equation
 
dheeraj
dheerajdheeraj
dheeraj
 

Similar to Wall follower autonomous robot development applying fuzzy incremental controller

Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...
Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...
Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...iosrjce
 
Fuzzy logic control for robot navigation
Fuzzy logic control for robot navigationFuzzy logic control for robot navigation
Fuzzy logic control for robot navigationRAVINDRASHINDE59
 
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM NITISH K
 
Motion Control of Mobile Robots using Fuzzy Controller
Motion Control of Mobile Robots using Fuzzy ControllerMotion Control of Mobile Robots using Fuzzy Controller
Motion Control of Mobile Robots using Fuzzy Controllerijtsrd
 
Ai robotics abstract110901
Ai robotics abstract110901Ai robotics abstract110901
Ai robotics abstract110901Kiran Mohan
 
A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...
A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...
A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...IJECEIAES
 
Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...csandit
 
Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...TELKOMNIKA JOURNAL
 
Performance Evaluation of Chaotic Mobile Robot Controllers
Performance Evaluation of Chaotic Mobile Robot Controllers Performance Evaluation of Chaotic Mobile Robot Controllers
Performance Evaluation of Chaotic Mobile Robot Controllers drboon
 
Synchronous Mobile Robots Formation Control
Synchronous Mobile Robots Formation ControlSynchronous Mobile Robots Formation Control
Synchronous Mobile Robots Formation ControlTELKOMNIKA JOURNAL
 
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...cscpconf
 
Overview of different techniques utilized in designing of a legged robot
Overview of different techniques utilized in designing of a legged robotOverview of different techniques utilized in designing of a legged robot
Overview of different techniques utilized in designing of a legged robotNikhil Koli
 
International Journal of Computational Engineering Research (IJCER)
International Journal of Computational Engineering Research (IJCER) International Journal of Computational Engineering Research (IJCER)
International Journal of Computational Engineering Research (IJCER) ijceronline
 
Robust Control of a Spherical Mobile Robot
Robust Control of a Spherical Mobile RobotRobust Control of a Spherical Mobile Robot
Robust Control of a Spherical Mobile RobotIRJET Journal
 
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...ijfls
 
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...Wireilla
 

Similar to Wall follower autonomous robot development applying fuzzy incremental controller (20)

Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...
Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...
Design of Mobile Robot Navigation system using SLAM and Adaptive Tracking Con...
 
K017655963
K017655963K017655963
K017655963
 
Fuzzy logic control for robot navigation
Fuzzy logic control for robot navigationFuzzy logic control for robot navigation
Fuzzy logic control for robot navigation
 
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
 
Motion Control of Mobile Robots using Fuzzy Controller
Motion Control of Mobile Robots using Fuzzy ControllerMotion Control of Mobile Robots using Fuzzy Controller
Motion Control of Mobile Robots using Fuzzy Controller
 
Ai robotics abstract110901
Ai robotics abstract110901Ai robotics abstract110901
Ai robotics abstract110901
 
A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...
A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...
A Multi-robot System Coordination Design and Analysis on Wall Follower Robot ...
 
Motion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular WorkspaceMotion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular Workspace
 
Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...Research on the mobile robots intelligent path planning based on ant colony a...
Research on the mobile robots intelligent path planning based on ant colony a...
 
Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...Design of a controller for wheeled mobile robots based on automatic movement ...
Design of a controller for wheeled mobile robots based on automatic movement ...
 
Performance Evaluation of Chaotic Mobile Robot Controllers
Performance Evaluation of Chaotic Mobile Robot Controllers Performance Evaluation of Chaotic Mobile Robot Controllers
Performance Evaluation of Chaotic Mobile Robot Controllers
 
Content server
Content serverContent server
Content server
 
Synchronous Mobile Robots Formation Control
Synchronous Mobile Robots Formation ControlSynchronous Mobile Robots Formation Control
Synchronous Mobile Robots Formation Control
 
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
RESEARCH ON THE MOBILE ROBOTS INTELLIGENT PATH PLANNING BASED ON ANT COLONY A...
 
Overview of different techniques utilized in designing of a legged robot
Overview of different techniques utilized in designing of a legged robotOverview of different techniques utilized in designing of a legged robot
Overview of different techniques utilized in designing of a legged robot
 
International Journal of Computational Engineering Research (IJCER)
International Journal of Computational Engineering Research (IJCER) International Journal of Computational Engineering Research (IJCER)
International Journal of Computational Engineering Research (IJCER)
 
Robust Control of a Spherical Mobile Robot
Robust Control of a Spherical Mobile RobotRobust Control of a Spherical Mobile Robot
Robust Control of a Spherical Mobile Robot
 
A010430107
A010430107A010430107
A010430107
 
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
 
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
EFFECTIVE REDIRECTING OF THE MOBILE ROBOT IN A MESSED ENVIRONMENT BASED ON TH...
 

Recently uploaded

(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...ranjana rawat
 
MANUFACTURING PROCESS-II UNIT-2 LATHE MACHINE
MANUFACTURING PROCESS-II UNIT-2 LATHE MACHINEMANUFACTURING PROCESS-II UNIT-2 LATHE MACHINE
MANUFACTURING PROCESS-II UNIT-2 LATHE MACHINESIVASHANKAR N
 
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...Soham Mondal
 
Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...
Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...
Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...Christo Ananth
 
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escortsranjana rawat
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCall Girls in Nagpur High Profile
 
UNIT-V FMM.HYDRAULIC TURBINE - Construction and working
UNIT-V FMM.HYDRAULIC TURBINE - Construction and workingUNIT-V FMM.HYDRAULIC TURBINE - Construction and working
UNIT-V FMM.HYDRAULIC TURBINE - Construction and workingrknatarajan
 
UNIT-III FMM. DIMENSIONAL ANALYSIS
UNIT-III FMM.        DIMENSIONAL ANALYSISUNIT-III FMM.        DIMENSIONAL ANALYSIS
UNIT-III FMM. DIMENSIONAL ANALYSISrknatarajan
 
Call Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service Nashik
Call Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service NashikCall Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service Nashik
Call Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service NashikCall Girls in Nagpur High Profile
 
Booking open Available Pune Call Girls Koregaon Park 6297143586 Call Hot Ind...
Booking open Available Pune Call Girls Koregaon Park  6297143586 Call Hot Ind...Booking open Available Pune Call Girls Koregaon Park  6297143586 Call Hot Ind...
Booking open Available Pune Call Girls Koregaon Park 6297143586 Call Hot Ind...Call Girls in Nagpur High Profile
 
Extrusion Processes and Their Limitations
Extrusion Processes and Their LimitationsExtrusion Processes and Their Limitations
Extrusion Processes and Their Limitations120cr0395
 
SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )Tsuyoshi Horigome
 
Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...
Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...
Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...Dr.Costas Sachpazis
 
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Serviceranjana rawat
 
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...ranjana rawat
 
Top Rated Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...
Top Rated  Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...Top Rated  Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...
Top Rated Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...Call Girls in Nagpur High Profile
 
Introduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptxIntroduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptxupamatechverse
 
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130Suhani Kapoor
 

Recently uploaded (20)

(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(ANVI) Koregaon Park Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
 
MANUFACTURING PROCESS-II UNIT-2 LATHE MACHINE
MANUFACTURING PROCESS-II UNIT-2 LATHE MACHINEMANUFACTURING PROCESS-II UNIT-2 LATHE MACHINE
MANUFACTURING PROCESS-II UNIT-2 LATHE MACHINE
 
9953056974 Call Girls In South Ex, Escorts (Delhi) NCR.pdf
9953056974 Call Girls In South Ex, Escorts (Delhi) NCR.pdf9953056974 Call Girls In South Ex, Escorts (Delhi) NCR.pdf
9953056974 Call Girls In South Ex, Escorts (Delhi) NCR.pdf
 
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
 
Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...
Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...
Call for Papers - African Journal of Biological Sciences, E-ISSN: 2663-2187, ...
 
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Isha Call 7001035870 Meet With Nagpur Escorts
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
 
UNIT-V FMM.HYDRAULIC TURBINE - Construction and working
UNIT-V FMM.HYDRAULIC TURBINE - Construction and workingUNIT-V FMM.HYDRAULIC TURBINE - Construction and working
UNIT-V FMM.HYDRAULIC TURBINE - Construction and working
 
UNIT-III FMM. DIMENSIONAL ANALYSIS
UNIT-III FMM.        DIMENSIONAL ANALYSISUNIT-III FMM.        DIMENSIONAL ANALYSIS
UNIT-III FMM. DIMENSIONAL ANALYSIS
 
Call Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service Nashik
Call Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service NashikCall Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service Nashik
Call Girls Service Nashik Vaishnavi 7001305949 Independent Escort Service Nashik
 
Booking open Available Pune Call Girls Koregaon Park 6297143586 Call Hot Ind...
Booking open Available Pune Call Girls Koregaon Park  6297143586 Call Hot Ind...Booking open Available Pune Call Girls Koregaon Park  6297143586 Call Hot Ind...
Booking open Available Pune Call Girls Koregaon Park 6297143586 Call Hot Ind...
 
Extrusion Processes and Their Limitations
Extrusion Processes and Their LimitationsExtrusion Processes and Their Limitations
Extrusion Processes and Their Limitations
 
Call Us -/9953056974- Call Girls In Vikaspuri-/- Delhi NCR
Call Us -/9953056974- Call Girls In Vikaspuri-/- Delhi NCRCall Us -/9953056974- Call Girls In Vikaspuri-/- Delhi NCR
Call Us -/9953056974- Call Girls In Vikaspuri-/- Delhi NCR
 
SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )SPICE PARK APR2024 ( 6,793 SPICE Models )
SPICE PARK APR2024 ( 6,793 SPICE Models )
 
Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...
Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...
Structural Analysis and Design of Foundations: A Comprehensive Handbook for S...
 
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
(RIA) Call Girls Bhosari ( 7001035870 ) HI-Fi Pune Escorts Service
 
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
The Most Attractive Pune Call Girls Budhwar Peth 8250192130 Will You Miss Thi...
 
Top Rated Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...
Top Rated  Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...Top Rated  Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...
Top Rated Pune Call Girls Budhwar Peth ⟟ 6297143586 ⟟ Call Me For Genuine Se...
 
Introduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptxIntroduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptx
 
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
 

Wall follower autonomous robot development applying fuzzy incremental controller

  • 1. Intelligent Control and Automation, 2013, 4, 18-25 http://dx.doi.org/10.4236/ica.2013.41003 Published Online February 2013 (http://www.scirp.org/journal/ica) Wall Follower Autonomous Robot Development Applying Fuzzy Incremental Controller Dirman Hanafi, Yousef Moh Abueejela, Mohamad Fauzi Zakaria Department of Mechatronic and Robotic Engineering, Faculty of Electrical and Electronic Engineering, Universiti Tun Hussein Onn Malaysia, Parit Raja, Malaysia Email: dr_dirman@yahoo.com Received September 18, 2012; revised October 18, 2012; accepted October 25, 2012 ABSTRACT This paper presents the design of an autonomous robot as a basic development of an intelligent wheeled mobile robot for air duct or corridor cleaning. The robot navigation is based on wall following algorithm. The robot is controlled us- ing fuzzy incremental controller (FIC) and embedded in PIC18F4550 microcontroller. FIC guides the robot to move along a wall in a desired direction by maintaining a constant distance to the wall. Two ultrasonic sensors are installed in the left side of the robot to sense the wall distance. The signals from these sensors are fed to FIC that then used to de- termine the speed control of two DC motors. The robot movement is obtained through differentiating the speed of these two motors. The experimental results show that FIC is successfully controlling the robot to follow the wall as a guid- ance line and has good performance compare with PID controller. Keywords: Autonomous Robot; Wall Follower; Fuzzy Incremental Controller; Embedded System 1. Introduction Wheeled robots are mechanical devices capable of mov- ing in an environment with a certain degree of autonomy. Autonomous navigation is associated to the availability of external sensors that get information of the environ- ment through visual images or distance or proximity mea- surements. The most common sensors are distance sen- sors (ultrasonic, laser, infrared, etc) able to detect obsta- cles and measure the distance to walls close to the robot path. When advanced autonomous robots navigate within indoor environments (industrial or civil buildings), they have to be endowed the ability to move through corridors, to follow walls, to turn corners and to enter open areas of the rooms [1-4]. The degree of a mobile robot ability to move around autonomously in its environment deter- mines its best possible application such as tasks that in- volve transportation, exploration, surveillance, inspection, etc. In attempts to formulate approaches that can handle real world uncertainty, researches are frequently faced with the necessity of considering tradeoffs between de- veloping complex cognitive systems that are difficult to control. Furthermore, they adopt a host of assumptions that lead to simplified models which are not sufficiently representative of the system or the real world. The latter option is a popular one which often enables the formula- tion of viable control laws. However, these control laws are typically valid only for systems that comply with im- posed assumptions, and furthermore, only in neighbor- hoods of some nominal state. Recent research and appli- cation employing non-analytical methods of computing such as fuzzy logic, evolutionary computation, and neu- ral networks have demonstrated the utility and potential of these paradigms for intelligent control of complex systems. In particular, fuzzy logic has proven to be a convenient tool for handling real world uncertainty and knowledge representation [3,5-7]. When a mobile robot is designed, the three key questions that need to be an- swered by the robot are: (Where am I, Where am I going, and how do I get there). So that, to reach these three answers the robot has to have a model of the environment. After that it needs to perceive and analyze the environment to find its position within the environment. The plan and execution of the movement will then be finally defined by its control me- thod. Most of the current practical robot technology in industries is focused on areas such as positioning, teach- ing-playback, and two-dimensional vision [8]. The first section of this paper gives introduction about mobile robot development. The second section explains related work with this paper. The third section gives in- sight into the methodology to develop a wall follower mobile robot. 2. Related Work Voluminous literature exists on the subject of mobile Copyright © 2013 SciRes. ICA
  • 2. D. HANAFI ET AL. 19 robotics motion control development. It is a heavily re- searched area due to both the challenging theoretical na- ture of the problem and its practical importance. Previous work in autonomous mobile robot control generally in- volves line following, wall following, path tracking con- trol, and so on. In order to follow a wall and navigate, image process- ing techniques can be used to detect perspective lines to guide the robot along the centre axis of the corridor. This technique requires cameras that can be expensive. Previ- ous work in autonomous mobile robot control generally involves path planning and path tracking control. It can be classified into the following four categories: linear [9,10], nonlinear [11,12], geometrical [13], and intelli- gent [3,13] approaches. Using two switches on the left of the robot to follow left wall and a bumper switch to de- tect an obstruction in front is suggested in [6,7]. A ge- netic algorithm using Fuzzy Logic Controller is devel- oped in [14]. A multivariable control and ultrasonic range finders for the measurement of a distance are being used for wall tracking robot in [15]. A Fuzzy Logic Controller is used to drive a robot parallel to the wall with the help of ultrasonic sensors in [16]. In this paper fuzzy incre- mental controller (FIC) is applied to improve the perfor- mance of wall follower robot with input from ultrasonic sensors. 3. Methodology 3.1. Robot Movement Principle The autonomous robot is modeled as a rigid body that satisfies a nonholonomic constraint, which means the motion of the system is not completely free. They are in which the instantaneous velocities of system components are restricted, thereby limiting the local movement of the system. This means that the mobile robot cannot move sideways and based on the principle of a rolling wheel. Figure 1 shows an idealized rolling wheel [17]. The wheel is free to rotate about its axis ( wY axis). The robot exhibits preferential rolling motion in one direction ( wX axis) and a certain amount of lateral slip. For lower ve- locities, rolling motion is dominant and slipping can be neglected. Where, r = wheel radius, V = wheel linear velocity and Figure 1. An idealized rolling wheel. ω = wheel angular velocity. In this case, some assumptions as below are used.  No slip occurs in the orthogonal direction of rolling (non-slipping).  No translation slip occurs between the wheel and the floor (pure rolling).  At most one steering link per wheel with the steering axis perpendicular to the floor. 3.2. Robot Model Deriving a model for the whole robot’s motion is a bot- tom-up process. Each individual wheel contributes to the robot’s motion and, at the same time, imposes constraints on robot motion. Wheels are tied together based on robot chassis geometry, and therefore their constraints combine to form constraints on the overall motion of the robot chassis. Other case the forces and each wheel constraints must be expressed with respect to a clear and consistent reference frame. The develop robot is a two-wheeled mobile robot (Differential Drive) whose position is de- fined by three Coordinates (3 DOF) in a plane  , ,x y  . Figure 2 below shows a two-wheeled robot, where P is the motion center of the autonomous robot and the grav- ity centre of the platform. Where,  ,x y represents li- near speed or tangential velocity and  is the angular velocity. Kinematics is the study of the mathematics of motion without considering the forces that affect the motion. It deals with the geometric relationships that govern the system. It develops a relationship between control para- meters and the behavior of a system in space. The model of the robot is as shown in Figure 3. The linear speed of the right and the left wheel are related to the angular speed as follows:  Right Left,  y vy vx   x Figure 2. The model of the mobile robot.  d R left v  right v R v Figure 3. Robot parameters. Copyright © 2013 SciRes. ICA
  • 3. D. HANAFI ET AL.20 Right Rightr   Left Leftr (1)    (2) where, r is the radius of the wheel. Right and Left is angular velocity of the right and left wheels respectively. R and R are the velocity and angular velocity of the robot respectively. The total linear and angular speed of the robot can be calculated as Equations (3) and (4). In order to specify the position of the robot on the plane, a relationship be- tween the global reference frame of the plane and the local reference frame of the robot are established as in Figure 3 [9,10]. The robot in a state of motion must al- ways rotate about a point that lies somewhere on the common axis of its two wheels. This point is often called the Instantaneous Centre of Curvature (ICC). The robot’s coordinates  ,x y   and its orientation  changed with respect to time can be calculated us- ing the following equations.  Right Left 2 R  (3)  Right Leftt d d dR   (4) d dx t x cosR   (5) d dy t sinRy    (6) R    00 (7) Integrating Equations (5) and (6), and taking the initial positions to be x x   00and y y with initial orientation 0 yields:          ft Right Left Right Left 0 0 2 sin sint d  0 Rightx d  Lex t                    (8)    0 Right Left Right Left 0 0 2 cos y t y d     Right Leftcos t d            cos 0 0 0 1 x R   (9) From the Equations (5)-(7), the kinematic model of the mobile robot with two independently driving wheels can be represented in Cartesian model as Equation (10). siny R x   y                                          (10) where, x and y are position variables,  is a heading direction angle (yaw angle), and  ,    are the forward velocity and the rotational velocity (angular velocity) of the robot, respectively [12].   The position and the orientation of the autonomous robot are determined by a set of differential equations below: Right Left Right Left cos 0 2 sin 0 0 1 x y d                                  (11) Equations (3) and (11) are extended to be: Right Left 1 2cos 1 2cos 1 2sin 1 2sin 0 1 x y d                                (12) 3.3. Wall Geometry and Robot Motion Model In case of a different set of state is considered, it is pos- sible to use the corridor navigation controller to enable the robot to follows a wall. This possibility is based on two tasks and very similar to each other. Where, the state are defined in relation to the wall as  and D.  is the angular deviation relative to the wall line and D is the distance of the robot from an imaginary line at a desired distance from the wall as represented in Figure 4 [10,18]. Two ultrasonic sensors are mounted in left side of ro- bot and named as 1 and 2 . Variable D is calculated through the following equations: S S cosD S (13)  1 21 2S S S  (14) Using Pythagorean Theorem, relationship between  and sensors reading  S S1 2 The develop controller is required to be back fed with the values of is represented as Figure 5.  and D at each instant. These values can be primarily obtained from ultrasonic measurements. For this case, the following Equations (15) and (16) can use to calculate the state variables.                 D S L Sensor 1 Sensor 2 Figure 4. Wall geometry and sensors model. L         21 SS Figure 5. Pythagorean Theorem. Copyright © 2013 SciRes. ICA
  • 4. D. HANAFI ET AL. 21     2 1 2S S 2 1 2cos S S L   (15) Inference Mechanism      Defuzzification Fuzzification 2 1 2L S S 2 1 21 2D S S  (16) Let consider that,  is very small and L is , the Equations (15) and (16) become: 1S S  2 2  1 21 2D S S  (17)  1 21 L S S   (18) The angle error E , distance error d and total error are evaluated based on the distance be- tween the robot and the wall which represented by Equa- tions (19)-(21).  E  TotE  ReE f D d (19)  1 2E S S   Tot dE E E (20)    0 (21) The right and the left angular velocity of each wheel are calculated using the following equation respect to the initial speed of each wheel  .  0 TotE      0 TotE   Right 0 Left 0  (22) (23) 3.4. Fuzzy Logic Controller Fuzzy logic is based on the principle of human expert decision making in problem solving mechanism. Where, the solution is described in a linguistic term or every spoken language, i.e., fast, slow, high, low, etc. [19,20]. In more complex cases, they include some hedge terms, i.e., very high, not so low, etc. To represent such terms, a nonmathematical fuzzy set theory is needed. Figure 6 shows the block diagram of fuzzy logic that consist four components: Fuzzification, Fuzzy rule based, Fuzzy inference and Defuzzification. The design of fuzzy logic controller generally has the following step: 1) Design the membership function for fuzzification input and output variables. 2) Implement the fuzzy inference by a series of IF- THEN rules. 3) Inference engine derives a conclusion from the facts and rules contained in the knowledge base using various human expert techniques. 4) Process to maps a fuzzy set into a crisp set. Fuzzy Incremental Controller (FIC) has main advan- tage that is smooth in signal control [21], therefore, it has been applied in this paper. Fuzzy Incremental Controller (FIC) as in Figure 7 has been developed to control wall follower robot. It has two input and two output variables. error (e) signal control (u) Rule Base Figure 6. Fuzzy logic block diagram. Input and output variables of FIC assumed have triangu- lar membership function. Input variables are S1 and S2 (feedback sensor’s reading) and each of them have been assigned three linguistic values as Near (N), Desired (D) and Far (F). The controller output is used to control the change in angular velocity of the right and left wheel of the robot. The changes in angular velocities of the two wheels  , Right Left have linguistic values: Slow (S), Medium (M) and Fast (F). The membership functions graphs of FIC develop are shown in Figures 8-11. The triangular membership func- tions are used for their simplicity is quite commonly ap- plied. Generating the rules for fuzzy control system is often the most difficult step in the design process. It usually requires some expert knowledge of the plant dynamics. This knowledge could be in the form of an intuitive un- derstanding gained from experimenting, or it could come from a plant model which is then used in a computer si- mulation. Rule tabulation of each variable for wall fol- lower robot is represented as in Tables 1 and 2. 4. Robot Construction Figure 12 shows the physical construction of the wall follower robot developed respectively. It has two wheels on either side of its chassis. Each of these wheels has a separate DC motor. These motors run independently from each other with the help of PWM signals generated by the PIC18F4550 Microcontroller, and a driver IC SN 754410. Moreover, a caster wheel is used in to balance the entire chassis. The robot measures the distance from a wall on its left side. Two ultrasonic sensors are instal- led on the left side to aid in following a wall. 5. Controller Experimental Result In this paper three kinds of controller have been applied for wall follower robot, they are fuzzy incremental con- troller (FIC), proportional differential (PD) controller and proportional integral and differential (PID) controller. Four graphs from each of controller responses are com- pared. First is Cartesian space, second is theta position of the robot, third is left back sensor response and finally is Copyright © 2013 SciRes. ICA
  • 5. D. HANAFI ET AL. ICA 22 Figure 7. FIC of wall follower robot block diagram. Figure 10. Membership function of ωRight. Figure 8. Memberships function of left back sensor (S1). Figure 11. Membership function of ωLeft. figures are in time unit (second). The experimental re- sults are as Figures 13-24: Figure 9. Memberships function of right back sensor (S2). Based on graphs above, FIC results give good per- formance, for angle of orientation, x position, y position Left front sensor response. The robot sets to follow the wall with 20 cm distance and it x axis of the response Copyright © 2013 SciRes.
  • 6. D. HANAFI ET AL. 23 Table 1. Rule tabulation of right wheel angular velocity. S1 ωRight N (Near) D (Desired) F (Far) S (Slow) S (Slow) S (Slow) S (Slow) M (Medium) F (Fast) S (Slow) S (Slow)S2 F (Fast) F (Fast) M (Medium) M (Medium) Table 2. Rule tabulation of left wheel angular velocity. S1 ωLeft N (Near) D (Desired) F (Far) S (Slow) M (Medium) F (Fast) F (Fast) M (Medium) S (Slow) F (Fast) M (Medium)S2 F (Fast) S (Slow) S (Slow) S (Slow) Figure 12. Robot physical construction. Figure 13. (x, y) Cartesian space response under FIC. Figure 14. Theta position of robot under FIC. Figure 15. Left back sensor response of robot under FIC. Figure 16. Left front sensor response of robot under FIC. Figure 17. (x, y) Cartesian space response under PD. Figure 18. Theta position of robot under PD.  ,xand y position as a whole. Besides that, FIC also produces lower overshoot for the motion and position of the robot in the orientation curve. Then the robot able to achieve reference position from the wall in short time Copyright © 2013 SciRes. ICA
  • 7. D. HANAFI ET AL.24 Figure 19. Left back sensor response of robot under PD. Figure 20. Left front sensor response of robot under PD. Figure 21. (x, y) Cartesian space response under PID. Figure 22. Theta position of robot under PID. compared with the other controllers. The parameters response comparisons of each control- ler are listed in Table 3. 6. Conclusion The wall following control of the autonomous robot has Figure 23. Left back sensor response of robot under PID. Figure 24. Left front sensor response of robot under PID. Table 3. Controller response parameters comparison. Fuzzy logic PD PID Overshoot 0.24 0.29 0.46 Setting time 0.5 0.9 1 Error 1.2 × 10–13 6.5 × 10–8 4.05 × 10–5 been presented using ultrasonic sensors. The sensor data are used to measure and obtain the distance and orienta- tion of the robot. Then, these data are utilized in the feedback controller. The FIC algorithm has been embed- ded in PIC18F4550 microcontroller for controlling the wall follower robot. The FIC responses good perform- ance compared to PD and PID controller. The experi- mental results show the FIC controller gives lowest over- shoot, shortest settling time and smallest error than PD and PID controller. It means FIC controller more suitable to be used in controlling wall follower robot. 7. Acknowledgements This work has been supported by Faculty of Electrical and Electronic Engineering Universiti Tun Hussein Onn Malaysia. REFERENCES [1] R. Carelli, C. Soria, O. Nasisi and E. O. Freire, “Stable AVG Corridor Navigation with Fuse Vision-Based Con- trol Signals,” IEEE Proceeding of Industrial Electronics Society Conference, Sevilla, 5-8 November 2002, pp. Copyright © 2013 SciRes. ICA
  • 8. D. HANAFI ET AL. Copyright © 2013 SciRes. ICA 25 2433-2438. [2] R. Carelli and E. Freire, “Stable Corridor Navigation Controller for Sonar-Based Mobile Robots,” Technical Report, INAW, Universidad Nacional de San Juan, San Juan, 2001. [3] R. Malhotra and A. Sarkar, “Development of a Fuzzy Logic Based Mobile Robot for Dynamic Obstacle Avoi- dance and Goal Acquisition in an Unstructured Envi- roment,” IEEE/ASME Proceeding of International Con- ference on Advanced Intelligent Mechatronics, Kobe, 20- 24 July 2003, pp. 235-247. [4] P. M. Peri, “Fuzzy Logic Controller for an Autonomous Mobile Robot,” Master Thesis, Cleveland State Univer- sity, Cleveland, 2005. [5] D. Ratner and P. McKerrow, “Navigation an Outdoor Robot along Continuous Landmarks with Ultrasonic Sen- sing,” Robotics and Autonomous Systems, Vol. 45, No. 1, 2003, pp. 73-82. doi:10.1016/S0921-8890(03)00096-4 [6] R. Carelli and E. O. Freire, “Navigation Outdoor and Wall-Following Stable Control for Sonar-Based Mobile Robots,” Robotics and Autonomous Systems, Vol. 45, No. 3-4, 2003, pp. 235-247. doi:10.1016/j.robot.2003.09.005 [7] R. Benporad, M. Di Marco and A. Tesi, “Wall-Following Controller for Sonar-Based Mobile Robots,” Proceeding of IEEE Conference on Decision and Control, San Diego, 10-12 December 1997, pp. 3063-3068. [8] Japan Robot Society, “Summary Report on Technology Strategy for Creating a Robot Society in 21st Century,” 2001. http://www.jara.jp/e/dl/report 0105.pdf [9] D. Simon, “Analyzing Control System Robustness,” IEEE Potentials, Vol. 21, No. 1, 2002, pp.16-19. [10] B. Davies and W. E. R. Davies, “Practical Robotics: Prin- ciples and Applications,” Prentice Hall, Upper Saddle River, 1997. [11] Z. Gao, “From Linear to Nonlinear Control Means: A Practical Progression,” ISA Transactions, Vol. 41, No. 2, 2002, pp. 177-189. doi:10.1016/S0019-0578(07)60077-9 [12] Z. Gao, Y. Huang and J. Han, “An Alternative Paradigm for Control System Design,” Proceeding of IEEE Con- ference on Decision and Control, Orlando, 4-7 December 2001, pp. 4578-4585. [13] G. McComb and M. Preoko, “The Robot Builder’s Bo- nanza,” 3rd Edition, McGraw Hill, New York, 2006. [14] R. Braunsting, J. Mujika and J. P. Uribe, “A Wall Fol- lowing Robot with a Fuzzy Logic Controller Optimized by a Genetic Algorithm,” Fuzzy Systems, Vol. 5, 1995, pp. 77-82. [15] M. Ergezer, “Multivariable Control Method for Wall Tracking Robot,” Project Paper, Department of Electrical and Computer Engineering, Cleveland State University, Cleveland, 2006. [16] O. J. Sordalen, “Feedback Control of Nonholonomic Mo- bile Robots,” Ph.D. Thesis, Department of Engineering Cybernetics, The Norwegian Institute of Technology, 2006. [17] B. Cai and D. Konik, “Intelligent Vehicle Active Suspen- sion Control Using Fuzzy Logic,” Proceeding of IFAC World Congress, Vol. 2, 1993, pp. 231-236. [18] Z. Yi, H. Y. Khing, C. C. Seng and Z. X. Wei, “Multi- Ultrasonic Sensor Fusion for Mobile Robots,” IEEE Pro- ceeding of the Intelligent Vehicle Symposium, Dearborn, 3-5 October 2000, pp. 387-391. [19] I. Skrjanc and D. Matko, “Predictive Function Control Based on Fuzzy Model for Heat-Exchanger Pilot Plant,” IEEE Transaction on Fuzzy Systems, Vol. 8, No. 6, 2000, pp. 705-712. doi:10.1109/91.890329 [20] D. Hanafi, M. N. M. Than, A. A. A. Emhemed, T. Muly- ana, A. M. Zaid and A. Johari, “Heat Exchanger’s Shell and Tube Modeling for Intelligent Control Design,” IEEE Proceeding of 3rd International Conference on Commu- nication Software and Networks, Xi’an, 27-29 May 2001, pp. 37-41. [21] M. Veerachary and D. Sharma, “Fuzzy Incremental Con- troller for the 3rd Bulk Converter,” IEEE Proceeding of International Conference on Power Electronics and Drive Systems, Bangkok, 27-30 November 2007, pp. 768-771.