SlideShare a Scribd company logo
1 of 8
Download to read offline
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 77
PERFORMANCE MEASUREMENT AND DYNAMIC ANALYSIS OF TWO
DOF ROBOTIC ARM MANIPULATOR
Y. D. Patel1
, P. M. George2
1
Associate Professor, Department of Mechanical Engineering, A. D. Patel Institute of Technology, New Vallabh
Vidyanagar, Gujarat, India, yash523@rediffmail.com
2
Professor, Department of Mechanical Engineering, Birla Vishvakarma Mahavidyalaya Engineering College, Vallabh
Vidyanagar, India, pmgeorge02@yahoo.com
Abstract
Forward and inverse kinematic analysis of 2DOF robot is presented to predict singular configurations. Cosine function is used for
servo motor simulation of kinematics and dynamics using Pro/Engineer. The significance of joint-2 for reducing internal singularities
is highlighted. Performance analysis in terms of condition number, local conditioning index and mobility index is carried out for the
manipulator. Dynamic analysis using Lagrangian’s and Newton’s Euler approach is worked out analytically using MATLAB and
results are plotted for their comparison.
Index Terms: Forward kinematics, Inverse Kinematics, Workspace boundary, Singularity, Dynamics
-----------------------------------------------------------------------***-----------------------------------------------------------------------
1. INTRODUCTION
Automation is an integral part of day to day activities of
modern manufacturing organizations throughout the world.
Serial as well as parallel robotic manipulators play a wider and
significant role for automation in those organizations.
Advancement in serial manipulators is lucrative for the
researchers either for its better control, singular
configurations, optimization of the manipulator parameters or
improving workspace. The prime importance in study of robot
motion without regard to forces that produce it is still a
challenging area for researchers for any type of manipulators.
Typically, it is constrained by the geometry of links used for
the configuration. Such areas include robot arm workspace-
points cloud of robotic manipulator reach, singularity- a
position in the robot's workspace where one or more joints no
longer represent independent controlling variables. The
equally important aspect of dynamic studies of the
manipulator is to understand nature and magnitude of forces
acting, singularity avoidance, power requirements as well as
optimization criterion. PD control with computed feed forward
controller was compared and was found best amongst
computed-torque control, PD+ control, PD control with
computed feed forward and PD control based on root mean
square average performance index by Reyes and Kelly [1].
Artificial Neural Network method as an alternative solution
for forward and inverse kinematic mapping was proposed by
Jolly Shah, S.S.Rattan, B.C.Nakra [2]. DH Parameter
formulation represented using four parameters by Denavit &
Hartenberg (1955) [3], which showed that a general
transformation between two joints in a space. The decoupling
of dynamic equations eliminates torques due to gravitational,
centripetal and coriolis forces [4]. Kinematic and dynamic
parameters are analyzed using ANNOVA to imitate the real
time performance measurement of 2-DOF planar manipulator
[5]. Optimal dynamic balancing is formulated by minimization
of the root-mean-square value of the input torque of 2DOF
serial manipulator and results are simulated using ADAMS
software [6]. The dynamic parameters of 2 DOF are estimated
and results are validated through simulation [7]. Non-linear
control law for serially arranged n-link is derived using
Lyapunov-based theory by M W Sponge [8]. Recently,
position control using neuro-fuzzy controller is proposed for
2-DOF serial manipulator [9].
Forward and inverse kinematics, DH parameters formulations
and dynamic analysis for 2 DOF robot arm is as under,
Fig -1: Two DOF planar manipulator
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 78
2. FORWARD KINEMATICS
The position and orientation of end effectors is a non linear
function of joint variables P3 x, y = f q .
x = L1cosq1 + L2cos q1 + q2 (1)
y = L1sinq1 + L2sin q1 + q2 (2)
Joint ranges are constrained for the manipulator analysis in the
present case as,
+90°
≤ q1 ≪ −90°
and + 45°
≤ q2 ≪ −45°
By differentiating the above two expressions,
x = −L1sinq1 ∙ q1 − L2sin q1 + q2 q1 + q2 (3)
y = L1cosq1 ∙ q1 + L2cos q1 + q2 q1 + q2 (4)
In matrix form,
x
y
=
−L1sinq1 − L2sin q1 + q2 −L2sin q1 + q2
L1cosq1 + L2cos q1 + q2 L2cos q1 + q2
q1
q2
X = J ∙ q
Where, X is the velocity of end effector, J is jacobian matrix
and q represents joint rates. For a rotational joint the analytic a
geometric jacobian are different. Jacobian matrix represents
the relationship between rates of change of pose with respect
to joint rates. Rank deficiency of jacobian represents
singularity.
2.1 DH parameters of 2DOF arm
Fig -2: Frame attachment for Two DOF planar manipulator
Table -1: DH Parameters
Link α a d θ
1 0 L1 0 θ1
2 0 L2 0 θ2
T =
C1 −S1 0 L1C1
S1 C1 0 L1S1
0 0 1 0
0 0 0 1
1
0
T =
C2 −S2 0 L2C2
S2 C2 0 L2S2
0 0 1 0
0 0 0 1
2
1
T =
C12 −S12 0 L1C1 + L2C12
S12 C12 0 L1S1 + L2S12
0 0 1 0
0 0 0 1
2
0
Where,
Li = Link length of ith link
θi = Joint rates of ith actuator
C1 = cosθ1
S1 = sinθ1
C12 = cos⁡θ1 + θ2
S12 = sin⁡θ1 + θ2
Fig -3: Kinematic Mapping
3. INVERSE KINEMATICS
The pose of the robot manipulator H =
R P
0 1
is known and
the joint variables need to be identified for a pose. The
geometric solution of the inverse kinematics are summarized
in the form of,
cosq2 =
x2
+ y2
− L1
2
− L2
2
2L1L2
tanq1 =
y L2cosq2 + L1 − x1L2sinq2
x L1 + L2cosq2 + yL2sinq2
Joint velocity and the end-effectors velocity has a velocity
constraint and is expressed as,
q = J−1
X
J−1
=
C12/ L1S2 S12/ L1S2
− L2C12 + L1C1 /L1L2S2 − L2S12 + L1S1 /L1L2S2
Task
Space
Forward Kinematics
Inverse Kinematics
Joint
Space
Rate of change
of Cartesian
pose
Jacobian
Rate of change
of joint position
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 79
Determinant of inverse jacobian matrix is − C12S1 − S12C1 /
L1L2S2
2
. If the value of determinant is zero for given task
space coordinates then the resulting configuration is singular.
Desired pose can be achieved by iterative determination of the
joint angles. Multi valued inverse mapping and redundancy
are common problems with inverse kinematic.
4. PERFORMANCE MEASUREMENT
Manipulability measures the effective robotic pose for object
manipulation with in workspace. The term was proposed by
Yoshikawa [10] and manipulability index (μ) is defined as,
μ = det⁡(J) = σi
2
i=1
Where, J is jacobian of robot kinematics. For a two DOF RR-
robotic manipulator, the manipulability index is in form
of μ = L1L2 sinq2 . The manipulability index always varies
within the workspace. The normalized mobility index is also
an alternative way to represent a singular configuration and
determining well conditioned workspace. Its value near to zero
near boundaries shows boundary singularities. The condition
number is another measure of presence of singularity as well
as dexterity of robotic pose. Normally, the larger value of
condition number above 30 indicates presence of singularity.
The condition number is representation of an amplification
factor of error during actuation. It is used for optimum
trajectory planning and gross motion calculation of robotic
manipulation within workspace. It ranges from 1 ≤ κ ≤ ∞.
Hence, the local conditioning index also known as reciprocal
of condition number is used to determine control accuracy,
dexterity and isotropy of manipulator. Figure 4(a) and 4(b)
shows the variation of mobility index and condition number
within workspace for l1 = 0.2m and l2 = 0.15 m without time
lag between servomotors with cosine input using MATLAB
program respectively. The position curve is also plotted in
same figure as shown on xy-plane for specified joint ranges.
Fig -4 (a): Variation of condition number
Fig -4 (b): Mobility Index μ
Moreover, jacobian matrix loses its rank then the
corresponding robot configurations are termed as singular
configurations. It means for the smaller movements in
operational space large amount of velocities are required at
joints.
Fig -5: Variation of condition number and mobility index
with respect to time
q = A ∗ cos 360 ∗
x
T
+ B + C is called a general cosine
function, which is used as an input to the both servo motors
simulation for kinematic and dynamic analysis. In the
expression A, B, C and T affects amplitude, phase, offset
(horizontal translation) and period (vertical translation)
respectively.
-0.4
-0.2
0
0.2
0.4
-0.2
0
0.2
0.4
0.6
0
200
400
600
x (m)y (m)
Conditionnumber
-0.4
-0.2
0
0.2
0.4
-0.2
0
0.2
0.4
0.6
0
0.5
1
x (m)y (m)
Normalizedmu
-0.4
-0.2
0
0.2
0.4
-0.2
0
0.2
0.4
0.6
0
200
400
600
x (m)y (m)
Conditionnumber
-0.4
-0.2
0
0.2
0.4
-0.2
0
0.2
0.4
0.6
0
0.5
1
x (m)y (m)
Normalizedmu
0.0
200.0
400.0
600.0
0 2 4 6
ConditionNumber
Time
0
0.5
1
1.5
0 2 4 6
MobilityIndex
Time (sec)
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 80
Fig -6: Cosine function with horizontal and vertical offset
5. DYNAMIC ANALYSIS
The dynamic behavior of manipulator is described in terms of
the time rate of change of the robot configuration in relation to
the joint torques exerted by the actuators. Hence, the resulting
equation of motions represents such relationship in form of set
of differential equations that govern the dynamic response of
the robot linkage to input joint torques. Dynamic model for
two DOF robot using Newton’s Euler approach, the dynamic
equations are written separately for each link. Equations are
evaluated in numeric or recursive manner. In this case, the
sum of forces is equal to variation of linear momentum. The
joint torques τ1 and τ2 are coupling moments.
M q . q + C q, q . q +g(q)+f q = τL
Where,
q = Joint displacements
q = Joint velocities
q = Joint accelerations
M q = Manipulator inertia matrix
C q, q = Matrix of centripetal & coriolis torques
g q = Gravitational torques
f q = Friction torques
τL = Applied torque inputs
For a two degree of freedom manipulator,
τ1
τ2
=
i11 i12
i21 i22
x3
x6
+
c11 c12
c21 c22
x2
x5
+
g11
g21
x1
Where,
q1 = x3
q1 = x2
q1 = x1
q2 = x6
q2 = x5
q2 = x4
The above equation can be rearranged in the form of,
τ1
τ2
=
g11 c11 i11 0 c12 i12
g21 c21 i21 0 c22 i22
x1
x2
x3
x4
x5
x6
The inertia matrix of 2 DOF robot arm is symmetric and
positive definite and its elements are,
i11 i12
i21 i22
Where,
i11 = m1ac1
2
+ m2 a1
2
+ ac2
2
+ 2a1ac2C2 + I1 + I2
i12 = m2 ac2
2
+ a1ac2C2 + I2
i21 = m2 ac2
2
+ a1ac2C2 + I2
i22 = m2ac2
2
+ I2
The inertia has maximum value for fully extended arm.
The elements of centripetal and coriolis matrix,
c11 c12
c21 c22
=
−2m2a1ac2S2x5 −m2a1ac2S2x5
m2a1ac2S2x2 0
Entries of gravitational terms are,
g11
g21
=
m1gac1C1 + m2g a1C1 + ac2C12
m2gac2C12
When arm is fully extended in the x-direction, the effect of
gravitational moment becomes maximums. The closed form
dynamic equations of n-degree-of-freedom robot in the form
of,
τi = Mijqj
n
j+1
+ Cijk qjqk + Gi qi + fi qi
n
k=1
n
j=1
,
i = 1, … . . , n
Lagrangian Euler approach is based on differentiation of
energy terms with respect to the systems variable and time.
Internal reaction forces are automatically eliminated using this
method. Closed form equations are directly obtained. Here, the
sum of torques is equal to variation of angular momentum.
The total energy stored in each link is represented as,
τi =
1
2
mi Vci
2
+
1
2
Iiωi
2
2
i=1
The resulting expression as same as obtained using Newton’s
Euler approach. Lagrangian formulation is simpler than
Newton’s Euler approach.
-2.5
-2
-1.5
-1
-0.5
0
0.5
1
1.5
0 100 200 300 400
Amplitude
Angle (deg)
T=2
cos(360*x/T)-1
cos(360*x/T)+10
cos(360*x/T)
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 81
5.1 Mass Properties of Both Links
The case of 2-DOF serial manipulator under consideration has
following mass properties,
Link1
Material Properties: steel (AISI 1045)
Poisson’s ratio: 0.27 at 25˚C
Young’s modulus: 199GPa
Coefficient of thermal expansion: 1.17×10−5
per ˚C
Density: 7.827×103
kg/m3
Length L1 = 0.2 m
Mass m1 = 1.383 kg
Link2
Material Properties: steel (AISI 1045)
Poisson’s ratio: 0.27 at 25˚C
Young’s modulus: 199GPa
Coefficient of thermal expansion: 1.17×10−5
per ˚C
Density: 7.827×103
kg/m3
Length L2 = 0.15 m
Mass m2 = 0.82658 kg
Inertia with respect to coordinate system attached at base
(tonne. m2)
1.234 × 1011
0 0
0 2.0405 × 1010
0
0 0 1.2155 × 1011
Inertia tensor at centre of gravity with respect to coordinate
system (tonne. m2)
2.1817 × 1010
0 0
0 2.0030 × 1010
0
0 0 2.0405 × 1010
As shown in above table, the inertia tensor for an object with
the coordinates of the centroid of the rigid body xc, yc, zc
and ρ is mass density, is computed as,
I =
Ixx Ixy Ixz
Iyx Iyy Iyz
Izx Izy Izz
Each element represents scalar quantity expressing resistance
changes with respect to change of rotation of an object. Hence,
the value of inertia tensor components varies with respect to
time. The three diagonal elements are called principal moment
of inertia and six off diagonal elements are called cross
product of inertia.
(a)Variation of θ1 with time
(b) Variation of θ2 with time
(c) Variation of velocity v1 with time
(d) Variation of velocity v2 with time
-20
30
80
130
180
0 1 2 3 4 5 6 7 8
Theta-1(degree)
Time (sec)
-10
10
30
50
70
90
0 1 2 3 4 5 6 7 8
Theta-2(degree)
Time (sec)
-200
-100
0
100
200
0 1 2 3 4 5 6 7 8
Velocoty-v1(deg/sec)
Time (sec)
-100
-50
0
50
100
0 1 2 3 4 5 6 7 8
Velocity-v2(deg/sec)
Time (sec)
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 82
(e) Variation of acceleration a1 with time
(f) Variation of acceleration a2 with time
Fig -7: Variation of q, q and q of joint-1 and joint-2 with
respect to time
(g) Variation of X_comp. of vel. of P3 with time
(h) Variation of X_comp. of vel. of P3 with time
(i) Variation of X_comp. of acc. of P3 with time
(j) Variation of Y_comp. of acc. of P3 with time
Fig -8: Variation of velocity and acceleration of point P3 with
respect to time
Fig -9: Torque requirements at joint-1 and joint-2 with respect
to time
-300
-200
-100
0
100
200
300
0 1 2 3 4 5 6 7 8
Acceleration-a1
(deg/sec2)
Time (sec)
-150
-100
-50
0
50
100
150
0 1 2 3 4 5 6 7 8
Acceleration-a2
(deg/sec2)
Time (sec)
-1048.64
-548.645
-48.6456
451.3543
951.3543
1451.354
0 2 4 6 8 10
X_componentofVel.
ofP3(mm/sec)
Time (Sec)
-759.828
-259.828
240.1715
740.1715
1240.171
0 2 4 6 8 10
Y_componentofVel.
P3(mm/sec)
Time (Sec)
-2519.41
-1519.41
-519.410
480.5898
1480.589
2480.589
3480.589
0 2 4 6 8 10
X_componentofacc.P3
(mm/sec2)
Time (Sec)
-3272.33
-2272.33
-1272.33
-272.338
727.6619
1727.662
2727.662
0 2 4 6 8 10
Y_componentofacc.P3
(mm/sec2) Time (Sec)
-100000
0
100000
200000
0 2 4 6
Torque(N-mm)
Time (Sec)
Lagrangian
Newton_Eule
-50000
0
50000
100000
150000
200000
250000
0 2 4 6
Torque(Nmm)
Time (Sec)
Lagrangia
Newton_Eule
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 83
6. WORKSPACE BOUNDARY:
Fig -10: Variation of X and Y components of position P3 with
time using cosine input
Singularity normally occurs near workspace boundary when
both links are fully extended. By increasing the joint range of
joint-2, there should not be significant change in workspace
boundary but the internal singularities are reduced
significantly. There may be existance of unreachable point
within the workspace boundary or outside of it due to physical
constraints of mechanism. Singularity is a case of infinite
acceleration in such cases. The value of A & C are varied from
±10°
to ±90°
for P3 x, y i.e. workspace boundary
determination as plotted in figure 11.
Fig -11: Work space boundary for 2 DOF serial manipulator
CONCLUSIONS
In this work, the mathematical formulation of complete
kinematics and dynamics of two degrees of freedom robotic
arm is presented. The simulation of kinematics and dynamics
is performed using Pro/Engineer software and results are
compared with analytical results. The results are plotted for
the performance measurement using condition number and
manipubality index. The value of condition number is not well
at time of actuation as well as at time of reaching the end of
joint limit. The work space boundary represents the limitation
of actuations and the space for a placement of work parts. In a
robot joint, it is known that friction can relate to temperature,
force/torque levels, position, velocity, acceleration, lubricant
properties. In this paper, models included nonlinearities and
frictions are neglected. It is observed that average variation in
the torques computed by Newton’s Euler at the both joint axis
around 3% at all possible position compared to Lagrangian
dynamics approach using MATLAB and Pro/engineer
software.
ACKNOWLEDGEMENTS
The authors would like to acknowledge support of
Sophisticated Instrumentation Centre for Applied Research
and Testing (SICART).
REFERENCES
[1]. Fernando Reyes, Rafael Kelly , Experimental evaluation
of model-based controllers on a direct-drive robot arm,
Mechatronics, Vol. 11, P.P. 267-282, 2001
[2]. Jolly Shah, S.S.Rattan, B.C.Nakra, Kinematic Analysis of
2-DOF Planer Robot Using Artificial Neural Network, World
Academy of Science, Engineering and Technology, Vol. 81,
pp. 282-285, 2011
[3]. Denavit, J. & Hartenberg, R. S., “A kinematic notation for
lower-pair mechanisms based on matrices”, Journal of
Applied Mechanics, Vol., 1, pp. 215-221, 1955
[4]. Tarcisio A.H. Coelho, Liang Yong, Valter F.A. Alves ,
“Decoupling of dynamic equations by means of adaptive
balancing of 2-dof open-loop mechanisms”, Mechanism and
Machine Theory 39, (2004), 871–881
[5]. B.K. Rout, R.K. Mittal, “Parametric design optimization
of 2-DOF R–R planar manipulator- A design of experiment
approach”, Robotics and Computer-Integrated Manufacturing,
24 (2008) 239–248
[6]. Vigen Arakelian , Jean-Paul Le Baron, Pauline Mottu,
“Torque minimization of the 2-DOF serial manipulators based
on minimum energy consideration and optimum mass
redistribution”, Mechatronics, 21 (2011) 310–314
[7]. Ravindra Biradar, M.B.Kiran, “The Dynamics of Fixed
Base and Free-Floating Robotic Manipulator”, International
Journal of Engineering Research & Technology, Vol. 1 (5),
2012, 1-9
-400
-200
0
200
400
0 1 2 3 4 5 6 7 8 9 10
Time
x
y
-200
-100
0
100
200
300
400
-400 -200 0 200 400
y_P3(mm)
x_P3 (mm)
-200
-100
0
100
200
300
400
-400 -200 0 200 400
y_P3(mm)
x_P3 (mm)
x_y_10
x_y_20
x_y_30
x_y_40
x_y_50
x_y_60
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 84
[8]. M W Spong, On the robust control of robot manipulators.
IEEE Transactions on Automatic Control ,Vol. 37(11), P.P.
1782-86, 1992
[9]. A new method for position control of a 2-DOF robot arm
using neuro – fuzzy controller, Indian Journal of Science and
Technology, Vol. 5(3), 2253-2257, 2012
[10]. Yoshikawa T., “Manipulability of robotic mechanisms”,
The International Journal of Robotics Research, 4, 1985, No 2,
3-9.
BIOGRAPHIES
Y.D Patel is working as Associate
Professor in Mechanical Engineering
department of A D Patel Institute of
Technology, New Vallabh Vidyanagar
Gujarat.
Dr. P.M. George is working as Head of
Department of Mechanical Engineering
at Birla Vishvakarma Mahavidyalaya,
Vallabh Vidyanagar, Gujarat.

More Related Content

What's hot

Tổng quan Vi điều khiển - Chức năng các chân 8951
Tổng quan Vi điều khiển - Chức năng các chân 8951Tổng quan Vi điều khiển - Chức năng các chân 8951
Tổng quan Vi điều khiển - Chức năng các chân 8951Ngananh Saodem
 
mạng truyền thông công nghiệp
mạng truyền thông công nghiệpmạng truyền thông công nghiệp
mạng truyền thông công nghiệpvanquanglong
 
Báo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGA
Báo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGABáo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGA
Báo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGAnataliej4
 
PLC power point presentation
PLC power point presentationPLC power point presentation
PLC power point presentationNaga Teja
 
Automotive Software Basics
Automotive Software BasicsAutomotive Software Basics
Automotive Software BasicsMedhat HUSSAIN
 
Mach vi dieu khien arduino va ung dung
Mach vi dieu khien arduino va ung dungMach vi dieu khien arduino va ung dung
Mach vi dieu khien arduino va ung dungHoa Le Gia
 
Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...
Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...
Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...Man_Ebook
 
Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc)
Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc) Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc)
Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc) nataliej4
 
Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!
Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!
Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!Văn Phong Cao
 
Bài giảng vận hành robot abb
Bài giảng vận hành robot abbBài giảng vận hành robot abb
Bài giảng vận hành robot abbMan_Ebook
 
S7 200 en dos horas
S7 200 en dos horasS7 200 en dos horas
S7 200 en dos horasartorius1968
 
Bài tập và ứng dụng PLC
Bài tập và ứng dụng PLCBài tập và ứng dụng PLC
Bài tập và ứng dụng PLCquanglocbp
 
Siemens s7 300 programming
Siemens s7 300 programming Siemens s7 300 programming
Siemens s7 300 programming satyajit patra
 
PPT Báo Cáo Đồ Án Tốt Nghiệp.pptx
PPT Báo Cáo Đồ Án Tốt Nghiệp.pptxPPT Báo Cáo Đồ Án Tốt Nghiệp.pptx
PPT Báo Cáo Đồ Án Tốt Nghiệp.pptxMinhVo20970
 

What's hot (20)

Co ban ve msp430
Co ban ve msp430Co ban ve msp430
Co ban ve msp430
 
S7 1200 basic
S7 1200 basicS7 1200 basic
S7 1200 basic
 
Tổng quan Vi điều khiển - Chức năng các chân 8951
Tổng quan Vi điều khiển - Chức năng các chân 8951Tổng quan Vi điều khiển - Chức năng các chân 8951
Tổng quan Vi điều khiển - Chức năng các chân 8951
 
mạng truyền thông công nghiệp
mạng truyền thông công nghiệpmạng truyền thông công nghiệp
mạng truyền thông công nghiệp
 
Báo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGA
Báo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGABáo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGA
Báo cáo đồ án chuyên ngành THIẾT KẾ BỘ TRUYỀN NHẬN UARTVÀ BÍT NẠP TRÊN KIT FPGA
 
PLC power point presentation
PLC power point presentationPLC power point presentation
PLC power point presentation
 
Automotive Software Basics
Automotive Software BasicsAutomotive Software Basics
Automotive Software Basics
 
Mach vi dieu khien arduino va ung dung
Mach vi dieu khien arduino va ung dungMach vi dieu khien arduino va ung dung
Mach vi dieu khien arduino va ung dung
 
Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...
Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...
Thiết kế và chế tạo cánh tay robot 3 bậc tự do ứng dụng trong phân loại sản p...
 
Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc)
Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc) Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc)
Ứng Dụng PLC Điều Khiển Và Ổn Định Lò Nhiệt (Kèm Bản Vẽ, Datasheet, Plc)
 
SINAMICS S120.ppt
SINAMICS S120.pptSINAMICS S120.ppt
SINAMICS S120.ppt
 
Đề tài: Bộ điều khiển trượt cho tay máy Robot 2 bậc tự do, HAY
Đề tài: Bộ điều khiển trượt cho tay máy Robot 2 bậc tự do, HAYĐề tài: Bộ điều khiển trượt cho tay máy Robot 2 bậc tự do, HAY
Đề tài: Bộ điều khiển trượt cho tay máy Robot 2 bậc tự do, HAY
 
Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!
Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!
Giáo trình điều khiển lập trình cỡ nhỏ - LOGO!
 
Bài giảng vận hành robot abb
Bài giảng vận hành robot abbBài giảng vận hành robot abb
Bài giảng vận hành robot abb
 
S7 200 en dos horas
S7 200 en dos horasS7 200 en dos horas
S7 200 en dos horas
 
Bài tập và ứng dụng PLC
Bài tập và ứng dụng PLCBài tập và ứng dụng PLC
Bài tập và ứng dụng PLC
 
Siemens s7 300 programming
Siemens s7 300 programming Siemens s7 300 programming
Siemens s7 300 programming
 
PPT Báo Cáo Đồ Án Tốt Nghiệp.pptx
PPT Báo Cáo Đồ Án Tốt Nghiệp.pptxPPT Báo Cáo Đồ Án Tốt Nghiệp.pptx
PPT Báo Cáo Đồ Án Tốt Nghiệp.pptx
 
Chương 1 tq kt robot new
Chương 1 tq kt robot newChương 1 tq kt robot new
Chương 1 tq kt robot new
 
Luận án: Xây dựng chương trình xử lý số liệu GNSS dạng RINEX
Luận án: Xây dựng chương trình xử lý số liệu GNSS dạng RINEXLuận án: Xây dựng chương trình xử lý số liệu GNSS dạng RINEX
Luận án: Xây dựng chương trình xử lý số liệu GNSS dạng RINEX
 

Viewers also liked

PID control dynamics of a robotic arm manipulator with two degrees of freedom.
PID control dynamics of a robotic arm manipulator with two degrees of freedom.PID control dynamics of a robotic arm manipulator with two degrees of freedom.
PID control dynamics of a robotic arm manipulator with two degrees of freedom.popochis
 
Robotics by rk mittal
Robotics by rk mittalRobotics by rk mittal
Robotics by rk mittalZAKI ANWER
 
Slides for my Master's Thesis
Slides for my Master's ThesisSlides for my Master's Thesis
Slides for my Master's ThesisHaijie Li
 
Fir 05 dynamics 2-dof
Fir 05 dynamics 2-dofFir 05 dynamics 2-dof
Fir 05 dynamics 2-dofnguyendattdh
 
Servo Based 5 Axis Robotic Arm Project Report
Servo Based 5 Axis Robotic Arm Project ReportServo Based 5 Axis Robotic Arm Project Report
Servo Based 5 Axis Robotic Arm Project ReportRobo India
 
Dynamics 6th ed meriam solution
Dynamics 6th ed meriam solutionDynamics 6th ed meriam solution
Dynamics 6th ed meriam solutionfitsum2020
 

Viewers also liked (8)

PID control dynamics of a robotic arm manipulator with two degrees of freedom.
PID control dynamics of a robotic arm manipulator with two degrees of freedom.PID control dynamics of a robotic arm manipulator with two degrees of freedom.
PID control dynamics of a robotic arm manipulator with two degrees of freedom.
 
Robotics by rk mittal
Robotics by rk mittalRobotics by rk mittal
Robotics by rk mittal
 
Slides for my Master's Thesis
Slides for my Master's ThesisSlides for my Master's Thesis
Slides for my Master's Thesis
 
Fir 05 dynamics 2-dof
Fir 05 dynamics 2-dofFir 05 dynamics 2-dof
Fir 05 dynamics 2-dof
 
Fir 05 dynamics
Fir 05 dynamicsFir 05 dynamics
Fir 05 dynamics
 
Robotic arm
Robotic armRobotic arm
Robotic arm
 
Servo Based 5 Axis Robotic Arm Project Report
Servo Based 5 Axis Robotic Arm Project ReportServo Based 5 Axis Robotic Arm Project Report
Servo Based 5 Axis Robotic Arm Project Report
 
Dynamics 6th ed meriam solution
Dynamics 6th ed meriam solutionDynamics 6th ed meriam solution
Dynamics 6th ed meriam solution
 

Similar to Performance measurement and dynamic analysis of two dof robotic arm manipulator

Performance measurement and dynamic analysis of two
Performance measurement and dynamic analysis of twoPerformance measurement and dynamic analysis of two
Performance measurement and dynamic analysis of twoeSAT Publishing House
 
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...ijscmcjournal
 
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...ijscmcj
 
Compensating Joint Configuration through Null Space Control in Composite Weig...
Compensating Joint Configuration through Null Space Control in Composite Weig...Compensating Joint Configuration through Null Space Control in Composite Weig...
Compensating Joint Configuration through Null Space Control in Composite Weig...Waqas Tariq
 
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...ijscmcj
 
Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...
Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...
Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...IJMTST Journal
 
Robust control of pmsm using genetic algorithm
Robust control of pmsm using genetic algorithmRobust control of pmsm using genetic algorithm
Robust control of pmsm using genetic algorithmeSAT Publishing House
 
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...IRJET Journal
 
Implementation of low power divider techniques using
Implementation of low power divider techniques usingImplementation of low power divider techniques using
Implementation of low power divider techniques usingeSAT Publishing House
 
Implementation of low power divider techniques using radix
Implementation of low power divider techniques using radixImplementation of low power divider techniques using radix
Implementation of low power divider techniques using radixeSAT Journals
 
Iaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signalIaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signalIaetsd Iaetsd
 
Controller design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqrController design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqreSAT Publishing House
 
Controller design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqrController design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqreSAT Journals
 
Modelling Quantum Transport in Nanostructures
Modelling Quantum Transport in NanostructuresModelling Quantum Transport in Nanostructures
Modelling Quantum Transport in Nanostructuresiosrjce
 
Performance Assessment of Polyphase Sequences Using Cyclic Algorithm
Performance Assessment of Polyphase Sequences Using Cyclic AlgorithmPerformance Assessment of Polyphase Sequences Using Cyclic Algorithm
Performance Assessment of Polyphase Sequences Using Cyclic Algorithmrahulmonikasharma
 
Super-twisting sliding mode based nonlinear control for planar dual arm robots
Super-twisting sliding mode based nonlinear control for planar dual arm robotsSuper-twisting sliding mode based nonlinear control for planar dual arm robots
Super-twisting sliding mode based nonlinear control for planar dual arm robotsjournalBEEI
 
Modeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic ControllerModeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic ControllerIJMER
 
PSO and SMC based Closed Loop V/F Control of AC Drive using SVPWM
PSO and SMC based Closed Loop V/F Control of AC Drive using SVPWMPSO and SMC based Closed Loop V/F Control of AC Drive using SVPWM
PSO and SMC based Closed Loop V/F Control of AC Drive using SVPWMIRJET Journal
 

Similar to Performance measurement and dynamic analysis of two dof robotic arm manipulator (20)

Performance measurement and dynamic analysis of two
Performance measurement and dynamic analysis of twoPerformance measurement and dynamic analysis of two
Performance measurement and dynamic analysis of two
 
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
 
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
 
Compensating Joint Configuration through Null Space Control in Composite Weig...
Compensating Joint Configuration through Null Space Control in Composite Weig...Compensating Joint Configuration through Null Space Control in Composite Weig...
Compensating Joint Configuration through Null Space Control in Composite Weig...
 
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
OPTIMAL PID CONTROLLER DESIGN FOR SPEED CONTROL OF A SEPARATELY EXCITED DC MO...
 
Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...
Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...
Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control o...
 
Robust control of pmsm using genetic algorithm
Robust control of pmsm using genetic algorithmRobust control of pmsm using genetic algorithm
Robust control of pmsm using genetic algorithm
 
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
 
Implementation of low power divider techniques using
Implementation of low power divider techniques usingImplementation of low power divider techniques using
Implementation of low power divider techniques using
 
Implementation of low power divider techniques using radix
Implementation of low power divider techniques using radixImplementation of low power divider techniques using radix
Implementation of low power divider techniques using radix
 
Dynamics
DynamicsDynamics
Dynamics
 
Iaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signalIaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signal
 
Controller design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqrController design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqr
 
Controller design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqrController design of inverted pendulum using pole placement and lqr
Controller design of inverted pendulum using pole placement and lqr
 
E010632226
E010632226E010632226
E010632226
 
Modelling Quantum Transport in Nanostructures
Modelling Quantum Transport in NanostructuresModelling Quantum Transport in Nanostructures
Modelling Quantum Transport in Nanostructures
 
Performance Assessment of Polyphase Sequences Using Cyclic Algorithm
Performance Assessment of Polyphase Sequences Using Cyclic AlgorithmPerformance Assessment of Polyphase Sequences Using Cyclic Algorithm
Performance Assessment of Polyphase Sequences Using Cyclic Algorithm
 
Super-twisting sliding mode based nonlinear control for planar dual arm robots
Super-twisting sliding mode based nonlinear control for planar dual arm robotsSuper-twisting sliding mode based nonlinear control for planar dual arm robots
Super-twisting sliding mode based nonlinear control for planar dual arm robots
 
Modeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic ControllerModeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic Controller
 
PSO and SMC based Closed Loop V/F Control of AC Drive using SVPWM
PSO and SMC based Closed Loop V/F Control of AC Drive using SVPWMPSO and SMC based Closed Loop V/F Control of AC Drive using SVPWM
PSO and SMC based Closed Loop V/F Control of AC Drive using SVPWM
 

More from eSAT Journals

Mechanical properties of hybrid fiber reinforced concrete for pavements
Mechanical properties of hybrid fiber reinforced concrete for pavementsMechanical properties of hybrid fiber reinforced concrete for pavements
Mechanical properties of hybrid fiber reinforced concrete for pavementseSAT Journals
 
Material management in construction – a case study
Material management in construction – a case studyMaterial management in construction – a case study
Material management in construction – a case studyeSAT Journals
 
Managing drought short term strategies in semi arid regions a case study
Managing drought    short term strategies in semi arid regions  a case studyManaging drought    short term strategies in semi arid regions  a case study
Managing drought short term strategies in semi arid regions a case studyeSAT Journals
 
Life cycle cost analysis of overlay for an urban road in bangalore
Life cycle cost analysis of overlay for an urban road in bangaloreLife cycle cost analysis of overlay for an urban road in bangalore
Life cycle cost analysis of overlay for an urban road in bangaloreeSAT Journals
 
Laboratory studies of dense bituminous mixes ii with reclaimed asphalt materials
Laboratory studies of dense bituminous mixes ii with reclaimed asphalt materialsLaboratory studies of dense bituminous mixes ii with reclaimed asphalt materials
Laboratory studies of dense bituminous mixes ii with reclaimed asphalt materialseSAT Journals
 
Laboratory investigation of expansive soil stabilized with natural inorganic ...
Laboratory investigation of expansive soil stabilized with natural inorganic ...Laboratory investigation of expansive soil stabilized with natural inorganic ...
Laboratory investigation of expansive soil stabilized with natural inorganic ...eSAT Journals
 
Influence of reinforcement on the behavior of hollow concrete block masonry p...
Influence of reinforcement on the behavior of hollow concrete block masonry p...Influence of reinforcement on the behavior of hollow concrete block masonry p...
Influence of reinforcement on the behavior of hollow concrete block masonry p...eSAT Journals
 
Influence of compaction energy on soil stabilized with chemical stabilizer
Influence of compaction energy on soil stabilized with chemical stabilizerInfluence of compaction energy on soil stabilized with chemical stabilizer
Influence of compaction energy on soil stabilized with chemical stabilizereSAT Journals
 
Geographical information system (gis) for water resources management
Geographical information system (gis) for water resources managementGeographical information system (gis) for water resources management
Geographical information system (gis) for water resources managementeSAT Journals
 
Forest type mapping of bidar forest division, karnataka using geoinformatics ...
Forest type mapping of bidar forest division, karnataka using geoinformatics ...Forest type mapping of bidar forest division, karnataka using geoinformatics ...
Forest type mapping of bidar forest division, karnataka using geoinformatics ...eSAT Journals
 
Factors influencing compressive strength of geopolymer concrete
Factors influencing compressive strength of geopolymer concreteFactors influencing compressive strength of geopolymer concrete
Factors influencing compressive strength of geopolymer concreteeSAT Journals
 
Experimental investigation on circular hollow steel columns in filled with li...
Experimental investigation on circular hollow steel columns in filled with li...Experimental investigation on circular hollow steel columns in filled with li...
Experimental investigation on circular hollow steel columns in filled with li...eSAT Journals
 
Experimental behavior of circular hsscfrc filled steel tubular columns under ...
Experimental behavior of circular hsscfrc filled steel tubular columns under ...Experimental behavior of circular hsscfrc filled steel tubular columns under ...
Experimental behavior of circular hsscfrc filled steel tubular columns under ...eSAT Journals
 
Evaluation of punching shear in flat slabs
Evaluation of punching shear in flat slabsEvaluation of punching shear in flat slabs
Evaluation of punching shear in flat slabseSAT Journals
 
Evaluation of performance of intake tower dam for recent earthquake in india
Evaluation of performance of intake tower dam for recent earthquake in indiaEvaluation of performance of intake tower dam for recent earthquake in india
Evaluation of performance of intake tower dam for recent earthquake in indiaeSAT Journals
 
Evaluation of operational efficiency of urban road network using travel time ...
Evaluation of operational efficiency of urban road network using travel time ...Evaluation of operational efficiency of urban road network using travel time ...
Evaluation of operational efficiency of urban road network using travel time ...eSAT Journals
 
Estimation of surface runoff in nallur amanikere watershed using scs cn method
Estimation of surface runoff in nallur amanikere watershed using scs cn methodEstimation of surface runoff in nallur amanikere watershed using scs cn method
Estimation of surface runoff in nallur amanikere watershed using scs cn methodeSAT Journals
 
Estimation of morphometric parameters and runoff using rs & gis techniques
Estimation of morphometric parameters and runoff using rs & gis techniquesEstimation of morphometric parameters and runoff using rs & gis techniques
Estimation of morphometric parameters and runoff using rs & gis techniqueseSAT Journals
 
Effect of variation of plastic hinge length on the results of non linear anal...
Effect of variation of plastic hinge length on the results of non linear anal...Effect of variation of plastic hinge length on the results of non linear anal...
Effect of variation of plastic hinge length on the results of non linear anal...eSAT Journals
 
Effect of use of recycled materials on indirect tensile strength of asphalt c...
Effect of use of recycled materials on indirect tensile strength of asphalt c...Effect of use of recycled materials on indirect tensile strength of asphalt c...
Effect of use of recycled materials on indirect tensile strength of asphalt c...eSAT Journals
 

More from eSAT Journals (20)

Mechanical properties of hybrid fiber reinforced concrete for pavements
Mechanical properties of hybrid fiber reinforced concrete for pavementsMechanical properties of hybrid fiber reinforced concrete for pavements
Mechanical properties of hybrid fiber reinforced concrete for pavements
 
Material management in construction – a case study
Material management in construction – a case studyMaterial management in construction – a case study
Material management in construction – a case study
 
Managing drought short term strategies in semi arid regions a case study
Managing drought    short term strategies in semi arid regions  a case studyManaging drought    short term strategies in semi arid regions  a case study
Managing drought short term strategies in semi arid regions a case study
 
Life cycle cost analysis of overlay for an urban road in bangalore
Life cycle cost analysis of overlay for an urban road in bangaloreLife cycle cost analysis of overlay for an urban road in bangalore
Life cycle cost analysis of overlay for an urban road in bangalore
 
Laboratory studies of dense bituminous mixes ii with reclaimed asphalt materials
Laboratory studies of dense bituminous mixes ii with reclaimed asphalt materialsLaboratory studies of dense bituminous mixes ii with reclaimed asphalt materials
Laboratory studies of dense bituminous mixes ii with reclaimed asphalt materials
 
Laboratory investigation of expansive soil stabilized with natural inorganic ...
Laboratory investigation of expansive soil stabilized with natural inorganic ...Laboratory investigation of expansive soil stabilized with natural inorganic ...
Laboratory investigation of expansive soil stabilized with natural inorganic ...
 
Influence of reinforcement on the behavior of hollow concrete block masonry p...
Influence of reinforcement on the behavior of hollow concrete block masonry p...Influence of reinforcement on the behavior of hollow concrete block masonry p...
Influence of reinforcement on the behavior of hollow concrete block masonry p...
 
Influence of compaction energy on soil stabilized with chemical stabilizer
Influence of compaction energy on soil stabilized with chemical stabilizerInfluence of compaction energy on soil stabilized with chemical stabilizer
Influence of compaction energy on soil stabilized with chemical stabilizer
 
Geographical information system (gis) for water resources management
Geographical information system (gis) for water resources managementGeographical information system (gis) for water resources management
Geographical information system (gis) for water resources management
 
Forest type mapping of bidar forest division, karnataka using geoinformatics ...
Forest type mapping of bidar forest division, karnataka using geoinformatics ...Forest type mapping of bidar forest division, karnataka using geoinformatics ...
Forest type mapping of bidar forest division, karnataka using geoinformatics ...
 
Factors influencing compressive strength of geopolymer concrete
Factors influencing compressive strength of geopolymer concreteFactors influencing compressive strength of geopolymer concrete
Factors influencing compressive strength of geopolymer concrete
 
Experimental investigation on circular hollow steel columns in filled with li...
Experimental investigation on circular hollow steel columns in filled with li...Experimental investigation on circular hollow steel columns in filled with li...
Experimental investigation on circular hollow steel columns in filled with li...
 
Experimental behavior of circular hsscfrc filled steel tubular columns under ...
Experimental behavior of circular hsscfrc filled steel tubular columns under ...Experimental behavior of circular hsscfrc filled steel tubular columns under ...
Experimental behavior of circular hsscfrc filled steel tubular columns under ...
 
Evaluation of punching shear in flat slabs
Evaluation of punching shear in flat slabsEvaluation of punching shear in flat slabs
Evaluation of punching shear in flat slabs
 
Evaluation of performance of intake tower dam for recent earthquake in india
Evaluation of performance of intake tower dam for recent earthquake in indiaEvaluation of performance of intake tower dam for recent earthquake in india
Evaluation of performance of intake tower dam for recent earthquake in india
 
Evaluation of operational efficiency of urban road network using travel time ...
Evaluation of operational efficiency of urban road network using travel time ...Evaluation of operational efficiency of urban road network using travel time ...
Evaluation of operational efficiency of urban road network using travel time ...
 
Estimation of surface runoff in nallur amanikere watershed using scs cn method
Estimation of surface runoff in nallur amanikere watershed using scs cn methodEstimation of surface runoff in nallur amanikere watershed using scs cn method
Estimation of surface runoff in nallur amanikere watershed using scs cn method
 
Estimation of morphometric parameters and runoff using rs & gis techniques
Estimation of morphometric parameters and runoff using rs & gis techniquesEstimation of morphometric parameters and runoff using rs & gis techniques
Estimation of morphometric parameters and runoff using rs & gis techniques
 
Effect of variation of plastic hinge length on the results of non linear anal...
Effect of variation of plastic hinge length on the results of non linear anal...Effect of variation of plastic hinge length on the results of non linear anal...
Effect of variation of plastic hinge length on the results of non linear anal...
 
Effect of use of recycled materials on indirect tensile strength of asphalt c...
Effect of use of recycled materials on indirect tensile strength of asphalt c...Effect of use of recycled materials on indirect tensile strength of asphalt c...
Effect of use of recycled materials on indirect tensile strength of asphalt c...
 

Recently uploaded

Application of Residue Theorem to evaluate real integrations.pptx
Application of Residue Theorem to evaluate real integrations.pptxApplication of Residue Theorem to evaluate real integrations.pptx
Application of Residue Theorem to evaluate real integrations.pptx959SahilShah
 
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
 
Call Girls Narol 7397865700 Independent Call Girls
Call Girls Narol 7397865700 Independent Call GirlsCall Girls Narol 7397865700 Independent Call Girls
Call Girls Narol 7397865700 Independent Call Girlsssuser7cb4ff
 
Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...VICTOR MAESTRE RAMIREZ
 
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
 
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
 
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdfCCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdfAsst.prof M.Gokilavani
 
main PPT.pptx of girls hostel security using rfid
main PPT.pptx of girls hostel security using rfidmain PPT.pptx of girls hostel security using rfid
main PPT.pptx of girls hostel security using rfidNikhilNagaraju
 
Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.eptoze12
 
Gurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort service
Gurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort serviceGurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort service
Gurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort servicejennyeacort
 
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptxDecoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptxJoão Esperancinha
 
Call Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile serviceCall Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile servicerehmti665
 
Past, Present and Future of Generative AI
Past, Present and Future of Generative AIPast, Present and Future of Generative AI
Past, Present and Future of Generative AIabhishek36461
 
Heart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptxHeart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptxPoojaBan
 
microprocessor 8085 and its interfacing
microprocessor 8085  and its interfacingmicroprocessor 8085  and its interfacing
microprocessor 8085 and its interfacingjaychoudhary37
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxpurnimasatapathy1234
 
chaitra-1.pptx fake news detection using machine learning
chaitra-1.pptx  fake news detection using machine learningchaitra-1.pptx  fake news detection using machine learning
chaitra-1.pptx fake news detection using machine learningmisbanausheenparvam
 
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
 
Biology for Computer Engineers Course Handout.pptx
Biology for Computer Engineers Course Handout.pptxBiology for Computer Engineers Course Handout.pptx
Biology for Computer Engineers Course Handout.pptxDeepakSakkari2
 

Recently uploaded (20)

Application of Residue Theorem to evaluate real integrations.pptx
Application of Residue Theorem to evaluate real integrations.pptxApplication of Residue Theorem to evaluate real integrations.pptx
Application of Residue Theorem to evaluate real integrations.pptx
 
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
 
Call Girls Narol 7397865700 Independent Call Girls
Call Girls Narol 7397865700 Independent Call GirlsCall Girls Narol 7397865700 Independent Call Girls
Call Girls Narol 7397865700 Independent Call Girls
 
Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...
 
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...
 
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 )
 
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdfCCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
 
main PPT.pptx of girls hostel security using rfid
main PPT.pptx of girls hostel security using rfidmain PPT.pptx of girls hostel security using rfid
main PPT.pptx of girls hostel security using rfid
 
Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.
 
Gurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort service
Gurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort serviceGurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort service
Gurgaon ✡️9711147426✨Call In girls Gurgaon Sector 51 escort service
 
young call girls in Rajiv Chowk🔝 9953056974 🔝 Delhi escort Service
young call girls in Rajiv Chowk🔝 9953056974 🔝 Delhi escort Serviceyoung call girls in Rajiv Chowk🔝 9953056974 🔝 Delhi escort Service
young call girls in Rajiv Chowk🔝 9953056974 🔝 Delhi escort Service
 
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptxDecoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
Decoding Kotlin - Your guide to solving the mysterious in Kotlin.pptx
 
Call Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile serviceCall Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile service
 
Past, Present and Future of Generative AI
Past, Present and Future of Generative AIPast, Present and Future of Generative AI
Past, Present and Future of Generative AI
 
Heart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptxHeart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptx
 
microprocessor 8085 and its interfacing
microprocessor 8085  and its interfacingmicroprocessor 8085  and its interfacing
microprocessor 8085 and its interfacing
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptx
 
chaitra-1.pptx fake news detection using machine learning
chaitra-1.pptx  fake news detection using machine learningchaitra-1.pptx  fake news detection using machine learning
chaitra-1.pptx fake news detection using machine learning
 
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
 
Biology for Computer Engineers Course Handout.pptx
Biology for Computer Engineers Course Handout.pptxBiology for Computer Engineers Course Handout.pptx
Biology for Computer Engineers Course Handout.pptx
 

Performance measurement and dynamic analysis of two dof robotic arm manipulator

  • 1. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 77 PERFORMANCE MEASUREMENT AND DYNAMIC ANALYSIS OF TWO DOF ROBOTIC ARM MANIPULATOR Y. D. Patel1 , P. M. George2 1 Associate Professor, Department of Mechanical Engineering, A. D. Patel Institute of Technology, New Vallabh Vidyanagar, Gujarat, India, yash523@rediffmail.com 2 Professor, Department of Mechanical Engineering, Birla Vishvakarma Mahavidyalaya Engineering College, Vallabh Vidyanagar, India, pmgeorge02@yahoo.com Abstract Forward and inverse kinematic analysis of 2DOF robot is presented to predict singular configurations. Cosine function is used for servo motor simulation of kinematics and dynamics using Pro/Engineer. The significance of joint-2 for reducing internal singularities is highlighted. Performance analysis in terms of condition number, local conditioning index and mobility index is carried out for the manipulator. Dynamic analysis using Lagrangian’s and Newton’s Euler approach is worked out analytically using MATLAB and results are plotted for their comparison. Index Terms: Forward kinematics, Inverse Kinematics, Workspace boundary, Singularity, Dynamics -----------------------------------------------------------------------***----------------------------------------------------------------------- 1. INTRODUCTION Automation is an integral part of day to day activities of modern manufacturing organizations throughout the world. Serial as well as parallel robotic manipulators play a wider and significant role for automation in those organizations. Advancement in serial manipulators is lucrative for the researchers either for its better control, singular configurations, optimization of the manipulator parameters or improving workspace. The prime importance in study of robot motion without regard to forces that produce it is still a challenging area for researchers for any type of manipulators. Typically, it is constrained by the geometry of links used for the configuration. Such areas include robot arm workspace- points cloud of robotic manipulator reach, singularity- a position in the robot's workspace where one or more joints no longer represent independent controlling variables. The equally important aspect of dynamic studies of the manipulator is to understand nature and magnitude of forces acting, singularity avoidance, power requirements as well as optimization criterion. PD control with computed feed forward controller was compared and was found best amongst computed-torque control, PD+ control, PD control with computed feed forward and PD control based on root mean square average performance index by Reyes and Kelly [1]. Artificial Neural Network method as an alternative solution for forward and inverse kinematic mapping was proposed by Jolly Shah, S.S.Rattan, B.C.Nakra [2]. DH Parameter formulation represented using four parameters by Denavit & Hartenberg (1955) [3], which showed that a general transformation between two joints in a space. The decoupling of dynamic equations eliminates torques due to gravitational, centripetal and coriolis forces [4]. Kinematic and dynamic parameters are analyzed using ANNOVA to imitate the real time performance measurement of 2-DOF planar manipulator [5]. Optimal dynamic balancing is formulated by minimization of the root-mean-square value of the input torque of 2DOF serial manipulator and results are simulated using ADAMS software [6]. The dynamic parameters of 2 DOF are estimated and results are validated through simulation [7]. Non-linear control law for serially arranged n-link is derived using Lyapunov-based theory by M W Sponge [8]. Recently, position control using neuro-fuzzy controller is proposed for 2-DOF serial manipulator [9]. Forward and inverse kinematics, DH parameters formulations and dynamic analysis for 2 DOF robot arm is as under, Fig -1: Two DOF planar manipulator
  • 2. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 78 2. FORWARD KINEMATICS The position and orientation of end effectors is a non linear function of joint variables P3 x, y = f q . x = L1cosq1 + L2cos q1 + q2 (1) y = L1sinq1 + L2sin q1 + q2 (2) Joint ranges are constrained for the manipulator analysis in the present case as, +90° ≤ q1 ≪ −90° and + 45° ≤ q2 ≪ −45° By differentiating the above two expressions, x = −L1sinq1 ∙ q1 − L2sin q1 + q2 q1 + q2 (3) y = L1cosq1 ∙ q1 + L2cos q1 + q2 q1 + q2 (4) In matrix form, x y = −L1sinq1 − L2sin q1 + q2 −L2sin q1 + q2 L1cosq1 + L2cos q1 + q2 L2cos q1 + q2 q1 q2 X = J ∙ q Where, X is the velocity of end effector, J is jacobian matrix and q represents joint rates. For a rotational joint the analytic a geometric jacobian are different. Jacobian matrix represents the relationship between rates of change of pose with respect to joint rates. Rank deficiency of jacobian represents singularity. 2.1 DH parameters of 2DOF arm Fig -2: Frame attachment for Two DOF planar manipulator Table -1: DH Parameters Link α a d θ 1 0 L1 0 θ1 2 0 L2 0 θ2 T = C1 −S1 0 L1C1 S1 C1 0 L1S1 0 0 1 0 0 0 0 1 1 0 T = C2 −S2 0 L2C2 S2 C2 0 L2S2 0 0 1 0 0 0 0 1 2 1 T = C12 −S12 0 L1C1 + L2C12 S12 C12 0 L1S1 + L2S12 0 0 1 0 0 0 0 1 2 0 Where, Li = Link length of ith link θi = Joint rates of ith actuator C1 = cosθ1 S1 = sinθ1 C12 = cos⁡θ1 + θ2 S12 = sin⁡θ1 + θ2 Fig -3: Kinematic Mapping 3. INVERSE KINEMATICS The pose of the robot manipulator H = R P 0 1 is known and the joint variables need to be identified for a pose. The geometric solution of the inverse kinematics are summarized in the form of, cosq2 = x2 + y2 − L1 2 − L2 2 2L1L2 tanq1 = y L2cosq2 + L1 − x1L2sinq2 x L1 + L2cosq2 + yL2sinq2 Joint velocity and the end-effectors velocity has a velocity constraint and is expressed as, q = J−1 X J−1 = C12/ L1S2 S12/ L1S2 − L2C12 + L1C1 /L1L2S2 − L2S12 + L1S1 /L1L2S2 Task Space Forward Kinematics Inverse Kinematics Joint Space Rate of change of Cartesian pose Jacobian Rate of change of joint position
  • 3. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 79 Determinant of inverse jacobian matrix is − C12S1 − S12C1 / L1L2S2 2 . If the value of determinant is zero for given task space coordinates then the resulting configuration is singular. Desired pose can be achieved by iterative determination of the joint angles. Multi valued inverse mapping and redundancy are common problems with inverse kinematic. 4. PERFORMANCE MEASUREMENT Manipulability measures the effective robotic pose for object manipulation with in workspace. The term was proposed by Yoshikawa [10] and manipulability index (μ) is defined as, μ = det⁡(J) = σi 2 i=1 Where, J is jacobian of robot kinematics. For a two DOF RR- robotic manipulator, the manipulability index is in form of μ = L1L2 sinq2 . The manipulability index always varies within the workspace. The normalized mobility index is also an alternative way to represent a singular configuration and determining well conditioned workspace. Its value near to zero near boundaries shows boundary singularities. The condition number is another measure of presence of singularity as well as dexterity of robotic pose. Normally, the larger value of condition number above 30 indicates presence of singularity. The condition number is representation of an amplification factor of error during actuation. It is used for optimum trajectory planning and gross motion calculation of robotic manipulation within workspace. It ranges from 1 ≤ κ ≤ ∞. Hence, the local conditioning index also known as reciprocal of condition number is used to determine control accuracy, dexterity and isotropy of manipulator. Figure 4(a) and 4(b) shows the variation of mobility index and condition number within workspace for l1 = 0.2m and l2 = 0.15 m without time lag between servomotors with cosine input using MATLAB program respectively. The position curve is also plotted in same figure as shown on xy-plane for specified joint ranges. Fig -4 (a): Variation of condition number Fig -4 (b): Mobility Index μ Moreover, jacobian matrix loses its rank then the corresponding robot configurations are termed as singular configurations. It means for the smaller movements in operational space large amount of velocities are required at joints. Fig -5: Variation of condition number and mobility index with respect to time q = A ∗ cos 360 ∗ x T + B + C is called a general cosine function, which is used as an input to the both servo motors simulation for kinematic and dynamic analysis. In the expression A, B, C and T affects amplitude, phase, offset (horizontal translation) and period (vertical translation) respectively. -0.4 -0.2 0 0.2 0.4 -0.2 0 0.2 0.4 0.6 0 200 400 600 x (m)y (m) Conditionnumber -0.4 -0.2 0 0.2 0.4 -0.2 0 0.2 0.4 0.6 0 0.5 1 x (m)y (m) Normalizedmu -0.4 -0.2 0 0.2 0.4 -0.2 0 0.2 0.4 0.6 0 200 400 600 x (m)y (m) Conditionnumber -0.4 -0.2 0 0.2 0.4 -0.2 0 0.2 0.4 0.6 0 0.5 1 x (m)y (m) Normalizedmu 0.0 200.0 400.0 600.0 0 2 4 6 ConditionNumber Time 0 0.5 1 1.5 0 2 4 6 MobilityIndex Time (sec)
  • 4. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 80 Fig -6: Cosine function with horizontal and vertical offset 5. DYNAMIC ANALYSIS The dynamic behavior of manipulator is described in terms of the time rate of change of the robot configuration in relation to the joint torques exerted by the actuators. Hence, the resulting equation of motions represents such relationship in form of set of differential equations that govern the dynamic response of the robot linkage to input joint torques. Dynamic model for two DOF robot using Newton’s Euler approach, the dynamic equations are written separately for each link. Equations are evaluated in numeric or recursive manner. In this case, the sum of forces is equal to variation of linear momentum. The joint torques τ1 and τ2 are coupling moments. M q . q + C q, q . q +g(q)+f q = τL Where, q = Joint displacements q = Joint velocities q = Joint accelerations M q = Manipulator inertia matrix C q, q = Matrix of centripetal & coriolis torques g q = Gravitational torques f q = Friction torques τL = Applied torque inputs For a two degree of freedom manipulator, τ1 τ2 = i11 i12 i21 i22 x3 x6 + c11 c12 c21 c22 x2 x5 + g11 g21 x1 Where, q1 = x3 q1 = x2 q1 = x1 q2 = x6 q2 = x5 q2 = x4 The above equation can be rearranged in the form of, τ1 τ2 = g11 c11 i11 0 c12 i12 g21 c21 i21 0 c22 i22 x1 x2 x3 x4 x5 x6 The inertia matrix of 2 DOF robot arm is symmetric and positive definite and its elements are, i11 i12 i21 i22 Where, i11 = m1ac1 2 + m2 a1 2 + ac2 2 + 2a1ac2C2 + I1 + I2 i12 = m2 ac2 2 + a1ac2C2 + I2 i21 = m2 ac2 2 + a1ac2C2 + I2 i22 = m2ac2 2 + I2 The inertia has maximum value for fully extended arm. The elements of centripetal and coriolis matrix, c11 c12 c21 c22 = −2m2a1ac2S2x5 −m2a1ac2S2x5 m2a1ac2S2x2 0 Entries of gravitational terms are, g11 g21 = m1gac1C1 + m2g a1C1 + ac2C12 m2gac2C12 When arm is fully extended in the x-direction, the effect of gravitational moment becomes maximums. The closed form dynamic equations of n-degree-of-freedom robot in the form of, τi = Mijqj n j+1 + Cijk qjqk + Gi qi + fi qi n k=1 n j=1 , i = 1, … . . , n Lagrangian Euler approach is based on differentiation of energy terms with respect to the systems variable and time. Internal reaction forces are automatically eliminated using this method. Closed form equations are directly obtained. Here, the sum of torques is equal to variation of angular momentum. The total energy stored in each link is represented as, τi = 1 2 mi Vci 2 + 1 2 Iiωi 2 2 i=1 The resulting expression as same as obtained using Newton’s Euler approach. Lagrangian formulation is simpler than Newton’s Euler approach. -2.5 -2 -1.5 -1 -0.5 0 0.5 1 1.5 0 100 200 300 400 Amplitude Angle (deg) T=2 cos(360*x/T)-1 cos(360*x/T)+10 cos(360*x/T)
  • 5. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 81 5.1 Mass Properties of Both Links The case of 2-DOF serial manipulator under consideration has following mass properties, Link1 Material Properties: steel (AISI 1045) Poisson’s ratio: 0.27 at 25˚C Young’s modulus: 199GPa Coefficient of thermal expansion: 1.17×10−5 per ˚C Density: 7.827×103 kg/m3 Length L1 = 0.2 m Mass m1 = 1.383 kg Link2 Material Properties: steel (AISI 1045) Poisson’s ratio: 0.27 at 25˚C Young’s modulus: 199GPa Coefficient of thermal expansion: 1.17×10−5 per ˚C Density: 7.827×103 kg/m3 Length L2 = 0.15 m Mass m2 = 0.82658 kg Inertia with respect to coordinate system attached at base (tonne. m2) 1.234 × 1011 0 0 0 2.0405 × 1010 0 0 0 1.2155 × 1011 Inertia tensor at centre of gravity with respect to coordinate system (tonne. m2) 2.1817 × 1010 0 0 0 2.0030 × 1010 0 0 0 2.0405 × 1010 As shown in above table, the inertia tensor for an object with the coordinates of the centroid of the rigid body xc, yc, zc and ρ is mass density, is computed as, I = Ixx Ixy Ixz Iyx Iyy Iyz Izx Izy Izz Each element represents scalar quantity expressing resistance changes with respect to change of rotation of an object. Hence, the value of inertia tensor components varies with respect to time. The three diagonal elements are called principal moment of inertia and six off diagonal elements are called cross product of inertia. (a)Variation of θ1 with time (b) Variation of θ2 with time (c) Variation of velocity v1 with time (d) Variation of velocity v2 with time -20 30 80 130 180 0 1 2 3 4 5 6 7 8 Theta-1(degree) Time (sec) -10 10 30 50 70 90 0 1 2 3 4 5 6 7 8 Theta-2(degree) Time (sec) -200 -100 0 100 200 0 1 2 3 4 5 6 7 8 Velocoty-v1(deg/sec) Time (sec) -100 -50 0 50 100 0 1 2 3 4 5 6 7 8 Velocity-v2(deg/sec) Time (sec)
  • 6. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 82 (e) Variation of acceleration a1 with time (f) Variation of acceleration a2 with time Fig -7: Variation of q, q and q of joint-1 and joint-2 with respect to time (g) Variation of X_comp. of vel. of P3 with time (h) Variation of X_comp. of vel. of P3 with time (i) Variation of X_comp. of acc. of P3 with time (j) Variation of Y_comp. of acc. of P3 with time Fig -8: Variation of velocity and acceleration of point P3 with respect to time Fig -9: Torque requirements at joint-1 and joint-2 with respect to time -300 -200 -100 0 100 200 300 0 1 2 3 4 5 6 7 8 Acceleration-a1 (deg/sec2) Time (sec) -150 -100 -50 0 50 100 150 0 1 2 3 4 5 6 7 8 Acceleration-a2 (deg/sec2) Time (sec) -1048.64 -548.645 -48.6456 451.3543 951.3543 1451.354 0 2 4 6 8 10 X_componentofVel. ofP3(mm/sec) Time (Sec) -759.828 -259.828 240.1715 740.1715 1240.171 0 2 4 6 8 10 Y_componentofVel. P3(mm/sec) Time (Sec) -2519.41 -1519.41 -519.410 480.5898 1480.589 2480.589 3480.589 0 2 4 6 8 10 X_componentofacc.P3 (mm/sec2) Time (Sec) -3272.33 -2272.33 -1272.33 -272.338 727.6619 1727.662 2727.662 0 2 4 6 8 10 Y_componentofacc.P3 (mm/sec2) Time (Sec) -100000 0 100000 200000 0 2 4 6 Torque(N-mm) Time (Sec) Lagrangian Newton_Eule -50000 0 50000 100000 150000 200000 250000 0 2 4 6 Torque(Nmm) Time (Sec) Lagrangia Newton_Eule
  • 7. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 83 6. WORKSPACE BOUNDARY: Fig -10: Variation of X and Y components of position P3 with time using cosine input Singularity normally occurs near workspace boundary when both links are fully extended. By increasing the joint range of joint-2, there should not be significant change in workspace boundary but the internal singularities are reduced significantly. There may be existance of unreachable point within the workspace boundary or outside of it due to physical constraints of mechanism. Singularity is a case of infinite acceleration in such cases. The value of A & C are varied from ±10° to ±90° for P3 x, y i.e. workspace boundary determination as plotted in figure 11. Fig -11: Work space boundary for 2 DOF serial manipulator CONCLUSIONS In this work, the mathematical formulation of complete kinematics and dynamics of two degrees of freedom robotic arm is presented. The simulation of kinematics and dynamics is performed using Pro/Engineer software and results are compared with analytical results. The results are plotted for the performance measurement using condition number and manipubality index. The value of condition number is not well at time of actuation as well as at time of reaching the end of joint limit. The work space boundary represents the limitation of actuations and the space for a placement of work parts. In a robot joint, it is known that friction can relate to temperature, force/torque levels, position, velocity, acceleration, lubricant properties. In this paper, models included nonlinearities and frictions are neglected. It is observed that average variation in the torques computed by Newton’s Euler at the both joint axis around 3% at all possible position compared to Lagrangian dynamics approach using MATLAB and Pro/engineer software. ACKNOWLEDGEMENTS The authors would like to acknowledge support of Sophisticated Instrumentation Centre for Applied Research and Testing (SICART). REFERENCES [1]. Fernando Reyes, Rafael Kelly , Experimental evaluation of model-based controllers on a direct-drive robot arm, Mechatronics, Vol. 11, P.P. 267-282, 2001 [2]. Jolly Shah, S.S.Rattan, B.C.Nakra, Kinematic Analysis of 2-DOF Planer Robot Using Artificial Neural Network, World Academy of Science, Engineering and Technology, Vol. 81, pp. 282-285, 2011 [3]. Denavit, J. & Hartenberg, R. S., “A kinematic notation for lower-pair mechanisms based on matrices”, Journal of Applied Mechanics, Vol., 1, pp. 215-221, 1955 [4]. Tarcisio A.H. Coelho, Liang Yong, Valter F.A. Alves , “Decoupling of dynamic equations by means of adaptive balancing of 2-dof open-loop mechanisms”, Mechanism and Machine Theory 39, (2004), 871–881 [5]. B.K. Rout, R.K. Mittal, “Parametric design optimization of 2-DOF R–R planar manipulator- A design of experiment approach”, Robotics and Computer-Integrated Manufacturing, 24 (2008) 239–248 [6]. Vigen Arakelian , Jean-Paul Le Baron, Pauline Mottu, “Torque minimization of the 2-DOF serial manipulators based on minimum energy consideration and optimum mass redistribution”, Mechatronics, 21 (2011) 310–314 [7]. Ravindra Biradar, M.B.Kiran, “The Dynamics of Fixed Base and Free-Floating Robotic Manipulator”, International Journal of Engineering Research & Technology, Vol. 1 (5), 2012, 1-9 -400 -200 0 200 400 0 1 2 3 4 5 6 7 8 9 10 Time x y -200 -100 0 100 200 300 400 -400 -200 0 200 400 y_P3(mm) x_P3 (mm) -200 -100 0 100 200 300 400 -400 -200 0 200 400 y_P3(mm) x_P3 (mm) x_y_10 x_y_20 x_y_30 x_y_40 x_y_50 x_y_60
  • 8. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 02 Issue: 09 | Sep-2013, Available @ http://www.ijret.org 84 [8]. M W Spong, On the robust control of robot manipulators. IEEE Transactions on Automatic Control ,Vol. 37(11), P.P. 1782-86, 1992 [9]. A new method for position control of a 2-DOF robot arm using neuro – fuzzy controller, Indian Journal of Science and Technology, Vol. 5(3), 2253-2257, 2012 [10]. Yoshikawa T., “Manipulability of robotic mechanisms”, The International Journal of Robotics Research, 4, 1985, No 2, 3-9. BIOGRAPHIES Y.D Patel is working as Associate Professor in Mechanical Engineering department of A D Patel Institute of Technology, New Vallabh Vidyanagar Gujarat. Dr. P.M. George is working as Head of Department of Mechanical Engineering at Birla Vishvakarma Mahavidyalaya, Vallabh Vidyanagar, Gujarat.