SlideShare a Scribd company logo
1 of 6
Download to read offline
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 612
A SOFTWARE FRAMEWORK FOR DYNAMIC MODELING OF DC
MOTORS AT ROBOT JOINTS
Mehmet Serdar Güzel1
1
Ankara University, Computer Engineering Department, Ankara, Turkey
Abstract
This paper addresses to develop an educational simulation tool for dynamic analysis of a 5 DOF robot arm’s actuators. Kinematics
analysis of robot arm was visually displayed with the corresponding tool in relation to dc motors, used at the robot arm joints.
Besides, dynamic modeling of DC motors is presented and their combined motion within the arm is analyzed and displayed visually.
Keywords: Robot arm, Robot Kinematics, PWM, DC Motor Simulation, Robot Simulator.
-----------------------------------------------------------------------***-----------------------------------------------------------------------
1. INTRODUCTION
Simulation is an engineering tool, used in designing and
analyzing of real time systems. It is mainly used to provide a
safe, reliable and inexpensive way for the operation of
complex systems. By using a simulator, experimental designs
can be effectively validated without consuming materials and
machining efforts in the workshop [1, 2, 3].
This paper presents the simulation of a position control system
using robot arm actuators having Five Degree of Freedom
(DOF). The simulation was mainly designed and implemented
based on the general mathematical model of DC servo motors.
Lynx-6 robot arm with 5 DOF was modelled analytically and
its forward and inverse kinematics was analyzed and
calculated. Consequently, a final model was generated and a
real time simulation was performed based on the proposed
model. Lynx-6 robot arm which is shown in figure 1 has 5
DOF with a grip movement. It is similar to human arm from
the number of joints point of view. These joints produce
shoulder rotation, shoulder back and forth, elbow, wrist up and
down, wrist rotation and gripper motion. [4,5]. One of the
most challenging and critical problems in control engineering
is to control analog voltages with digital inputs. PWM (Pulse-
Width Modulation) technique is used to vary the analogue
voltages by using digital pulses; these digital pulses are
generated through computer programming according to
motion specifications of the user by a servo control card.
Control cards are utilized to handle the given problem. In this
study, a SSC-32 servo control card has been attached into the
Lynx-6 Robot arm. The card mainly aims to convert the
digital pulses to dc voltages during the pulse duration to drive
the dc motors of the joints in required amounts [6]. In the
application part of this study a high level visual software
package was developed to simulate dynamically both a Lynx-
6 Robot arm’s actuators and their combined motion .Visual
Studio Net platform with C# programming Language was
employed to developed this visual software package.
Fig 1: Lynx-6 Robot Arm
2. DC MOTOR SIMULATION
DC motors are preferred to be used in control systems due to
the fact that they provide continuous motion unlike the stepper
motor motion in steps. Mathematical model of a DC motor is
derived to observe and define the control mechanism
analytically. The most common control technique for DC
motors is the armature-current control to generate rotational
motion. [7]. A typical DC motor, used in the Lynx-6 robot
arm is illustrated in Figure 2.
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 613
Fig 2: DC Motor
The basic mathematical model of a DC motor, employed in
the corresponding robot arm, was shown in Figure 3. In the
model, va is the supply voltage, ia is the winding current , Ra is
the resistance of the armature circuit, La is the inductance of
the armature circuit, J is the moment of inertia of the system
(including the motor and the load), the back emf is ea =
ke.ωa(here ke is known as the back emf constant or torque
constant ωa is the angular speed of the system, Te is the
electromagnetic torque developed by the motor, TL is the load
torque, and B is the damping coefficient which is usually
ignored. The comprehensive information about these is given
in reference [8].
Va +
RaLas 
1
kt
Te
+
TL
_
Bs 
1
wa(s)
kv
Vc
_
Ia(s)
Fig 3: Mathematical model of a DC Motor
The dynamic simulation of the dc motor constitutes:
a) voltage/current equation of the motor armature,
b) Dynamic equation of the motor-load (mechanical) system,
c) Electromagnetic torque equation
a
a
aaaa e
dt
di
LiRv  (1)
m
e m L
d
T J B T
dt

   (2)
TL = ke ia (3)
The general formula to solve differential equations given in
(2) and (3) is illustrated as follows :
 e
tctot
xtoxxtx
/)(
)()()()(

 (4)
Where (tc) time constant for RL circuits is L/R , Equation 4
can be interpreted as in equation (5) due to fact that all
Resistors, Capacitors, and Inductors have positive values
when t>0 [7].
3. PWM (PULSE-WIDTH MODULATION)
PWM was employed in variety of applications, ranging from
measurement and communications to power control. It is a
way of digitally encoding analog signal levels. Through the
use of high-resolution counters, the duty cycle of a square
wave is modulated to encode a specific analog signal level. At
any given time, the full DC supply is either fully ON or fully
OFF.
The voltage or current source is supplied to the load by means
of a series of on and off pulses. The on-time is the time during
which the DC supply is applied to the load, and the off-time is
the period during which the supply is switched off. Figure 4
presents three different PWM signal outputs, used in actuator
motor control. For example PWM signal output with %10
duty cycle in (a) is ON during %10 of its period and OFF
during %90 of its period. Others in (b) and (c) have the similar
properties with different ON/OFF periods.
The initial position of any dc servo motor of Lynx-6 robot
arm was compared with the new required positions which
were both defined by user program parameters. The difference
between positions is applied as an input signal to servo card
and the essential PWM signal was generated to feed the dc
motors with dc supply. Robot arm motors were chosen to be
used in no more than 90 degree range of motion. Hence the
corres- ponding “width” of the PWM signal pulse varied from
0.9 milliseconds (minimum position), to 2.1 ms (maximum
position). The Pulse is repeated every 14 to 20 milliseconds
[9] .
Fig 4: PWM signals with varying Duty Cycles a) %10 duty
cycle b) %50 duty cycle c) %90 duty cycle
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 614
4. KINEMATICS
Denavit-Hartenberg representation is used to model the joints
of Lynx-6 Robot arm, [10] , can be seen in Figure 5. All the
joints are assigned by using the principles of D-H convention.
Robot kinematics is mainly divided into two groups, namely,
forward kinematics and inverse kinematics. In forward
kinematics, the length of each link and the angle of each joint
are given and the position of any point in the work space of
the robot is calculated. As opposed to forward kinematics, in
inverse kinematics, the length of each link and the position of
the point in work space are given and the angle of each joint is
calculated.
Fig 5: Model of Lynx-6 Robot Arm
4.1 Forward Kinematics
To calculate forward kinematics equations for 5 dof Lynx
arms, the transformation matrices corresponding to robot arm
joints, [11], were manipulated and the final forward
kinematics solution was shown below.
Tf = A1*A2*A3*A4*A5 , for 5 Dof (5)
4.2 Inverse Kinematics
Inverse Kinematics analysis determines the joint angles for
desired position and orientation in Cartesian space. The robot
arm manipulator which is used in this study has five degrees
of freedom (DOF). In order to determine the joint angles, the
final matrix equation is multiplied by An
-1
(n=1, 2, 3, 4, 5, 6)
on both sides sequentially and the generated linear equations
were solved [11]. The inverse kinematic solutions for five
DOF Lynx arm are shown below:
0 0 0 1
x x ax x
y y ay y
f
z z z z
n o p
n o p
T
n o a p
 
 
 
 
 
 
 

θ234 (WARTG=Wrist Angle Relative to G round) (6)
θ1 = arc tan (py/px) or θ1 = θ1 + 180° (7)
θ2 = arc tan (S2 /C2) (8)
θ3 = arc tan (S3 /C3) (9)
θ4 = θ234 - θ3 - θ4 (10)
θ5 = arc tan(S5 / C5 ) (11)
5. SOFTWARE DESIGN
The control program has been implemented using C#
programming language in Visual Studio Net platform. The
program supports two main operation modes, simulation of
DC servo motors and kinematics analysis of Lynx-6. Main
Screen of the program was shown in figure 6.
Fig 6: Main Screen of the Framework
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 615
On the left side of the main screen, there are two graphical
views, side view and top view of the robot arm, are displayed
to show the robot arm’s motion in real time. There are three
engines exist within the software package, namely,
Kinematics Engine, PWM Engine, and Simulator Engine.
Kinematics Engine: It is responsible with the solutions of
forward and inverse kinematics equations and the calculations
related to joints and Cartesian coordinates.
PWM Engine: It is responsible with the managing of
analogue voltages’ and digital pulses and provides correlation
between user defined input values (angle or position) and
control card parameters.
Simulator Engine: It is responsible with the interpretation of
the robot model, construction of internal data structures to
represent the robot and manipulating the joint angles, as
specified by simulation commands and the robot’s kinematics
The developed software is mainly designed to simulate and
show the operational stages of the robot arm. The general
flowchart is shown in figure 7.
Fig 7: Flow Chart Diagram of the Software
The steps of algorithm are defined as follows:
a) Program is started.
b) Data is entered either as degree angles from Forward
Kinematics Input Screen or as position coordinates from
Inverse Kinematics Input Screen.
c) If given input values are position values; Kinematics Engine
start to work and use inverse kinematics equations to derive
required input angle values, which has been detailed in
Kinematics section.
d) Derived angle values must be converted into control
card (SSC-32) parameters [6].
e) PWM engine is responsible for managing analogue values
with digital inputs, using applied voltage Interval, paired with
corresponding angle value by the engine.
f) All related joints engines are start to work for dynamic
simulation with given constant motor parameters such as
Armature Resistance , Inductance etc. and calculated values as
applied voltage by PWM engine.
g) Simulator Engine starts to show the work. All motional
characteristics of robot arm were displayed with these models.
There are also graphical windows on the main screen for all
joints to show robot joint response such as current vs time
(current responses to varying time) and angular speed vs
time (speed response to varying time) graphs. An example of
robot base joint is shown in figures 8 and 9 respectively.
Fig 8: Current-Time Graph for Base (45 degrees)
Figure 8 presents an experiment in which it can be inferred
that as 2.7 volt is applied to the system; the motor can only
achieve a maximum value of 1.8 amber. Besides, it takes the
motor one second to reach its steady-state value. This example
in essence shows the change in current according to the time
interval. Additionally, Angular Speed/Time graph of given
software is also shown below that as the same volt is applied
to the system, the motor can only achieve a maximum speed
of 5 rad/sec, which also takes the motor one second to reach
its steady-state speed.
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 616
Fig 9: Angular Speed-Time Graph for Base (45 degrees)
There is also a kinematics screen which shows all
transformation matrices which are derived from Final
Kinematics Matrices is shown in figure 10. This screen is
developed for detailed analysis of Kinematics equations. All
transformation matrices of related joints can be observed and
tested by users.
Fig 10: Movement Matrices for (x=23;y=10;z=23)
6. DISCUSSION AND CONCLUSIONS
This section addresses to discuss the results of a numerical
example that all calculation steps including the simulation
logic of the proposed software framework will be detailed as
follows:
The following initial values are given for the experiment:
Ra = 5; Armeture Resistance
L = 2; Inductance
Jm = 0.025; motor constant
Bm = 0.1; friction constant
kb = 0.1; back emf constant
Ki = 0.5; moment constant
Tl = 0.0; Load moment
for given 0 – 6V applied voltage interval
Position  Angle Values are calculated
X Y Z BASE SHOULDER ELBOW WRIST
23 8 21 20 9 -3 35
As angle values are calculated from position vector by
Kinematics Engine into signals, they are ready to be used by
the control card [6]. The signal consists of positive going
pulses ranging from 0.5 to 2.5mS (milliseconds) long,
repeated 50 times a second (every 20mS). The servo positions
its output shaft in proportion to the width of the pulse. PWM
engine calculates signal values for four different joints
simultaneously that applied voltages are also calculated by
given pulse values.
Calculated pulse values are,
BASE SHOULDER ELBOW WRIST
1713 ms 1400 ms 1538 ms 1438 ms
Calculated voltage values are,
BASE SHOULDER ELBOW WRIST
4.1 V 2.5 V 1.4 V 0.8 V
Base motor simulator screen is illustrated in figure 11 and the
corresponding Current-Time graph can also be seen in figure
12.
Fig 11: DC simulator for Base (22 degrees)
Fig 12: Current-Time Graph for Base (22 degrees)
At the final stage, the final position matrices are displayed and
the simulator takes its new position with respected to the
calculated angle values.
IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308
__________________________________________________________________________________________
Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 617
Fig 13: Final Position Matrices and Simulator
Overall, a new software tool for manipulator based simulation
has been presented in this paper. The tool supports low cost
Lynx arms which are mainly employed for scientific and
educational applications. The tool analyzes manipulator
actuators (DC servo motors), as well as it works on motional
characteristics of manipulator and to be able to solve both
inverse and forward kinematics. The proposed tool is flexible
and open source that researches and students can use this tool
for different tasks with minor modification. The interface of
the proposed software framework is user friendly that
researchers can learn and utilize the tool for their problems
with minor effort.
The most powerful side of the tool is its ability to provide
association between dynamic analysis of DC motors and
Motional Characteristics of Lynx-6 robot arms. There exists
more powerful DC motor simulators such as LABVIEW and
MATLAB, but their costs are high for many researchers to
handle and they do not provide association between dynamic
analysis of DC motors and Kinematics of Lynx-6
Manipulators as the proposed software does.
Furthermore, the proposed software framework is free
Software package and will be on the official web page of
Computer Engineering Department of Ankara University
(http://comp.eng.ankara.edu.tr/proje.html. This paper is a
revised version of a conference paper that appeared as [12].
REFERENCES
[1]. White, R.B., Read, R., Koch, M. and Schilling, R.J., “A
graphics simulator for a robotic arm,” IEEE Trans. Education,
Vol. 32, No. 4, pp. 417-429, (1989)
[2]. T. Raz, “Graphics robot simulator for teaching
introductory robotics,” IEEE Trans. Educ., vol. 32, pp. 153–
159, May (1989)
[3]. Antonia Yordan-Nones , Heterogeneous Modeling &
Design of Robot Arm Control System, , University of Puertro
Rico , Mayagüez.
[4]. Koyuncu, B. and Güzel, M., Software Analysis of Lynx-6
Robot arm, ARC 2008, pp. 1-8
[5]. Güzel, M. S, Hinislioglu, Y., “A robotic software for
intelligent applications, Artifical Life and Robotics 18 (1-2),
76-82
[6]. Lynx SSC-32 Servo motor controller board user manual.
Available online at www.lynx.com. com. Accessed on
December 2007
[7]. Luca Zaccarian , DC motors: dynamic model and control
techniques , pp 16-22
[8]. Raymond A. DECARLO, Linear Circuit Analysis. pp.
224 -229 , Prentice HALL.
[9]. Lynxmotion Inc ,2007 http://www.lynxmotion.com
[10]. J. Denavit and R.S. Hartanberg , “A kinematic notation
for lower-pair mechanisms based upon matrices” ASME J.
Appl .Mechanics vol. 22, pp. 215 -221, 1955.
[11]. Koyuncu, B., and Güzel, M., “Software Development
for the Kinematic Analysis of a Lynx 6 Robot Arm
,International Journal of Applied Science, Engineering and
Technology , Volume 4, Number 4 pp. 228-233 ,2007
[12]. Koyuncu,B.,Güzel, M: A visual Tool for Kinematics
Analyses of Lynx-6 Robot Arms together with dynamic
modeling of dc motors at robot joints ,International conference
on Automation, Robotics and control systems, arcs-08,
Florida, USA,July 2008, pp 145-150.

More Related Content

What's hot

Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...
Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...
Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...IJPEDS-IAES
 
International Journal of Engineering Research and Development
International Journal of Engineering Research and DevelopmentInternational Journal of Engineering Research and Development
International Journal of Engineering Research and DevelopmentIJERD Editor
 
IRJET- Simulation and Kinematic Analysis of MTAB ARISTO Robot
IRJET-  	  Simulation and Kinematic Analysis of MTAB ARISTO RobotIRJET-  	  Simulation and Kinematic Analysis of MTAB ARISTO Robot
IRJET- Simulation and Kinematic Analysis of MTAB ARISTO RobotIRJET Journal
 
Modelling and Analysis of Induction Motor using LabVIEW
Modelling and Analysis of Induction Motor using LabVIEWModelling and Analysis of Induction Motor using LabVIEW
Modelling and Analysis of Induction Motor using LabVIEWIJPEDS-IAES
 
PID Control of A Quadrotor UAV
PID Control of A Quadrotor UAVPID Control of A Quadrotor UAV
PID Control of A Quadrotor UAVIRJET Journal
 
Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560
Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560
Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560IOSR Journals
 
A novel p q control algorithm for combined active front end converter and shu...
A novel p q control algorithm for combined active front end converter and shu...A novel p q control algorithm for combined active front end converter and shu...
A novel p q control algorithm for combined active front end converter and shu...eSAT Journals
 
CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...
CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...
CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...Ijripublishers Ijri
 
Minimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicleMinimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicleeSAT Journals
 
Fuzzy Controller for Speed Control of BLDC motor using MATLAB
Fuzzy Controller for Speed Control of BLDC motor using MATLABFuzzy Controller for Speed Control of BLDC motor using MATLAB
Fuzzy Controller for Speed Control of BLDC motor using MATLABIRJET Journal
 
Comparison of modulation techniques for cascaded h bridge type multilevel cu...
Comparison of modulation techniques for cascaded  h bridge type multilevel cu...Comparison of modulation techniques for cascaded  h bridge type multilevel cu...
Comparison of modulation techniques for cascaded h bridge type multilevel cu...IAEME Publication
 
Quadrotor Control using Adaptive Fuzzy PD Technique
Quadrotor Control using Adaptive Fuzzy PD TechniqueQuadrotor Control using Adaptive Fuzzy PD Technique
Quadrotor Control using Adaptive Fuzzy PD TechniqueIRJET Journal
 
Speed Control of Brushless DC Motor using Different Intelligence Schemes
Speed Control of Brushless DC Motor using Different Intelligence SchemesSpeed Control of Brushless DC Motor using Different Intelligence Schemes
Speed Control of Brushless DC Motor using Different Intelligence SchemesIRJET Journal
 
A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...
A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...
A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...IRJET Journal
 
Design and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotDesign and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotIJTET Journal
 

What's hot (20)

Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...
Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...
Low cost Real Time Centralized Speed Control of DC Motor Using Lab View -NI U...
 
International Journal of Engineering Research and Development
International Journal of Engineering Research and DevelopmentInternational Journal of Engineering Research and Development
International Journal of Engineering Research and Development
 
IRJET- Simulation and Kinematic Analysis of MTAB ARISTO Robot
IRJET-  	  Simulation and Kinematic Analysis of MTAB ARISTO RobotIRJET-  	  Simulation and Kinematic Analysis of MTAB ARISTO Robot
IRJET- Simulation and Kinematic Analysis of MTAB ARISTO Robot
 
aecv2007_goodell_final
aecv2007_goodell_finalaecv2007_goodell_final
aecv2007_goodell_final
 
Modelling and Analysis of Induction Motor using LabVIEW
Modelling and Analysis of Induction Motor using LabVIEWModelling and Analysis of Induction Motor using LabVIEW
Modelling and Analysis of Induction Motor using LabVIEW
 
PID Control of A Quadrotor UAV
PID Control of A Quadrotor UAVPID Control of A Quadrotor UAV
PID Control of A Quadrotor UAV
 
Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560
Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560
Kineto-Elasto Dynamic Analysis of Robot Manipulator Puma-560
 
[000008]
[000008][000008]
[000008]
 
A novel p q control algorithm for combined active front end converter and shu...
A novel p q control algorithm for combined active front end converter and shu...A novel p q control algorithm for combined active front end converter and shu...
A novel p q control algorithm for combined active front end converter and shu...
 
CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...
CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...
CPREDICTION OF INVERSE KINEMATICS SOLUTION OF A REDUNDANT MANIPULATOR USING A...
 
T04405112116
T04405112116T04405112116
T04405112116
 
Bo044402410
Bo044402410Bo044402410
Bo044402410
 
Minimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicleMinimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicle
 
Fuzzy Controller for Speed Control of BLDC motor using MATLAB
Fuzzy Controller for Speed Control of BLDC motor using MATLABFuzzy Controller for Speed Control of BLDC motor using MATLAB
Fuzzy Controller for Speed Control of BLDC motor using MATLAB
 
Comparison of modulation techniques for cascaded h bridge type multilevel cu...
Comparison of modulation techniques for cascaded  h bridge type multilevel cu...Comparison of modulation techniques for cascaded  h bridge type multilevel cu...
Comparison of modulation techniques for cascaded h bridge type multilevel cu...
 
Quadrotor Control using Adaptive Fuzzy PD Technique
Quadrotor Control using Adaptive Fuzzy PD TechniqueQuadrotor Control using Adaptive Fuzzy PD Technique
Quadrotor Control using Adaptive Fuzzy PD Technique
 
Gz3512221228
Gz3512221228Gz3512221228
Gz3512221228
 
Speed Control of Brushless DC Motor using Different Intelligence Schemes
Speed Control of Brushless DC Motor using Different Intelligence SchemesSpeed Control of Brushless DC Motor using Different Intelligence Schemes
Speed Control of Brushless DC Motor using Different Intelligence Schemes
 
A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...
A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...
A Novel 4WD Permanent Magnet Synchronous Motor for an Electrical Vehicle Cont...
 
Design and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of RobotDesign and Analysis of Articulated Inspection Arm of Robot
Design and Analysis of Articulated Inspection Arm of Robot
 

Viewers also liked

Brisk and secure ad hoc vehicular communication
Brisk and secure ad hoc vehicular communicationBrisk and secure ad hoc vehicular communication
Brisk and secure ad hoc vehicular communicationeSAT Publishing House
 
Optimization of process parameter for stir casted
Optimization of process parameter for stir castedOptimization of process parameter for stir casted
Optimization of process parameter for stir castedeSAT Publishing House
 
Measurable, safe and secure data management for sensitive users in cloud comp...
Measurable, safe and secure data management for sensitive users in cloud comp...Measurable, safe and secure data management for sensitive users in cloud comp...
Measurable, safe and secure data management for sensitive users in cloud comp...eSAT Publishing House
 
The demonstration of fourier series to first year undergraduate engineering s...
The demonstration of fourier series to first year undergraduate engineering s...The demonstration of fourier series to first year undergraduate engineering s...
The demonstration of fourier series to first year undergraduate engineering s...eSAT Publishing House
 
A review of pre combustion co2 capture in igcc
A review of pre combustion co2 capture in igccA review of pre combustion co2 capture in igcc
A review of pre combustion co2 capture in igcceSAT Publishing House
 
Mac protocols for cooperative diversity in wlan
Mac protocols for cooperative diversity in wlanMac protocols for cooperative diversity in wlan
Mac protocols for cooperative diversity in wlaneSAT Publishing House
 
An overview on data mining designed for imbalanced datasets
An overview on data mining designed for imbalanced datasetsAn overview on data mining designed for imbalanced datasets
An overview on data mining designed for imbalanced datasetseSAT Publishing House
 
Process design features of a 5 tonnesday multi – stage, intermittent drainage...
Process design features of a 5 tonnesday multi – stage, intermittent drainage...Process design features of a 5 tonnesday multi – stage, intermittent drainage...
Process design features of a 5 tonnesday multi – stage, intermittent drainage...eSAT Publishing House
 
Elevating forensic investigation system for file clustering
Elevating forensic investigation system for file clusteringElevating forensic investigation system for file clustering
Elevating forensic investigation system for file clusteringeSAT Publishing House
 
Optimized sensor nodes by fault node recovery algorithm
Optimized sensor nodes by fault node recovery algorithmOptimized sensor nodes by fault node recovery algorithm
Optimized sensor nodes by fault node recovery algorithmeSAT Publishing House
 
Design evaluation and optimization of steering yoke of an automobile
Design evaluation and optimization of steering yoke of an automobileDesign evaluation and optimization of steering yoke of an automobile
Design evaluation and optimization of steering yoke of an automobileeSAT Publishing House
 
Design features of a 5 tonne day multi – stage, intermittent drainage, conti...
Design features of a 5 tonne  day multi – stage, intermittent drainage, conti...Design features of a 5 tonne  day multi – stage, intermittent drainage, conti...
Design features of a 5 tonne day multi – stage, intermittent drainage, conti...eSAT Publishing House
 
Seismic response of reinforced concrete structure by using different bracing ...
Seismic response of reinforced concrete structure by using different bracing ...Seismic response of reinforced concrete structure by using different bracing ...
Seismic response of reinforced concrete structure by using different bracing ...eSAT Publishing House
 
An iterative unsymmetrical trimmed midpoint median filter for removal of high...
An iterative unsymmetrical trimmed midpoint median filter for removal of high...An iterative unsymmetrical trimmed midpoint median filter for removal of high...
An iterative unsymmetrical trimmed midpoint median filter for removal of high...eSAT Publishing House
 
Power system stability improvement under three
Power system stability improvement under threePower system stability improvement under three
Power system stability improvement under threeeSAT Publishing House
 
Application of stochastic modeling in geomagnetism
Application of stochastic modeling in geomagnetismApplication of stochastic modeling in geomagnetism
Application of stochastic modeling in geomagnetismeSAT Publishing House
 
Web performance prediction using geo statistical method
Web performance prediction using geo statistical methodWeb performance prediction using geo statistical method
Web performance prediction using geo statistical methodeSAT Publishing House
 
Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...
Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...
Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...eSAT Publishing House
 
Intelligent two axis dual-ccd image-servo shooting platform design
Intelligent two axis dual-ccd image-servo shooting platform designIntelligent two axis dual-ccd image-servo shooting platform design
Intelligent two axis dual-ccd image-servo shooting platform designeSAT Publishing House
 
Factors affecting def and asr in the concrete dam at vrané nad vltavou
Factors affecting def and asr in the concrete dam at vrané nad vltavouFactors affecting def and asr in the concrete dam at vrané nad vltavou
Factors affecting def and asr in the concrete dam at vrané nad vltavoueSAT Publishing House
 

Viewers also liked (20)

Brisk and secure ad hoc vehicular communication
Brisk and secure ad hoc vehicular communicationBrisk and secure ad hoc vehicular communication
Brisk and secure ad hoc vehicular communication
 
Optimization of process parameter for stir casted
Optimization of process parameter for stir castedOptimization of process parameter for stir casted
Optimization of process parameter for stir casted
 
Measurable, safe and secure data management for sensitive users in cloud comp...
Measurable, safe and secure data management for sensitive users in cloud comp...Measurable, safe and secure data management for sensitive users in cloud comp...
Measurable, safe and secure data management for sensitive users in cloud comp...
 
The demonstration of fourier series to first year undergraduate engineering s...
The demonstration of fourier series to first year undergraduate engineering s...The demonstration of fourier series to first year undergraduate engineering s...
The demonstration of fourier series to first year undergraduate engineering s...
 
A review of pre combustion co2 capture in igcc
A review of pre combustion co2 capture in igccA review of pre combustion co2 capture in igcc
A review of pre combustion co2 capture in igcc
 
Mac protocols for cooperative diversity in wlan
Mac protocols for cooperative diversity in wlanMac protocols for cooperative diversity in wlan
Mac protocols for cooperative diversity in wlan
 
An overview on data mining designed for imbalanced datasets
An overview on data mining designed for imbalanced datasetsAn overview on data mining designed for imbalanced datasets
An overview on data mining designed for imbalanced datasets
 
Process design features of a 5 tonnesday multi – stage, intermittent drainage...
Process design features of a 5 tonnesday multi – stage, intermittent drainage...Process design features of a 5 tonnesday multi – stage, intermittent drainage...
Process design features of a 5 tonnesday multi – stage, intermittent drainage...
 
Elevating forensic investigation system for file clustering
Elevating forensic investigation system for file clusteringElevating forensic investigation system for file clustering
Elevating forensic investigation system for file clustering
 
Optimized sensor nodes by fault node recovery algorithm
Optimized sensor nodes by fault node recovery algorithmOptimized sensor nodes by fault node recovery algorithm
Optimized sensor nodes by fault node recovery algorithm
 
Design evaluation and optimization of steering yoke of an automobile
Design evaluation and optimization of steering yoke of an automobileDesign evaluation and optimization of steering yoke of an automobile
Design evaluation and optimization of steering yoke of an automobile
 
Design features of a 5 tonne day multi – stage, intermittent drainage, conti...
Design features of a 5 tonne  day multi – stage, intermittent drainage, conti...Design features of a 5 tonne  day multi – stage, intermittent drainage, conti...
Design features of a 5 tonne day multi – stage, intermittent drainage, conti...
 
Seismic response of reinforced concrete structure by using different bracing ...
Seismic response of reinforced concrete structure by using different bracing ...Seismic response of reinforced concrete structure by using different bracing ...
Seismic response of reinforced concrete structure by using different bracing ...
 
An iterative unsymmetrical trimmed midpoint median filter for removal of high...
An iterative unsymmetrical trimmed midpoint median filter for removal of high...An iterative unsymmetrical trimmed midpoint median filter for removal of high...
An iterative unsymmetrical trimmed midpoint median filter for removal of high...
 
Power system stability improvement under three
Power system stability improvement under threePower system stability improvement under three
Power system stability improvement under three
 
Application of stochastic modeling in geomagnetism
Application of stochastic modeling in geomagnetismApplication of stochastic modeling in geomagnetism
Application of stochastic modeling in geomagnetism
 
Web performance prediction using geo statistical method
Web performance prediction using geo statistical methodWeb performance prediction using geo statistical method
Web performance prediction using geo statistical method
 
Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...
Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...
Energy efficient ccrvc scheme for secure communications in mobile ad hoc netw...
 
Intelligent two axis dual-ccd image-servo shooting platform design
Intelligent two axis dual-ccd image-servo shooting platform designIntelligent two axis dual-ccd image-servo shooting platform design
Intelligent two axis dual-ccd image-servo shooting platform design
 
Factors affecting def and asr in the concrete dam at vrané nad vltavou
Factors affecting def and asr in the concrete dam at vrané nad vltavouFactors affecting def and asr in the concrete dam at vrané nad vltavou
Factors affecting def and asr in the concrete dam at vrané nad vltavou
 

Similar to A software framework for dynamic modeling of dc motors at robot joints

Design and development of touch screen controlled stairs climbing robot
Design and development of touch screen controlled stairs climbing robotDesign and development of touch screen controlled stairs climbing robot
Design and development of touch screen controlled stairs climbing roboteSAT Journals
 
Design and operation of synchronized robotic arm
Design and operation of synchronized robotic armDesign and operation of synchronized robotic arm
Design and operation of synchronized robotic armeSAT Journals
 
Design and operation of synchronized robotic arm
Design and operation of synchronized robotic armDesign and operation of synchronized robotic arm
Design and operation of synchronized robotic armeSAT Publishing House
 
Dc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# applicationDc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# applicationeSAT Publishing House
 
Dc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# applicationDc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# applicationeSAT Journals
 
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...IJERD Editor
 
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...IJERD Editor
 
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerDesign and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerIOSR Journals
 
Design of three phase inverter fed induction motor
Design of three phase inverter fed induction motorDesign of three phase inverter fed induction motor
Design of three phase inverter fed induction motoreSAT Publishing House
 
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...IRJET Journal
 
IRJET- Crane Control by using Hand Gestures
IRJET-  	  Crane Control by using Hand GesturesIRJET-  	  Crane Control by using Hand Gestures
IRJET- Crane Control by using Hand GesturesIRJET Journal
 
Control robotic module using LIFA
Control robotic module using LIFAControl robotic module using LIFA
Control robotic module using LIFAVatsal N Shah
 
Performance analysis of a single phase ac voltage controller under induction ...
Performance analysis of a single phase ac voltage controller under induction ...Performance analysis of a single phase ac voltage controller under induction ...
Performance analysis of a single phase ac voltage controller under induction ...eSAT Publishing House
 
IRJET - Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...
IRJET -  	  Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...IRJET -  	  Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...
IRJET - Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...IRJET Journal
 
Motion compensation for hand held camera devices
Motion compensation for hand held camera devicesMotion compensation for hand held camera devices
Motion compensation for hand held camera deviceseSAT Journals
 
Paper id 24201493
Paper id 24201493Paper id 24201493
Paper id 24201493IJRAT
 
C04010 01 1831
C04010 01 1831C04010 01 1831
C04010 01 1831IJMER
 
An expanded haar wavelet transform and morphological deal based approach for ...
An expanded haar wavelet transform and morphological deal based approach for ...An expanded haar wavelet transform and morphological deal based approach for ...
An expanded haar wavelet transform and morphological deal based approach for ...eSAT Publishing House
 

Similar to A software framework for dynamic modeling of dc motors at robot joints (20)

Design and development of touch screen controlled stairs climbing robot
Design and development of touch screen controlled stairs climbing robotDesign and development of touch screen controlled stairs climbing robot
Design and development of touch screen controlled stairs climbing robot
 
Design and operation of synchronized robotic arm
Design and operation of synchronized robotic armDesign and operation of synchronized robotic arm
Design and operation of synchronized robotic arm
 
Design and operation of synchronized robotic arm
Design and operation of synchronized robotic armDesign and operation of synchronized robotic arm
Design and operation of synchronized robotic arm
 
Dc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# applicationDc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# application
 
Dc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# applicationDc motor speed control with feedback monitor based on c# application
Dc motor speed control with feedback monitor based on c# application
 
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
 
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
IJERD (www.ijerd.com) International Journal of Engineering Research and Devel...
 
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM ControllerDesign and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
Design and Implementation of Robot Arm Control Using LabVIEW and ARM Controller
 
Design of three phase inverter fed induction motor
Design of three phase inverter fed induction motorDesign of three phase inverter fed induction motor
Design of three phase inverter fed induction motor
 
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
Design and Implementation of a Self-Balancing Two-Wheeled Robot Driven by a F...
 
IRJET- Crane Control by using Hand Gestures
IRJET-  	  Crane Control by using Hand GesturesIRJET-  	  Crane Control by using Hand Gestures
IRJET- Crane Control by using Hand Gestures
 
Control robotic module using LIFA
Control robotic module using LIFAControl robotic module using LIFA
Control robotic module using LIFA
 
Performance analysis of a single phase ac voltage controller under induction ...
Performance analysis of a single phase ac voltage controller under induction ...Performance analysis of a single phase ac voltage controller under induction ...
Performance analysis of a single phase ac voltage controller under induction ...
 
IRJET - Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...
IRJET -  	  Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...IRJET -  	  Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...
IRJET - Controlling 4 DOF Robotic ARM with 3-Axis Accelerometer and Flex ...
 
L41047379
L41047379L41047379
L41047379
 
Motion compensation for hand held camera devices
Motion compensation for hand held camera devicesMotion compensation for hand held camera devices
Motion compensation for hand held camera devices
 
Paper id 24201493
Paper id 24201493Paper id 24201493
Paper id 24201493
 
[IJET-V1I4P11] Authors :Wai Mar Myint, Theingi
[IJET-V1I4P11] Authors :Wai Mar Myint, Theingi[IJET-V1I4P11] Authors :Wai Mar Myint, Theingi
[IJET-V1I4P11] Authors :Wai Mar Myint, Theingi
 
C04010 01 1831
C04010 01 1831C04010 01 1831
C04010 01 1831
 
An expanded haar wavelet transform and morphological deal based approach for ...
An expanded haar wavelet transform and morphological deal based approach for ...An expanded haar wavelet transform and morphological deal based approach for ...
An expanded haar wavelet transform and morphological deal based approach for ...
 

More from eSAT Publishing House

Likely impacts of hudhud on the environment of visakhapatnam
Likely impacts of hudhud on the environment of visakhapatnamLikely impacts of hudhud on the environment of visakhapatnam
Likely impacts of hudhud on the environment of visakhapatnameSAT Publishing House
 
Impact of flood disaster in a drought prone area – case study of alampur vill...
Impact of flood disaster in a drought prone area – case study of alampur vill...Impact of flood disaster in a drought prone area – case study of alampur vill...
Impact of flood disaster in a drought prone area – case study of alampur vill...eSAT Publishing House
 
Hudhud cyclone – a severe disaster in visakhapatnam
Hudhud cyclone – a severe disaster in visakhapatnamHudhud cyclone – a severe disaster in visakhapatnam
Hudhud cyclone – a severe disaster in visakhapatnameSAT Publishing House
 
Groundwater investigation using geophysical methods a case study of pydibhim...
Groundwater investigation using geophysical methods  a case study of pydibhim...Groundwater investigation using geophysical methods  a case study of pydibhim...
Groundwater investigation using geophysical methods a case study of pydibhim...eSAT Publishing House
 
Flood related disasters concerned to urban flooding in bangalore, india
Flood related disasters concerned to urban flooding in bangalore, indiaFlood related disasters concerned to urban flooding in bangalore, india
Flood related disasters concerned to urban flooding in bangalore, indiaeSAT Publishing House
 
Enhancing post disaster recovery by optimal infrastructure capacity building
Enhancing post disaster recovery by optimal infrastructure capacity buildingEnhancing post disaster recovery by optimal infrastructure capacity building
Enhancing post disaster recovery by optimal infrastructure capacity buildingeSAT Publishing House
 
Effect of lintel and lintel band on the global performance of reinforced conc...
Effect of lintel and lintel band on the global performance of reinforced conc...Effect of lintel and lintel band on the global performance of reinforced conc...
Effect of lintel and lintel band on the global performance of reinforced conc...eSAT Publishing House
 
Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...
Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...
Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...eSAT Publishing House
 
Wind damage to buildings, infrastrucuture and landscape elements along the be...
Wind damage to buildings, infrastrucuture and landscape elements along the be...Wind damage to buildings, infrastrucuture and landscape elements along the be...
Wind damage to buildings, infrastrucuture and landscape elements along the be...eSAT Publishing House
 
Shear strength of rc deep beam panels – a review
Shear strength of rc deep beam panels – a reviewShear strength of rc deep beam panels – a review
Shear strength of rc deep beam panels – a revieweSAT Publishing House
 
Role of voluntary teams of professional engineers in dissater management – ex...
Role of voluntary teams of professional engineers in dissater management – ex...Role of voluntary teams of professional engineers in dissater management – ex...
Role of voluntary teams of professional engineers in dissater management – ex...eSAT Publishing House
 
Risk analysis and environmental hazard management
Risk analysis and environmental hazard managementRisk analysis and environmental hazard management
Risk analysis and environmental hazard managementeSAT Publishing House
 
Review study on performance of seismically tested repaired shear walls
Review study on performance of seismically tested repaired shear wallsReview study on performance of seismically tested repaired shear walls
Review study on performance of seismically tested repaired shear wallseSAT Publishing House
 
Monitoring and assessment of air quality with reference to dust particles (pm...
Monitoring and assessment of air quality with reference to dust particles (pm...Monitoring and assessment of air quality with reference to dust particles (pm...
Monitoring and assessment of air quality with reference to dust particles (pm...eSAT Publishing House
 
Low cost wireless sensor networks and smartphone applications for disaster ma...
Low cost wireless sensor networks and smartphone applications for disaster ma...Low cost wireless sensor networks and smartphone applications for disaster ma...
Low cost wireless sensor networks and smartphone applications for disaster ma...eSAT Publishing House
 
Coastal zones – seismic vulnerability an analysis from east coast of india
Coastal zones – seismic vulnerability an analysis from east coast of indiaCoastal zones – seismic vulnerability an analysis from east coast of india
Coastal zones – seismic vulnerability an analysis from east coast of indiaeSAT Publishing House
 
Can fracture mechanics predict damage due disaster of structures
Can fracture mechanics predict damage due disaster of structuresCan fracture mechanics predict damage due disaster of structures
Can fracture mechanics predict damage due disaster of structureseSAT Publishing House
 
Assessment of seismic susceptibility of rc buildings
Assessment of seismic susceptibility of rc buildingsAssessment of seismic susceptibility of rc buildings
Assessment of seismic susceptibility of rc buildingseSAT Publishing House
 
A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...
A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...
A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...eSAT Publishing House
 
Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...
Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...
Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...eSAT Publishing House
 

More from eSAT Publishing House (20)

Likely impacts of hudhud on the environment of visakhapatnam
Likely impacts of hudhud on the environment of visakhapatnamLikely impacts of hudhud on the environment of visakhapatnam
Likely impacts of hudhud on the environment of visakhapatnam
 
Impact of flood disaster in a drought prone area – case study of alampur vill...
Impact of flood disaster in a drought prone area – case study of alampur vill...Impact of flood disaster in a drought prone area – case study of alampur vill...
Impact of flood disaster in a drought prone area – case study of alampur vill...
 
Hudhud cyclone – a severe disaster in visakhapatnam
Hudhud cyclone – a severe disaster in visakhapatnamHudhud cyclone – a severe disaster in visakhapatnam
Hudhud cyclone – a severe disaster in visakhapatnam
 
Groundwater investigation using geophysical methods a case study of pydibhim...
Groundwater investigation using geophysical methods  a case study of pydibhim...Groundwater investigation using geophysical methods  a case study of pydibhim...
Groundwater investigation using geophysical methods a case study of pydibhim...
 
Flood related disasters concerned to urban flooding in bangalore, india
Flood related disasters concerned to urban flooding in bangalore, indiaFlood related disasters concerned to urban flooding in bangalore, india
Flood related disasters concerned to urban flooding in bangalore, india
 
Enhancing post disaster recovery by optimal infrastructure capacity building
Enhancing post disaster recovery by optimal infrastructure capacity buildingEnhancing post disaster recovery by optimal infrastructure capacity building
Enhancing post disaster recovery by optimal infrastructure capacity building
 
Effect of lintel and lintel band on the global performance of reinforced conc...
Effect of lintel and lintel band on the global performance of reinforced conc...Effect of lintel and lintel band on the global performance of reinforced conc...
Effect of lintel and lintel band on the global performance of reinforced conc...
 
Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...
Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...
Wind damage to trees in the gitam university campus at visakhapatnam by cyclo...
 
Wind damage to buildings, infrastrucuture and landscape elements along the be...
Wind damage to buildings, infrastrucuture and landscape elements along the be...Wind damage to buildings, infrastrucuture and landscape elements along the be...
Wind damage to buildings, infrastrucuture and landscape elements along the be...
 
Shear strength of rc deep beam panels – a review
Shear strength of rc deep beam panels – a reviewShear strength of rc deep beam panels – a review
Shear strength of rc deep beam panels – a review
 
Role of voluntary teams of professional engineers in dissater management – ex...
Role of voluntary teams of professional engineers in dissater management – ex...Role of voluntary teams of professional engineers in dissater management – ex...
Role of voluntary teams of professional engineers in dissater management – ex...
 
Risk analysis and environmental hazard management
Risk analysis and environmental hazard managementRisk analysis and environmental hazard management
Risk analysis and environmental hazard management
 
Review study on performance of seismically tested repaired shear walls
Review study on performance of seismically tested repaired shear wallsReview study on performance of seismically tested repaired shear walls
Review study on performance of seismically tested repaired shear walls
 
Monitoring and assessment of air quality with reference to dust particles (pm...
Monitoring and assessment of air quality with reference to dust particles (pm...Monitoring and assessment of air quality with reference to dust particles (pm...
Monitoring and assessment of air quality with reference to dust particles (pm...
 
Low cost wireless sensor networks and smartphone applications for disaster ma...
Low cost wireless sensor networks and smartphone applications for disaster ma...Low cost wireless sensor networks and smartphone applications for disaster ma...
Low cost wireless sensor networks and smartphone applications for disaster ma...
 
Coastal zones – seismic vulnerability an analysis from east coast of india
Coastal zones – seismic vulnerability an analysis from east coast of indiaCoastal zones – seismic vulnerability an analysis from east coast of india
Coastal zones – seismic vulnerability an analysis from east coast of india
 
Can fracture mechanics predict damage due disaster of structures
Can fracture mechanics predict damage due disaster of structuresCan fracture mechanics predict damage due disaster of structures
Can fracture mechanics predict damage due disaster of structures
 
Assessment of seismic susceptibility of rc buildings
Assessment of seismic susceptibility of rc buildingsAssessment of seismic susceptibility of rc buildings
Assessment of seismic susceptibility of rc buildings
 
A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...
A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...
A geophysical insight of earthquake occurred on 21 st may 2014 off paradip, b...
 
Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...
Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...
Effect of hudhud cyclone on the development of visakhapatnam as smart and gre...
 

Recently uploaded

OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...Soham Mondal
 
HARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICS
HARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICSHARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICS
HARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICSRajkumarAkumalla
 
247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).ppt
247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).ppt247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).ppt
247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).pptssuser5c9d4b1
 
Introduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptxIntroduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptxupamatechverse
 
Call Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile serviceCall Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile servicerehmti665
 
HARMONY IN THE NATURE AND EXISTENCE - Unit-IV
HARMONY IN THE NATURE AND EXISTENCE - Unit-IVHARMONY IN THE NATURE AND EXISTENCE - Unit-IV
HARMONY IN THE NATURE AND EXISTENCE - Unit-IVRajaP95
 
Introduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptxIntroduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptxupamatechverse
 
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝soniya singh
 
High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...
High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...
High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...Call Girls in Nagpur High Profile
 
(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escorts
(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escorts(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escorts
(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escortsranjana rawat
 
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur EscortsCall Girls in Nagpur High Profile
 
ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...
ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...
ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...ZTE
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCall Girls in Nagpur High Profile
 
APPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICS
APPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICSAPPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICS
APPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICSKurinjimalarL3
 
Internship report on mechanical engineering
Internship report on mechanical engineeringInternship report on mechanical engineering
Internship report on mechanical engineeringmalavadedarshan25
 
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...ranjana rawat
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxpurnimasatapathy1234
 
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130Suhani Kapoor
 
Call Girls in Nagpur Suman Call 7001035870 Meet With Nagpur Escorts
Call Girls in Nagpur Suman Call 7001035870 Meet With Nagpur EscortsCall Girls in Nagpur Suman Call 7001035870 Meet With Nagpur Escorts
Call Girls in Nagpur Suman Call 7001035870 Meet With Nagpur EscortsCall Girls in Nagpur High Profile
 

Recently uploaded (20)

OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
OSVC_Meta-Data based Simulation Automation to overcome Verification Challenge...
 
HARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICS
HARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICSHARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICS
HARDNESS, FRACTURE TOUGHNESS AND STRENGTH OF CERAMICS
 
247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).ppt
247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).ppt247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).ppt
247267395-1-Symmetric-and-distributed-shared-memory-architectures-ppt (1).ppt
 
Introduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptxIntroduction to Multiple Access Protocol.pptx
Introduction to Multiple Access Protocol.pptx
 
Call Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile serviceCall Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile service
 
HARMONY IN THE NATURE AND EXISTENCE - Unit-IV
HARMONY IN THE NATURE AND EXISTENCE - Unit-IVHARMONY IN THE NATURE AND EXISTENCE - Unit-IV
HARMONY IN THE NATURE AND EXISTENCE - Unit-IV
 
Introduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptxIntroduction to IEEE STANDARDS and its different types.pptx
Introduction to IEEE STANDARDS and its different types.pptx
 
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
Model Call Girl in Narela Delhi reach out to us at 🔝8264348440🔝
 
High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...
High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...
High Profile Call Girls Nashik Megha 7001305949 Independent Escort Service Na...
 
(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escorts
(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escorts(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escorts
(MEERA) Dapodi Call Girls Just Call 7001035870 [ Cash on Delivery ] Pune Escorts
 
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur EscortsHigh Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
High Profile Call Girls Nagpur Meera Call 7001035870 Meet With Nagpur Escorts
 
ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...
ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...
ZXCTN 5804 / ZTE PTN / ZTE POTN / ZTE 5804 PTN / ZTE POTN 5804 ( 100/200 GE Z...
 
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service NashikCollege Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
College Call Girls Nashik Nehal 7001305949 Independent Escort Service Nashik
 
APPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICS
APPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICSAPPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICS
APPLICATIONS-AC/DC DRIVES-OPERATING CHARACTERISTICS
 
Internship report on mechanical engineering
Internship report on mechanical engineeringInternship report on mechanical engineering
Internship report on mechanical engineering
 
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
(PRIYA) Rajgurunagar Call Girls Just Call 7001035870 [ Cash on Delivery ] Pun...
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptx
 
★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR
★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR
★ CALL US 9953330565 ( HOT Young Call Girls In Badarpur delhi NCR
 
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
VIP Call Girls Service Kondapur Hyderabad Call +91-8250192130
 
Call Girls in Nagpur Suman Call 7001035870 Meet With Nagpur Escorts
Call Girls in Nagpur Suman Call 7001035870 Meet With Nagpur EscortsCall Girls in Nagpur Suman Call 7001035870 Meet With Nagpur Escorts
Call Girls in Nagpur Suman Call 7001035870 Meet With Nagpur Escorts
 

A software framework for dynamic modeling of dc motors at robot joints

  • 1. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 612 A SOFTWARE FRAMEWORK FOR DYNAMIC MODELING OF DC MOTORS AT ROBOT JOINTS Mehmet Serdar Güzel1 1 Ankara University, Computer Engineering Department, Ankara, Turkey Abstract This paper addresses to develop an educational simulation tool for dynamic analysis of a 5 DOF robot arm’s actuators. Kinematics analysis of robot arm was visually displayed with the corresponding tool in relation to dc motors, used at the robot arm joints. Besides, dynamic modeling of DC motors is presented and their combined motion within the arm is analyzed and displayed visually. Keywords: Robot arm, Robot Kinematics, PWM, DC Motor Simulation, Robot Simulator. -----------------------------------------------------------------------***----------------------------------------------------------------------- 1. INTRODUCTION Simulation is an engineering tool, used in designing and analyzing of real time systems. It is mainly used to provide a safe, reliable and inexpensive way for the operation of complex systems. By using a simulator, experimental designs can be effectively validated without consuming materials and machining efforts in the workshop [1, 2, 3]. This paper presents the simulation of a position control system using robot arm actuators having Five Degree of Freedom (DOF). The simulation was mainly designed and implemented based on the general mathematical model of DC servo motors. Lynx-6 robot arm with 5 DOF was modelled analytically and its forward and inverse kinematics was analyzed and calculated. Consequently, a final model was generated and a real time simulation was performed based on the proposed model. Lynx-6 robot arm which is shown in figure 1 has 5 DOF with a grip movement. It is similar to human arm from the number of joints point of view. These joints produce shoulder rotation, shoulder back and forth, elbow, wrist up and down, wrist rotation and gripper motion. [4,5]. One of the most challenging and critical problems in control engineering is to control analog voltages with digital inputs. PWM (Pulse- Width Modulation) technique is used to vary the analogue voltages by using digital pulses; these digital pulses are generated through computer programming according to motion specifications of the user by a servo control card. Control cards are utilized to handle the given problem. In this study, a SSC-32 servo control card has been attached into the Lynx-6 Robot arm. The card mainly aims to convert the digital pulses to dc voltages during the pulse duration to drive the dc motors of the joints in required amounts [6]. In the application part of this study a high level visual software package was developed to simulate dynamically both a Lynx- 6 Robot arm’s actuators and their combined motion .Visual Studio Net platform with C# programming Language was employed to developed this visual software package. Fig 1: Lynx-6 Robot Arm 2. DC MOTOR SIMULATION DC motors are preferred to be used in control systems due to the fact that they provide continuous motion unlike the stepper motor motion in steps. Mathematical model of a DC motor is derived to observe and define the control mechanism analytically. The most common control technique for DC motors is the armature-current control to generate rotational motion. [7]. A typical DC motor, used in the Lynx-6 robot arm is illustrated in Figure 2.
  • 2. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 613 Fig 2: DC Motor The basic mathematical model of a DC motor, employed in the corresponding robot arm, was shown in Figure 3. In the model, va is the supply voltage, ia is the winding current , Ra is the resistance of the armature circuit, La is the inductance of the armature circuit, J is the moment of inertia of the system (including the motor and the load), the back emf is ea = ke.ωa(here ke is known as the back emf constant or torque constant ωa is the angular speed of the system, Te is the electromagnetic torque developed by the motor, TL is the load torque, and B is the damping coefficient which is usually ignored. The comprehensive information about these is given in reference [8]. Va + RaLas  1 kt Te + TL _ Bs  1 wa(s) kv Vc _ Ia(s) Fig 3: Mathematical model of a DC Motor The dynamic simulation of the dc motor constitutes: a) voltage/current equation of the motor armature, b) Dynamic equation of the motor-load (mechanical) system, c) Electromagnetic torque equation a a aaaa e dt di LiRv  (1) m e m L d T J B T dt     (2) TL = ke ia (3) The general formula to solve differential equations given in (2) and (3) is illustrated as follows :  e tctot xtoxxtx /)( )()()()(   (4) Where (tc) time constant for RL circuits is L/R , Equation 4 can be interpreted as in equation (5) due to fact that all Resistors, Capacitors, and Inductors have positive values when t>0 [7]. 3. PWM (PULSE-WIDTH MODULATION) PWM was employed in variety of applications, ranging from measurement and communications to power control. It is a way of digitally encoding analog signal levels. Through the use of high-resolution counters, the duty cycle of a square wave is modulated to encode a specific analog signal level. At any given time, the full DC supply is either fully ON or fully OFF. The voltage or current source is supplied to the load by means of a series of on and off pulses. The on-time is the time during which the DC supply is applied to the load, and the off-time is the period during which the supply is switched off. Figure 4 presents three different PWM signal outputs, used in actuator motor control. For example PWM signal output with %10 duty cycle in (a) is ON during %10 of its period and OFF during %90 of its period. Others in (b) and (c) have the similar properties with different ON/OFF periods. The initial position of any dc servo motor of Lynx-6 robot arm was compared with the new required positions which were both defined by user program parameters. The difference between positions is applied as an input signal to servo card and the essential PWM signal was generated to feed the dc motors with dc supply. Robot arm motors were chosen to be used in no more than 90 degree range of motion. Hence the corres- ponding “width” of the PWM signal pulse varied from 0.9 milliseconds (minimum position), to 2.1 ms (maximum position). The Pulse is repeated every 14 to 20 milliseconds [9] . Fig 4: PWM signals with varying Duty Cycles a) %10 duty cycle b) %50 duty cycle c) %90 duty cycle
  • 3. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 614 4. KINEMATICS Denavit-Hartenberg representation is used to model the joints of Lynx-6 Robot arm, [10] , can be seen in Figure 5. All the joints are assigned by using the principles of D-H convention. Robot kinematics is mainly divided into two groups, namely, forward kinematics and inverse kinematics. In forward kinematics, the length of each link and the angle of each joint are given and the position of any point in the work space of the robot is calculated. As opposed to forward kinematics, in inverse kinematics, the length of each link and the position of the point in work space are given and the angle of each joint is calculated. Fig 5: Model of Lynx-6 Robot Arm 4.1 Forward Kinematics To calculate forward kinematics equations for 5 dof Lynx arms, the transformation matrices corresponding to robot arm joints, [11], were manipulated and the final forward kinematics solution was shown below. Tf = A1*A2*A3*A4*A5 , for 5 Dof (5) 4.2 Inverse Kinematics Inverse Kinematics analysis determines the joint angles for desired position and orientation in Cartesian space. The robot arm manipulator which is used in this study has five degrees of freedom (DOF). In order to determine the joint angles, the final matrix equation is multiplied by An -1 (n=1, 2, 3, 4, 5, 6) on both sides sequentially and the generated linear equations were solved [11]. The inverse kinematic solutions for five DOF Lynx arm are shown below: 0 0 0 1 x x ax x y y ay y f z z z z n o p n o p T n o a p                θ234 (WARTG=Wrist Angle Relative to G round) (6) θ1 = arc tan (py/px) or θ1 = θ1 + 180° (7) θ2 = arc tan (S2 /C2) (8) θ3 = arc tan (S3 /C3) (9) θ4 = θ234 - θ3 - θ4 (10) θ5 = arc tan(S5 / C5 ) (11) 5. SOFTWARE DESIGN The control program has been implemented using C# programming language in Visual Studio Net platform. The program supports two main operation modes, simulation of DC servo motors and kinematics analysis of Lynx-6. Main Screen of the program was shown in figure 6. Fig 6: Main Screen of the Framework
  • 4. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 615 On the left side of the main screen, there are two graphical views, side view and top view of the robot arm, are displayed to show the robot arm’s motion in real time. There are three engines exist within the software package, namely, Kinematics Engine, PWM Engine, and Simulator Engine. Kinematics Engine: It is responsible with the solutions of forward and inverse kinematics equations and the calculations related to joints and Cartesian coordinates. PWM Engine: It is responsible with the managing of analogue voltages’ and digital pulses and provides correlation between user defined input values (angle or position) and control card parameters. Simulator Engine: It is responsible with the interpretation of the robot model, construction of internal data structures to represent the robot and manipulating the joint angles, as specified by simulation commands and the robot’s kinematics The developed software is mainly designed to simulate and show the operational stages of the robot arm. The general flowchart is shown in figure 7. Fig 7: Flow Chart Diagram of the Software The steps of algorithm are defined as follows: a) Program is started. b) Data is entered either as degree angles from Forward Kinematics Input Screen or as position coordinates from Inverse Kinematics Input Screen. c) If given input values are position values; Kinematics Engine start to work and use inverse kinematics equations to derive required input angle values, which has been detailed in Kinematics section. d) Derived angle values must be converted into control card (SSC-32) parameters [6]. e) PWM engine is responsible for managing analogue values with digital inputs, using applied voltage Interval, paired with corresponding angle value by the engine. f) All related joints engines are start to work for dynamic simulation with given constant motor parameters such as Armature Resistance , Inductance etc. and calculated values as applied voltage by PWM engine. g) Simulator Engine starts to show the work. All motional characteristics of robot arm were displayed with these models. There are also graphical windows on the main screen for all joints to show robot joint response such as current vs time (current responses to varying time) and angular speed vs time (speed response to varying time) graphs. An example of robot base joint is shown in figures 8 and 9 respectively. Fig 8: Current-Time Graph for Base (45 degrees) Figure 8 presents an experiment in which it can be inferred that as 2.7 volt is applied to the system; the motor can only achieve a maximum value of 1.8 amber. Besides, it takes the motor one second to reach its steady-state value. This example in essence shows the change in current according to the time interval. Additionally, Angular Speed/Time graph of given software is also shown below that as the same volt is applied to the system, the motor can only achieve a maximum speed of 5 rad/sec, which also takes the motor one second to reach its steady-state speed.
  • 5. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 616 Fig 9: Angular Speed-Time Graph for Base (45 degrees) There is also a kinematics screen which shows all transformation matrices which are derived from Final Kinematics Matrices is shown in figure 10. This screen is developed for detailed analysis of Kinematics equations. All transformation matrices of related joints can be observed and tested by users. Fig 10: Movement Matrices for (x=23;y=10;z=23) 6. DISCUSSION AND CONCLUSIONS This section addresses to discuss the results of a numerical example that all calculation steps including the simulation logic of the proposed software framework will be detailed as follows: The following initial values are given for the experiment: Ra = 5; Armeture Resistance L = 2; Inductance Jm = 0.025; motor constant Bm = 0.1; friction constant kb = 0.1; back emf constant Ki = 0.5; moment constant Tl = 0.0; Load moment for given 0 – 6V applied voltage interval Position  Angle Values are calculated X Y Z BASE SHOULDER ELBOW WRIST 23 8 21 20 9 -3 35 As angle values are calculated from position vector by Kinematics Engine into signals, they are ready to be used by the control card [6]. The signal consists of positive going pulses ranging from 0.5 to 2.5mS (milliseconds) long, repeated 50 times a second (every 20mS). The servo positions its output shaft in proportion to the width of the pulse. PWM engine calculates signal values for four different joints simultaneously that applied voltages are also calculated by given pulse values. Calculated pulse values are, BASE SHOULDER ELBOW WRIST 1713 ms 1400 ms 1538 ms 1438 ms Calculated voltage values are, BASE SHOULDER ELBOW WRIST 4.1 V 2.5 V 1.4 V 0.8 V Base motor simulator screen is illustrated in figure 11 and the corresponding Current-Time graph can also be seen in figure 12. Fig 11: DC simulator for Base (22 degrees) Fig 12: Current-Time Graph for Base (22 degrees) At the final stage, the final position matrices are displayed and the simulator takes its new position with respected to the calculated angle values.
  • 6. IJRET: International Journal of Research in Engineering and Technology eISSN: 2319-1163 | pISSN: 2321-7308 __________________________________________________________________________________________ Volume: 03 Issue: 04 | Apr-2014, Available @ http://www.ijret.org 617 Fig 13: Final Position Matrices and Simulator Overall, a new software tool for manipulator based simulation has been presented in this paper. The tool supports low cost Lynx arms which are mainly employed for scientific and educational applications. The tool analyzes manipulator actuators (DC servo motors), as well as it works on motional characteristics of manipulator and to be able to solve both inverse and forward kinematics. The proposed tool is flexible and open source that researches and students can use this tool for different tasks with minor modification. The interface of the proposed software framework is user friendly that researchers can learn and utilize the tool for their problems with minor effort. The most powerful side of the tool is its ability to provide association between dynamic analysis of DC motors and Motional Characteristics of Lynx-6 robot arms. There exists more powerful DC motor simulators such as LABVIEW and MATLAB, but their costs are high for many researchers to handle and they do not provide association between dynamic analysis of DC motors and Kinematics of Lynx-6 Manipulators as the proposed software does. Furthermore, the proposed software framework is free Software package and will be on the official web page of Computer Engineering Department of Ankara University (http://comp.eng.ankara.edu.tr/proje.html. This paper is a revised version of a conference paper that appeared as [12]. REFERENCES [1]. White, R.B., Read, R., Koch, M. and Schilling, R.J., “A graphics simulator for a robotic arm,” IEEE Trans. Education, Vol. 32, No. 4, pp. 417-429, (1989) [2]. T. Raz, “Graphics robot simulator for teaching introductory robotics,” IEEE Trans. Educ., vol. 32, pp. 153– 159, May (1989) [3]. Antonia Yordan-Nones , Heterogeneous Modeling & Design of Robot Arm Control System, , University of Puertro Rico , Mayagüez. [4]. Koyuncu, B. and Güzel, M., Software Analysis of Lynx-6 Robot arm, ARC 2008, pp. 1-8 [5]. Güzel, M. S, Hinislioglu, Y., “A robotic software for intelligent applications, Artifical Life and Robotics 18 (1-2), 76-82 [6]. Lynx SSC-32 Servo motor controller board user manual. Available online at www.lynx.com. com. Accessed on December 2007 [7]. Luca Zaccarian , DC motors: dynamic model and control techniques , pp 16-22 [8]. Raymond A. DECARLO, Linear Circuit Analysis. pp. 224 -229 , Prentice HALL. [9]. Lynxmotion Inc ,2007 http://www.lynxmotion.com [10]. J. Denavit and R.S. Hartanberg , “A kinematic notation for lower-pair mechanisms based upon matrices” ASME J. Appl .Mechanics vol. 22, pp. 215 -221, 1955. [11]. Koyuncu, B., and Güzel, M., “Software Development for the Kinematic Analysis of a Lynx 6 Robot Arm ,International Journal of Applied Science, Engineering and Technology , Volume 4, Number 4 pp. 228-233 ,2007 [12]. Koyuncu,B.,Güzel, M: A visual Tool for Kinematics Analyses of Lynx-6 Robot Arms together with dynamic modeling of dc motors at robot joints ,International conference on Automation, Robotics and control systems, arcs-08, Florida, USA,July 2008, pp 145-150.