SlideShare a Scribd company logo
IOSR Journal of Mechanical and Civil Engineering (IOSR-JMCE)
e-ISSN: 2278-1684 Volume 6, Issue 1 (Mar. - Apr. 2013), PP 66-72
www.iosrjournals.org
www.iosrjournals.org 66 | Page
Kinematic Model of Anthropomorphic Robotics Finger
Mechanisms
Abdul Haseeb Zaidy1
, Wasim Akram2
, P. Tauseef Ahmad 3
, Mohd. Parvez4
1
(Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India
2
(Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India
3
(Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India
4
(Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India
Abstract: Research on Kinematic Model of Anthropomorphic robotics Finger mechanisms is being carried out
to accommodate a variety of tasks such as grasping and manipulation of objects in the field of industrial
applications, service robots, and rehabilitation robots. The first step in realizing a fully functional of
anthropomorphic robotics Finger mechanisms is kinematic modeling. In this paper, a Kinematic Model of
Anthropomorphic robotics Finger mechanism is proposed based on the biological equivalent of human hand
where each links interconnect at the metacarpophalangeal (MCP), proximal interphalangeal (PIP) and distal
interphalangeal (DIP) joints respectively. The Kinematic modeling was carried out using Denavit Hartenburg
(DH) algorithm for the proposed of Kinematic Model of Anthropomorphic robotics Finger mechanisms.
Index Terms— Anthropomorphic robot Finger, Modeling, Robotics, Simulation
I. Introduction
Among the vast applications of robotics, robotic assistance in human daily life and has been the major
factor that contributes to its development. The focus on the anthropomorphism robotic limbs is currently
undergoing a very rapid development. The creation of a multifingered anthropomorphic robotic hand is a
challenge that demands innovative integration of mechanical, electronics, control and embedded software
designs.
II. Literature Review -
The normal human hand has a set of hand which includes palm and fingers. There are five fingers in each
hand, where each finger has three different phalanxes: Proximal, Middle and Distal Phalanxes. These three
phalanxes are separated by two joints, called the Interphalangeal joints (IP joints). The IP joints function like
hinges for bending and straightening the fingers and the thumb. The IP joint closest to the palm is called the
Metacarpals joint (MCP). Next to the MCP joint is the Proximal IP joint (PIP) which is in between the Proximal
and Middle Phalanx of a finger. The joint at the end of the finger is called the Distal IP joint (DIP). Both PIP
and DIP joints have one Degree of Freedom (DOF) owing to rotational movement [7]. The thumb is a complex
physical structure among the fingers and only has one IP joint between the two thumb phalanxes. Except for the
thumb, the other four fingers (index, middle, ring and pinky) have similar structures in terms of kinematics and
dynamics features. Average range of motion among the four fingers for flexion-extension movement is 650 at
the DIP joint, 1000 at the PIP joint and 800 at the MCP joint while the abduction-adduction angles for the
index finger has been measured as 200 at the MCP joint[7,8]. Figure 1 illustrates the structure of a human
finger.
Fig.1: Structure of Human Finger
Kinematic Model of Anthropomorphic robotics Finger mechanisms
www.iosrjournals.org 67 | Page
III. KINEMATIC RELATIONSHIP BETWEEN ADJACENT LINKS
In 1955, Denavit and Hartenberg[1] published a paper in the ASME journal of applied mechanics that
was later used to represent and model space mechanism and to derive their eq. o motion. The DH model of
representation is a very simple way of modeling space mechanism links and joints that can be used for any space
mechanism configuration, regardless of its sequence or complexity. It can also be used to represent
transformation in any coordinates such as Cartesian, cylindrical, spherical, Euler and RPY.[2,3,4,5,6]
Kinematic modeling of space mechanism describe by D-H Notation. There are four D-H parameters-
two link parameters (ai , αi) and two joint parameters (di,θi)- are defined as:
(a) Link Length (ai) –Distance measured along xi-axis from the point of intersection of xi-axis with zi-1 axis to
the origin of frame {i}, that is , distance CD.
(b) Link twist (αi) – angle between zi-1 and zi axes measured about xi axes in the right hand sense.
(c) Joint distance (di)- distance measured along zi-1 from the origin of frame{i-1} (point B) to the intersection
of xi axis with zi-1 axis (point C) that is, distance BC
(d) Joint angle (θi)- angle between xi-1 and xi axes measured about the zi-1 axis in the right hand sense.
This notation is presented in this section and followed throughout the text Denavit and Hartenberg
Representation.
First, we need to define a representation of position and orientation (pose) of one body relative to
another, in the form of our transformation matrix. There are any number of general ways to do this, and several
accepted conventions for doing this. In serial robotics, the Denavit and Hartenberg representation is the
standard for position kinematics. In the Denavit and Hartenberg (D&H) convention, a general transformation
between two bodies is defined as the product of four basic transformations: a rotation about the initial z axis
by q, a translation along the initial z axis by d, a translation along the new x axis by a, and a rotation about the
new x axis by a.
Notice now that we are able to define the general pose of one body with respect to another with only 4
parameters, q, d, a, and a instead of 6 which we would expect.[7] This is due to a careful choice for attaching
these frames in the D-H convention and shown here.
Consider two general space mechanism links connected with joints as shown fig.2 here.
Fig.2: Joint-Link Parameters
IV. Matlab Programming
In order to obtain eq. (2), the symbolic operations have to be performed in MATLAB. For that the
following commands are used;
>syms bi thi8 ai ali;
>tbm=[1,0,0,0;0,1,0,0;0,1,bi;0,0,0,1];
>tthm=[cos(thi0,-sin(thi),0,0;sin(thi),cos(thi),0,0;0,0,1,0;0,0,0,1];
>tam=[1,0,0,ai;0,1,0,0;0,0,1,0;0,0,0,1];
>talm=[1,0,0,0;0,cos(ali),-sin(ali),0;0,sin(ali),cos(ali),0;0,0,0,1];
>tim=tbm*tthm*tam8talm
Tim=
[cos(thi),sin(thi)*cos(ali),in(thi)*sin(ali), cos(thi)*ai]
[sin(thi),cos(thi)*cos(ali)-cos(thi)*sin(ali), sin(thi)*ai]
Kinematic Model of Anthropomorphic robotics Finger mechanisms
www.iosrjournals.org 68 | Page
[ 0, sin(ali), os(ali), bi]
[ 0, 0, 0, 1]
Where command „syms‟ are used to define the symbolic variables,‟bi‟ „thi,‟ „ai,‟ and „ali‟ for the DH parameter
bi, θi, ai, and αi respectively. Moreover,the notations,‟tbm,‟ „tthm,‟ and „talm‟ are used to represent thye
matrices Tb,Tθ ,Ta and Tα, given by eqs.(2),respectively.finally, the resultant matrix Ti, denoted as‟tim‟ in the
MATLAB environment, is evaluated above, which matches with eq.(2).[10]
V. MODELING OF FINGER MECHANISM
The convention outlined above does not result in a unique attachment of frames to links because
alternative choices are available. For example: Joint axes i have two choices for direction to point zi-axis, one
pointing upward (as in fig.2) and other pointing downward. To minimize such options and get a consistent set of
frames, an algorithm 1.1 is presented below to assign frames to all links of a space mechanism.
Algorithm 1.1
This algorithm assigns frames and determines the DH-parameters for each link of an n-DOF
manipulator .Both, the first link 0 and the last link n, are connected to only one other link and, thus, have more
arbitrariness in frame assignment. For this reason, the first (frame{0})and the last (frame{n}) frames are
assigned after assigning frames to intermediate links, link 1 to link(n-1).The displacement of each joint-link is
measured with respect to a frame; therefore the zero position of each link needs to be clearly defined. The zero
position for a revolute joint is when the joint angle θ is zero, while for a prismatic joint it is when the joint
displacement is minimal; it may or may not be zero. When all the joints are in zero position, the manipulator is
said to be in home position. Thus, the home position of an n-DOF manipulator is the position where the n x 1
vector of joint variables is equal to the zero vector, that is ,qi=0 for i=1,2,……,n.
Before assigning frames, the zero position of each joint, that is, the home position of the manipulator
must be decided. The frames are then assigned imagining the manipulator in home position. Because of
mechanical constraints, the range of joint motion possible is restricted and, in some cases, this may result in a
home position that is unreachable. In such cases, the home position is redefined by changing the initial
manipulator joint positions and/or frame assignments. The new home position can be obtained by adding a
constant value to the joint angle in case of revolute joint and to the joint displacement in case of prismatic joint.
This shifting of the home position is illustrated in design project, 6- DOF space mechanism.
The algorithm is divided into four parts. The first segment gives steps for labeling scheme and the
second one describes the steps for frame assignment to intermediate links 1 to (n-1). The third and fourth
segments give steps for frame {0} and frame {n} assignment, respectively.
Step 0 Identify and number the joints starting with base and ending with end-effector. Number the links from 0
to n starting with immobile base as 0 and ending with last link as n.
Step 1 Align axis zi with axis of joint (i+1)for i= 0,1,……,n-1.
Assigning frames to intermediate links- link 1 to link (n-1) For each link repeat steps 2and3.
Step 2 The xi-axis is fixed perpendicular to both zi-1 –and zi-axes and points away from zi-1. The origin of
frame {i} is located at the intersection of zi- and xi-axes. Three situations are possible:
Case (1) if zi-1-axes intersect; choose the origin at the point or their intersection. The xi-axis will
be perpendicular to the plane containing zi-1-and zi-axes. This will give ai to be zero.
Case (2) If zi-1-and zi-axes are parallel or lie in parallel planes then their common normal is not
uniquely defined. If joint t is revolute then xi –axis is chosen along that common normal, which passes through
origin of frame {i-1}. This will fix the origin and make di zero .if joint I is prismatic, xi-axis is located distal end
of the link i.
Case(3) if Zi-1 and zi-axis coincide ,the origin lies on the common axis. if joint I is revolute, origin is
located to coincide with origin of frame{i-1} and xi-axis coincide with xi-1 axis coincide with xi-1 axis to cause
di to be zero. if joint I is prismatic, xi-axis to cause di to be 0. If joint I is prismatic, xi-axis is chosen parallel to
xi-1 axis to make ai to be 0. The origin is located at distal end of link i.
Step3 the yi-axis has no choice and is fixed to right –handed orthonormal coordinate frame {i}. Assigning
frame to link 09, the immobile base-frame {0}
Step4 The frame {0} location is arbitrary. Its choice is made based on simplification of the model and
some convenient reference in workspace. The x0-axis, which is perpendicular to z0-axis, is chosen to be parallel
to xi-axis in the home position to make θ1=0. The origin of frame {0} is located based on type of joint 1. If joint
1 is revolute, the origin of frame {0} can be chosen at a convenient reference such as, floor, work table, and so
on, giving a constant value for parameter d1 zero.
If joint 1 is prismatic, parallel x0-and x1-axes will makeθ1to be zero and origin of frame {0} is placed
arbitrarily.
Step 5 The yo-axis completes the right-handed orthonormal coordinate frame {0}.
Kinematic Model of Anthropomorphic robotics Finger mechanisms
www.iosrjournals.org 69 | Page
Link n, the end-effector, frame assignment – frame {n}
Stape 6 The origin of frame {n} is chosen at the tip of the manipulator, that is, a convenient point on the last
link (the end -effecrtor). This point is called the tool point and the frame {n} is the tool frame.
Step 7 The zn-axis is fixed along the direction of zn-1-axus and pointing away from the link n. It is the
direction of approach.
Step 8 If joint n is prismatic; take xn parallel to xn-1-axis. If joint n is revolute, the choice of xn is similar to
step 4, that is, xn is perpendicular to both zn-1-and zn-axes. Xn direction is the normal direction. The yn –axis is
chosen to complete the right –handed orthonormal frame {n}. The yn – axis is the “orientation” or “sliding”
direction,[9]
IV. Result And Discussion
Fig. 3 shows the model of the proposed Kinematic Model of Anthropomorphic robotics Finger
mechanism. In Fig. 3, the fingers are assumed to be index, middle, ring and little fingers.
Fig.3: Model of a MFRH
The finger has 3 active joints. DIP joint has connection with PIP joint. The thumb is designed by
having 2 active joints. The joint of each link of MFRH model is a frame to determine the kinematic derivation.
Fig. 4 shows that the finger has four frames with three joints. The first frame also known as the base
frame is x0, y0, z0 and the subsequent frames are assigned as per the figure starting with x1, y1, z1 and ending
with x4, y4, z4. The forward kinematic solution of a finger will be assigned using homogenous matrix.
Fig.4:Single Finger Model
Forward Kinematic
Forward Kinematic is used to determine the position and orientation of MFRH to determine the
position and orientation of the robot hand relative to the robot base coordinate system. The derivation of forward
kinematic equation based on Table 1
Kinematic Model of Anthropomorphic robotics Finger mechanisms
www.iosrjournals.org 70 | Page
Hence, the forward kinematic for the fingers of robot hand are given by:
We assume that,
Kinematic Model of Anthropomorphic robotics Finger mechanisms
www.iosrjournals.org 71 | Page
Kinematic Model of Anthropomorphic robotics Finger mechanisms
www.iosrjournals.org 72 | Page
Thus, this completes the kinematic modeling of anthropomorphic robot Finger mechanisms. These equations are
used in the simulation of the design of anthropomorphic robot Finger mechanisms. The results of the simulation
shall be communicated in the next publication.
V. Conclusion
The kinematic modeling plays an important role in simulation of anthropomorphic robot Finger
mechanisms. In this paper, the complete derivation of the kinematic modeling of anthropomorphic robot Finger
mechanisms was carried out to enable subsequent simulation work. The results will be published in future.
Other work such as development of control algorithm and development of anthropomorphic robot Finger
mechanisms will be addressed in the next phase of study.
References
[1]. Denavit, j.,R.S. Hartenberg.” A kinematic Notation for Lower –Pair Mechanisms Based on Matrices.” ASME Journal of Applied
Mechanics, June 1955, 215-221.
[2]. Paul Richard P., “Robot Manipulator, mathematics, Programming, and control,” MIT Press, Cambridge ,Mass., 1981.
[3]. Craig, John J., Introduction to Robotics: Mechanics and Contorl, 2d Edition, Addison Wesley, 1989.
[4]. Shahinpoor, Mohsen, A robot Engineering Textbook, Harper &Row, Publishers,1987.
[5]. Koren, Yoram, Robotics for Engineers, McGraw-Hill, 1985.
[6]. Fu, K.S., R.C. Gonzalez and C.S.G.Lee, Robotics: Control, Sensing, Vision, and Inteliangence, McGraw-Hill, 1987
[7]. Neil A. Davidoff, Andris Freivalds (August4, 1993). “A graphic model of the human hand using CATIA”. Department of Industrial
and Management Systems Engineering, Pennsylvania State University, University Park, PA 16802, USA
[8]. Jung Won Kang, Hyun Seok Hong, Bong Sung Kim , Myung Jin Chung, “Work Assistive Mobile Robots Assisting the Disabled in a
Real Manufacturing Environment”, International Journal of Assistive Robotics and Mechtronics, Volume 8 Number 3, September
2007.
[9]. S.C. Jacobsen, E.K. Inversen, D.F. Knutti, R. T. Johnson and K.B. Biggers, “Design of the Utah/MIT Dexterous Hand, Proceedings
of the 1986 IEEE International Conference on Robotics and Automation, pp 1520-1532, 1986.
[10]. Matlab, 2002,MATLAB- The language of computing, version 6.5, Release 13.

More Related Content

What's hot

Differential kinematics robotic
Differential kinematics  roboticDifferential kinematics  robotic
Differential kinematics robotic
dahmane sid ahmed
 
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
Siva Samy
 
Robot kinematics
Robot kinematicsRobot kinematics
Robot kinematics
Varinder Singh
 
robot kinematics
robot kinematicsrobot kinematics
robot kinematics
Sumit Kumar
 
Kinematics final
Kinematics finalKinematics final
Kinematics final
Angga Fajarianto
 
Virtual reality
Virtual realityVirtual reality
Virtual reality
ReachLocal Services India
 
Robot Arm Kinematics
Robot Arm KinematicsRobot Arm Kinematics
Robot Arm Kinematics
cairo university
 
Robotics position and orientation
Robotics position and orientationRobotics position and orientation
Robotics position and orientation
Thiyagarajan Palanisamy
 
Manipulator kinematics
Manipulator kinematicsManipulator kinematics
Manipulator kinematics
Sudhir Reddy
 
Fir 05 dynamics
Fir 05 dynamicsFir 05 dynamics
Fir 05 dynamics
nguyendattdh
 
Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
nguyendattdh
 
Denavit hartenberg convention
Denavit hartenberg conventionDenavit hartenberg convention
Denavit hartenberg convention
nguyendattdh
 
Robotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory PlanningRobotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory Planning
Damian T. Gordon
 
Robotics
RoboticsRobotics
Robotics
Deepam Goyal
 
11 kinematicsrobot
11 kinematicsrobot11 kinematicsrobot
11 kinematicsrobot
Pallavi Choudekar
 
Matlab robotics toolbox
Matlab robotics toolboxMatlab robotics toolbox
Matlab robotics toolbox
Rajesh Raveendran
 
Jacobian inverse manipulator
Jacobian inverse manipulatorJacobian inverse manipulator
Jacobian inverse manipulator
Hitesh Mohapatra
 
Manipulator Jacobian
Manipulator JacobianManipulator Jacobian
Manipulator Jacobian
Hitesh Mohapatra
 
Industrial Robots
Industrial RobotsIndustrial Robots
Industrial Robots
Nafis Ahmad
 
Position analysis and dimensional synthesis
Position analysis and dimensional synthesisPosition analysis and dimensional synthesis
Position analysis and dimensional synthesis
Preetshah1212
 

What's hot (20)

Differential kinematics robotic
Differential kinematics  roboticDifferential kinematics  robotic
Differential kinematics robotic
 
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
 
Robot kinematics
Robot kinematicsRobot kinematics
Robot kinematics
 
robot kinematics
robot kinematicsrobot kinematics
robot kinematics
 
Kinematics final
Kinematics finalKinematics final
Kinematics final
 
Virtual reality
Virtual realityVirtual reality
Virtual reality
 
Robot Arm Kinematics
Robot Arm KinematicsRobot Arm Kinematics
Robot Arm Kinematics
 
Robotics position and orientation
Robotics position and orientationRobotics position and orientation
Robotics position and orientation
 
Manipulator kinematics
Manipulator kinematicsManipulator kinematics
Manipulator kinematics
 
Fir 05 dynamics
Fir 05 dynamicsFir 05 dynamics
Fir 05 dynamics
 
Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
 
Denavit hartenberg convention
Denavit hartenberg conventionDenavit hartenberg convention
Denavit hartenberg convention
 
Robotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory PlanningRobotics: Cartesian Trajectory Planning
Robotics: Cartesian Trajectory Planning
 
Robotics
RoboticsRobotics
Robotics
 
11 kinematicsrobot
11 kinematicsrobot11 kinematicsrobot
11 kinematicsrobot
 
Matlab robotics toolbox
Matlab robotics toolboxMatlab robotics toolbox
Matlab robotics toolbox
 
Jacobian inverse manipulator
Jacobian inverse manipulatorJacobian inverse manipulator
Jacobian inverse manipulator
 
Manipulator Jacobian
Manipulator JacobianManipulator Jacobian
Manipulator Jacobian
 
Industrial Robots
Industrial RobotsIndustrial Robots
Industrial Robots
 
Position analysis and dimensional synthesis
Position analysis and dimensional synthesisPosition analysis and dimensional synthesis
Position analysis and dimensional synthesis
 

Similar to Kinematic Model of Anthropomorphic Robotics Finger Mechanisms

Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...
Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...
Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...
Waqas Tariq
 
Kinematics Modeling of a 4-DOF Robotic Arm
Kinematics Modeling of a 4-DOF Robotic ArmKinematics Modeling of a 4-DOF Robotic Arm
Kinematics Modeling of a 4-DOF Robotic Arm
Amin A. Mohammed
 
Abstract— To be able to control a robot manipulator as.docx
  Abstract— To be able to control a robot manipulator as.docx  Abstract— To be able to control a robot manipulator as.docx
Abstract— To be able to control a robot manipulator as.docx
aryan532920
 
Forward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic ManipulatorsForward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic Manipulators
IRJET Journal
 
Forward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic ManipulatorsForward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic Manipulators
IRJET Journal
 
Insect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigationInsect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigation
eSAT Journals
 
07 robot arm kinematics
07 robot arm kinematics07 robot arm kinematics
07 robot arm kinematics
cairo university
 
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
ijsc
 
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Waqas Tariq
 
Insect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigationInsect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigation
eSAT Publishing House
 
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
IJERA Editor
 
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
IJRESJOURNAL
 
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
ijsc
 
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
IAEME Publication
 
K012145762
K012145762K012145762
K012145762
IOSR Journals
 
Inverse Kinematics Solution for Biped Robot
Inverse Kinematics Solution for Biped RobotInverse Kinematics Solution for Biped Robot
Inverse Kinematics Solution for Biped Robot
IOSR Journals
 
welding
weldingwelding
welding
engrode
 
Design and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based onDesign and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based on
eSAT Publishing House
 
Design and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based onDesign and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based on
eSAT Publishing House
 
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
eSAT Publishing House
 

Similar to Kinematic Model of Anthropomorphic Robotics Finger Mechanisms (20)

Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...
Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...
Human Arm Inverse Kinematic Solution Based Geometric Relations and Optimizati...
 
Kinematics Modeling of a 4-DOF Robotic Arm
Kinematics Modeling of a 4-DOF Robotic ArmKinematics Modeling of a 4-DOF Robotic Arm
Kinematics Modeling of a 4-DOF Robotic Arm
 
Abstract— To be able to control a robot manipulator as.docx
  Abstract— To be able to control a robot manipulator as.docx  Abstract— To be able to control a robot manipulator as.docx
Abstract— To be able to control a robot manipulator as.docx
 
Forward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic ManipulatorsForward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic Manipulators
 
Forward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic ManipulatorsForward and Inverse Kinematic Analysis of Robotic Manipulators
Forward and Inverse Kinematic Analysis of Robotic Manipulators
 
Insect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigationInsect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigation
 
07 robot arm kinematics
07 robot arm kinematics07 robot arm kinematics
07 robot arm kinematics
 
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
 
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
 
Insect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigationInsect inspired hexapod robot for terrain navigation
Insect inspired hexapod robot for terrain navigation
 
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
 
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
 
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
Solution of Inverse Kinematics for SCARA Manipulator Using Adaptive Neuro-Fuz...
 
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
FORWARD KINEMATIC ANALYSIS OF A ROBOTIC MANIPULATOR WITH TRIANGULAR PRISM STR...
 
K012145762
K012145762K012145762
K012145762
 
Inverse Kinematics Solution for Biped Robot
Inverse Kinematics Solution for Biped RobotInverse Kinematics Solution for Biped Robot
Inverse Kinematics Solution for Biped Robot
 
welding
weldingwelding
welding
 
Design and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based onDesign and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based on
 
Design and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based onDesign and analysis of x y-q positioning stage based on
Design and analysis of x y-q positioning stage based on
 
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
 

More from IOSR Journals

A011140104
A011140104A011140104
A011140104
IOSR Journals
 
M0111397100
M0111397100M0111397100
M0111397100
IOSR Journals
 
L011138596
L011138596L011138596
L011138596
IOSR Journals
 
K011138084
K011138084K011138084
K011138084
IOSR Journals
 
J011137479
J011137479J011137479
J011137479
IOSR Journals
 
I011136673
I011136673I011136673
I011136673
IOSR Journals
 
G011134454
G011134454G011134454
G011134454
IOSR Journals
 
H011135565
H011135565H011135565
H011135565
IOSR Journals
 
F011134043
F011134043F011134043
F011134043
IOSR Journals
 
E011133639
E011133639E011133639
E011133639
IOSR Journals
 
D011132635
D011132635D011132635
D011132635
IOSR Journals
 
C011131925
C011131925C011131925
C011131925
IOSR Journals
 
B011130918
B011130918B011130918
B011130918
IOSR Journals
 
A011130108
A011130108A011130108
A011130108
IOSR Journals
 
I011125160
I011125160I011125160
I011125160
IOSR Journals
 
H011124050
H011124050H011124050
H011124050
IOSR Journals
 
G011123539
G011123539G011123539
G011123539
IOSR Journals
 
F011123134
F011123134F011123134
F011123134
IOSR Journals
 
E011122530
E011122530E011122530
E011122530
IOSR Journals
 
D011121524
D011121524D011121524
D011121524
IOSR Journals
 

More from IOSR Journals (20)

A011140104
A011140104A011140104
A011140104
 
M0111397100
M0111397100M0111397100
M0111397100
 
L011138596
L011138596L011138596
L011138596
 
K011138084
K011138084K011138084
K011138084
 
J011137479
J011137479J011137479
J011137479
 
I011136673
I011136673I011136673
I011136673
 
G011134454
G011134454G011134454
G011134454
 
H011135565
H011135565H011135565
H011135565
 
F011134043
F011134043F011134043
F011134043
 
E011133639
E011133639E011133639
E011133639
 
D011132635
D011132635D011132635
D011132635
 
C011131925
C011131925C011131925
C011131925
 
B011130918
B011130918B011130918
B011130918
 
A011130108
A011130108A011130108
A011130108
 
I011125160
I011125160I011125160
I011125160
 
H011124050
H011124050H011124050
H011124050
 
G011123539
G011123539G011123539
G011123539
 
F011123134
F011123134F011123134
F011123134
 
E011122530
E011122530E011122530
E011122530
 
D011121524
D011121524D011121524
D011121524
 

Recently uploaded

IEEE Aerospace and Electronic Systems Society as a Graduate Student Member
IEEE Aerospace and Electronic Systems Society as a Graduate Student MemberIEEE Aerospace and Electronic Systems Society as a Graduate Student Member
IEEE Aerospace and Electronic Systems Society as a Graduate Student Member
VICTOR MAESTRE RAMIREZ
 
22CYT12-Unit-V-E Waste and its Management.ppt
22CYT12-Unit-V-E Waste and its Management.ppt22CYT12-Unit-V-E Waste and its Management.ppt
22CYT12-Unit-V-E Waste and its Management.ppt
KrishnaveniKrishnara1
 
Textile Chemical Processing and Dyeing.pdf
Textile Chemical Processing and Dyeing.pdfTextile Chemical Processing and Dyeing.pdf
Textile Chemical Processing and Dyeing.pdf
NazakatAliKhoso2
 
Properties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptxProperties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptx
MDSABBIROJJAMANPAYEL
 
BPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdf
BPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdfBPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdf
BPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdf
MIGUELANGEL966976
 
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
171ticu
 
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
Yasser Mahgoub
 
spirit beverages ppt without graphics.pptx
spirit beverages ppt without graphics.pptxspirit beverages ppt without graphics.pptx
spirit beverages ppt without graphics.pptx
Madan Karki
 
Engineering Drawings Lecture Detail Drawings 2014.pdf
Engineering Drawings Lecture Detail Drawings 2014.pdfEngineering Drawings Lecture Detail Drawings 2014.pdf
Engineering Drawings Lecture Detail Drawings 2014.pdf
abbyasa1014
 
DEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODEL
DEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODELDEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODEL
DEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODEL
gerogepatton
 
哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样
哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样
哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样
insn4465
 
Question paper of renewable energy sources
Question paper of renewable energy sourcesQuestion paper of renewable energy sources
Question paper of renewable energy sources
mahammadsalmanmech
 
Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...
Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...
Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...
University of Maribor
 
Recycled Concrete Aggregate in Construction Part II
Recycled Concrete Aggregate in Construction Part IIRecycled Concrete Aggregate in Construction Part II
Recycled Concrete Aggregate in Construction Part II
Aditya Rajan Patra
 
5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...
5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...
5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...
ihlasbinance2003
 
Comparative analysis between traditional aquaponics and reconstructed aquapon...
Comparative analysis between traditional aquaponics and reconstructed aquapon...Comparative analysis between traditional aquaponics and reconstructed aquapon...
Comparative analysis between traditional aquaponics and reconstructed aquapon...
bijceesjournal
 
Engine Lubrication performance System.pdf
Engine Lubrication performance System.pdfEngine Lubrication performance System.pdf
Engine Lubrication performance System.pdf
mamamaam477
 
Harnessing WebAssembly for Real-time Stateless Streaming Pipelines
Harnessing WebAssembly for Real-time Stateless Streaming PipelinesHarnessing WebAssembly for Real-time Stateless Streaming Pipelines
Harnessing WebAssembly for Real-time Stateless Streaming Pipelines
Christina Lin
 
CSM Cloud Service Management Presentarion
CSM Cloud Service Management PresentarionCSM Cloud Service Management Presentarion
CSM Cloud Service Management Presentarion
rpskprasana
 
Electric vehicle and photovoltaic advanced roles in enhancing the financial p...
Electric vehicle and photovoltaic advanced roles in enhancing the financial p...Electric vehicle and photovoltaic advanced roles in enhancing the financial p...
Electric vehicle and photovoltaic advanced roles in enhancing the financial p...
IJECEIAES
 

Recently uploaded (20)

IEEE Aerospace and Electronic Systems Society as a Graduate Student Member
IEEE Aerospace and Electronic Systems Society as a Graduate Student MemberIEEE Aerospace and Electronic Systems Society as a Graduate Student Member
IEEE Aerospace and Electronic Systems Society as a Graduate Student Member
 
22CYT12-Unit-V-E Waste and its Management.ppt
22CYT12-Unit-V-E Waste and its Management.ppt22CYT12-Unit-V-E Waste and its Management.ppt
22CYT12-Unit-V-E Waste and its Management.ppt
 
Textile Chemical Processing and Dyeing.pdf
Textile Chemical Processing and Dyeing.pdfTextile Chemical Processing and Dyeing.pdf
Textile Chemical Processing and Dyeing.pdf
 
Properties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptxProperties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptx
 
BPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdf
BPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdfBPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdf
BPV-GUI-01-Guide-for-ASME-Review-Teams-(General)-10-10-2023.pdf
 
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
 
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
 
spirit beverages ppt without graphics.pptx
spirit beverages ppt without graphics.pptxspirit beverages ppt without graphics.pptx
spirit beverages ppt without graphics.pptx
 
Engineering Drawings Lecture Detail Drawings 2014.pdf
Engineering Drawings Lecture Detail Drawings 2014.pdfEngineering Drawings Lecture Detail Drawings 2014.pdf
Engineering Drawings Lecture Detail Drawings 2014.pdf
 
DEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODEL
DEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODELDEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODEL
DEEP LEARNING FOR SMART GRID INTRUSION DETECTION: A HYBRID CNN-LSTM-BASED MODEL
 
哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样
哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样
哪里办理(csu毕业证书)查尔斯特大学毕业证硕士学历原版一模一样
 
Question paper of renewable energy sources
Question paper of renewable energy sourcesQuestion paper of renewable energy sources
Question paper of renewable energy sources
 
Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...
Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...
Presentation of IEEE Slovenia CIS (Computational Intelligence Society) Chapte...
 
Recycled Concrete Aggregate in Construction Part II
Recycled Concrete Aggregate in Construction Part IIRecycled Concrete Aggregate in Construction Part II
Recycled Concrete Aggregate in Construction Part II
 
5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...
5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...
5214-1693458878915-Unit 6 2023 to 2024 academic year assignment (AutoRecovere...
 
Comparative analysis between traditional aquaponics and reconstructed aquapon...
Comparative analysis between traditional aquaponics and reconstructed aquapon...Comparative analysis between traditional aquaponics and reconstructed aquapon...
Comparative analysis between traditional aquaponics and reconstructed aquapon...
 
Engine Lubrication performance System.pdf
Engine Lubrication performance System.pdfEngine Lubrication performance System.pdf
Engine Lubrication performance System.pdf
 
Harnessing WebAssembly for Real-time Stateless Streaming Pipelines
Harnessing WebAssembly for Real-time Stateless Streaming PipelinesHarnessing WebAssembly for Real-time Stateless Streaming Pipelines
Harnessing WebAssembly for Real-time Stateless Streaming Pipelines
 
CSM Cloud Service Management Presentarion
CSM Cloud Service Management PresentarionCSM Cloud Service Management Presentarion
CSM Cloud Service Management Presentarion
 
Electric vehicle and photovoltaic advanced roles in enhancing the financial p...
Electric vehicle and photovoltaic advanced roles in enhancing the financial p...Electric vehicle and photovoltaic advanced roles in enhancing the financial p...
Electric vehicle and photovoltaic advanced roles in enhancing the financial p...
 

Kinematic Model of Anthropomorphic Robotics Finger Mechanisms

  • 1. IOSR Journal of Mechanical and Civil Engineering (IOSR-JMCE) e-ISSN: 2278-1684 Volume 6, Issue 1 (Mar. - Apr. 2013), PP 66-72 www.iosrjournals.org www.iosrjournals.org 66 | Page Kinematic Model of Anthropomorphic Robotics Finger Mechanisms Abdul Haseeb Zaidy1 , Wasim Akram2 , P. Tauseef Ahmad 3 , Mohd. Parvez4 1 (Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India 2 (Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India 3 (Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India 4 (Research Scholar, Mechanical Engg. Department,AFSET Dhauj Faridabad , India Abstract: Research on Kinematic Model of Anthropomorphic robotics Finger mechanisms is being carried out to accommodate a variety of tasks such as grasping and manipulation of objects in the field of industrial applications, service robots, and rehabilitation robots. The first step in realizing a fully functional of anthropomorphic robotics Finger mechanisms is kinematic modeling. In this paper, a Kinematic Model of Anthropomorphic robotics Finger mechanism is proposed based on the biological equivalent of human hand where each links interconnect at the metacarpophalangeal (MCP), proximal interphalangeal (PIP) and distal interphalangeal (DIP) joints respectively. The Kinematic modeling was carried out using Denavit Hartenburg (DH) algorithm for the proposed of Kinematic Model of Anthropomorphic robotics Finger mechanisms. Index Terms— Anthropomorphic robot Finger, Modeling, Robotics, Simulation I. Introduction Among the vast applications of robotics, robotic assistance in human daily life and has been the major factor that contributes to its development. The focus on the anthropomorphism robotic limbs is currently undergoing a very rapid development. The creation of a multifingered anthropomorphic robotic hand is a challenge that demands innovative integration of mechanical, electronics, control and embedded software designs. II. Literature Review - The normal human hand has a set of hand which includes palm and fingers. There are five fingers in each hand, where each finger has three different phalanxes: Proximal, Middle and Distal Phalanxes. These three phalanxes are separated by two joints, called the Interphalangeal joints (IP joints). The IP joints function like hinges for bending and straightening the fingers and the thumb. The IP joint closest to the palm is called the Metacarpals joint (MCP). Next to the MCP joint is the Proximal IP joint (PIP) which is in between the Proximal and Middle Phalanx of a finger. The joint at the end of the finger is called the Distal IP joint (DIP). Both PIP and DIP joints have one Degree of Freedom (DOF) owing to rotational movement [7]. The thumb is a complex physical structure among the fingers and only has one IP joint between the two thumb phalanxes. Except for the thumb, the other four fingers (index, middle, ring and pinky) have similar structures in terms of kinematics and dynamics features. Average range of motion among the four fingers for flexion-extension movement is 650 at the DIP joint, 1000 at the PIP joint and 800 at the MCP joint while the abduction-adduction angles for the index finger has been measured as 200 at the MCP joint[7,8]. Figure 1 illustrates the structure of a human finger. Fig.1: Structure of Human Finger
  • 2. Kinematic Model of Anthropomorphic robotics Finger mechanisms www.iosrjournals.org 67 | Page III. KINEMATIC RELATIONSHIP BETWEEN ADJACENT LINKS In 1955, Denavit and Hartenberg[1] published a paper in the ASME journal of applied mechanics that was later used to represent and model space mechanism and to derive their eq. o motion. The DH model of representation is a very simple way of modeling space mechanism links and joints that can be used for any space mechanism configuration, regardless of its sequence or complexity. It can also be used to represent transformation in any coordinates such as Cartesian, cylindrical, spherical, Euler and RPY.[2,3,4,5,6] Kinematic modeling of space mechanism describe by D-H Notation. There are four D-H parameters- two link parameters (ai , αi) and two joint parameters (di,θi)- are defined as: (a) Link Length (ai) –Distance measured along xi-axis from the point of intersection of xi-axis with zi-1 axis to the origin of frame {i}, that is , distance CD. (b) Link twist (αi) – angle between zi-1 and zi axes measured about xi axes in the right hand sense. (c) Joint distance (di)- distance measured along zi-1 from the origin of frame{i-1} (point B) to the intersection of xi axis with zi-1 axis (point C) that is, distance BC (d) Joint angle (θi)- angle between xi-1 and xi axes measured about the zi-1 axis in the right hand sense. This notation is presented in this section and followed throughout the text Denavit and Hartenberg Representation. First, we need to define a representation of position and orientation (pose) of one body relative to another, in the form of our transformation matrix. There are any number of general ways to do this, and several accepted conventions for doing this. In serial robotics, the Denavit and Hartenberg representation is the standard for position kinematics. In the Denavit and Hartenberg (D&H) convention, a general transformation between two bodies is defined as the product of four basic transformations: a rotation about the initial z axis by q, a translation along the initial z axis by d, a translation along the new x axis by a, and a rotation about the new x axis by a. Notice now that we are able to define the general pose of one body with respect to another with only 4 parameters, q, d, a, and a instead of 6 which we would expect.[7] This is due to a careful choice for attaching these frames in the D-H convention and shown here. Consider two general space mechanism links connected with joints as shown fig.2 here. Fig.2: Joint-Link Parameters IV. Matlab Programming In order to obtain eq. (2), the symbolic operations have to be performed in MATLAB. For that the following commands are used; >syms bi thi8 ai ali; >tbm=[1,0,0,0;0,1,0,0;0,1,bi;0,0,0,1]; >tthm=[cos(thi0,-sin(thi),0,0;sin(thi),cos(thi),0,0;0,0,1,0;0,0,0,1]; >tam=[1,0,0,ai;0,1,0,0;0,0,1,0;0,0,0,1]; >talm=[1,0,0,0;0,cos(ali),-sin(ali),0;0,sin(ali),cos(ali),0;0,0,0,1]; >tim=tbm*tthm*tam8talm Tim= [cos(thi),sin(thi)*cos(ali),in(thi)*sin(ali), cos(thi)*ai] [sin(thi),cos(thi)*cos(ali)-cos(thi)*sin(ali), sin(thi)*ai]
  • 3. Kinematic Model of Anthropomorphic robotics Finger mechanisms www.iosrjournals.org 68 | Page [ 0, sin(ali), os(ali), bi] [ 0, 0, 0, 1] Where command „syms‟ are used to define the symbolic variables,‟bi‟ „thi,‟ „ai,‟ and „ali‟ for the DH parameter bi, θi, ai, and αi respectively. Moreover,the notations,‟tbm,‟ „tthm,‟ and „talm‟ are used to represent thye matrices Tb,Tθ ,Ta and Tα, given by eqs.(2),respectively.finally, the resultant matrix Ti, denoted as‟tim‟ in the MATLAB environment, is evaluated above, which matches with eq.(2).[10] V. MODELING OF FINGER MECHANISM The convention outlined above does not result in a unique attachment of frames to links because alternative choices are available. For example: Joint axes i have two choices for direction to point zi-axis, one pointing upward (as in fig.2) and other pointing downward. To minimize such options and get a consistent set of frames, an algorithm 1.1 is presented below to assign frames to all links of a space mechanism. Algorithm 1.1 This algorithm assigns frames and determines the DH-parameters for each link of an n-DOF manipulator .Both, the first link 0 and the last link n, are connected to only one other link and, thus, have more arbitrariness in frame assignment. For this reason, the first (frame{0})and the last (frame{n}) frames are assigned after assigning frames to intermediate links, link 1 to link(n-1).The displacement of each joint-link is measured with respect to a frame; therefore the zero position of each link needs to be clearly defined. The zero position for a revolute joint is when the joint angle θ is zero, while for a prismatic joint it is when the joint displacement is minimal; it may or may not be zero. When all the joints are in zero position, the manipulator is said to be in home position. Thus, the home position of an n-DOF manipulator is the position where the n x 1 vector of joint variables is equal to the zero vector, that is ,qi=0 for i=1,2,……,n. Before assigning frames, the zero position of each joint, that is, the home position of the manipulator must be decided. The frames are then assigned imagining the manipulator in home position. Because of mechanical constraints, the range of joint motion possible is restricted and, in some cases, this may result in a home position that is unreachable. In such cases, the home position is redefined by changing the initial manipulator joint positions and/or frame assignments. The new home position can be obtained by adding a constant value to the joint angle in case of revolute joint and to the joint displacement in case of prismatic joint. This shifting of the home position is illustrated in design project, 6- DOF space mechanism. The algorithm is divided into four parts. The first segment gives steps for labeling scheme and the second one describes the steps for frame assignment to intermediate links 1 to (n-1). The third and fourth segments give steps for frame {0} and frame {n} assignment, respectively. Step 0 Identify and number the joints starting with base and ending with end-effector. Number the links from 0 to n starting with immobile base as 0 and ending with last link as n. Step 1 Align axis zi with axis of joint (i+1)for i= 0,1,……,n-1. Assigning frames to intermediate links- link 1 to link (n-1) For each link repeat steps 2and3. Step 2 The xi-axis is fixed perpendicular to both zi-1 –and zi-axes and points away from zi-1. The origin of frame {i} is located at the intersection of zi- and xi-axes. Three situations are possible: Case (1) if zi-1-axes intersect; choose the origin at the point or their intersection. The xi-axis will be perpendicular to the plane containing zi-1-and zi-axes. This will give ai to be zero. Case (2) If zi-1-and zi-axes are parallel or lie in parallel planes then their common normal is not uniquely defined. If joint t is revolute then xi –axis is chosen along that common normal, which passes through origin of frame {i-1}. This will fix the origin and make di zero .if joint I is prismatic, xi-axis is located distal end of the link i. Case(3) if Zi-1 and zi-axis coincide ,the origin lies on the common axis. if joint I is revolute, origin is located to coincide with origin of frame{i-1} and xi-axis coincide with xi-1 axis coincide with xi-1 axis to cause di to be zero. if joint I is prismatic, xi-axis to cause di to be 0. If joint I is prismatic, xi-axis is chosen parallel to xi-1 axis to make ai to be 0. The origin is located at distal end of link i. Step3 the yi-axis has no choice and is fixed to right –handed orthonormal coordinate frame {i}. Assigning frame to link 09, the immobile base-frame {0} Step4 The frame {0} location is arbitrary. Its choice is made based on simplification of the model and some convenient reference in workspace. The x0-axis, which is perpendicular to z0-axis, is chosen to be parallel to xi-axis in the home position to make θ1=0. The origin of frame {0} is located based on type of joint 1. If joint 1 is revolute, the origin of frame {0} can be chosen at a convenient reference such as, floor, work table, and so on, giving a constant value for parameter d1 zero. If joint 1 is prismatic, parallel x0-and x1-axes will makeθ1to be zero and origin of frame {0} is placed arbitrarily. Step 5 The yo-axis completes the right-handed orthonormal coordinate frame {0}.
  • 4. Kinematic Model of Anthropomorphic robotics Finger mechanisms www.iosrjournals.org 69 | Page Link n, the end-effector, frame assignment – frame {n} Stape 6 The origin of frame {n} is chosen at the tip of the manipulator, that is, a convenient point on the last link (the end -effecrtor). This point is called the tool point and the frame {n} is the tool frame. Step 7 The zn-axis is fixed along the direction of zn-1-axus and pointing away from the link n. It is the direction of approach. Step 8 If joint n is prismatic; take xn parallel to xn-1-axis. If joint n is revolute, the choice of xn is similar to step 4, that is, xn is perpendicular to both zn-1-and zn-axes. Xn direction is the normal direction. The yn –axis is chosen to complete the right –handed orthonormal frame {n}. The yn – axis is the “orientation” or “sliding” direction,[9] IV. Result And Discussion Fig. 3 shows the model of the proposed Kinematic Model of Anthropomorphic robotics Finger mechanism. In Fig. 3, the fingers are assumed to be index, middle, ring and little fingers. Fig.3: Model of a MFRH The finger has 3 active joints. DIP joint has connection with PIP joint. The thumb is designed by having 2 active joints. The joint of each link of MFRH model is a frame to determine the kinematic derivation. Fig. 4 shows that the finger has four frames with three joints. The first frame also known as the base frame is x0, y0, z0 and the subsequent frames are assigned as per the figure starting with x1, y1, z1 and ending with x4, y4, z4. The forward kinematic solution of a finger will be assigned using homogenous matrix. Fig.4:Single Finger Model Forward Kinematic Forward Kinematic is used to determine the position and orientation of MFRH to determine the position and orientation of the robot hand relative to the robot base coordinate system. The derivation of forward kinematic equation based on Table 1
  • 5. Kinematic Model of Anthropomorphic robotics Finger mechanisms www.iosrjournals.org 70 | Page Hence, the forward kinematic for the fingers of robot hand are given by: We assume that,
  • 6. Kinematic Model of Anthropomorphic robotics Finger mechanisms www.iosrjournals.org 71 | Page
  • 7. Kinematic Model of Anthropomorphic robotics Finger mechanisms www.iosrjournals.org 72 | Page Thus, this completes the kinematic modeling of anthropomorphic robot Finger mechanisms. These equations are used in the simulation of the design of anthropomorphic robot Finger mechanisms. The results of the simulation shall be communicated in the next publication. V. Conclusion The kinematic modeling plays an important role in simulation of anthropomorphic robot Finger mechanisms. In this paper, the complete derivation of the kinematic modeling of anthropomorphic robot Finger mechanisms was carried out to enable subsequent simulation work. The results will be published in future. Other work such as development of control algorithm and development of anthropomorphic robot Finger mechanisms will be addressed in the next phase of study. References [1]. Denavit, j.,R.S. Hartenberg.” A kinematic Notation for Lower –Pair Mechanisms Based on Matrices.” ASME Journal of Applied Mechanics, June 1955, 215-221. [2]. Paul Richard P., “Robot Manipulator, mathematics, Programming, and control,” MIT Press, Cambridge ,Mass., 1981. [3]. Craig, John J., Introduction to Robotics: Mechanics and Contorl, 2d Edition, Addison Wesley, 1989. [4]. Shahinpoor, Mohsen, A robot Engineering Textbook, Harper &Row, Publishers,1987. [5]. Koren, Yoram, Robotics for Engineers, McGraw-Hill, 1985. [6]. Fu, K.S., R.C. Gonzalez and C.S.G.Lee, Robotics: Control, Sensing, Vision, and Inteliangence, McGraw-Hill, 1987 [7]. Neil A. Davidoff, Andris Freivalds (August4, 1993). “A graphic model of the human hand using CATIA”. Department of Industrial and Management Systems Engineering, Pennsylvania State University, University Park, PA 16802, USA [8]. Jung Won Kang, Hyun Seok Hong, Bong Sung Kim , Myung Jin Chung, “Work Assistive Mobile Robots Assisting the Disabled in a Real Manufacturing Environment”, International Journal of Assistive Robotics and Mechtronics, Volume 8 Number 3, September 2007. [9]. S.C. Jacobsen, E.K. Inversen, D.F. Knutti, R. T. Johnson and K.B. Biggers, “Design of the Utah/MIT Dexterous Hand, Proceedings of the 1986 IEEE International Conference on Robotics and Automation, pp 1520-1532, 1986. [10]. Matlab, 2002,MATLAB- The language of computing, version 6.5, Release 13.