SlideShare a Scribd company logo
1 of 5
Download to read offline
Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al.

ISSN: 2086-5023

Path Tracking Controller of Quadruped Robot for
Obstacle Avoidance Using Potential Functions
Method
Giang Hoang#1, Hak Kyeong Kim#1, and Sang Bong Kim#1
#

Department of Mechanical and Automotive Engineering, Pukyong National University,
Busan 608-739, Korea
1

kimsb@pknu.ac.kr

Abstract— This paper proposes a tracking controller for obstacle
avoidance of a quadruped robot using potential functions method.
The followings are done for this task. At first, a ceiling-mounted
camera system is installed for image processing. The goal point and
obstacles are separated and recognized by a color recognition
method. Second, a path planning algorithm using potential functions
method is proposed to generate the path to avoid obstacles and to
plan a path for the quadruped robot to reach from start point to goal
point. Third, a quadruped robot is chosen as the mobile platform for
this study and the kinematic model for the robot is presented. Fourth,
a tracking controller is designed for the quadruped robot to track the
trajectory based on the backstepping method using Lyapunov
function. Finally, the simulation results are presented to show the
effectiveness of the proposed trajectory planning algorithm and the
tracking controller.
[Keywords— Path tracking; back stepping; obstacles avoidance;
potential functions; quadruped robot].

I. INTRODUCTION
During the last decade, research on walking robots has been
focused mainly on gait generation. Many gaits have been
studied and implemented in walking machines. Although gait
generation has been a very important subject for researching,
lack of attention has been paid to path tracking with walking
robot. Zhang et al. formulated the wave-crab gait and the
circular wave gait in [1]. In [2], a four-legged walking robot
called PVII was built by Hirose and Umetani. The PVII can
maintain a horizontal body orientation and has contact sensor
on each foot to detect contact with the ground. In [3], Ma et al.
proposed a gait transition method for a quadruped robot to
achieve omni-directional static walking. These papers
proposed only walking gaits and stability of the walking robot.
In [4], Santos et al. introduced path tracking methods using
discontinuous gaits. But they used an open loop control
algorithm. Therefore, a closed-loop control with camera
feedbacks is needed.
This paper addressed a trajectory tracking problem: control
a quadruped robot to track a path generated by a path planning
algorithm for obstacles avoidance. The control technology for
our system is presented in following sequence. First, the
server computer receives image from the camera. The
obstacles and goal point are marked. Second, the proposed
potential functions method is applied and a trajectory from a
start point to a goal point is generated. Third, the kinematic
model for the quadruped robot is presented. From the
modelling, a backstepping controller is designed for the robot
to track the planned trajectory generated by the potential
functions method. The simulation results are presented to
show the effectiveness of the proposed trajectory planning

IJSE Journal

algorithm and tracking controller of the robot for obstacle
avoidance.
II. SYSTEM DESCRIPTION AND PATH PLANNING ALGORITHM
USING POTENTIAL FUNCTIONS METHOD
A. System description
In this section, the ceiling-mounted camera system
configuration is introduced. The system includes a ceilingmounted camera, server computer, the quadruped robot and
obstacles in random positions in Fig. 1.

Fig. 1 Configuration of Ceiling-mounted Camera System

The camera is connected to the server computer by USB
interface. The server computer receives image from the
camera to perform image processing, generates the path and
then sends commands to the robot.
B. Potential function
This section describes the use of potential functions in path
planning [5]. A potential function U (p) can be viewed as
energy. Hence the gradient ÑU (p) of the potential function
can be viewed as force as follows:

ÑU = [ ¶U / ¶x(p ), ¶U / ¶y (p )]

T

(1)

T

where p = [x y] is a position vector of the robot in the map.
The potential function approach directs the robot as if it is a
particle moving in a gradient vector field. Gradients can be
intuitively viewed as forces acting on a positively charged
particle robot which attached to the negatively charged goal.
Obstacles also have a positive charge which forms a repulsive
force directing the robot away from obstacles. The
combination of repulsive and attractive forces directs the robot

1
Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al.

from the start point to the goal point while avoiding obstacles.
Potential function can be constructed as the sum of attractive
and repulsive potentials as follows:

U (p) = U att (p) + U rep (p)

(2)

where U att (p) is the attractive potential function and

U rep (p) is the repulsive potential function.
The attractive potential represents that the robot attract to
the goal. The repulsive potential represents that the robot
repels from obstacles. The repulsive potential function in
terms of individual obstacles can be commonly used the
following form.
2
ì1 æ 1
1 ö
ï hç
- *÷
U repi (p ) = í 2 è di (p) Q ø
ï
î0

, di (p) £ Q *
, di (p) > Q

(3)

*

ISSN: 2086-5023
*
ìz (p - p goal )
, d (p, p goal ) £ d goal
ï *
ÑU att (p) = í d goal z (p - p goal )
*
, d (p, p goal ) > d goal
ï
d (p, p goal )
î

(7)

C. Gradient descent
The robot moves from a “high value” state to a “low value”
state of the potential function. The vector of the gradient
points the direction that the potential function will increase.
Therefore, the robot follows a path “downhill” by following
the negated gradient of the potential function. Following such
a path is called gradient descent. The robot terminates motion
when and p* is called a critical point. The point p* is
maximum, minimum or saddle point. We use the second
derivative (Hessian matrix) to determine the type of critical
point.
The gradient descent algorithm can be defined as:

p(0) = p start
i=0

where di (p) is the distance from the robot to obstacle i, Qi* is
the threshold distance to allow the robot to ignore obstacles
and h is the repulsive gain.

while (|| ÑU (p i ) ||< e ) do
p i +1 = p i - a ´ (ÑU (p i ))

(8)

i = i + 1;
end while

Then the repulsive gradient is:

ì æ 1
1 ö 1
Ñdi (p) , di (p) £ Q *
ïh ç * ÷
Q
d i (p ) ø d i 2 (p )
ï è
ï
ÑU rep i (p) = í
ï
, d i (p) > Q *
ï0
ï
î

(4)

III. KINEMATIC MODELLING OF QUADRUPED ROBOT

The total repulsive function and gradient can be calculated
as follows:
n

U rep (p) = å U rep i (p)
i =0

n

ÑU rep (p) = å ÑU rep i (p)

where the notation p i is used to denote the value of p at the ith
iteration and the final path consist of the sequence of iterates
{p 0 , p1 , p 2 ,..., pi } that is the path for trajectory tracking
controller. The value of the scalar a determines the step size
of the iteration.

A. Design of quadruped robot
The quadruped robot in this paper consists of one body and
four legs. Each leg has three joints. Fig. 2 shows the
simplified model of the robot.

(5)

i =0

The attractive potential can be chosen as follows:

ì1
2
*
, d (p, p goal ) £ d goal
ï 2 z d (p, p goal )
ï
U att (p ) = í
ïd * z d (p, p ) - 1 z (d * ) 2 , d (p, p ) > d *
goal
goal
goal
goal
ï goal
î
2
(6)
where d (p, p goal ) is the distance from the robot position to the
*
goal position, d goal is a threshold distance from the robot

position to the goal position where the attractive potential
function switch and z is the repulsive gain.
And the attractive gradient is:

IJSE Journal

Fig. 2 Simplified model of the robot

B. Three joint leg configuration
A three-joint leg can be considered as a three-link revolute
joint manipulator, which is attached to robot body. Therefore,
the kinematic modelling is performed by the conventional

2
Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al.

robotics approaches. The kinematic model is derived
according to the Denavit-Hartenberg (DH) convention [6]. In
Fig. 3, a representation of a three joint leg is shown with the
reference frames and corresponding joint variables.

ISSN: 2086-5023

p d = pe0 + p r

(11)

where p d = [ xd yd zd ]T is the desired point of end-effector,

p r = [r ´ sin b , r ´ cos b ,0]T , p e 0 = [ xe 0 , ye 0 , ze 0 ]T is the
initial position of end-effector and b is then angle of moving
and r is the distance of one robot step.

Fig. 3 Three-joint leg

The end-effector position vector of one leg, p e = [ xe ye ze ]T ,
can be calculated as follows [6]:

xe = cos q1 (a1 + a3 cos(q 2 + q3 ) + a2 cos q 2 )
ye = sin q1 (a1 + a3 cos(q 2 + q 3 ) + a2 cos q 2 )

(9)

ze = -a3 sin(q 2 + q 3 ) - a2 sin q 2

Fig. 4 Crab gait motion for one leg

The operational space error vector between the desired and
the actual end-effector is defined as follows:

where q = [q1 q 2 q 3 ]T is joint angles vector.
The translational velocity vector of the end-effector, v e , can
be expressed as the time derivative of the end-effector
position vector.

& & & T
&
&
v e = p e = J P (q)q = J P (q) éq1 q 2 q 3 ù
ë
û
where J P = ¶p e / ¶q is

the

analytical

(10)
Jacobian

(12)

Then the time derivative of the error vector is:

& &
&
&
&
e = p d - p e = p d - J P (q)q

(13)

[6],

T

& ë& & & û
q = éq1 q 2 q3 ù is joint angular velocity vector and z 0 , z1 ,
z 2 are unit vectors as shown in Fig. 3.
IV. PATH TRACKING CONTROLLER DESIGN
A. Path discretization
The path generated by the potential functions method is
discretized into appropriate steps. As a simple example, in
order for the robot move for a distance of 10.0cm, the motion
planner decides to take ten 1.0cm steps. In the execution, the
legs start from a specified home position. The desired values
are supplied to the robot. The new joint angles are computed
by the tracking controller on the robot
B. Tracking controller design
At first, the gait of the robot chosen in this study is the crab
gait. The crab gait consists in moving the center of gravity of
the body along a trajectory while maintaining the body’s
orientation constant. The advantages of the crab gait are high
stability margin that allows the robot to move in larger
direction angle and computation of the joint angles is similar
for all legs. A desired tracking controller is designed to track
the path obtained from path planning algorithm.
The robot walks in direction with the angle β by moving the
end-effector of every leg with the same angle β to a desired
point as shown in Fig. 4. The desired point position is
calculated as follow:

IJSE Journal

e = pd - pe

In this paper, a controller backstepping method [8] is
proposed. The candidate Lyapunov function (clf) is chosen as
follows:

1
V (e) = eT Ke ³ 0
(14)
2
where K is a symmetric positive definite matrix.
Using Eq. (13), the derivative of Eq. (14) wrt to time is
derived as follows:

&
&
&
&
V = eT Ke = eT K (p d - J P (q)q)

(15)
&
Control input chosen are joint velocity vector, q . On the
assumption that matrix JP(q) is square and nonsingular, the
control input is chosen as follows:

&
&
q = J -1 (q)(p d + Ke)
P

(16)

From Eqs. (15) and (16), we have:
&
(17)
V = -eT Ke < 0
The joint velocity vector is designed to make the error
converge to zero when t ® ¥ . In the case of singular J P (q) .
The solution of Eq. (16) can be generalized into

3
Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al.

&
&
q = J + (q)(p d + Ke)
P
+
P

-1

ISSN: 2086-5023

(18)

where J (q) = (J (q) J P (q)) J (q) is a pseudo inverse
T
P

T
P

matrix of J P (q) .
With the control input of Eq. (18), the operational space
error e converges to 0 when t ® ¥ [6].
V. SIMULATION RESULTS
A. The potential function results
In the following simulations, the workspace is within a 10m
x 10m and there are some circular obstacles placed in it. The
starting position of the robot at point (0, 0) and the goal
position at point (8, 8). For the potential functions method, the
parameters are chosen as shows in table 1.
TABLE I
POTENTIAL FUNCTIONS METHOD PARAMETERS

Parameters

Description

h

B. The tracking simulation results

0.1

z

1

Q

d

*

*
goal

Fig. 6 Potential function

Unit

1.5

m

10

1) One path discretization
Fig.7 shows the path generated by the path planning
algorithm. The path is discretized into appropriate steps. In
this case, a step is the distance of one robot step, r = 2cm. The
direction of robot motion of each step, β, is calculated from
the path. Then the distance of one step and the direction of
each robot step are sent to robot to follow.

m

Fig. 5 shows the trajectory generated by path planning
algorithm using potential functions method. The path avoids
two obstacles at point (1, 3) and another one at point (5, 7)
and reaches goal position at point (8, 8).

Fig. 7 Path from potential functions method

Fig. 5 Path planning algorithm

Fig. 6 shows the potential function in the workspace. There
are three maxima at three obstacles and one minimum at the
goal point. The robot follows the path to move from a “high
value” state to a “low value” state of the potential function.

2) One leg simulation results
For one leg simulation results, the one leg simulation
parameters are shown in Table II .
TABLE II
ONE LEG SIMULATION PARAMETERS

Description

Unit

β

π/4

rad

r

2

cm

a1

2

cm

a2

6

cm

a3

IJSE Journal

Parameters

10

cm

4
Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al.

The initial values are chosen as shows in Table III.
TABLE III
SIMULATION INITIAL VALUES

Parameters

Description
3.121

cm

ye0

0

cm

ze0

-2.829

cm

xd

4.535

cm

yd

1.414

cm

zd

-2.829

cm

θ1

0

rad

θ2

π/4

rad

θ3

-3π/4

rad

ex

1.414

cm

ey

1.414

cm

ez

0

cm

Fig. 10 shows the operational space error when the robot
steps. After 2 seconds, the error converges to zero. The endeffector reaches the desired point Pd.

Unit

xe0

ISSN: 2086-5023

Fig. 8 shows a step of one leg from initial point to desired
point.

Fig. 10 The operational space error e

VI. CONCLUSION
This paper proposed to design a tracking controller for
obstacle avoidance of quadruped robot from start point to goal
point using a ceiling-mounted camera system method.
Ceiling-Mounted Camera system is used for image processing.
By the system, the robot and obstacles are recognized by the
color recognition method. The kinematic the robot is
presented. Potential functions method is proposed as the path
planning method to generate the path. Based on the kinematic
modelling, the path tracking controller using the backstepping
technique is presented to track the path generated by the path
planning method. The simulation results of the controller
verified the effectiveness of the proposed path planning
algorithm using potential functions method and the proposed
tracking controller.
ACKNOWLEDGMENTS
This research was supported by a grant from Construction
Technology. Innovation Program (CTIP) funded by Ministry
of Land, Transportation and Maritime Affairs (MLTM) of
Korean government.
REFERENCES
[1]
[2]

Fig. 8 A step of one leg
[3]

Fig. 9 shows the joint angles of the joints of the leg to move
one step.

[4]

[5]

[6]
[7]

[8]

C. Zhang and S. M. Song, “Gaits and Geometry of a Walking Chair for
Disabled”, J. Terramech, vol. 26, pp. 211-233, Nov. 1989.
S. Hirose and Y. Umetani, “The Basic Consideration on a Feasible
Walking Mechanism as a Terrain Vehicle”, Trans. Soc. Instrument
Contr. Engineers, vol. 15, pp. 298-933, Nov. 1979.
S. Ma, T. Tomiyama and H. Wada, “Omnidirectional Static Walking of
a Quadruped Robot”, IEEE Trans. on Robotics, vol. 21, pp. 152-161,
Apr. 2005.
P. G. D. Santos and M. A. Jimenez, “Path Tracking With Quadruped
Walking Machines Using Discontinuous Gaits”, Computers Elect.
Engng, vol. 21, pp. 383-396, Aug. 1995.
Y. K. Hwang and N. Ahuja, “A Potential Field Approach to Path
Planning”, IEEE Trans. on Robotics and Automation, vol. 8, pp. 23-32,
Feb. 1992.
B. Siciliano, L. Sciavicco, L. Villani and G. Oriolo: Robotics
Modelling, Planning and Control, 2nd ed., Springer-Verlag, 2009.
R. Fierro and F. L. Lewis, “Control of a Nonholonomic Mobile Robot:
Backstepping Kinematics into Dynamics”, Journal of Robotic Systems,
vol.14, pp. 149-163, Nov. 1997.
Y. Go, X. Yin and A. Bowling, “Navigability of Multi-Legged Robots”,
IEEE/ASME Trans. on Mechatronics, vol. 11, pp.1-8, Feb. 2006.

Fig. 9 Joint angles in one step

IJSE Journal

5

More Related Content

What's hot

Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...eSAT Journals
 
Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...eSAT Publishing House
 
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
 
Manipulability index of a parallel robot manipulator
Manipulability index of a parallel robot manipulatorManipulability index of a parallel robot manipulator
Manipulability index of a parallel robot manipulatorIAEME Publication
 
Pedestrian dead reckoning indoor localization based on os-elm
Pedestrian dead reckoning indoor localization based on os-elmPedestrian dead reckoning indoor localization based on os-elm
Pedestrian dead reckoning indoor localization based on os-elmAlwin Poulose
 
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...JaresJournal
 
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMINGROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMINGTAMILMECHKIT
 
Robot forward and inverse kinematics research using matlab by d.sivasamy
Robot forward and inverse kinematics research using matlab by d.sivasamyRobot forward and inverse kinematics research using matlab by d.sivasamy
Robot forward and inverse kinematics research using matlab by d.sivasamySiva Samy
 
Parameter study of stable walking gaits for nao humanoid robot
Parameter study of stable walking gaits for nao humanoid robotParameter study of stable walking gaits for nao humanoid robot
Parameter study of stable walking gaits for nao humanoid roboteSAT Journals
 
Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...
Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...
Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...IOSR Journals
 
Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)
Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)
Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)IOSR Journals
 
Parameter study of stable walking gaits for nao
Parameter study of stable walking gaits for naoParameter study of stable walking gaits for nao
Parameter study of stable walking gaits for naoeSAT Publishing House
 
Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematicsnguyendattdh
 
path planning for nedocio
path planning for nedociopath planning for nedocio
path planning for nedocioCarlos Iza
 

What's hot (20)

Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...
 
Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...
 
Trajectory
TrajectoryTrajectory
Trajectory
 
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...
 
Manipulability index of a parallel robot manipulator
Manipulability index of a parallel robot manipulatorManipulability index of a parallel robot manipulator
Manipulability index of a parallel robot manipulator
 
Pedestrian dead reckoning indoor localization based on os-elm
Pedestrian dead reckoning indoor localization based on os-elmPedestrian dead reckoning indoor localization based on os-elm
Pedestrian dead reckoning indoor localization based on os-elm
 
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
A NOVEL NAVIGATION STRATEGY FOR AN UNICYCLE MOBILE ROBOT INSPIRED FROM THE DU...
 
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMINGROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
ROBOTICS-ROBOT KINEMATICS AND ROBOT PROGRAMMING
 
sawano-icma2000
sawano-icma2000sawano-icma2000
sawano-icma2000
 
Robot forward and inverse kinematics research using matlab by d.sivasamy
Robot forward and inverse kinematics research using matlab by d.sivasamyRobot forward and inverse kinematics research using matlab by d.sivasamy
Robot forward and inverse kinematics research using matlab by d.sivasamy
 
report
reportreport
report
 
Parameter study of stable walking gaits for nao humanoid robot
Parameter study of stable walking gaits for nao humanoid robotParameter study of stable walking gaits for nao humanoid robot
Parameter study of stable walking gaits for nao humanoid robot
 
Robotics - introduction to Robotics
Robotics -  introduction to Robotics  Robotics -  introduction to Robotics
Robotics - introduction to Robotics
 
Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...
Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...
Car Dynamics using Quarter Model and Passive Suspension, Part II: A Novel Sim...
 
Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)
Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)
Analysis Of NACA 6412 Airfoil (Purpose: Propeller For Flying Bike)
 
Parameter study of stable walking gaits for nao
Parameter study of stable walking gaits for naoParameter study of stable walking gaits for nao
Parameter study of stable walking gaits for nao
 
Manor_final
Manor_finalManor_final
Manor_final
 
Matlab robotics toolbox
Matlab robotics toolboxMatlab robotics toolbox
Matlab robotics toolbox
 
Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
 
path planning for nedocio
path planning for nedociopath planning for nedocio
path planning for nedocio
 

Viewers also liked

Tugas softskill desember
Tugas softskill desemberTugas softskill desember
Tugas softskill desemberAhmad Fahrizald
 
Keindahan terumbu karang indonesia
Keindahan terumbu karang indonesiaKeindahan terumbu karang indonesia
Keindahan terumbu karang indonesiaAhmad Fahrizald
 
Makalah ekonomi teknik desember2
Makalah ekonomi teknik desember2Makalah ekonomi teknik desember2
Makalah ekonomi teknik desember2Ahmad Fahrizald
 
Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...
Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...
Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...Ahmad Fahrizald
 

Viewers also liked (6)

Tugas softskill desember
Tugas softskill desemberTugas softskill desember
Tugas softskill desember
 
Keindahan terumbu karang indonesia
Keindahan terumbu karang indonesiaKeindahan terumbu karang indonesia
Keindahan terumbu karang indonesia
 
Presentation2
Presentation2Presentation2
Presentation2
 
Makalah ekonomi teknik desember2
Makalah ekonomi teknik desember2Makalah ekonomi teknik desember2
Makalah ekonomi teknik desember2
 
1265 2956-1-pb
1265 2956-1-pb1265 2956-1-pb
1265 2956-1-pb
 
Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...
Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...
Tugas ekonomi teknik (laporan studi kasus perancangan alat pencuci mobil otom...
 

Similar to 4260 9235-1-pb

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
 
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOT
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOTGENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOT
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOTcscpconf
 
Research on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot TrajectoryResearch on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot TrajectoryIJRESJOURNAL
 
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
 
Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...
Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...
Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...IJERA Editor
 
A New Method For Solving Kinematics Model Of An RA-02
A New Method For Solving Kinematics Model Of An RA-02A New Method For Solving Kinematics Model Of An RA-02
A New Method For Solving Kinematics Model Of An RA-02IJERA Editor
 
simuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematicssimuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematicsReza Fazaeli
 
Ultimate Goals In Robotics
Ultimate Goals In RoboticsUltimate Goals In Robotics
Ultimate Goals In RoboticsFarzad Nozarian
 
Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...
Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...
Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...IJRES Journal
 
Path Planning And Navigation
Path Planning And NavigationPath Planning And Navigation
Path Planning And Navigationguest90654fd
 
Path Planning And Navigation
Path Planning And NavigationPath Planning And Navigation
Path Planning And Navigationguest90654fd
 
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
 
The cubic root unscented kalman filter to estimate the position and orientat...
The cubic root unscented kalman filter to estimate  the position and orientat...The cubic root unscented kalman filter to estimate  the position and orientat...
The cubic root unscented kalman filter to estimate the position and orientat...IJECEIAES
 
Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...
Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...
Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...Nooria Sukmaningtyas
 
Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Onyebuchi nosiri
 
Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Onyebuchi nosiri
 
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...IJECEIAES
 
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...UniversitasGadjahMada
 
Simulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorSimulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorjournalBEEI
 
090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdfsivapathuri
 

Similar to 4260 9235-1-pb (20)

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
 
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOT
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOTGENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOT
GENERATION AND DEPARTABILITY OF GVG FOR CAR-LIKE ROBOT
 
Research on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot TrajectoryResearch on The Control of Joint Robot Trajectory
Research on The Control of Joint Robot Trajectory
 
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
 
Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...
Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...
Implementation of an Algorithm for the Locomotion of Quadruped Robot with Bim...
 
A New Method For Solving Kinematics Model Of An RA-02
A New Method For Solving Kinematics Model Of An RA-02A New Method For Solving Kinematics Model Of An RA-02
A New Method For Solving Kinematics Model Of An RA-02
 
simuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematicssimuliton of biped walkinng robot using kinematics
simuliton of biped walkinng robot using kinematics
 
Ultimate Goals In Robotics
Ultimate Goals In RoboticsUltimate Goals In Robotics
Ultimate Goals In Robotics
 
Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...
Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...
Experimental Comparison of Trajectory Planning Algorithms for Wheeled Mobile ...
 
Path Planning And Navigation
Path Planning And NavigationPath Planning And Navigation
Path Planning And Navigation
 
Path Planning And Navigation
Path Planning And NavigationPath Planning And Navigation
Path Planning And Navigation
 
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
 
The cubic root unscented kalman filter to estimate the position and orientat...
The cubic root unscented kalman filter to estimate  the position and orientat...The cubic root unscented kalman filter to estimate  the position and orientat...
The cubic root unscented kalman filter to estimate the position and orientat...
 
Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...
Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...
Robot Three Dimensional Space Path-planning Applying the Improved Ant Colony ...
 
Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery
 
Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery Quadcopter Design for Payload Delivery
Quadcopter Design for Payload Delivery
 
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
 
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
Center of Pressure Feedback for Controlling the Walking Stability Bipedal Rob...
 
Simulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulatorSimulation design of trajectory planning robot manipulator
Simulation design of trajectory planning robot manipulator
 
090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf090RobotTrajectoryGenerationEn.pdf
090RobotTrajectoryGenerationEn.pdf
 

Recently uploaded

How to Remove Document Management Hurdles with X-Docs?
How to Remove Document Management Hurdles with X-Docs?How to Remove Document Management Hurdles with X-Docs?
How to Remove Document Management Hurdles with X-Docs?XfilesPro
 
CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):comworks
 
Enhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for PartnersEnhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for PartnersThousandEyes
 
Pigging Solutions Piggable Sweeping Elbows
Pigging Solutions Piggable Sweeping ElbowsPigging Solutions Piggable Sweeping Elbows
Pigging Solutions Piggable Sweeping ElbowsPigging Solutions
 
Making_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptx
Making_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptxMaking_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptx
Making_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptxnull - The Open Security Community
 
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024BookNet Canada
 
Snow Chain-Integrated Tire for a Safe Drive on Winter Roads
Snow Chain-Integrated Tire for a Safe Drive on Winter RoadsSnow Chain-Integrated Tire for a Safe Drive on Winter Roads
Snow Chain-Integrated Tire for a Safe Drive on Winter RoadsHyundai Motor Group
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machinePadma Pradeep
 
#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024BookNet Canada
 
Next-generation AAM aircraft unveiled by Supernal, S-A2
Next-generation AAM aircraft unveiled by Supernal, S-A2Next-generation AAM aircraft unveiled by Supernal, S-A2
Next-generation AAM aircraft unveiled by Supernal, S-A2Hyundai Motor Group
 
WhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure serviceWhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure servicePooja Nehwal
 
How to convert PDF to text with Nanonets
How to convert PDF to text with NanonetsHow to convert PDF to text with Nanonets
How to convert PDF to text with Nanonetsnaman860154
 
Slack Application Development 101 Slides
Slack Application Development 101 SlidesSlack Application Development 101 Slides
Slack Application Development 101 Slidespraypatel2
 
Key Features Of Token Development (1).pptx
Key  Features Of Token  Development (1).pptxKey  Features Of Token  Development (1).pptx
Key Features Of Token Development (1).pptxLBM Solutions
 
08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking MenDelhi Call girls
 
Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Allon Mureinik
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsMark Billinghurst
 

Recently uploaded (20)

How to Remove Document Management Hurdles with X-Docs?
How to Remove Document Management Hurdles with X-Docs?How to Remove Document Management Hurdles with X-Docs?
How to Remove Document Management Hurdles with X-Docs?
 
CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):CloudStudio User manual (basic edition):
CloudStudio User manual (basic edition):
 
Enhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for PartnersEnhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for Partners
 
Pigging Solutions Piggable Sweeping Elbows
Pigging Solutions Piggable Sweeping ElbowsPigging Solutions Piggable Sweeping Elbows
Pigging Solutions Piggable Sweeping Elbows
 
Making_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptx
Making_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptxMaking_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptx
Making_way_through_DLL_hollowing_inspite_of_CFG_by_Debjeet Banerjee.pptx
 
The transition to renewables in India.pdf
The transition to renewables in India.pdfThe transition to renewables in India.pdf
The transition to renewables in India.pdf
 
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
 
Snow Chain-Integrated Tire for a Safe Drive on Winter Roads
Snow Chain-Integrated Tire for a Safe Drive on Winter RoadsSnow Chain-Integrated Tire for a Safe Drive on Winter Roads
Snow Chain-Integrated Tire for a Safe Drive on Winter Roads
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machine
 
#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
#StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
 
Next-generation AAM aircraft unveiled by Supernal, S-A2
Next-generation AAM aircraft unveiled by Supernal, S-A2Next-generation AAM aircraft unveiled by Supernal, S-A2
Next-generation AAM aircraft unveiled by Supernal, S-A2
 
WhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure serviceWhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 ✓Call Girls In Kalyan ( Mumbai ) secure service
 
How to convert PDF to text with Nanonets
How to convert PDF to text with NanonetsHow to convert PDF to text with Nanonets
How to convert PDF to text with Nanonets
 
E-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptx
E-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptxE-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptx
E-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptx
 
Slack Application Development 101 Slides
Slack Application Development 101 SlidesSlack Application Development 101 Slides
Slack Application Development 101 Slides
 
Vulnerability_Management_GRC_by Sohang Sengupta.pptx
Vulnerability_Management_GRC_by Sohang Sengupta.pptxVulnerability_Management_GRC_by Sohang Sengupta.pptx
Vulnerability_Management_GRC_by Sohang Sengupta.pptx
 
Key Features Of Token Development (1).pptx
Key  Features Of Token  Development (1).pptxKey  Features Of Token  Development (1).pptx
Key Features Of Token Development (1).pptx
 
08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men
 
Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)Injustice - Developers Among Us (SciFiDevCon 2024)
Injustice - Developers Among Us (SciFiDevCon 2024)
 
Human Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR SystemsHuman Factors of XR: Using Human Factors to Design XR Systems
Human Factors of XR: Using Human Factors to Design XR Systems
 

4260 9235-1-pb

  • 1. Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al. ISSN: 2086-5023 Path Tracking Controller of Quadruped Robot for Obstacle Avoidance Using Potential Functions Method Giang Hoang#1, Hak Kyeong Kim#1, and Sang Bong Kim#1 # Department of Mechanical and Automotive Engineering, Pukyong National University, Busan 608-739, Korea 1 kimsb@pknu.ac.kr Abstract— This paper proposes a tracking controller for obstacle avoidance of a quadruped robot using potential functions method. The followings are done for this task. At first, a ceiling-mounted camera system is installed for image processing. The goal point and obstacles are separated and recognized by a color recognition method. Second, a path planning algorithm using potential functions method is proposed to generate the path to avoid obstacles and to plan a path for the quadruped robot to reach from start point to goal point. Third, a quadruped robot is chosen as the mobile platform for this study and the kinematic model for the robot is presented. Fourth, a tracking controller is designed for the quadruped robot to track the trajectory based on the backstepping method using Lyapunov function. Finally, the simulation results are presented to show the effectiveness of the proposed trajectory planning algorithm and the tracking controller. [Keywords— Path tracking; back stepping; obstacles avoidance; potential functions; quadruped robot]. I. INTRODUCTION During the last decade, research on walking robots has been focused mainly on gait generation. Many gaits have been studied and implemented in walking machines. Although gait generation has been a very important subject for researching, lack of attention has been paid to path tracking with walking robot. Zhang et al. formulated the wave-crab gait and the circular wave gait in [1]. In [2], a four-legged walking robot called PVII was built by Hirose and Umetani. The PVII can maintain a horizontal body orientation and has contact sensor on each foot to detect contact with the ground. In [3], Ma et al. proposed a gait transition method for a quadruped robot to achieve omni-directional static walking. These papers proposed only walking gaits and stability of the walking robot. In [4], Santos et al. introduced path tracking methods using discontinuous gaits. But they used an open loop control algorithm. Therefore, a closed-loop control with camera feedbacks is needed. This paper addressed a trajectory tracking problem: control a quadruped robot to track a path generated by a path planning algorithm for obstacles avoidance. The control technology for our system is presented in following sequence. First, the server computer receives image from the camera. The obstacles and goal point are marked. Second, the proposed potential functions method is applied and a trajectory from a start point to a goal point is generated. Third, the kinematic model for the quadruped robot is presented. From the modelling, a backstepping controller is designed for the robot to track the planned trajectory generated by the potential functions method. The simulation results are presented to show the effectiveness of the proposed trajectory planning IJSE Journal algorithm and tracking controller of the robot for obstacle avoidance. II. SYSTEM DESCRIPTION AND PATH PLANNING ALGORITHM USING POTENTIAL FUNCTIONS METHOD A. System description In this section, the ceiling-mounted camera system configuration is introduced. The system includes a ceilingmounted camera, server computer, the quadruped robot and obstacles in random positions in Fig. 1. Fig. 1 Configuration of Ceiling-mounted Camera System The camera is connected to the server computer by USB interface. The server computer receives image from the camera to perform image processing, generates the path and then sends commands to the robot. B. Potential function This section describes the use of potential functions in path planning [5]. A potential function U (p) can be viewed as energy. Hence the gradient ÑU (p) of the potential function can be viewed as force as follows: ÑU = [ ¶U / ¶x(p ), ¶U / ¶y (p )] T (1) T where p = [x y] is a position vector of the robot in the map. The potential function approach directs the robot as if it is a particle moving in a gradient vector field. Gradients can be intuitively viewed as forces acting on a positively charged particle robot which attached to the negatively charged goal. Obstacles also have a positive charge which forms a repulsive force directing the robot away from obstacles. The combination of repulsive and attractive forces directs the robot 1
  • 2. Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al. from the start point to the goal point while avoiding obstacles. Potential function can be constructed as the sum of attractive and repulsive potentials as follows: U (p) = U att (p) + U rep (p) (2) where U att (p) is the attractive potential function and U rep (p) is the repulsive potential function. The attractive potential represents that the robot attract to the goal. The repulsive potential represents that the robot repels from obstacles. The repulsive potential function in terms of individual obstacles can be commonly used the following form. 2 ì1 æ 1 1 ö ï hç - *÷ U repi (p ) = í 2 è di (p) Q ø ï î0 , di (p) £ Q * , di (p) > Q (3) * ISSN: 2086-5023 * ìz (p - p goal ) , d (p, p goal ) £ d goal ï * ÑU att (p) = í d goal z (p - p goal ) * , d (p, p goal ) > d goal ï d (p, p goal ) î (7) C. Gradient descent The robot moves from a “high value” state to a “low value” state of the potential function. The vector of the gradient points the direction that the potential function will increase. Therefore, the robot follows a path “downhill” by following the negated gradient of the potential function. Following such a path is called gradient descent. The robot terminates motion when and p* is called a critical point. The point p* is maximum, minimum or saddle point. We use the second derivative (Hessian matrix) to determine the type of critical point. The gradient descent algorithm can be defined as: p(0) = p start i=0 where di (p) is the distance from the robot to obstacle i, Qi* is the threshold distance to allow the robot to ignore obstacles and h is the repulsive gain. while (|| ÑU (p i ) ||< e ) do p i +1 = p i - a ´ (ÑU (p i )) (8) i = i + 1; end while Then the repulsive gradient is: ì æ 1 1 ö 1 Ñdi (p) , di (p) £ Q * ïh ç * ÷ Q d i (p ) ø d i 2 (p ) ï è ï ÑU rep i (p) = í ï , d i (p) > Q * ï0 ï î (4) III. KINEMATIC MODELLING OF QUADRUPED ROBOT The total repulsive function and gradient can be calculated as follows: n U rep (p) = å U rep i (p) i =0 n ÑU rep (p) = å ÑU rep i (p) where the notation p i is used to denote the value of p at the ith iteration and the final path consist of the sequence of iterates {p 0 , p1 , p 2 ,..., pi } that is the path for trajectory tracking controller. The value of the scalar a determines the step size of the iteration. A. Design of quadruped robot The quadruped robot in this paper consists of one body and four legs. Each leg has three joints. Fig. 2 shows the simplified model of the robot. (5) i =0 The attractive potential can be chosen as follows: ì1 2 * , d (p, p goal ) £ d goal ï 2 z d (p, p goal ) ï U att (p ) = í ïd * z d (p, p ) - 1 z (d * ) 2 , d (p, p ) > d * goal goal goal goal ï goal î 2 (6) where d (p, p goal ) is the distance from the robot position to the * goal position, d goal is a threshold distance from the robot position to the goal position where the attractive potential function switch and z is the repulsive gain. And the attractive gradient is: IJSE Journal Fig. 2 Simplified model of the robot B. Three joint leg configuration A three-joint leg can be considered as a three-link revolute joint manipulator, which is attached to robot body. Therefore, the kinematic modelling is performed by the conventional 2
  • 3. Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al. robotics approaches. The kinematic model is derived according to the Denavit-Hartenberg (DH) convention [6]. In Fig. 3, a representation of a three joint leg is shown with the reference frames and corresponding joint variables. ISSN: 2086-5023 p d = pe0 + p r (11) where p d = [ xd yd zd ]T is the desired point of end-effector, p r = [r ´ sin b , r ´ cos b ,0]T , p e 0 = [ xe 0 , ye 0 , ze 0 ]T is the initial position of end-effector and b is then angle of moving and r is the distance of one robot step. Fig. 3 Three-joint leg The end-effector position vector of one leg, p e = [ xe ye ze ]T , can be calculated as follows [6]: xe = cos q1 (a1 + a3 cos(q 2 + q3 ) + a2 cos q 2 ) ye = sin q1 (a1 + a3 cos(q 2 + q 3 ) + a2 cos q 2 ) (9) ze = -a3 sin(q 2 + q 3 ) - a2 sin q 2 Fig. 4 Crab gait motion for one leg The operational space error vector between the desired and the actual end-effector is defined as follows: where q = [q1 q 2 q 3 ]T is joint angles vector. The translational velocity vector of the end-effector, v e , can be expressed as the time derivative of the end-effector position vector. & & & T & & v e = p e = J P (q)q = J P (q) éq1 q 2 q 3 ù ë û where J P = ¶p e / ¶q is the analytical (10) Jacobian (12) Then the time derivative of the error vector is: & & & & & e = p d - p e = p d - J P (q)q (13) [6], T & ë& & & û q = éq1 q 2 q3 ù is joint angular velocity vector and z 0 , z1 , z 2 are unit vectors as shown in Fig. 3. IV. PATH TRACKING CONTROLLER DESIGN A. Path discretization The path generated by the potential functions method is discretized into appropriate steps. As a simple example, in order for the robot move for a distance of 10.0cm, the motion planner decides to take ten 1.0cm steps. In the execution, the legs start from a specified home position. The desired values are supplied to the robot. The new joint angles are computed by the tracking controller on the robot B. Tracking controller design At first, the gait of the robot chosen in this study is the crab gait. The crab gait consists in moving the center of gravity of the body along a trajectory while maintaining the body’s orientation constant. The advantages of the crab gait are high stability margin that allows the robot to move in larger direction angle and computation of the joint angles is similar for all legs. A desired tracking controller is designed to track the path obtained from path planning algorithm. The robot walks in direction with the angle β by moving the end-effector of every leg with the same angle β to a desired point as shown in Fig. 4. The desired point position is calculated as follow: IJSE Journal e = pd - pe In this paper, a controller backstepping method [8] is proposed. The candidate Lyapunov function (clf) is chosen as follows: 1 V (e) = eT Ke ³ 0 (14) 2 where K is a symmetric positive definite matrix. Using Eq. (13), the derivative of Eq. (14) wrt to time is derived as follows: & & & & V = eT Ke = eT K (p d - J P (q)q) (15) & Control input chosen are joint velocity vector, q . On the assumption that matrix JP(q) is square and nonsingular, the control input is chosen as follows: & & q = J -1 (q)(p d + Ke) P (16) From Eqs. (15) and (16), we have: & (17) V = -eT Ke < 0 The joint velocity vector is designed to make the error converge to zero when t ® ¥ . In the case of singular J P (q) . The solution of Eq. (16) can be generalized into 3
  • 4. Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al. & & q = J + (q)(p d + Ke) P + P -1 ISSN: 2086-5023 (18) where J (q) = (J (q) J P (q)) J (q) is a pseudo inverse T P T P matrix of J P (q) . With the control input of Eq. (18), the operational space error e converges to 0 when t ® ¥ [6]. V. SIMULATION RESULTS A. The potential function results In the following simulations, the workspace is within a 10m x 10m and there are some circular obstacles placed in it. The starting position of the robot at point (0, 0) and the goal position at point (8, 8). For the potential functions method, the parameters are chosen as shows in table 1. TABLE I POTENTIAL FUNCTIONS METHOD PARAMETERS Parameters Description h B. The tracking simulation results 0.1 z 1 Q d * * goal Fig. 6 Potential function Unit 1.5 m 10 1) One path discretization Fig.7 shows the path generated by the path planning algorithm. The path is discretized into appropriate steps. In this case, a step is the distance of one robot step, r = 2cm. The direction of robot motion of each step, β, is calculated from the path. Then the distance of one step and the direction of each robot step are sent to robot to follow. m Fig. 5 shows the trajectory generated by path planning algorithm using potential functions method. The path avoids two obstacles at point (1, 3) and another one at point (5, 7) and reaches goal position at point (8, 8). Fig. 7 Path from potential functions method Fig. 5 Path planning algorithm Fig. 6 shows the potential function in the workspace. There are three maxima at three obstacles and one minimum at the goal point. The robot follows the path to move from a “high value” state to a “low value” state of the potential function. 2) One leg simulation results For one leg simulation results, the one leg simulation parameters are shown in Table II . TABLE II ONE LEG SIMULATION PARAMETERS Description Unit β π/4 rad r 2 cm a1 2 cm a2 6 cm a3 IJSE Journal Parameters 10 cm 4
  • 5. Internat. J. of Sci. and Eng., Vol. 4(1):1-5, January 2013, Giang Hoang et al. The initial values are chosen as shows in Table III. TABLE III SIMULATION INITIAL VALUES Parameters Description 3.121 cm ye0 0 cm ze0 -2.829 cm xd 4.535 cm yd 1.414 cm zd -2.829 cm θ1 0 rad θ2 π/4 rad θ3 -3π/4 rad ex 1.414 cm ey 1.414 cm ez 0 cm Fig. 10 shows the operational space error when the robot steps. After 2 seconds, the error converges to zero. The endeffector reaches the desired point Pd. Unit xe0 ISSN: 2086-5023 Fig. 8 shows a step of one leg from initial point to desired point. Fig. 10 The operational space error e VI. CONCLUSION This paper proposed to design a tracking controller for obstacle avoidance of quadruped robot from start point to goal point using a ceiling-mounted camera system method. Ceiling-Mounted Camera system is used for image processing. By the system, the robot and obstacles are recognized by the color recognition method. The kinematic the robot is presented. Potential functions method is proposed as the path planning method to generate the path. Based on the kinematic modelling, the path tracking controller using the backstepping technique is presented to track the path generated by the path planning method. The simulation results of the controller verified the effectiveness of the proposed path planning algorithm using potential functions method and the proposed tracking controller. ACKNOWLEDGMENTS This research was supported by a grant from Construction Technology. Innovation Program (CTIP) funded by Ministry of Land, Transportation and Maritime Affairs (MLTM) of Korean government. REFERENCES [1] [2] Fig. 8 A step of one leg [3] Fig. 9 shows the joint angles of the joints of the leg to move one step. [4] [5] [6] [7] [8] C. Zhang and S. M. Song, “Gaits and Geometry of a Walking Chair for Disabled”, J. Terramech, vol. 26, pp. 211-233, Nov. 1989. S. Hirose and Y. Umetani, “The Basic Consideration on a Feasible Walking Mechanism as a Terrain Vehicle”, Trans. Soc. Instrument Contr. Engineers, vol. 15, pp. 298-933, Nov. 1979. S. Ma, T. Tomiyama and H. Wada, “Omnidirectional Static Walking of a Quadruped Robot”, IEEE Trans. on Robotics, vol. 21, pp. 152-161, Apr. 2005. P. G. D. Santos and M. A. Jimenez, “Path Tracking With Quadruped Walking Machines Using Discontinuous Gaits”, Computers Elect. Engng, vol. 21, pp. 383-396, Aug. 1995. Y. K. Hwang and N. Ahuja, “A Potential Field Approach to Path Planning”, IEEE Trans. on Robotics and Automation, vol. 8, pp. 23-32, Feb. 1992. B. Siciliano, L. Sciavicco, L. Villani and G. Oriolo: Robotics Modelling, Planning and Control, 2nd ed., Springer-Verlag, 2009. R. Fierro and F. L. Lewis, “Control of a Nonholonomic Mobile Robot: Backstepping Kinematics into Dynamics”, Journal of Robotic Systems, vol.14, pp. 149-163, Nov. 1997. Y. Go, X. Yin and A. Bowling, “Navigability of Multi-Legged Robots”, IEEE/ASME Trans. on Mechatronics, vol. 11, pp.1-8, Feb. 2006. Fig. 9 Joint angles in one step IJSE Journal 5