SlideShare a Scribd company logo
Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com
ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154
www.ijera.com 151 | P a g e
Direct Kinematic modeling of 6R Robot using Robotics Toolbox
Prashant Badoni*
*(Department of Mechanical Engineering, Graphic Era University, Dehradun-248002)
ABSTRACT
The traditional approaches are insufficient to solve the complex kinematics problems of the redundant robotic
manipulators. To overcome such intricacy, Peter Corke’s Robotics Toolbox [1] is utilized in the present study.
This paper aims to model the direct kinematics of a 6 degree of freedom (DOF) Robotic arm. The Toolbox uses
the Denavit-Hartenberg (DH) Methodology [2] to compute the kinematic model of the robot.
Keywords - Direct Kinematics Solution, MATLAB, Robotic Toolbox, Robot manipulator.
I. INTRODUCTION
Kinematic modeling of a robot is concerned with
its motion without consideration of forces. The
kinematic modeling of a robot is usually categorized
into forward or direct kinematics and inverse
kinematics. In the direct kinematics problem, the
location of end effector in the work space i.e. position
and orientation, is determined based on the joint
variables [3] [4]. The inverse kinematics problem
refers to finding the values of the joint variables that
allows the manipulator to reach the given location.
The relationship between direct and inverse
kinematics is illustrated in Fig.1.
Fig.1. Relationship between direct and inverse kinematics
The present paper describes the modeling and
analysis of a 6R robot with the application of
Robotics Toolbox [1] in MATLAB. The Toolbox is
based on a general method of representing kinematics
and dynamics of serial link manipulators by
description matrices. In this study, the toolbox is used
for direct kinematic solution of a six link robot
manipulator. The toolbox is also capable of plotting
3D graphical robot and allows users to drive the robot
model. A general serial 6R robot is shown in Fig.2.
Fig.2. Schematic of a general serial 6R robot manipulator [5]
II. DIRECT KINEMATIC MODEL
Direct kinematic analysis of 6R robot is done by
using Robotics Toolbox in MATLAB. Various
functions are used to complete the analysis
conveniently. First, create the six links and set the D-
H parameters as given in Table 1.
Table 1: D-H parameters of the manipulator
Links ai αi di θi Range
1 0 -90 1 θ1 0 to 360
2 0 90 4 θ2 -27 to 189
3 10 0 3 θ3 -241 to 82
4 10 0 0 θ4 0 to 360
5 0 -90 3 θ5 -100 to 100
6 0 0 1 θ6 0 to 360
Here θi is joint angle, di is joint offset, ai is link
length and αi is the twist angle. The limits of each
joint angle is given in the above table and utilized in
the m-file.
The joint variable is set to be zero at the starting.
A few workspace variables are created to define the
useful joint angles: qz for all starting position, qr for
ready position or reach position. The trajectory
between any of these two joint angle vectors can be
generated with respect to time. After that, the forward
kinematic can be computed easily by using fkine
function, which returns a homogeneous
transformation for the last link of the robot. Here is
the source code in MATLAB.
Direct
Kinematics
Inverse
Kinematics
Link Parameters
Joint
angles
Position and
Orientation of
end-effector
Link Parameters
Joint
angles
RESEARCH ARTICLE OPEN ACCESS
Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com
ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154
www.ijera.com 152 | P a g e
% create links using D-H parameters
% L = Link([theta, d, a, alpha]
L(1) = Link([0 1 0 –pi/2]);
L(2) = Link([0 4 0 pi/2]);
L(3) = Link([0 3 10 0]);
L(4) = Link([0 0 10 0]);
L(5) = Link([0 3 0 –pi/2]);
L(6) = Link([0 1 0 0]);
% Joint limits
L(1).qlim = pi/180*[0 360];
L(2).qlim = pi/180*[-27 189];
L(3).qlim = pi/180*[-241 82];
L(4).qlim = pi/180*[0 360];
L(5).qlim = pi/180*[-100 100];
L(6).qlim = pi/180*[0 360];
% create the robot model
Robot = SerialLink(L);
Robot.name = ‘Robot’
% starting position
qz = [0 0 0 0 0 0];
% ready position
qr = [pi/4 0 pi/4 0 –pi/2 pi];
% generate a time vector
t = [0:0.056:2];
% computes the joint coordinate trajectory
q = jtraj(qz, qr, t);
% direct kinematics for each joint co-ordinate
T = Robot.fkine(q)
Joint space trajectory can be animated by using the
following command:
>>Robot.plot(q)
Starting and ready position of the robot manipulator
from this simulation are given below in Fig.3 and
Fig.4:
Fig.3. Zero Pose of Robot
Fig.4. Ready Pose of Robot
3D Trajectory of the end-effector of the robot can be
plotted by:
>>figure,plot3(squeeze(T(1,4,:)),squeeze(T(2,4,:)),
squeeze(T(3,4,:)));
xlabel('X(inch)'),ylabel('Y(inch)'),zlabel('Z(inch)'),
title(‘End-effector 3D Trajectory’),grid;
Fig.5. Robot direct kinematics end-effector trajectory
Cartesian coordinates x, y, z of end-effector can be
plotted against time by:
>>figure,plot(t,squeeze(T(1,4,:)),
'-',t,squeeze(T(2,4,:)),'--',t,squeeze(T(3,4,:)),'-.');
xlabel('Time(s)'), ylabel('Coordinate(inch)'),grid,
legend('X','Y','Z'), title('End-effector Position');
Fig.6. Robot direct kinematics end-effector X, Y, Z coordinates
Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com
ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154
www.ijera.com 153 | P a g e
Generalized coordinates for each joint of the robot
can be plotted against time by:
>>subplot(6,1,1); plot(t,q(:,1));
xlabel('Time(s)'); ylabel('Joint1(rad)');
subplot(6,1,2); plot(t,q(:,2));
xlabel('Time(s)'); ylabel('Joint2(rad)');
subplot(6,1,3); plot(t,q(:,3));
xlabel('Time(s)'); ylabel('Joint3(rad)');
subplot(6,1,4); plot(t,q(:,4));
xlabel('Time(s)'); ylabel('Joint4(rad)');
subplot(6,1,5); plot(t,q(:,5));
xlabel('Time(s)'); ylabel('Joint5(rad)');
subplot(6,1,6);plot(t,q(:,6));
xlabel('Time(s)'); ylabel('Joint6(rad)');
Fig.7. Robot direct kinematics joint angles against time
Velocity and acceleration profile can be obtained by:
>> [q,qd,qdd] = jtraj(qz, qr, t)
Velocity profile of joints of the robot manipulator is
given by:
>>subplot(6,1,1); plot(t,q(:,1));title(‘Velocity’);
xlabel('Time(s)'); ylabel('Joint1(rad/s)');
subplot(6,1,2); plot(t,q(:,2));
xlabel('Time(s)'); ylabel('Joint2(rad/s)');
subplot(6,1,3); plot(t,q(:,3));
xlabel('Time(s)'); ylabel('Joint3(rad/s)');
subplot(6,1,4); plot(t,q(:,4));
xlabel('Time(s)'); ylabel('Joint4(rad/s)');
subplot(6,1,5); plot(t,q(:,5));
xlabel('Time(s)'); ylabel('Joint5(rad/s)');
subplot(6,1,6);plot(t,q(:,6));
xlabel('Time(s)'); ylabel('Joint6(rad/s)');
Fig.8. Joint velocity against time
Acceleration profile is given by:
>>subplot(6,1,1); plot(t,q(:,1));title(‘Acceleration’);
xlabel('Time(s)'); ylabel('Joint1(rad/s2)');
subplot(6,1,2); plot(t,q(:,2));
xlabel('Time(s)'); ylabel('Joint2(rad/s2)');
subplot(6,1,3); plot(t,q(:,3));
xlabel('Time(s)'); ylabel('Joint3(rad/s2)');
subplot(6,1,4); plot(t,q(:,4));
xlabel('Time(s)'); ylabel('Joint4(rad/s2)');
subplot(6,1,5); plot(t,q(:,5));
xlabel('Time(s)'); ylabel('Joint5(rad/s2)');
subplot(6,1,6);plot(t,q(:,6));
xlabel('Time(s)'); ylabel('Joint6(rad/s2)');
Fig.9. Joint acceleration against time
III. CONCLUSION
In this paper, the direct kinematic model of a 6R
robot is presented by utilizing the principal features
of the Robotic Toolbox in MATLAB. The Toolbox
provides several essential tools for the modeling and
analysis of the robotic manipulator, as well as
analyzing the experimental results.
Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com
ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154
www.ijera.com 154 | P a g e
REFERENCES
[1] P.I. Corke, A Robotics Toolbox for
MATLAB, IEEE Robotics and Automation
Magazine, Vol.3, No.1, pp.24-32, March
1996.
[2] J. Denavit, R.S. Hartenberg, A Kinematic
Notation for Lower-Pair Mechanisms Based
on Matricies, Trans. of ASME J.App. Mech.
vol. 77, pp.215-221, June 1955.
[3] J.J. Crage, Introduction to Robotics
Mechanics and Control, 3rd Edition,
Prentice Hall, 2005.
[4] M.W. Spong, S. Hutchinson and M.
Vidyasagar, Robot Modeling and Control,
1st
Edition, Jon Wiley & Sons Inc, 2005.
[5] Zhongtao Fu, Wenyu Yang and Zhen Yang,
Solution of Inverse Kinematics for 6R Robot
Manipulators With Offset Wrist Based on
Geometric Algebra, Journal of Mechanism
and Robotics, August 2013, Vol. 5.

More Related Content

PPTX
Lecture warshall floyd
PDF
[Question Paper] Electronic and Communication Technology (Revised Course) [Ap...
DOCX
AIP Inverse Test
PDF
Kinematic Synthesis of Four Bar Mechanism using Function Generator
PPTX
Delta Like Robot
PPTX
An Algebraic Method to Check the Singularity-Free Paths for Parallel Robots
PPTX
Invariant Generalised Hough Transform
PDF
[Question Paper] Computer Graphics (Revised Course) [January / 2017]
Lecture warshall floyd
[Question Paper] Electronic and Communication Technology (Revised Course) [Ap...
AIP Inverse Test
Kinematic Synthesis of Four Bar Mechanism using Function Generator
Delta Like Robot
An Algebraic Method to Check the Singularity-Free Paths for Parallel Robots
Invariant Generalised Hough Transform
[Question Paper] Computer Graphics (Revised Course) [January / 2017]

What's hot (9)

PPTX
Influence of the trajectory planning on the accuracy of the Orthoglide 5-axis
PPTX
Ph.D. Thesis : Ranjan JHA : Contributions to the Performance Analysis of Para...
PDF
A Polynomial-Space Exact Algorithm for TSP in Degree-5 Graphs
PDF
[Question Paper] Computer Graphics (Revised Course) [January / 2014]
PPTX
Influence of Design Parameters on the Singularities and Workspace of a 3-RPS ...
PDF
[Question Paper] Computer Graphics (Revised Course) [April / 2014]
PDF
Digital Signals and Systems (April – 2017) [Question Paper | CBSGS: 75:25 Pat...
PDF
Singularity condition of wrist partitioned 6-r serial
PDF
Digital Signals and System (April – 2017) [75:25 Pattern | Question Paper]
Influence of the trajectory planning on the accuracy of the Orthoglide 5-axis
Ph.D. Thesis : Ranjan JHA : Contributions to the Performance Analysis of Para...
A Polynomial-Space Exact Algorithm for TSP in Degree-5 Graphs
[Question Paper] Computer Graphics (Revised Course) [January / 2014]
Influence of Design Parameters on the Singularities and Workspace of a 3-RPS ...
[Question Paper] Computer Graphics (Revised Course) [April / 2014]
Digital Signals and Systems (April – 2017) [Question Paper | CBSGS: 75:25 Pat...
Singularity condition of wrist partitioned 6-r serial
Digital Signals and System (April – 2017) [75:25 Pattern | Question Paper]
Ad

Viewers also liked (20)

PDF
A Study of Saving Electrical Energy in the State of Kuwait by Reducing Power ...
PPS
Tm07
PPT
Tm03
PPS
Tm02
PPS
Tm06
PPS
Tm01
PPS
Tm03
PDF
Technological Considerations and Constraints in the Manufacture of High Preci...
PPS
Tm01
PPS
Tm09
PPT
Tutorial 2r
PDF
Alert System for High Speed Vehicles to Avoid Wildlife Accidents
PPT
Email setup-tutorial
PDF
Visual Product Identification for Blind
PDF
A Hybrid method of face detection based on Feature Extraction using PIFR and ...
PDF
Optimization of Ultrasound-Assisted Extraction of Arbutin from Leaves of Pyru...
PDF
A Hypothetical Study on Structural aspects of Indole-3-carbinol (I3C) by Hype...
DOCX
FAIZAL ACCOUNT
DOCX
Ehab Bayoumi RESUME
PPTX
3. Termokimya 1
A Study of Saving Electrical Energy in the State of Kuwait by Reducing Power ...
Tm07
Tm03
Tm02
Tm06
Tm01
Tm03
Technological Considerations and Constraints in the Manufacture of High Preci...
Tm01
Tm09
Tutorial 2r
Alert System for High Speed Vehicles to Avoid Wildlife Accidents
Email setup-tutorial
Visual Product Identification for Blind
A Hybrid method of face detection based on Feature Extraction using PIFR and ...
Optimization of Ultrasound-Assisted Extraction of Arbutin from Leaves of Pyru...
A Hypothetical Study on Structural aspects of Indole-3-carbinol (I3C) by Hype...
FAIZAL ACCOUNT
Ehab Bayoumi RESUME
3. Termokimya 1
Ad

Similar to Direct Kinematic modeling of 6R Robot using Robotics Toolbox (20)

PDF
A New Method For Solving Kinematics Model Of An RA-02
PDF
IRJET- Simulation and Kinematic Analysis of MTAB ARISTO Robot
PDF
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
PDF
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
PDF
Forward and Inverse Kinematic Analysis of Robotic Manipulators
PPT
Travelling Salesman Problem, Robotics & Inverse Kinematics
PDF
Kinematics Modeling and Simulation of SCARA Robot Arm
PDF
Forward and Inverse Kinematic Analysis of Robotic Manipulators
PDF
Robot forward and inverse kinematics research using matlab by d.sivasamy
PDF
Kinematics Modeling of a 4-DOF Robotic Arm
PDF
The research on end-effector position and orientation error distribution of S...
PDF
The kinematics analysis and trajectory planning of Series robot
PDF
Fractional-order sliding mode controller for the two-link robot arm
PDF
Predicting organic reaction outcomes with weisfeiler lehman network
DOCX
Final Project
PDF
kinematics of 8-axis robot for material handling applications
PDF
Robotic Manipulator with Revolute and Prismatic Joints
PDF
Indigenously Design Development and Motion Control of Multi-DoF Robotic Manip...
PDF
Simultaneous State and Actuator Fault Estimation With Fuzzy Descriptor PMID a...
PDF
Insect inspired hexapod robot for terrain navigation
A New Method For Solving Kinematics Model Of An RA-02
IRJET- Simulation and Kinematic Analysis of MTAB ARISTO Robot
IRJET - Radius Approach for Inverse Kinematics of 4-R Manipulator in Spatial ...
Inverse Kinematics Analysis for Manipulator Robot with Wrist Offset Based On ...
Forward and Inverse Kinematic Analysis of Robotic Manipulators
Travelling Salesman Problem, Robotics & Inverse Kinematics
Kinematics Modeling and Simulation of SCARA Robot Arm
Forward and Inverse Kinematic Analysis of Robotic Manipulators
Robot forward and inverse kinematics research using matlab by d.sivasamy
Kinematics Modeling of a 4-DOF Robotic Arm
The research on end-effector position and orientation error distribution of S...
The kinematics analysis and trajectory planning of Series robot
Fractional-order sliding mode controller for the two-link robot arm
Predicting organic reaction outcomes with weisfeiler lehman network
Final Project
kinematics of 8-axis robot for material handling applications
Robotic Manipulator with Revolute and Prismatic Joints
Indigenously Design Development and Motion Control of Multi-DoF Robotic Manip...
Simultaneous State and Actuator Fault Estimation With Fuzzy Descriptor PMID a...
Insect inspired hexapod robot for terrain navigation

Recently uploaded (20)

PPTX
Lecture Notes Electrical Wiring System Components
PDF
Mohammad Mahdi Farshadian CV - Prospective PhD Student 2026
PPTX
Engineering Ethics, Safety and Environment [Autosaved] (1).pptx
PPTX
M Tech Sem 1 Civil Engineering Environmental Sciences.pptx
PPTX
Infosys Presentation by1.Riyan Bagwan 2.Samadhan Naiknavare 3.Gaurav Shinde 4...
PPTX
additive manufacturing of ss316l using mig welding
PPTX
Geodesy 1.pptx...............................................
PPTX
Sustainable Sites - Green Building Construction
PPTX
FINAL REVIEW FOR COPD DIANOSIS FOR PULMONARY DISEASE.pptx
PPTX
KTU 2019 -S7-MCN 401 MODULE 2-VINAY.pptx
PPTX
Internet of Things (IOT) - A guide to understanding
PDF
Model Code of Practice - Construction Work - 21102022 .pdf
PPTX
UNIT 4 Total Quality Management .pptx
PPT
Mechanical Engineering MATERIALS Selection
PDF
composite construction of structures.pdf
PDF
Structs to JSON How Go Powers REST APIs.pdf
PPTX
UNIT-1 - COAL BASED THERMAL POWER PLANTS
PPTX
Lesson 3_Tessellation.pptx finite Mathematics
PDF
PPT on Performance Review to get promotions
PPTX
CH1 Production IntroductoryConcepts.pptx
Lecture Notes Electrical Wiring System Components
Mohammad Mahdi Farshadian CV - Prospective PhD Student 2026
Engineering Ethics, Safety and Environment [Autosaved] (1).pptx
M Tech Sem 1 Civil Engineering Environmental Sciences.pptx
Infosys Presentation by1.Riyan Bagwan 2.Samadhan Naiknavare 3.Gaurav Shinde 4...
additive manufacturing of ss316l using mig welding
Geodesy 1.pptx...............................................
Sustainable Sites - Green Building Construction
FINAL REVIEW FOR COPD DIANOSIS FOR PULMONARY DISEASE.pptx
KTU 2019 -S7-MCN 401 MODULE 2-VINAY.pptx
Internet of Things (IOT) - A guide to understanding
Model Code of Practice - Construction Work - 21102022 .pdf
UNIT 4 Total Quality Management .pptx
Mechanical Engineering MATERIALS Selection
composite construction of structures.pdf
Structs to JSON How Go Powers REST APIs.pdf
UNIT-1 - COAL BASED THERMAL POWER PLANTS
Lesson 3_Tessellation.pptx finite Mathematics
PPT on Performance Review to get promotions
CH1 Production IntroductoryConcepts.pptx

Direct Kinematic modeling of 6R Robot using Robotics Toolbox

  • 1. Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154 www.ijera.com 151 | P a g e Direct Kinematic modeling of 6R Robot using Robotics Toolbox Prashant Badoni* *(Department of Mechanical Engineering, Graphic Era University, Dehradun-248002) ABSTRACT The traditional approaches are insufficient to solve the complex kinematics problems of the redundant robotic manipulators. To overcome such intricacy, Peter Corke’s Robotics Toolbox [1] is utilized in the present study. This paper aims to model the direct kinematics of a 6 degree of freedom (DOF) Robotic arm. The Toolbox uses the Denavit-Hartenberg (DH) Methodology [2] to compute the kinematic model of the robot. Keywords - Direct Kinematics Solution, MATLAB, Robotic Toolbox, Robot manipulator. I. INTRODUCTION Kinematic modeling of a robot is concerned with its motion without consideration of forces. The kinematic modeling of a robot is usually categorized into forward or direct kinematics and inverse kinematics. In the direct kinematics problem, the location of end effector in the work space i.e. position and orientation, is determined based on the joint variables [3] [4]. The inverse kinematics problem refers to finding the values of the joint variables that allows the manipulator to reach the given location. The relationship between direct and inverse kinematics is illustrated in Fig.1. Fig.1. Relationship between direct and inverse kinematics The present paper describes the modeling and analysis of a 6R robot with the application of Robotics Toolbox [1] in MATLAB. The Toolbox is based on a general method of representing kinematics and dynamics of serial link manipulators by description matrices. In this study, the toolbox is used for direct kinematic solution of a six link robot manipulator. The toolbox is also capable of plotting 3D graphical robot and allows users to drive the robot model. A general serial 6R robot is shown in Fig.2. Fig.2. Schematic of a general serial 6R robot manipulator [5] II. DIRECT KINEMATIC MODEL Direct kinematic analysis of 6R robot is done by using Robotics Toolbox in MATLAB. Various functions are used to complete the analysis conveniently. First, create the six links and set the D- H parameters as given in Table 1. Table 1: D-H parameters of the manipulator Links ai αi di θi Range 1 0 -90 1 θ1 0 to 360 2 0 90 4 θ2 -27 to 189 3 10 0 3 θ3 -241 to 82 4 10 0 0 θ4 0 to 360 5 0 -90 3 θ5 -100 to 100 6 0 0 1 θ6 0 to 360 Here θi is joint angle, di is joint offset, ai is link length and αi is the twist angle. The limits of each joint angle is given in the above table and utilized in the m-file. The joint variable is set to be zero at the starting. A few workspace variables are created to define the useful joint angles: qz for all starting position, qr for ready position or reach position. The trajectory between any of these two joint angle vectors can be generated with respect to time. After that, the forward kinematic can be computed easily by using fkine function, which returns a homogeneous transformation for the last link of the robot. Here is the source code in MATLAB. Direct Kinematics Inverse Kinematics Link Parameters Joint angles Position and Orientation of end-effector Link Parameters Joint angles RESEARCH ARTICLE OPEN ACCESS
  • 2. Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154 www.ijera.com 152 | P a g e % create links using D-H parameters % L = Link([theta, d, a, alpha] L(1) = Link([0 1 0 –pi/2]); L(2) = Link([0 4 0 pi/2]); L(3) = Link([0 3 10 0]); L(4) = Link([0 0 10 0]); L(5) = Link([0 3 0 –pi/2]); L(6) = Link([0 1 0 0]); % Joint limits L(1).qlim = pi/180*[0 360]; L(2).qlim = pi/180*[-27 189]; L(3).qlim = pi/180*[-241 82]; L(4).qlim = pi/180*[0 360]; L(5).qlim = pi/180*[-100 100]; L(6).qlim = pi/180*[0 360]; % create the robot model Robot = SerialLink(L); Robot.name = ‘Robot’ % starting position qz = [0 0 0 0 0 0]; % ready position qr = [pi/4 0 pi/4 0 –pi/2 pi]; % generate a time vector t = [0:0.056:2]; % computes the joint coordinate trajectory q = jtraj(qz, qr, t); % direct kinematics for each joint co-ordinate T = Robot.fkine(q) Joint space trajectory can be animated by using the following command: >>Robot.plot(q) Starting and ready position of the robot manipulator from this simulation are given below in Fig.3 and Fig.4: Fig.3. Zero Pose of Robot Fig.4. Ready Pose of Robot 3D Trajectory of the end-effector of the robot can be plotted by: >>figure,plot3(squeeze(T(1,4,:)),squeeze(T(2,4,:)), squeeze(T(3,4,:))); xlabel('X(inch)'),ylabel('Y(inch)'),zlabel('Z(inch)'), title(‘End-effector 3D Trajectory’),grid; Fig.5. Robot direct kinematics end-effector trajectory Cartesian coordinates x, y, z of end-effector can be plotted against time by: >>figure,plot(t,squeeze(T(1,4,:)), '-',t,squeeze(T(2,4,:)),'--',t,squeeze(T(3,4,:)),'-.'); xlabel('Time(s)'), ylabel('Coordinate(inch)'),grid, legend('X','Y','Z'), title('End-effector Position'); Fig.6. Robot direct kinematics end-effector X, Y, Z coordinates
  • 3. Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154 www.ijera.com 153 | P a g e Generalized coordinates for each joint of the robot can be plotted against time by: >>subplot(6,1,1); plot(t,q(:,1)); xlabel('Time(s)'); ylabel('Joint1(rad)'); subplot(6,1,2); plot(t,q(:,2)); xlabel('Time(s)'); ylabel('Joint2(rad)'); subplot(6,1,3); plot(t,q(:,3)); xlabel('Time(s)'); ylabel('Joint3(rad)'); subplot(6,1,4); plot(t,q(:,4)); xlabel('Time(s)'); ylabel('Joint4(rad)'); subplot(6,1,5); plot(t,q(:,5)); xlabel('Time(s)'); ylabel('Joint5(rad)'); subplot(6,1,6);plot(t,q(:,6)); xlabel('Time(s)'); ylabel('Joint6(rad)'); Fig.7. Robot direct kinematics joint angles against time Velocity and acceleration profile can be obtained by: >> [q,qd,qdd] = jtraj(qz, qr, t) Velocity profile of joints of the robot manipulator is given by: >>subplot(6,1,1); plot(t,q(:,1));title(‘Velocity’); xlabel('Time(s)'); ylabel('Joint1(rad/s)'); subplot(6,1,2); plot(t,q(:,2)); xlabel('Time(s)'); ylabel('Joint2(rad/s)'); subplot(6,1,3); plot(t,q(:,3)); xlabel('Time(s)'); ylabel('Joint3(rad/s)'); subplot(6,1,4); plot(t,q(:,4)); xlabel('Time(s)'); ylabel('Joint4(rad/s)'); subplot(6,1,5); plot(t,q(:,5)); xlabel('Time(s)'); ylabel('Joint5(rad/s)'); subplot(6,1,6);plot(t,q(:,6)); xlabel('Time(s)'); ylabel('Joint6(rad/s)'); Fig.8. Joint velocity against time Acceleration profile is given by: >>subplot(6,1,1); plot(t,q(:,1));title(‘Acceleration’); xlabel('Time(s)'); ylabel('Joint1(rad/s2)'); subplot(6,1,2); plot(t,q(:,2)); xlabel('Time(s)'); ylabel('Joint2(rad/s2)'); subplot(6,1,3); plot(t,q(:,3)); xlabel('Time(s)'); ylabel('Joint3(rad/s2)'); subplot(6,1,4); plot(t,q(:,4)); xlabel('Time(s)'); ylabel('Joint4(rad/s2)'); subplot(6,1,5); plot(t,q(:,5)); xlabel('Time(s)'); ylabel('Joint5(rad/s2)'); subplot(6,1,6);plot(t,q(:,6)); xlabel('Time(s)'); ylabel('Joint6(rad/s2)'); Fig.9. Joint acceleration against time III. CONCLUSION In this paper, the direct kinematic model of a 6R robot is presented by utilizing the principal features of the Robotic Toolbox in MATLAB. The Toolbox provides several essential tools for the modeling and analysis of the robotic manipulator, as well as analyzing the experimental results.
  • 4. Prashant Badoni Int. Journal of Engineering Research and Applications www.ijera.com ISSN: 2248-9622, Vol. 6, Issue 1, (Part - 3) January 2016, pp.151-154 www.ijera.com 154 | P a g e REFERENCES [1] P.I. Corke, A Robotics Toolbox for MATLAB, IEEE Robotics and Automation Magazine, Vol.3, No.1, pp.24-32, March 1996. [2] J. Denavit, R.S. Hartenberg, A Kinematic Notation for Lower-Pair Mechanisms Based on Matricies, Trans. of ASME J.App. Mech. vol. 77, pp.215-221, June 1955. [3] J.J. Crage, Introduction to Robotics Mechanics and Control, 3rd Edition, Prentice Hall, 2005. [4] M.W. Spong, S. Hutchinson and M. Vidyasagar, Robot Modeling and Control, 1st Edition, Jon Wiley & Sons Inc, 2005. [5] Zhongtao Fu, Wenyu Yang and Zhen Yang, Solution of Inverse Kinematics for 6R Robot Manipulators With Offset Wrist Based on Geometric Algebra, Journal of Mechanism and Robotics, August 2013, Vol. 5.