SlideShare a Scribd company logo
1 of 5
Download to read offline
IOSR Journal of Electrical and Electronics Engineering (IOSR-JEEE)
e-ISSN: 2278-1676,p-ISSN: 2320-3331, Volume 10, Issue 3 Ver. IV (May – Jun. 2015), PP 13-17
www.iosrjournals.org
DOI: 10.9790/1676-10341317 www.iosrjournals.org 13 | Page
Optimal PID control of a brushless DC motor using PSOtechnique
R.R.Navatakke1
, Jagadeesh.Bichagatti.2
1,2. (P.G.Department, M.B.E.S.C.O.E Ambajogai./ Dr.B.A.M.University, INDIA )
Abstract:This paper proposes PID controller tuning for time delayed process(BLDC Motor) using particle swarm
optimization. The Proportional Integral Derivative (PID) structure is mainly used to achieve the desired output in case of
closed loop control systems in most of the industry applications. In PID controller it is difficult to obtain the proper values of
the controlling parameters Kp, Ki and Kd. The paper describes the design of dynamic control system model with PID
controller and the values of the controlling parameters Kp, Ki and Kd are computed by using stochastic global search
method i.e. Particle Swarm Optimization (PSO) speed control of a brushless DC motor (BLDC). It is an efficient and fast
tuning scheme compare to other conventional techniques. The (BLDC) motor is modeled in simulink in Matlab. The
proposed technique was more efficient in improving the step response characteristicsas well as reducing the steady-state
error, rise time, settling time and maximum overshoot.
Keywords: Partical Swarm Optimisation(PSO), Partical Swarm Intelligence, PID Controller
I. Introduction
The brushless DC motor (BLDC motor) where the permanent magnet provides the necessary air gap flux instead
of the wire-wound field poles.
There are many modern control methodologies such as nonlinear control, optimal control, variable structure
control and adaptive control have been widely proposed for speed control of brushless permanent magnet DC
motor.However, these approaches are either complex and difficult to implement. PID controller with itsthree terms
functionality covering treatment for transientand steady-state response offers the simplest and gets mostefficient solution to
many real world control problems. PID (Proportional Integral Derivative) control is one of the earlier control strategies
which are used for controlling any plant transfer function. Now to get better efficiency, the actual output should be matched
with the set output. Hence some control action should be carried out. Since many control systems using PID controller gives
satisfactory result and it helps to tune the control parameters to the optimum values, it is used in industrial control. Now
there are various methods to obtain optimum values of the parameters of PID controller for the purpose of tuning. Optimally
tuning gains of PIDcontrollers are quite difficult. Recently, the computationalintelligence has proposed Particle Swarm
Optimization (PSO) technique for the same purpose.Anew tuning approach “Particle swarm optimization” has been
introduced in this paper for tuning of PID controller. PSO was first introduced by Dr. J. Kennedy and R. C. Eberhart in 1995
[X]. Particle swarm optimization is population based technique which is inspired by the social behaviour of biological
organism. It is an efficient and fast tuning scheme for solving nonlinear large scale optimization problems.
II. Brushless dc motor
BLDC motor drives, system in which permanent magnet synchronous motor is fed with variable frequency
inverter controlled by shaft position sensor. there appears a lack of commercial simulation packages for design of controllers
for such BLDC motor drives.
Fig 1.Three-phase full-bridge power circuit for BLDC motor drive.
The BLDC motor is a DC motor turned inside out, so that field is on the rotor and armature is on stator. The
brushes DC motor is actually a permanent magnet AC motor whose torque current characteristic mimic the dc motor. Instead
of commutating the armature current using brushes, electronic commutation is used. This eliminates the problems associated
with the brush and commutatorarrangments. This kind of motor not only has the advantages of DC motor such as better
velocity capability and no mechanical commutator but also has the advantages of AC motor such as simple structure, higher
reliability and freemaintenance. In addition, brushless DC motor has the following advantages: smaller volume, high torque,
and simple system structure. So it is widely applied in areas which needs high performance drive. In this paper a three-phase
and two-pole BLDC motor is studied.The characteristic equations of BLDC motor are described by equations (1) (4).
Vapp(t) =L
𝑑𝑖(𝑡)
𝑑𝑡 + Ri(t) + Vemf(1)
Vemf = 𝐾𝑏 × 𝜔(𝑡)(2)
Optimal PID control of a brushless DC motor using PSO technique
DOI: 10.9790/1676-10341317 www.iosrjournals.org 14 | Page
𝑇 𝑡 = 𝐾t × i(t) (3)
T(t) =J
𝑑𝜔 (𝑡)
𝑑𝑡
+ D.ω(t) (4)
Where,Vapp(t) is the applied voltage, ω(t)is the motor speed, L is the inductance of the stator, i(t) is the current of
the circuit, R is resistance of the stator, Vemf is the back electromotive force, T is the torque of motor, D is the viscous
coefficient, J is the moment of inertia, kt is the motor torque constant, kb is the back electromotive force constant, and
Fig.1shows the equivalent circuit of three-phase full-bridge power circuit for (BLDC) motor drive.
III. PID Controller
In Control Engineering, any model is represented by transfer function for single input and single output and linear
time invariant dynamical system. The popularity of PID controllers in industry has increased due to their applicability,
functional simplicity and reliability in performance. Transfer function of PID controller is shown in Fig.3(a).
.
Fig.3(a). Transfer function of PID controller
Where, E(s) is error input signal, M(s) is manipulated output signal. Kp is propotional gain, Ki is integral gain and kd is
derivative gain.
Fig.3(b). Block diagram of PID controller
The optimization methods are introduced for the purpose of tuning the parameters to search for the best solution by
minimizing the objective function. To obtain the objective the associated characteristics like rise time, maximum overshoot,
settling time, are measured. A set of performance indicators may be used as a design tool to evaluate tuning method.
The parameters Kp, Ki and Kd are chosen to meet prescribed performance criteria, classically specified in terms of
rise and settling times, overshoot, and steady-state error. In this paper PSO technique used to find the optimal values of
parameters Kp, Ki and Kd of (PID) controller for BLDC motor speed control system.
IV. Overview of Partical swarm optimisation
PSO is an easy & smart artificial techniques and a evolutionary computation technique which is developed by
Kennedy &Eberhart [13] .it is used to explore the search space of a given problem to find the settings or parameters required
to optimize a particular objective. It is based on following two concepts: (i) The idea of swarm intelligence based on the
observation of swarming habits by certain kinds of animals (such as birds and fish), (ii) The field of evolutionary
computation .The assumption is basic of PSO. In the proposed PSO method each particle contains three members kp, ki and
kd. It means that the search space has three dimensions and particles must fly in a three dimensional space.
PSO is basically developed through simulation of bird flocking in three-dimensional space. The positive of each
agent is represented by xyz axes position and also the velocity is expressed by vx (the velocity of x-axis, vy (the velocity of
y-axis) and vz (the velocity of z-axis). Modification of the agent position is realized by the position and velocity For n-
variables optimization problem a flock of particles are put into the n-dimensional search space with randomly chosen
velocities and positions knowing their best values, so far ( ) and the position in the n-dimensional space. The velocity of each
particle, adjusted accordingly to its own experience and the other particles flying experience. For example, the 𝑖𝑡h particle is
represented as
𝑋𝑖=(𝑥𝑖1,𝑥𝑖2,𝑥𝑖3……………..𝑥𝑖𝑑 ) in the d-dimensional space,
the best previous positions of the 𝑖𝑡�particle is represented as:
𝑃𝑏𝑒𝑠𝑡 = (𝑃𝑏𝑒𝑠𝑡𝑖,1,𝑃𝑏𝑒𝑠𝑡𝑖,2,𝑃𝑏𝑒𝑠𝑡𝑖,3………………𝑃𝑏𝑒𝑠𝑡𝑖,𝑑 )
The index of the best particle among the group is Gbest. Velocity of the 𝑖𝑡h particle is represented as:
𝑉𝑖 = (𝑉𝑖,1,𝑉𝑖,2𝑉𝑖,3………….𝑉𝑖,𝑑 )
This modification can be represented by the concept of velocity. Velocity of each agent can be modified by the following
equation:
Optimal PID control of a brushless DC motor using PSO technique
DOI: 10.9790/1676-10341317 www.iosrjournals.org 15 | Page
Vk+1
i = W × Vk
i + C1rand1 × (Pbesti - Xk
i) + C2rand2 ×(Gbesti - Xk
i) (5)
Where,
Vk
i - Velocity of agent i at iteration k
W - Weighting function
Cj - Correction factor
rand - random no. between 0 and 1
Pbest - particle best position of agent i
Gbest -global particle best position of the group
Xk
i -Current position of agent i at iteration k
The following weighting function is usually utilized in: (6)
Where,
Wmax - Final weight
Wmin - Initial weight
iter - Current iteration number
itermax - Maximum iteration number
The current position (searching point in the solution space) can be modified by the following equation:
Sk+1
i =Si
k
+ Vi
k+1
(7)
V. Implementation Of Pso-Pid Controller
5.1 Fitness Function
In This paper a time domain criterion is used for evaluating the PID Controller .A set of good control parameters
P,I and D Can yield a good step response that will result in performance criteria minimization in the time domain .These
performance criteria in the time domain include the overshoot, rise time, Settling time, and steady state error[4]. Therefore,
the performance criterion is defined as follows:
W (K) = (1- 𝑒−𝛽).(𝑀𝑝 + 𝐸𝑠𝑠) + 𝑒−𝛽.(𝑡𝑠 - 𝑡𝑟) (8)
where K is [P,I,D]and β is weightening factor.
The performance criterion W (K) can satisfy the designer requirement using the weightening factor β value. β can
set to be larger than 0.5 to reduce the overshoot and steady state error, also can set smaller 0.5 to reduce the rise time and
settling time. The optimum selection of β depends on the designer requirement and the characteristics of the plant under
control. In BLDC motor speed control system the lower β would lead to moreoptimum responses. In this paper, due to trial,
β is set to be 0.5 to optimum the step response of speed control system.
The fitness function is reciprocal of the performance criterion,
F =
1
𝜔 𝑘
(9)
5.2. Proposed PID controller
In this paper a PSO-PID controller is used to find the optimal values of BLDC speed control system. Fig.5.2(a)
shows the block diagram of optimal PID control for the BLDC motor. In the proposed PSO method each particle contains
three members P, I and D. It means that the search space has three dimension and particles must fly in a three dimensional
space.
Fig.5.2(a). Block Diagram Optimal PID Control
Flow chart of PSO PID Controller is shown in Fig.5.2(b)
Optimal PID control of a brushless DC motor using PSO technique
DOI: 10.9790/1676-10341317 www.iosrjournals.org 16 | Page
Fig.5.2(b)Flowchart of PID controller
VI. Simulation Results
In this section, a comparison between the proposed and the conventional PID tuning is done. Fig.6(a) shows the
error signal for PI,PID controller and PID-PSO approach. Fig.6(b) shows the system output for PI,PID controller and PID-
PSO approach. Fig.6(c) shows the control signal for PI,PID controller and PID-PSO approach.Kp_PID=11.327;
Ti_PID=0.0082;
Td_PID=0.00205;
Kp_PSO=6.6397;
Ki_PSO=1;
Kd_PSO=0.0028;
Fig6(a). Characteristic of error signal Fig6(b).Characteristic of system output
Optimal PID control of a brushless DC motor using PSO technique
DOI: 10.9790/1676-10341317 www.iosrjournals.org 17 | Page
Fig6(c).Characteristic of Control signal
Table 1.PSO(PID) Controller
PSO(PID)
Controller
Peak time
tp
Rise time
tr
Settling time
ts
Max.
OvershootMp%
Steady state
error
ess
With 0.0035 0.0034 0.0035 0 0.01
Without 0.0065 0.0055 0.0066 0 0.066
VII. Conclusion
This paper presents the application of evolutionary algorithms used as optimization methods for the purpose of
parameter estimation of a PID controller rather thanusing classical method of tuning the parameters. The obtained results
through the simulation of BLDC motor shows that the proposed controller can perform an efficient search for optimal PID
controller and can improve the dynamic performance of the system in a better way.
References
[1]. C.L.Lin, H.Y.Jan, Evolutionarily multiobjective PID control for linear brushless DC motor, in: Proc. Of IEEE Int. Conf Industrial Elect. Society(3) Nov. 2002,
pp. 2033-2038.
[2]. Huang Han, Qin Hu, HaoZhifeng, Lim Andrew. Example-based learning particle swarm optimization for continuous optimization. Inform Sci 2012;182(1):125–
38.
[3]. Pooja Sharma et al Int. Journal of Engineering Research and Application,Tuning of PID Controller for A Linear Brushless DC Motor using Swarm Intelligence
Technique Vol. 4, Issue 5( Version 7), May 2014, pp.125-128
[4]. M.P.Prasanna Kumar, P. Devendra, R. SrinivasaRao, IndranilSaaki, Optimal Tuning of PID Controller for a Linear Brushless DC Motor using Particle Swarm
Optimization Technique International Journal of Engineering Research and Applications (IJERA) Vol. 2, Issue 4, July-August 2012, pp.1416-1420.
[5]. Namami Krishna Sharmal, D.Suresh Babu2, and Dr.S.c. Choube3 Application of Particle Swarm OptimizationTechnique for Reactive Power Optimization IEEE-
International Conference On Advances In Engineering, Science And Management (ICAESM -2012) March 30, 31, 2012
[6]. Qinghai Bai, Analysis of Particle Swarm Optimization Algorithm,computer and imformationscience,vol 3, no. 1,feb 2010.
[7]. Ang, K.H. and Chong, G.C.Y. and Li, Y. (2005) PID control system analysis, design, and technology. IEEE Transactions on Control SystemsTechnology
13(4):pp. 559-576.
[8]. G.Prasad, N.SreeRamya, P.V.N.Prasad, G.Tulasi Ram Das, Modelling and Simulation Analysis of the Brushless DC Motor by using MATLAB, International
Journal of Innovative Technology and Exploring Engineering (IJITEE) ISSN: 2278-3075, Volume-1, Issue-5, October 2012
[9]. G Prasad, Venkateswara Reddy M, Dr. P V N Prasad, Dr. G Tulasi Ram Das, Speed control of Brushless DC motor with DSP controller using Matlab
International Journal of Engineering Research and Applications (IJERA),Vol. 2, Issue 3, May-Jun 2012, pp.2120-2125
[10]. Manjeet Singh, DiveshThareja, A Thermal Economic Dispatch Problem Solving, By Particle Swarm Optimization,IPASJ International Journal of Electrical
Engineering (IIJEE),Volume 1, Issue 6, December 2013

More Related Content

What's hot

Effects of Different Parameters on Power System Transient Stability Studies
Effects of Different Parameters on Power System Transient Stability StudiesEffects of Different Parameters on Power System Transient Stability Studies
Effects of Different Parameters on Power System Transient Stability StudiesPower System Operation
 
Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...IJECEIAES
 
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC MotorNovelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC MotorIRJET Journal
 
Security Constrained UCP with Operational and Power Flow Constraints
Security Constrained UCP with Operational and Power Flow ConstraintsSecurity Constrained UCP with Operational and Power Flow Constraints
Security Constrained UCP with Operational and Power Flow ConstraintsIDES Editor
 
Iaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signalIaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signalIaetsd Iaetsd
 
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...idescitation
 
Analysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID ControllerAnalysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID ControllerIJERA Editor
 
Application of neuro fuzzy controller in torque ripple minimization of vec
Application of neuro fuzzy controller in torque ripple minimization of vecApplication of neuro fuzzy controller in torque ripple minimization of vec
Application of neuro fuzzy controller in torque ripple minimization of vecIAEME Publication
 
Nonlinear Control of an Active Magnetic Bearing with Output Constraint
Nonlinear Control of an Active Magnetic Bearing with Output ConstraintNonlinear Control of an Active Magnetic Bearing with Output Constraint
Nonlinear Control of an Active Magnetic Bearing with Output ConstraintIJECEIAES
 
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...IJECEIAES
 
A Comparison Study between Inferred State-Space and Neural Network Based Syst...
A Comparison Study between Inferred State-Space and Neural Network Based Syst...A Comparison Study between Inferred State-Space and Neural Network Based Syst...
A Comparison Study between Inferred State-Space and Neural Network Based Syst...Ahmed Momtaz Hosny, PhD
 
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...ijscmcj
 

What's hot (20)

V04507125128
V04507125128V04507125128
V04507125128
 
Tuning of PID, SVFB and LQ Controllers Using Genetic Algorithms
Tuning of PID, SVFB and LQ Controllers Using Genetic AlgorithmsTuning of PID, SVFB and LQ Controllers Using Genetic Algorithms
Tuning of PID, SVFB and LQ Controllers Using Genetic Algorithms
 
Effects of Different Parameters on Power System Transient Stability Studies
Effects of Different Parameters on Power System Transient Stability StudiesEffects of Different Parameters on Power System Transient Stability Studies
Effects of Different Parameters on Power System Transient Stability Studies
 
[000008]
[000008][000008]
[000008]
 
Optimal parameter estimation for a DC motor using genetic algorithm
Optimal parameter estimation for a DC motor using genetic algorithmOptimal parameter estimation for a DC motor using genetic algorithm
Optimal parameter estimation for a DC motor using genetic algorithm
 
Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...Indirect power control of DFIG based on wind turbine operating in MPPT using ...
Indirect power control of DFIG based on wind turbine operating in MPPT using ...
 
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC MotorNovelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
Novelty Method of Speed Control Analysis of Permanent Magnet Brushless DC Motor
 
Article 1
Article 1Article 1
Article 1
 
Security Constrained UCP with Operational and Power Flow Constraints
Security Constrained UCP with Operational and Power Flow ConstraintsSecurity Constrained UCP with Operational and Power Flow Constraints
Security Constrained UCP with Operational and Power Flow Constraints
 
Prakash narendra
Prakash narendraPrakash narendra
Prakash narendra
 
30120130406002
3012013040600230120130406002
30120130406002
 
Iaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signalIaetsd estimation of damping torque for small-signal
Iaetsd estimation of damping torque for small-signal
 
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
PID Controller Design for a Real Time Ball and Beam System – A Double Integra...
 
Analysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID ControllerAnalysis & Control of Inverted Pendulum System Using PID Controller
Analysis & Control of Inverted Pendulum System Using PID Controller
 
Application of neuro fuzzy controller in torque ripple minimization of vec
Application of neuro fuzzy controller in torque ripple minimization of vecApplication of neuro fuzzy controller in torque ripple minimization of vec
Application of neuro fuzzy controller in torque ripple minimization of vec
 
Nonlinear Control of an Active Magnetic Bearing with Output Constraint
Nonlinear Control of an Active Magnetic Bearing with Output ConstraintNonlinear Control of an Active Magnetic Bearing with Output Constraint
Nonlinear Control of an Active Magnetic Bearing with Output Constraint
 
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
Real Time Implementation of Fuzzy Adaptive PI-sliding Mode Controller for Ind...
 
A Comparison Study between Inferred State-Space and Neural Network Based Syst...
A Comparison Study between Inferred State-Space and Neural Network Based Syst...A Comparison Study between Inferred State-Space and Neural Network Based Syst...
A Comparison Study between Inferred State-Space and Neural Network Based Syst...
 
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
Optimal PID Controller Design for Speed Control of a Separately Excited DC Mo...
 
Comperative Performance Analysis of PMSM Drive Using MPSO and ACO Techniques
Comperative Performance Analysis of PMSM Drive Using MPSO and ACO TechniquesComperative Performance Analysis of PMSM Drive Using MPSO and ACO Techniques
Comperative Performance Analysis of PMSM Drive Using MPSO and ACO Techniques
 

Viewers also liked

Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...
Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...
Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...IOSR Journals
 
Cloud Computing for E-Commerce
Cloud Computing for E-CommerceCloud Computing for E-Commerce
Cloud Computing for E-CommerceIOSR Journals
 
In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...
In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...
In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...IOSR Journals
 
Computation of Theoretical Heat of Formation in a Kiln Using Fortran Language
Computation of Theoretical Heat of Formation in a Kiln Using Fortran LanguageComputation of Theoretical Heat of Formation in a Kiln Using Fortran Language
Computation of Theoretical Heat of Formation in a Kiln Using Fortran LanguageIOSR Journals
 
Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...
Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...
Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...IOSR Journals
 
Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...
Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...
Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...IOSR Journals
 
An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...
An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...
An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...IOSR Journals
 
OSPCV: Off-line Signature Verification using Principal Component Variances
OSPCV: Off-line Signature Verification using Principal Component VariancesOSPCV: Off-line Signature Verification using Principal Component Variances
OSPCV: Off-line Signature Verification using Principal Component VariancesIOSR Journals
 
Auxin induced germination and plantlet regeneration via Rhizome section cultu...
Auxin induced germination and plantlet regeneration via Rhizome section cultu...Auxin induced germination and plantlet regeneration via Rhizome section cultu...
Auxin induced germination and plantlet regeneration via Rhizome section cultu...IOSR Journals
 
Determination of baseline Widal titre among apparently healthy population in ...
Determination of baseline Widal titre among apparently healthy population in ...Determination of baseline Widal titre among apparently healthy population in ...
Determination of baseline Widal titre among apparently healthy population in ...IOSR Journals
 
Fractal Reconfigurable Multiband Communicating Antenna for Cognitive Radio
Fractal Reconfigurable Multiband Communicating Antenna for Cognitive RadioFractal Reconfigurable Multiband Communicating Antenna for Cognitive Radio
Fractal Reconfigurable Multiband Communicating Antenna for Cognitive RadioIOSR Journals
 
Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...
Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...
Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...IOSR Journals
 
Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...
Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...
Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...IOSR Journals
 

Viewers also liked (20)

Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...
Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...
Marketing Analysis of onion in Bade and Geidam Local Government Areas of Yobe...
 
T01761138146
T01761138146T01761138146
T01761138146
 
Cloud Computing for E-Commerce
Cloud Computing for E-CommerceCloud Computing for E-Commerce
Cloud Computing for E-Commerce
 
In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...
In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...
In-vivo anthelmintic evaluation of a processed herbal drug from Entada leptos...
 
Computation of Theoretical Heat of Formation in a Kiln Using Fortran Language
Computation of Theoretical Heat of Formation in a Kiln Using Fortran LanguageComputation of Theoretical Heat of Formation in a Kiln Using Fortran Language
Computation of Theoretical Heat of Formation in a Kiln Using Fortran Language
 
Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...
Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...
Dietary Supplementation with Calcium in Healthy Rats Administered with Artemi...
 
Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...
Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...
Physiological, Biochemical and Modern Biotechnological Approach to Improvemen...
 
An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...
An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...
An Overview of Intrusion Detection and Prevention Systems (IDPS) and Security...
 
OSPCV: Off-line Signature Verification using Principal Component Variances
OSPCV: Off-line Signature Verification using Principal Component VariancesOSPCV: Off-line Signature Verification using Principal Component Variances
OSPCV: Off-line Signature Verification using Principal Component Variances
 
F1102024349
F1102024349F1102024349
F1102024349
 
Auxin induced germination and plantlet regeneration via Rhizome section cultu...
Auxin induced germination and plantlet regeneration via Rhizome section cultu...Auxin induced germination and plantlet regeneration via Rhizome section cultu...
Auxin induced germination and plantlet regeneration via Rhizome section cultu...
 
M017619194
M017619194M017619194
M017619194
 
C1803061620
C1803061620C1803061620
C1803061620
 
Determination of baseline Widal titre among apparently healthy population in ...
Determination of baseline Widal titre among apparently healthy population in ...Determination of baseline Widal titre among apparently healthy population in ...
Determination of baseline Widal titre among apparently healthy population in ...
 
Fractal Reconfigurable Multiband Communicating Antenna for Cognitive Radio
Fractal Reconfigurable Multiband Communicating Antenna for Cognitive RadioFractal Reconfigurable Multiband Communicating Antenna for Cognitive Radio
Fractal Reconfigurable Multiband Communicating Antenna for Cognitive Radio
 
Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...
Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...
Analysis of Pattern Transformation Algorithms for Sensitive Knowledge Protect...
 
Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...
Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...
Chebyshev Collocation Approach for a Continuous Formulation of Implicit Hybri...
 
A1804010105
A1804010105A1804010105
A1804010105
 
J010126267
J010126267J010126267
J010126267
 
N010237982
N010237982N010237982
N010237982
 

Similar to B010341317

Modeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic ControllerModeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic ControllerIJMER
 
Modified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC MotorModified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC MotorIJMER
 
Analysis and Design of Conventional Controller for Speed Control of DC Motor ...
Analysis and Design of Conventional Controller for Speed Control of DC Motor ...Analysis and Design of Conventional Controller for Speed Control of DC Motor ...
Analysis and Design of Conventional Controller for Speed Control of DC Motor ...IJERA Editor
 
Optimal PID controller design using artificial bee colony algorithm for robot...
Optimal PID controller design using artificial bee colony algorithm for robot...Optimal PID controller design using artificial bee colony algorithm for robot...
Optimal PID controller design using artificial bee colony algorithm for robot...nooriasukmaningtyas
 
6. performance analysis of pd, pid controllers for speed control of dc motor
6. performance analysis of pd, pid controllers for speed control of dc motor6. performance analysis of pd, pid controllers for speed control of dc motor
6. performance analysis of pd, pid controllers for speed control of dc motork srikanth
 
OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...
OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...
OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...elelijjournal
 
Paper id 24201493
Paper id 24201493Paper id 24201493
Paper id 24201493IJRAT
 
Design of Fractional Order PID controller using Soft computing methods for a ...
Design of Fractional Order PID controller using Soft computing methods for a ...Design of Fractional Order PID controller using Soft computing methods for a ...
Design of Fractional Order PID controller using Soft computing methods for a ...IOSR Journals
 
Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...
Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...
Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...inventionjournals
 
Comparison of dc motor speed control performance using fuzzy logic and model ...
Comparison of dc motor speed control performance using fuzzy logic and model ...Comparison of dc motor speed control performance using fuzzy logic and model ...
Comparison of dc motor speed control performance using fuzzy logic and model ...Mustefa Jibril
 
Fractional order PID controller tuned by bat algorithm for robot trajectory c...
Fractional order PID controller tuned by bat algorithm for robot trajectory c...Fractional order PID controller tuned by bat algorithm for robot trajectory c...
Fractional order PID controller tuned by bat algorithm for robot trajectory c...nooriasukmaningtyas
 
Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Editor IJARCET
 
Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Editor IJARCET
 
A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...
A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...
A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...paperpublications3
 

Similar to B010341317 (20)

Modeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic ControllerModeling & Simulation of PMSM Drives with Fuzzy Logic Controller
Modeling & Simulation of PMSM Drives with Fuzzy Logic Controller
 
Modified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC MotorModified Chattering Free Sliding Mode Control of DC Motor
Modified Chattering Free Sliding Mode Control of DC Motor
 
Analysis and Design of Conventional Controller for Speed Control of DC Motor ...
Analysis and Design of Conventional Controller for Speed Control of DC Motor ...Analysis and Design of Conventional Controller for Speed Control of DC Motor ...
Analysis and Design of Conventional Controller for Speed Control of DC Motor ...
 
Ia2414161420
Ia2414161420Ia2414161420
Ia2414161420
 
Optimal PID controller design using artificial bee colony algorithm for robot...
Optimal PID controller design using artificial bee colony algorithm for robot...Optimal PID controller design using artificial bee colony algorithm for robot...
Optimal PID controller design using artificial bee colony algorithm for robot...
 
6. performance analysis of pd, pid controllers for speed control of dc motor
6. performance analysis of pd, pid controllers for speed control of dc motor6. performance analysis of pd, pid controllers for speed control of dc motor
6. performance analysis of pd, pid controllers for speed control of dc motor
 
OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...
OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...
OPTIMAL TORQUE RIPPLE CONTROL OF ASYNCHRONOUS DRIVE USING INTELLIGENT CONTROL...
 
Paper id 24201493
Paper id 24201493Paper id 24201493
Paper id 24201493
 
Design of Fractional Order PID controller using Soft computing methods for a ...
Design of Fractional Order PID controller using Soft computing methods for a ...Design of Fractional Order PID controller using Soft computing methods for a ...
Design of Fractional Order PID controller using Soft computing methods for a ...
 
Implementation of speed control of sensorless brushless DC motor drive using ...
Implementation of speed control of sensorless brushless DC motor drive using ...Implementation of speed control of sensorless brushless DC motor drive using ...
Implementation of speed control of sensorless brushless DC motor drive using ...
 
Discrete Time Optimal Tracking Control of BLDC Motor
Discrete Time Optimal Tracking Control of BLDC MotorDiscrete Time Optimal Tracking Control of BLDC Motor
Discrete Time Optimal Tracking Control of BLDC Motor
 
Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...
Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...
Comparative Study of the Success of PI and PI-Fuzzy Controller for Induction ...
 
Comparison of dc motor speed control performance using fuzzy logic and model ...
Comparison of dc motor speed control performance using fuzzy logic and model ...Comparison of dc motor speed control performance using fuzzy logic and model ...
Comparison of dc motor speed control performance using fuzzy logic and model ...
 
Km3617971803
Km3617971803Km3617971803
Km3617971803
 
40620130101003
4062013010100340620130101003
40620130101003
 
Fractional order PID controller tuned by bat algorithm for robot trajectory c...
Fractional order PID controller tuned by bat algorithm for robot trajectory c...Fractional order PID controller tuned by bat algorithm for robot trajectory c...
Fractional order PID controller tuned by bat algorithm for robot trajectory c...
 
Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138
 
Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138
 
A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...
A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...
A Comparative Study of GA tuned and PSO tuned PI Controller Based Speed Contr...
 
Performance Study of Enhanced Non-Linear PID Control Applied on Brushless DC ...
Performance Study of Enhanced Non-Linear PID Control Applied on Brushless DC ...Performance Study of Enhanced Non-Linear PID Control Applied on Brushless DC ...
Performance Study of Enhanced Non-Linear PID Control Applied on Brushless DC ...
 

More from IOSR Journals (20)

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

Recently uploaded

Streamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project SetupStreamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project SetupFlorian Wilhelm
 
"Federated learning: out of reach no matter how close",Oleksandr Lapshyn
"Federated learning: out of reach no matter how close",Oleksandr Lapshyn"Federated learning: out of reach no matter how close",Oleksandr Lapshyn
"Federated learning: out of reach no matter how close",Oleksandr LapshynFwdays
 
Enhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for PartnersEnhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for PartnersThousandEyes
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machinePadma Pradeep
 
Scanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL CertsScanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL CertsRizwan Syed
 
SIEMENS: RAPUNZEL – A Tale About Knowledge Graph
SIEMENS: RAPUNZEL – A Tale About Knowledge GraphSIEMENS: RAPUNZEL – A Tale About Knowledge Graph
SIEMENS: RAPUNZEL – A Tale About Knowledge GraphNeo4j
 
Breaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountBreaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountPuma Security, LLC
 
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 3652toLead Limited
 
Unlocking the Potential of the Cloud for IBM Power Systems
Unlocking the Potential of the Cloud for IBM Power SystemsUnlocking the Potential of the Cloud for IBM Power Systems
Unlocking the Potential of the Cloud for IBM Power SystemsPrecisely
 
The Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptxThe Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptxMalak Abu Hammad
 
Kotlin Multiplatform & Compose Multiplatform - Starter kit for pragmatics
Kotlin Multiplatform & Compose Multiplatform - Starter kit for pragmaticsKotlin Multiplatform & Compose Multiplatform - Starter kit for pragmatics
Kotlin Multiplatform & Compose Multiplatform - Starter kit for pragmaticscarlostorres15106
 
Maximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptxMaximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptxOnBoard
 
Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...Alan Dix
 
Unleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding ClubUnleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding ClubKalema Edgar
 
Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Mattias Andersson
 
08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking MenDelhi Call girls
 
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...shyamraj55
 
Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024Scott Keck-Warren
 
New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024
New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024
New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024BookNet Canada
 

Recently uploaded (20)

Streamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project SetupStreamlining Python Development: A Guide to a Modern Project Setup
Streamlining Python Development: A Guide to a Modern Project Setup
 
"Federated learning: out of reach no matter how close",Oleksandr Lapshyn
"Federated learning: out of reach no matter how close",Oleksandr Lapshyn"Federated learning: out of reach no matter how close",Oleksandr Lapshyn
"Federated learning: out of reach no matter how close",Oleksandr Lapshyn
 
Enhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for PartnersEnhancing Worker Digital Experience: A Hands-on Workshop for Partners
Enhancing Worker Digital Experience: A Hands-on Workshop for Partners
 
Install Stable Diffusion in windows machine
Install Stable Diffusion in windows machineInstall Stable Diffusion in windows machine
Install Stable Diffusion in windows machine
 
Scanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL CertsScanning the Internet for External Cloud Exposures via SSL Certs
Scanning the Internet for External Cloud Exposures via SSL Certs
 
SIEMENS: RAPUNZEL – A Tale About Knowledge Graph
SIEMENS: RAPUNZEL – A Tale About Knowledge GraphSIEMENS: RAPUNZEL – A Tale About Knowledge Graph
SIEMENS: RAPUNZEL – A Tale About Knowledge Graph
 
Breaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path MountBreaking the Kubernetes Kill Chain: Host Path Mount
Breaking the Kubernetes Kill Chain: Host Path Mount
 
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
Tech-Forward - Achieving Business Readiness For Copilot in Microsoft 365
 
Unlocking the Potential of the Cloud for IBM Power Systems
Unlocking the Potential of the Cloud for IBM Power SystemsUnlocking the Potential of the Cloud for IBM Power Systems
Unlocking the Potential of the Cloud for IBM Power Systems
 
The Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptxThe Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptx
 
Kotlin Multiplatform & Compose Multiplatform - Starter kit for pragmatics
Kotlin Multiplatform & Compose Multiplatform - Starter kit for pragmaticsKotlin Multiplatform & Compose Multiplatform - Starter kit for pragmatics
Kotlin Multiplatform & Compose Multiplatform - Starter kit for pragmatics
 
Maximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptxMaximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptx
 
Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...Swan(sea) Song – personal research during my six years at Swansea ... and bey...
Swan(sea) Song – personal research during my six years at Swansea ... and bey...
 
Unleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding ClubUnleash Your Potential - Namagunga Girls Coding Club
Unleash Your Potential - Namagunga Girls Coding Club
 
E-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptx
E-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptxE-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptx
E-Vehicle_Hacking_by_Parul Sharma_null_owasp.pptx
 
Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?Are Multi-Cloud and Serverless Good or Bad?
Are Multi-Cloud and Serverless Good or Bad?
 
08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men08448380779 Call Girls In Friends Colony Women Seeking Men
08448380779 Call Girls In Friends Colony Women Seeking Men
 
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
Automating Business Process via MuleSoft Composer | Bangalore MuleSoft Meetup...
 
Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024Advanced Test Driven-Development @ php[tek] 2024
Advanced Test Driven-Development @ php[tek] 2024
 
New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024
New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024
New from BookNet Canada for 2024: BNC BiblioShare - Tech Forum 2024
 

B010341317

  • 1. IOSR Journal of Electrical and Electronics Engineering (IOSR-JEEE) e-ISSN: 2278-1676,p-ISSN: 2320-3331, Volume 10, Issue 3 Ver. IV (May – Jun. 2015), PP 13-17 www.iosrjournals.org DOI: 10.9790/1676-10341317 www.iosrjournals.org 13 | Page Optimal PID control of a brushless DC motor using PSOtechnique R.R.Navatakke1 , Jagadeesh.Bichagatti.2 1,2. (P.G.Department, M.B.E.S.C.O.E Ambajogai./ Dr.B.A.M.University, INDIA ) Abstract:This paper proposes PID controller tuning for time delayed process(BLDC Motor) using particle swarm optimization. The Proportional Integral Derivative (PID) structure is mainly used to achieve the desired output in case of closed loop control systems in most of the industry applications. In PID controller it is difficult to obtain the proper values of the controlling parameters Kp, Ki and Kd. The paper describes the design of dynamic control system model with PID controller and the values of the controlling parameters Kp, Ki and Kd are computed by using stochastic global search method i.e. Particle Swarm Optimization (PSO) speed control of a brushless DC motor (BLDC). It is an efficient and fast tuning scheme compare to other conventional techniques. The (BLDC) motor is modeled in simulink in Matlab. The proposed technique was more efficient in improving the step response characteristicsas well as reducing the steady-state error, rise time, settling time and maximum overshoot. Keywords: Partical Swarm Optimisation(PSO), Partical Swarm Intelligence, PID Controller I. Introduction The brushless DC motor (BLDC motor) where the permanent magnet provides the necessary air gap flux instead of the wire-wound field poles. There are many modern control methodologies such as nonlinear control, optimal control, variable structure control and adaptive control have been widely proposed for speed control of brushless permanent magnet DC motor.However, these approaches are either complex and difficult to implement. PID controller with itsthree terms functionality covering treatment for transientand steady-state response offers the simplest and gets mostefficient solution to many real world control problems. PID (Proportional Integral Derivative) control is one of the earlier control strategies which are used for controlling any plant transfer function. Now to get better efficiency, the actual output should be matched with the set output. Hence some control action should be carried out. Since many control systems using PID controller gives satisfactory result and it helps to tune the control parameters to the optimum values, it is used in industrial control. Now there are various methods to obtain optimum values of the parameters of PID controller for the purpose of tuning. Optimally tuning gains of PIDcontrollers are quite difficult. Recently, the computationalintelligence has proposed Particle Swarm Optimization (PSO) technique for the same purpose.Anew tuning approach “Particle swarm optimization” has been introduced in this paper for tuning of PID controller. PSO was first introduced by Dr. J. Kennedy and R. C. Eberhart in 1995 [X]. Particle swarm optimization is population based technique which is inspired by the social behaviour of biological organism. It is an efficient and fast tuning scheme for solving nonlinear large scale optimization problems. II. Brushless dc motor BLDC motor drives, system in which permanent magnet synchronous motor is fed with variable frequency inverter controlled by shaft position sensor. there appears a lack of commercial simulation packages for design of controllers for such BLDC motor drives. Fig 1.Three-phase full-bridge power circuit for BLDC motor drive. The BLDC motor is a DC motor turned inside out, so that field is on the rotor and armature is on stator. The brushes DC motor is actually a permanent magnet AC motor whose torque current characteristic mimic the dc motor. Instead of commutating the armature current using brushes, electronic commutation is used. This eliminates the problems associated with the brush and commutatorarrangments. This kind of motor not only has the advantages of DC motor such as better velocity capability and no mechanical commutator but also has the advantages of AC motor such as simple structure, higher reliability and freemaintenance. In addition, brushless DC motor has the following advantages: smaller volume, high torque, and simple system structure. So it is widely applied in areas which needs high performance drive. In this paper a three-phase and two-pole BLDC motor is studied.The characteristic equations of BLDC motor are described by equations (1) (4). Vapp(t) =L 𝑑𝑖(𝑡) 𝑑𝑡 + Ri(t) + Vemf(1) Vemf = 𝐾𝑏 × 𝜔(𝑡)(2)
  • 2. Optimal PID control of a brushless DC motor using PSO technique DOI: 10.9790/1676-10341317 www.iosrjournals.org 14 | Page 𝑇 𝑡 = 𝐾t × i(t) (3) T(t) =J 𝑑𝜔 (𝑡) 𝑑𝑡 + D.ω(t) (4) Where,Vapp(t) is the applied voltage, ω(t)is the motor speed, L is the inductance of the stator, i(t) is the current of the circuit, R is resistance of the stator, Vemf is the back electromotive force, T is the torque of motor, D is the viscous coefficient, J is the moment of inertia, kt is the motor torque constant, kb is the back electromotive force constant, and Fig.1shows the equivalent circuit of three-phase full-bridge power circuit for (BLDC) motor drive. III. PID Controller In Control Engineering, any model is represented by transfer function for single input and single output and linear time invariant dynamical system. The popularity of PID controllers in industry has increased due to their applicability, functional simplicity and reliability in performance. Transfer function of PID controller is shown in Fig.3(a). . Fig.3(a). Transfer function of PID controller Where, E(s) is error input signal, M(s) is manipulated output signal. Kp is propotional gain, Ki is integral gain and kd is derivative gain. Fig.3(b). Block diagram of PID controller The optimization methods are introduced for the purpose of tuning the parameters to search for the best solution by minimizing the objective function. To obtain the objective the associated characteristics like rise time, maximum overshoot, settling time, are measured. A set of performance indicators may be used as a design tool to evaluate tuning method. The parameters Kp, Ki and Kd are chosen to meet prescribed performance criteria, classically specified in terms of rise and settling times, overshoot, and steady-state error. In this paper PSO technique used to find the optimal values of parameters Kp, Ki and Kd of (PID) controller for BLDC motor speed control system. IV. Overview of Partical swarm optimisation PSO is an easy & smart artificial techniques and a evolutionary computation technique which is developed by Kennedy &Eberhart [13] .it is used to explore the search space of a given problem to find the settings or parameters required to optimize a particular objective. It is based on following two concepts: (i) The idea of swarm intelligence based on the observation of swarming habits by certain kinds of animals (such as birds and fish), (ii) The field of evolutionary computation .The assumption is basic of PSO. In the proposed PSO method each particle contains three members kp, ki and kd. It means that the search space has three dimensions and particles must fly in a three dimensional space. PSO is basically developed through simulation of bird flocking in three-dimensional space. The positive of each agent is represented by xyz axes position and also the velocity is expressed by vx (the velocity of x-axis, vy (the velocity of y-axis) and vz (the velocity of z-axis). Modification of the agent position is realized by the position and velocity For n- variables optimization problem a flock of particles are put into the n-dimensional search space with randomly chosen velocities and positions knowing their best values, so far ( ) and the position in the n-dimensional space. The velocity of each particle, adjusted accordingly to its own experience and the other particles flying experience. For example, the 𝑖𝑡h particle is represented as 𝑋𝑖=(𝑥𝑖1,𝑥𝑖2,𝑥𝑖3……………..𝑥𝑖𝑑 ) in the d-dimensional space, the best previous positions of the 𝑖𝑡�particle is represented as: 𝑃𝑏𝑒𝑠𝑡 = (𝑃𝑏𝑒𝑠𝑡𝑖,1,𝑃𝑏𝑒𝑠𝑡𝑖,2,𝑃𝑏𝑒𝑠𝑡𝑖,3………………𝑃𝑏𝑒𝑠𝑡𝑖,𝑑 ) The index of the best particle among the group is Gbest. Velocity of the 𝑖𝑡h particle is represented as: 𝑉𝑖 = (𝑉𝑖,1,𝑉𝑖,2𝑉𝑖,3………….𝑉𝑖,𝑑 ) This modification can be represented by the concept of velocity. Velocity of each agent can be modified by the following equation:
  • 3. Optimal PID control of a brushless DC motor using PSO technique DOI: 10.9790/1676-10341317 www.iosrjournals.org 15 | Page Vk+1 i = W × Vk i + C1rand1 × (Pbesti - Xk i) + C2rand2 ×(Gbesti - Xk i) (5) Where, Vk i - Velocity of agent i at iteration k W - Weighting function Cj - Correction factor rand - random no. between 0 and 1 Pbest - particle best position of agent i Gbest -global particle best position of the group Xk i -Current position of agent i at iteration k The following weighting function is usually utilized in: (6) Where, Wmax - Final weight Wmin - Initial weight iter - Current iteration number itermax - Maximum iteration number The current position (searching point in the solution space) can be modified by the following equation: Sk+1 i =Si k + Vi k+1 (7) V. Implementation Of Pso-Pid Controller 5.1 Fitness Function In This paper a time domain criterion is used for evaluating the PID Controller .A set of good control parameters P,I and D Can yield a good step response that will result in performance criteria minimization in the time domain .These performance criteria in the time domain include the overshoot, rise time, Settling time, and steady state error[4]. Therefore, the performance criterion is defined as follows: W (K) = (1- 𝑒−𝛽).(𝑀𝑝 + 𝐸𝑠𝑠) + 𝑒−𝛽.(𝑡𝑠 - 𝑡𝑟) (8) where K is [P,I,D]and β is weightening factor. The performance criterion W (K) can satisfy the designer requirement using the weightening factor β value. β can set to be larger than 0.5 to reduce the overshoot and steady state error, also can set smaller 0.5 to reduce the rise time and settling time. The optimum selection of β depends on the designer requirement and the characteristics of the plant under control. In BLDC motor speed control system the lower β would lead to moreoptimum responses. In this paper, due to trial, β is set to be 0.5 to optimum the step response of speed control system. The fitness function is reciprocal of the performance criterion, F = 1 𝜔 𝑘 (9) 5.2. Proposed PID controller In this paper a PSO-PID controller is used to find the optimal values of BLDC speed control system. Fig.5.2(a) shows the block diagram of optimal PID control for the BLDC motor. In the proposed PSO method each particle contains three members P, I and D. It means that the search space has three dimension and particles must fly in a three dimensional space. Fig.5.2(a). Block Diagram Optimal PID Control Flow chart of PSO PID Controller is shown in Fig.5.2(b)
  • 4. Optimal PID control of a brushless DC motor using PSO technique DOI: 10.9790/1676-10341317 www.iosrjournals.org 16 | Page Fig.5.2(b)Flowchart of PID controller VI. Simulation Results In this section, a comparison between the proposed and the conventional PID tuning is done. Fig.6(a) shows the error signal for PI,PID controller and PID-PSO approach. Fig.6(b) shows the system output for PI,PID controller and PID- PSO approach. Fig.6(c) shows the control signal for PI,PID controller and PID-PSO approach.Kp_PID=11.327; Ti_PID=0.0082; Td_PID=0.00205; Kp_PSO=6.6397; Ki_PSO=1; Kd_PSO=0.0028; Fig6(a). Characteristic of error signal Fig6(b).Characteristic of system output
  • 5. Optimal PID control of a brushless DC motor using PSO technique DOI: 10.9790/1676-10341317 www.iosrjournals.org 17 | Page Fig6(c).Characteristic of Control signal Table 1.PSO(PID) Controller PSO(PID) Controller Peak time tp Rise time tr Settling time ts Max. OvershootMp% Steady state error ess With 0.0035 0.0034 0.0035 0 0.01 Without 0.0065 0.0055 0.0066 0 0.066 VII. Conclusion This paper presents the application of evolutionary algorithms used as optimization methods for the purpose of parameter estimation of a PID controller rather thanusing classical method of tuning the parameters. The obtained results through the simulation of BLDC motor shows that the proposed controller can perform an efficient search for optimal PID controller and can improve the dynamic performance of the system in a better way. References [1]. C.L.Lin, H.Y.Jan, Evolutionarily multiobjective PID control for linear brushless DC motor, in: Proc. Of IEEE Int. Conf Industrial Elect. Society(3) Nov. 2002, pp. 2033-2038. [2]. Huang Han, Qin Hu, HaoZhifeng, Lim Andrew. Example-based learning particle swarm optimization for continuous optimization. Inform Sci 2012;182(1):125– 38. [3]. Pooja Sharma et al Int. Journal of Engineering Research and Application,Tuning of PID Controller for A Linear Brushless DC Motor using Swarm Intelligence Technique Vol. 4, Issue 5( Version 7), May 2014, pp.125-128 [4]. M.P.Prasanna Kumar, P. Devendra, R. SrinivasaRao, IndranilSaaki, Optimal Tuning of PID Controller for a Linear Brushless DC Motor using Particle Swarm Optimization Technique International Journal of Engineering Research and Applications (IJERA) Vol. 2, Issue 4, July-August 2012, pp.1416-1420. [5]. Namami Krishna Sharmal, D.Suresh Babu2, and Dr.S.c. Choube3 Application of Particle Swarm OptimizationTechnique for Reactive Power Optimization IEEE- International Conference On Advances In Engineering, Science And Management (ICAESM -2012) March 30, 31, 2012 [6]. Qinghai Bai, Analysis of Particle Swarm Optimization Algorithm,computer and imformationscience,vol 3, no. 1,feb 2010. [7]. Ang, K.H. and Chong, G.C.Y. and Li, Y. (2005) PID control system analysis, design, and technology. IEEE Transactions on Control SystemsTechnology 13(4):pp. 559-576. [8]. G.Prasad, N.SreeRamya, P.V.N.Prasad, G.Tulasi Ram Das, Modelling and Simulation Analysis of the Brushless DC Motor by using MATLAB, International Journal of Innovative Technology and Exploring Engineering (IJITEE) ISSN: 2278-3075, Volume-1, Issue-5, October 2012 [9]. G Prasad, Venkateswara Reddy M, Dr. P V N Prasad, Dr. G Tulasi Ram Das, Speed control of Brushless DC motor with DSP controller using Matlab International Journal of Engineering Research and Applications (IJERA),Vol. 2, Issue 3, May-Jun 2012, pp.2120-2125 [10]. Manjeet Singh, DiveshThareja, A Thermal Economic Dispatch Problem Solving, By Particle Swarm Optimization,IPASJ International Journal of Electrical Engineering (IIJEE),Volume 1, Issue 6, December 2013