Design and Development of a Robotic Arm
Kruthika,K Kiran Kumar B.M Dr. Sanjay Lakshminarayanan
Department of Electrical Engineering Department of Electrical Engineering Department of Electrical Engineering
M.S.Ramaiah University Of Applied Sciences M.S.R.U.A.S M.S.R.U.A.S
Bangalore, India Bangalore, India Bangalore, India
Email: kruthi2805@gmail.com Email: kirankumar.ee.et@msruas.ac.in Email:sanjay.ee.et@msruas.ac.in
Abstract—Demand for assistive robots are increasing as they the hardware description of the project which includes soft-
allow individuals to work independently and perform tasks that ware and hardware implementation. Section IV discusses the
are impossible without them. This paper presents the design and kinematic modelling for 5-DOF robotic arm and finally the
development of 5-Degree of Freedom (DOF) robotic arm which results and future works are discussed in Section V of the
is used for feeding the elderly or specially challenged people, paper.
where the position of the joints are controlled by the user. Using
principles of robotic Kinematics and MATLAB, the robotic arm
is controlled. The alogrithms are verified using stick diagram. A
Graphical user Interface is developed for controlling the actuators II. PROJECT DESCRIPTION
which in turn controls each joint of the robotic arm. Arduino
MEGA2560 I/O board is the main heart of this project which Mechanical configuration describes the components used
interface with the Graphical User Interface, motors and sensors. for fabricating the robotic arm for feeding application.
A mimic of the developed robotic arm is designed in MATLAB
and it is simulated using forward and inverse transformation to
check the accuracy of the algorithm.
A. Mechanical configuration
Keywords—Robotic arm, degrees of freedom, feeding, GUI,
Arduino, MATLAB, forward and inverse kinematics
I. INTRODUCTION
Robots have been used for assisting individuals in critical
environments, research trends are towards developing robotic
arm for assisting specially challenged or elderly people in
their daily routine. This paper presents the designing and
developing a safe robotic arm which is used for feeding food
for specially challenged or elderly people. This paper is an in
depth understanding the issues related to gripper positioning
and solving it with the help of kinematics.
In literature it is evident that for the robotic arm to interact
with humans, it should have easy controlling techniques and
should be light-weight. In [1] the author explains the design
of the 7-DOF robotic arm with cable driven which are used
as pick and place robotic arm, cable driven methods acts as a
disadvantage as it is not feasible. In [2] the author uses slider- Fig. 1. Robotic Arm model
crank mechanism which reduces the gravitational torque, this
design is also not feasible as the slider causes vibrations. Fig 1. shows the exact model of the developed robotic
A 5-DOF articulated robotic arm is designed which consists arm built using Aluminum due to its characteristics such as
of five axes, the position and orientation of the robotic arm is light weight, do not wear out easily, cheaper and machining
solved from the base to the gripper using kinematics. This is easier. A stepper motor of 5 kg-cm torque is placed at the
kinematic model is implemented using MATLAB and the base which is used for rotating the entire arm clockwise or
same is simulated to check if the designed model reaches the counter clockwise using pinon and gear mechanism. Other
destination point. Arduino Mega2560 is used as the brain of joints i,e., the shoulder, elbow, wrist and the gripper consists of
the robotic arm, force sensors are placed at the gripper for DC geared motor of 3.5 rpm. DC motors and stepper motors
finding the force applied on the object, and potentiometers are are used as they are easy to control [9,10] giving HIGH or
used at the joints for detecting the position of the motor shaft. LOW pulses from the Arduino I/O board. To detect the position
of the joint, potentiometers are placed, which acts as a sensor
This paper is organized as follows: Section II discusses which feeds the output signal back to the Arduino I/O board
the brief description of the project including the mechanical for reducing the error signal. Force sensors are placed at the
configuration and the components used. Section III involves gripper for detecting the force applied on the object being held.
have less or limited limb functionalities to move their wrist
or fingers. GUI takes the user inputs and move the joints
accordingly. GUI was developed using Processing3 software
which uses Java platform for programming [5], the main
advantage of using this software is that it is an open source
software and it can be programmed according to the user
requirements. The developed GUI consists of 12 buttons, a
couple of buttons are assigned to each motors which are
attached to the joints of the robotic arm. Each button are
programmed such a way that, till the button is pressed the
motor rotates and stops rotating if the button are released.
Fig. 2. Proposed block diagram for the robotic arm
III. HARDWARE DESCRIPTION
A. Hardware description
Fig 2 shows the complete block diagram for the robotic
arm control. The commands from the user are given through
the Graphical user interface which communicates with Arduino
I/O board serially. Arduino I/O board on receiving the com-
mands from the GUI controls the position of the motor shaft
which in turn controls the movement of the joints.
B. Arduino Mega and L298
Arduino Mega2560 consists of 54 digital I/O pins, 16 Ana-
log pins [5], 14 PWM outputs and 4 serial pins. COMPIM is
used for serial communication between Arduino I/O board and
processing software which is used for developing Graphical
user interface (GUI). Pins D2 to D16 are used for interfacing
stepper motor, DC motor and sensors. L298 (H-bridge) are
used for interfacing motors to Arduino I/O board, stepper
motor consists of four wires, two wires for each coil. DC
motors consists of two wires connected to H-bridge, H-bridge
takes in 12V voltage supply for activating motors and gives
+5V as output for Arduino I/O board.
C. Sensors
The position of the motor shaft is detected using poten-
tiometer which consists of 3 pins [4], one end of the poten-
tiometer is connected to +5V supply, other end is connected to
the ground, middle pin is connected to the analog pin on the
Arduino board. Potentiometer are placed at the shoulder joint
and the elbow joint. At the shoulder joint, gears are connected
to the potentiometers shaft, these gears are connected to the
gears placed on the stepper motor. Force sensors are placed
at the gripper for detecting the amount of pressure applied on
the object. Force sensor consists of 2 pins. A pulldown resistor
of 10K [3,4] is used, one end of the sensor is connected to
+5V and other end to the ground as well as the analog pin on
the Arduino board. Programming the force sensor is similar to
that of the potentiometer.
D. Graphical User Interface (GUI) Fig. 3. Flowchart for Robotic arm operation
The developed robotic arm is not completely closed loop
system. An individual suffering from upper limb disorder will
E. Software implementation
Arduino IDE and Processing3 software platforms are used S i = Sini , C i = Cosi , S i = Sini , C i = Cosi (1)
for automating the developed robotic arm, where both the 0
=1 T 0 (q1 )2 T 0 (q2 )......n T n−1 (qn )
nT (2)
softwares communicate with each other serially. Processing
software are used for developing GUI as discussed above. The overall transformation matrix for the robotic arm is derived
Arduino IDE are used for initialing stepper motor, DC motors from the basic translation and rotation of the matrix as,
and sensors. Software flow diagram is as shown in the Fig 3,
C1 Sa C5 −C1 Sa S5 + S1 C5 C1 Ca C1 c
it starts from initializing the serial communication setting the
S C C − C1 S5 −S1 Sb S5 − C1 C5 S1 Cb S1 c
baud rate as 9600 and communication port as 4, for transferring T = 1 b 5
and receiving the information. Window size, color, the size and −Cb C5 Cb S5 −Sb d
color of the buttons are specified, the location of the buttons 0 0 0 1
are also defined in Processing. The pins for connecting the where, C23 = S23 = a
stepper motors, DC motors and the sensors are initialized in C234 = S234 = b
Arduino IDE. Buttons are assigned for each and every motor L2 C + L3 Ca + L5 C234 = c
on the robotic arm. L1 − L2 S2 − L3 Sa − L5 Sb = d
IV. KINEMATIC MODELLING FOR THE
DEVELOPED ROBOTIC ARM B. Inverse kinematics
The geometrical configuration of the robotic arm consists Inverse Kinematics is the procedure in which the joints
of waist, shoulder, elbow, and wrist, all of these joints have are controlled in order to achieve the end position, given the
single DOF. position and orientation of the robotic arm. Solving Inverse
kinematics is important compared to forward kinematics, as
A. Forward kinematics model it can move the gripper to the target position, which would
be helpful in grasping any object at the target location. There
Forward kinematics calculates the position and orientation are two different methods in solving inverse kinematics [8]:
of the end-effector with respect to the given reference frame, geometrical and algebraic methods. As algebraic methods re-
given the set of joint-link parameters. There are two different sults in complicated solution as the Degree of Freedom (DOF)
methods used are Denavit-Hartenberg (D-H) parameter [6] and increases, geometrical methods are discussed in this paper. The
successive screw displacements. D-H method and geometric target location is manually entered, algorithm checks is the
methods are used in this paper for implementing forward kine- target is within the workspace, if the target object is within
matics. [8] D-H parameters works using four parameters twist the location Jacobian matrix is calculated and pseudo inverse
angle, link length, link offset and joint angle (αi , ai , di andθi )- is also calculated. This results in nonlinear solutions and is
orthonormal coordinate frames are attached to each of the link solved finding the minimum constraints, the end-effector frame
of the robotic arm as shown in Fig 4 and the length of each reaches the object, if the solution is equal to that of the entered
link is as shown in the table-1. target location.
Transformation matrix [7] describes the position and orienta-
tion of the frames which are assigned for each link. V. RESULTS AND DISCUSSION
To test the functionality of the developed algorithm in Ar-
duino IDE and processing, Proteus is used. Serial communica-
tion takes place between Proteus, Arduino IDE and Processing
using COMPIM. Fig 5. shows the complete software setup in
Proteus where serial communication takes place and the motors
starts to rotate depending on the button pressed on the GUI
Forward kinematics is implemented in Matlab and the results
Fig. 4. Assigning Coordinate frame
TABLE I. L INK L ENGTHS FOR THE DEVELOPED ROBOTIC ARM
Joint Waist Shoulder Elbow Wrist
Symbol L1 L2 L3 L4
Link Length (mm) 350 250 220 180
A general method to calculate the matrices are as follows:
Cθi −Sθi Cαi Sθi Sαi ai Cθi
Sθ Cθi Cαi −Cθi Sαi ai Sθi
iT
i−1
= i
0 Si Ci di
0 0 0 1 Fig. 5. Complete software setup for the system
for the same is shown in the Fig 6. The frames are assigned for
each link, the joint angles are assigned for each joint for finding
the position and orientation of the gripper. The animation for
the forward kinematics shows the movement of frames from
home position to the position defined. Using the transformation
matrix calculated in the forward kinematic modelling, inverse
kinematics is derived using Jacobian matrix and pseudo inverse
to find the joint angles for each joint, given the position of the
target object.
Fig. 8. Plot for Inverse kinematics to reach the target]
When the buttons on the GUI are pressed the corresponding
motor rotates until an error signal is sent by the sensors.
Hardware setup of the robotic arm can be automated using
Fig. 6. Plot for joint angle configuration [00 − 900 900 900 ]
Inverse kinematics to move the arm to the target location.
Fig 7 shows the animation of the stick diagram in Matlab, R EFERENCES
the frame of the end effector reaches the target location. qi [1] Kurbanhusen Mustafa, S., Yang, G., Huat Yeo, S., Lin, W. and Chen,
is the actual joint angles for the robotic arm to move to the M., 2008. Self-calibration of a biologically inspired 7 DOF cable-driven
target location, as shown in the Table. II. q0 is actual joint robotic arm. Mechatronics, IEEE/ASME Transactions on, 13(1), pp.66-
75.
angles which is calculated by the robotic arm automatically
[2] Kim, H.S., Min, J.K. and Song, J.B., 2016. Multiple-Degree-of-Freedom
using Inverse kinematics. Table. II shows the values of qi and Counterbalance Robot Arm Based on Slider-Crank Mechanism and Bevel
q0 which approximately equal to the desired location of the Gear Units. IEEE Transactions on Robotics, 32(1), pp.230-235.
target. [3] Kim, H.J., Tanaka, Y., Kawamura, A., Kawamura, S. and Nishioka,
Y., 2015, August. Development of an inflatable robotic arm system
controlled by a joystick. In Robot and Human Interactive Communication
(RO-MAN), 2015 24th IEEE International Symposium on (pp. 664-669).
IEEE.
[4] Mohammed, A.A. and Sunar, M., 2015, May. Kinematics modeling of
a 4-DOF robotic arm. In Control, Automation and Robotics (ICCAR),
2015 International Conference on (pp. 87-91). IEEE.
[5] Siciliano, B., 2009. Robotics. London: Springer
[6] Zhang, Z., 2015. Wearable sensor technologies applied for post-stroke
rehabilitation (Doctoral dissertation, RMIT University).
[7] Qassem, M.A., Abuhadrous, I. and Elaydi, H., 2010, March. Modeling
and Simulation of 5 DOF educational robot arm. In Advanced Computer
Control (ICACC), 2010 2nd International Conference on (Vol. 5, pp.
569-574). IEEE.
[8] Bhuyan, A.I. and Mallick, T.C., 2014, October. Gyro-accelerometer
based control of a robotic Arm using AVR microcontroller. In Strategic
Technology (IFOST), 2014 9th International Forum on (pp. 409-413).
IEEE.
Fig. 7. Plot for Inverse kinematics to reach the target] [9] Anon, 2016. The Ninth International Symposium. [online] Robotics
Research. Available at: http://Robotics Research: The Ninth International
Symposium [Accessed 4 Apr. 2016]
TABLE II. L INK L ENGTHS FOR THE DEVELOPED ROBOTIC ARM [10] Condit, R. and Jones, D.W., 2004. Stepping motors fundamentals. Mi-
crochip Application Note: AN907,[Online]. Available: www. microchip.
Joint Waist Shoulder Elbow Wrist
q1 1.570796 -0.7854 0.785398 0.392699082
Com
q0 1.570796 -0.7854 0.785398 0.344830452
Fig 8. shows the complete setup of the robotic arm which
includes GUI, Potentiometers at the elbow joint for detecting
the position of the motor shaft, force sensor at the gripper.