SlideShare a Scribd company logo
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072
© 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2119
PSO BASED PID CONTROLLER FOR BIDIRECTIONAL INDUCTIVE POWER
TRANSFER SYSTEM
B.Balaki1, Dr.K.Yasoda2
1ME-Power Systems Engineering, Department of Electrical and Electronics Engineering, Government College of
Technology, Coimbatore, Tamil nadu, India
2Assistant Professor, Department of Electrical and Electronics Engineering, Government College of Technology,
Coimbatore, Tamil nadu, India
---------------------------------------------------------------------***---------------------------------------------------------------------
Abstract - This paper presents the optimal proportional-
integral-derivative (PID) controller for a Bidirectional
inductive power transfer (IPT) system using multiobjective
Particle Swarm Optimization (PSO). Theobjectiveofthepaper
is to analyze the power flow in Bidirectional inductive power
transfer systems and to design and implement the optimal
parameters of PID controller. The optimal PID control
parameters are applied for a composition control system. The
performance of PSO- tuned controller is dependent on nature
of the objective function and with the determination of
parameters of PID controller basedPSOisobserved. Simulated
performance analysis of the proposed PSO-based PID
controller is compared with other well-known tuning method
to investigate the optimal response and the best balance
between performance and robustness. Finally, design
parameters for bidirectional IPT system, implemented with a
PSO-based PID controller, which uses a multiobjective fitness
function, are presented to demonstrate the validity,
performance and effectiveness of the optimum controller
design.
Key Words: Proportional-integral-derivative (PID),
Inductive power transfer system (IPT), Particle swarm
optimization (PSO), genetic algorithm (GA)
1. INTRODUCTION
PID control is the most ancient and the strongest control
method in process industries. With the advancement in
technology control systems are becoming more and more
complex day by day. Conventional PID control is not able to
solve such complex problems. In recent years many
intelligent controllers have been introduced such as fuzzy
PID controller, neural network and so on. Theintelligent PID
controllers having the properties such as self-adaptability,
self-learning ability and self-organization are able tocontrol
complex systems. PID controller is widely used in industrial
control systems. PID controller calculates the error between
set point value and measured response. The objective of PID
controller is to minimize the generating error. PIDcontroller
calculation involvesthreetermsproportional, derivativeand
integral. The purpose of proportional term is to determine
the reaction of current error, integrating term determines
the reaction of sum of current error and derivative term
determines the rate of error generating. The objectiveofPID
controller tuning is to design such a controller which meet
the desired closed loop performance. A PID controller
improves the transient response of the system by reducing
the overshoot in the step response, and by reducing the
settling and rise time. Standard methods of PID tuning
involve Ziegler Nichols, Corecon’s,AstromandHagglund and
many other techniques. This paper presents soft computing
technique for designing an intelligent PID controller.
2. PARTICLE SWARM OPTIMIZATION
Particle swarm optimization has been used here for the
tuning of PID controller. PSO isa populationbasedstochastic
optimization algorithm which is first proposed by Eberhart
and Kennedy in 1995.This technique is derived from
research on biological organism such as bird flocking and
fish schooling. Craig Reynolds (1987) showed that flock is
simply the result of the interaction between thebehaviorsof
individual birds. To simulate a flock we simulate the
behavior of an individual bird. He concluded that to build a
simulated bird flock model followingthreesimple rulesmust
be followed: Velocity Matching, centering of bird flock and
avoid collisions. Work of Kennedy and Eberhart was
influenced by Heppner and Germander’s (1990) work on
simulated behavior of bird.
2.1 PSO Flowchart Steps
In PSO a number of particles are placed in the search
space of some problem. Each particleintheswarmevaluates
the objective function at its current location. Each particle
then move through the search space accordingtothehistory
of its own current and best location of neighborhood in the
swarm on each iteration. The next iteration takes place after
all particles have been moved. In PSO swarm moves like a
bird flock searching for food. Each individual intheswarm is
composed of three d-dimensional vectors, where d is the
dimension of the search space. Three vectors arethecurrent
position xi, the previous best position pi, and the velocity vi.
The PSO algorithm based on the concept that individual
member refine their knowledge about the search space by
social interaction. In PSO each member is called particle and
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072
© 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2120
population is called swarm. The term ‘swarm’ means
irregular movement of particles. Particle swarm
optimization is a member of swarm intelligence familyit has
some advantages over other intelligent optimization
techniques: 1) It is simple to implement 2) There are fewer
parameters to adjust. 3) It has more effective memory
capability 4) It uses a relatively small population 5) It is fast
6) PSO is more effective in maintaining diversity of swarm
and lead to fast convergence These advantages have given it
popularity to solve nonlinear optimization problems in the
field of evolutionary computation. PSO have been
successfully applied in many areas of system design, system
modeling, system identification, signal processing, pattern
recognition, robotic applications. The algorithm of PSO
include following steps: 1.Initialize the swarm by assigning
random position and velocity to each particle. 2. Evaluate
fitness function for each particle. 3. Compare the current
fitness value with the pbest value of the particleinhistory. 4.
If current fitness value is better than the previous best value
(pbest), then set this value as current pbest. 5. Now best
evaluated value of pbest is set as gbest value. 6. Update the
velocity and position of the particles according to the
equation 5 and 6. 7. Repeat the steps 2 to 6 until sufficiently
good stopping criterion is met such as maximum number of
iterations or best fitness value.
Particle Swarm Optimization (PSO), an evolutionary
algorithm for optimization is extended to determine if
natural selection, or survival-of-the fittest, can enhance the
ability of the PSO algorithm to escape from local optima. To
simulate selection, many simultaneous, parallel PSO
algorithms, each one a swarm, operate on a test problem.
Simple rules are developed to implement selection. The
ability of this so-called DarwinianPSOtoescapelocal optima
is evaluated by comparing a singleswarmanda similarset of
swarms, differing primarily in the absence of the selection
mechanism, operating on the same test problem. The
selection process is shown to be capable of evolving the best
type of particle velocity control, which is a problem specific
design choice of the PSO algorithm
A particular algorithm may work well on one problem
but may fail on another problem. If an algorithm could be
designed to adapt to the fitness function, adjusting itself to
the fitness landscape, a more robust algorithm with wider
applicability, without a need for problem specific
engineering would result. Strategies for avoiding local
optima include stretching of Parsopoulos and other
convexification strategies. Nature points to a way that may
help circumvent local optima. We propose a strategy based
on natural selection in which, when a search tends to a local
optimum, the search in that area is simply discarded and
another area is searched instead. This is the type of search
designed and analyzed in this paper.
A swarm consists of several particles.Eachparticlekeeps
track of its own attributes. The most important attribute is
their current positions which are represented by n-
dimensional vectors. The position of the particles
corresponds to potential solutionsofthecostfunctionwhich
is to be minimized. Another attribute of the particle is
current velocity which keeps track of the current speed and
direction of travel by the particles. Each particle has a
current fitness value which is obtained by evaluating the
error function of the particles current position. Eachparticle
has to remember its own personal bestpositionsothatit can
be used to guide the construction of new solutions. The best
overall positions among all particles are recorded. This
position is used for termination of the algorithm.
Fig -1: Flowchart of PSO algorithm in bidirectional IPT
system
2.2 PID using PSO Algorithm
Objective of tuning method is to find a set of controller
parameters which gives better results. The objective of PID
controller is to adjust parameters like that system perform
better in the wide range of operating conditions.
Start
For each particle’s position (p), evaluate fitness
Initialize particles with
random position and
velocity vectors
If fitness (p) is better
than fitness (pBest)
then set pBest=p
Iterate
until all
Particle
Exhaust
Iterate
until all
Particle
Exhaust
Set best of pbest as
gbest
Update particles
velocity and position
Stop
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072
© 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2121
Fig -2: Block diagram for PSO Based PID tuned controller
2.3 PID controller design
To design PID controller with PSO some parameters and
fitness function are required. Particle swarm optimization
algorithm is population based techniquesofirstofall haveto
produce initial swarm of particles in search space
represented by a matrix of dimension swarm size. Swarm
size is the number of particles. Maximum number of
iterations has been used here. However more number of
iterations produce better results but for study and
comparison between different performance indices
iterations have been used in this paper.
ZN method may cause high overshoots, largeoscillations,
and longer settling times for higher order systems. The
bidirectional IPT system, being a higher order resonant
network falls into this category and the task of tuning PID
gains for this system is, therefore, a major challenge. One of
the most efficient methodsof tuningPIDparametersforsuch
systems is through direct optimization, whichoftenrequires
a solution to a non-convex problem. Various other methods
such as refined ZN and pole placement have also been
proposed to obtain the optimum PID parameters. PSO must
have a fitness evaluation function to decide the better and
best positions, the function can take the particle’s position
and assigns it a fitness value. Then the objective is to
optimize the fitness function. In general, the fitness function
is pre-defined and is depend on the problem.Fig.5showsthe
simulation output for the PID controller. It istheresultofthe
controller during tuning for the IPT systems.
3. BIDIRECTIONAL IPT SYSTEM
Fig. 3 shows a typical bidirectional IPTsystem,consisting
of a primary and a secondary side. The secondary circuit,
which receives power from the primary through an air gap,
is typically referred to as the pickup. The primary and the
pickup use identical electronic circuitry, comprising a
converter, an inductor–capacitor–inductor (LCL) resonant
network with a series capacitor and a dedicated controller.
The controllers are independent of each other and operate
the converters on both sides to regulate the power flow
across the air gap. The primary controller operates the
primary-side converter, which is connected to the LCL
resonate network to produce a constant sinusoidal current
at a desired frequency f0 intheprimarywinding,represented
by the coil Lpt . This primary winding is commonly referred
to as the primary track or the primary pad in IPT
applications. The LCL circuits on both sidesofthesystem are
tuned to the frequency of track current ipt generated by the
converter on the primary side. In a bidirectional IPT system,
the magnitude and/or phase angle of the voltage vector
produced by the pickup converter can be controlled with
respect to the voltage vector produced by the primary
converter to regulate the magnitude and direction of power
flow, as described later.
Assume that the primary-side converter of the
bidirectional IPT system, shown in Fig. 3, produces a
reference sinusoidal voltage Vpi∠0atanangularfrequencyω,
and the track current ipt is held constant by the primary-side
controller. Since the inductor Lpt is magnetically coupled to
the secondary or the pickup coil Lst , a voltage is induced
across Lst due to ipt. The induced voltage Vsr in the pickup coil
can be given by,
Vsr= j*ω*M*ipt (1)
where M represents the mutual inductance between the
windings Lpt and Lst and can be given by,
M = k*Lpt*Lst (2)
where k is the coupling coefficient of the system, which
typically is in the range of 0.1–0.3. As such, the coupling
between the primary and secondary of an IPT system is
significantly less than that of a traditional transformer or an
induction motor, which have coupling coefficients greater
than 0.95.
M = k*√Lpt*Lst (3)
The pickup may be operated as a source or a sink by the
controller and, despite the mode of operation,thevoltage Vpr
reflected onto the track can be expressed by,
Vpr = j*ω*M*ist (4)
Fig -3: Equivalent circuit representation of a bidirectional
IPT system
Under these conditions, it can be shown that thecurrents
ipi and ipt of the primary are given by,
ipi = j Vpr (5)
ωLpt
Initialize
parameters
PSO
Algorithm
Design PID
controller
Design
Bidirectional PID
Controller
Analyze
Performance
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072
© 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2122
ipt = −j Vpi (6)
ωLpt
Similarly, the input and output currents of the pickup
circuit can be given by,
isi = j Vsr (7)
ωLst
ist = −j Vsi (8)
ωLst
Solving for isi using,
ipi = j MVpr (9)
ωLpt
If the equivalent ac voltage of the input voltage to the
pickup side converter is given by Vsi ∠ − θ, then the power
input Psi of the pickup is given by
Psi = Re : { Vsi (isi)* } (10)
Substituting (6) into (8)
Psi = M | Vsi | | Vpi | sin (θ) (11)
Lst ωLpt
It is evident from (11) that maximum power transfer
takes place when the phase difference θ between the
primary and pickup voltage vectors is ±90◦. A leading phase
angle constitutes power transfer from the pickup to the
primary, while a lagging phase angle enables powertransfer
from the primary to the pickup. As evidentfrom (11),forany
given Vpi and Vsi, the amount and direction of power flow
between the primary and the pickup can be regulated by
controlling both the magnitude and relative phase angle of
the voltage vectors generated by the converters.
4. BIDIRECTIONAL IPT PICKUP-SIDECONTROLLER
Decentralized controllercan beusedtocontrol thepower
flow in a bidirectional IPT system. Therefore,thispaperonly
presents the design and optimization of the pickup-side
controller and the primary side of thesystemisoperated ata
fixed phase angle using an open-loop controller. The pickup
controller regulates the output power by measuring the
power flowing into the load andcontrollingthemagnitude of
the voltage Vsi applied to the pickup’s resonant network
accordingly. A simplified diagram depicting how the
magnitude of the voltage vsi is controlled is shown in Fig 4.
The voltage Vpi applied to the input of the primary resonant
network is shown in the top plot. The second and third
waveforms show the switching signals applied to the
switches in the left-hand leg of the full bridge, whereas the
fourth and fifth waveforms show the control signals applied
to the right-hand leg. As evident from Fig.4, switches in each
leg are driven with complementary waveforms with a phase
delay/advance of αs / 2 with respect to Vpi . The final plot
shows the resultant voltage applied to the input of the
pickup-side resonant network. As can be seen from Fig.3, by
increasing the phase angle αs, the magnitude of the voltage
Vsi can be increased, thus increasing the power flow while
keeping the phase shift θ between the primary and pickup
constant at 90◦.
Fig -4: Switching waveforms for pickup-side controller
The root-mean-square (RMS) value of the fundamental
voltage component produced by thepickupconvertercanbe
expressed as a function of the control variable αs through,
Vsi = Vsin* 4 *sin (αs ) (12)
√2π
where Vsin is the dc voltage of the active load supplied by
the pickup-side converter. Combining (12) with (10), the
input power of the pickup can be given by
Psi =8*M*Vpin*Vsin*sin (αp) *sin (αs)* sin (θ) (13)
ωπ2 * Lpt *Lst
where αp is the phase delay applied to the primary-side
converter to control ipt and Vpin is the dc voltage applied to
the primary side converter. Both αp and αs are time discrete
variables with a sampling period tsamp equal to twice the
converters switching frequency ω.
5. SIMULATION RESULTS
The response of the bidirectional IPT system when
following a step change in reference output power was
investigated using MATLAB Simulink-based software
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072
© 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2123
package. At 0 ms, a step change in the reference power level
was introduced, where the power level was changed from 0
to −1 kW, which corresponds to power flowing in the
forward direction from the primary to pickup. Under such
conditions, the step response of the power flowing into the
pickup-side converter.
The response of a bidirectional IPT system to a step
change in the power reference is somewhat different when
the power flow is reversed. As such, it is essential to verify
that the controller gains derived in the preceding section
results in a stable and fast response when the power is
flowing in the reverse direction (from the pickup to the
primary). Similarly, to the response shown by the system
when power was flowing in the forward direction,
oscillations can be observed in the powerwhenthepickup is
controlled derived using the ZN tuning method. However,
the magnitudes of oscillations in the step responses are
much smaller in comparison to the response yielded when
the IPT system was transmitting powerinforwarddirection.
Fig -5: PID controller tuned output for the bidirectional
IPT system
5.1 PID controller design
The objective function for PSO algorithm is calculated as
power in terms of error. The fitness function plot as in Fig. 6
represents the fitness function of power transferred in
bidirectional IPT system. It is calculated by the no. of
populations and iterations in the algorithm.
The objective function of the bidirectional IPT system
using PSO algorithm is calculated by the following,
Y= KP e (t) + KI ʃ e (t) dt +KD d/dt e (t)
Y is the output from the PID controller for tuning the
bidirectional IPT system. KP is the proportional error
constant, KD is the derivative error constant and KI is the
integral error constant.
C(S) = U(S) / E(S) = KP + KI /S + KDS
C(S) represents the transfer function of the IPT system
with tuned PID controller. U(S) represents the output and
E(S) represents the input for the general transfer functionof
the system.
Kp = 0.5; Ki = 0.05; Kd = 3 are the designed error values
obtained for the PID controller to tune the bidirectional IPT
systems.These are the error constants which acts as the
objective functions for the system to perform analysisinthis
paper.
Fig 6 represents the fitness function plot forthedesigned
PID control parameters of the PSO algorithm.PSOiteratively
less compared to other algorithm techniques and so in this
graph the obtained fitness is effective with less number of
iterations and populations of the system.
Fig -6: Fitness function of PSO algorithm
5.2 MATLAB coding results
Data= [-8.9454150197628479 0.10119999999999998
- 0.006333881644934803];
Minimized Data= [-0.006333881644934803 -
8.9454150197628479];
Psi = 1.537254777568402;
T = 360; Tdc = 0.624;
Tf = 1000; Ti = 0.10119999999999998;
er = -0.059569137078034018;
er1= 2.0365063896576885E-5;
er2 = 5.8387519707991942E-5;
ist = 31432.467291003421;
Vpi = 439.86028856145924;
Vsi = 439.86028856145924;
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072
© 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2124
w = 0.12725695259515554;
Here, T represents the phase shifts and integral time
period of oscillation of the PID controller. Tdc represents the
derivative time of the controller. k is the coupling co-
efficient. Ti is the initial time period and Tf is the final time
period for the controller in the bidirectional IPT systems.
The errors are represented as er, er1, er2. Ist is the
interference calculated for the bidirectional IPT system. Psi
is the simulated power transferred to the system. Vpi is the
induced voltage in the primary where as Vsi is the induced
voltage in the pickup side (secondary) controller and w is
the switching angular frequency.
5.3 Comparison on analysis between GA and PSO
The proposed PSO algorithm is compared with earlier
popular techniques such as genetic algorithm (GA). In Fig 7
show the fitness function comparison between GA and PSO.
PSO is comparatively effective as it requires minimum
iteration than GA to obtain the fitness of the system.
Fig -7: Fitness function of GA and PSO algorithm
Table 1 shows the effective parameter comparison
between GA and PSO algorithms. With infer to the table,PSO
is more effective than GSO in all terms of parameters
analysis of the system. Fig 8 & 9 shows the bidirectional
power transfer of the IPT systems. It represents the forward
and reverse direction of the PSO based PID controller of the
bidirectional IPT system. Fig 10 & 11 shows the interference
or disturbances that are take in consideration in the IPT
system. The trapezoidal form of plot represents the
interference in forward direction whereas triangle form
represents the interference in reverse direction.
Table -1: Comparison between GA and PSO
Parameters
Comparative Analysis
GA based
PID
controller
PSO based PID
controller
Parameters
Comparative Analysis
GA based
PID
controller
PSO based PID
controller
Fitness function
value
0.089 0.077
Population 100 100
Rise Time (ms) 0.40 0.31
Settling Time (ms) 0.61 0.20
Peak overshoot
(%)
1.22 1.55
Simulated Power
(kw)
1.0 1.537
Fig -8: Power transfer in forward direction
Fig -9: Power transfer in reverse direction
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072
© 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2125
Fig -10: Interference in forward direction
Fig -11: Interference in reverse direction
6. CONCLUSION
Bidirectional IPT systems are essentially higher order
systems and therefore conventional approachesofdesigning
PID controllers, especially those based on ZN and various
model reduction techniques do not yield satisfactory
performance. Therefore, a systematic approach based on
PSO has been proposed to tune the PID parameters. The
parameters of PID controller along with interference have
been analyzed and simulated using PSO. Simulated
performance results of GA and PSO based PID controller has
been compared to show the effectiveness with less iterative
time. The results of simulation convincingly illustrate that
PSO-based PID controller, which used effective objective
functions, offers the best balance between performance and
robustness.
REFERENCES
[1] Michael J. Neath, Akshya K. Swain, Udaya K.
Madawala,and Duleepa J. Thrimawithana (2015), “An
Optimal PID Controller for a Bidirectional Inductive
Power Transfer System Using Multiobjective Genetic
Algorithm”, IEEETransactionsonPowerElectronics,vol.
29, no. 3
[2] Yusoff, T.A.F.K., Atan, M.F., Rahman, N.A., Salleh,S.F.,and
Wahab, N.A. (2015), “Optimization of PID tuning using
genetic algorithm”, Journal of Applied Science&Process
Engineering.
[3] C. Y. Huang, J. T. Boys, and G. A. Covic (2013), “LCL
pickup circulating current controller for inductive
power transfer systems,” IEEE Trans. Power Electron.,
vol. 28, no. 4, pp. 2081–2093.
[4] Akshya K. Swain, Member, Michael J. Neath, Udaya K.
Madawal, and Duleepa J. Thrimawithana (2012), “A
Dynamic Multivariable State-Space Model for
Bidirectional Inductive Power Transfer Systems”, IEEE
Transactions on Power Electronics, vol. 27, no. 11.
[5] M. P. Kazmierkowski and A. J. Moradewicz (2012),
“Unplugged but connected:Reviewofcontactlessenergy
transfer systems,” IEEE Ind. Electron. Mag.,vol. 6, no. 4,
pp. 47–55
[6] U. K. Madawala and D. J. Thrimawithana (2012), “New
technique for inductive power transfer using a single
controller,” IET Power Electron., vol. 5, no. 2, pp. 248–
256.
[7] U. K. Madawala and D. J. Thrimawithana (2012),
“Modular-based inductive power transfer system for
high-power applications,” IET Power Electron.,vol. 5, no.
7, pp. 1119–1126
[8] U. K.Madawala andD. J. Thrimawithana (2011),“Current
sourced bi-directional inductivepowertransfersystem,”
IET Power Electron., vol. 4, no. 4,pp. 471–480.
[9] J.Huh, S. W. Lee,W. Y. Lee, G. H. Cho, and C. T.Rim(2011),
“Narrow-width inductive power transfer system for
online electrical vehicles,” IEEE Trans.Power Electron.,
vol. 26, no. 12, pp. 3666–3679.
[10] U. K. Madawala and D. J. Thrimawithana (2011), “A
bidirectional inductivepower interface for electric
vehicles in V2G systems,” IEEE Trans. Ind.Electron., vol.
58, no. 10, pp. 4789–4796.

More Related Content

What's hot

PSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOT
PSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOTPSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOT
PSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOT
JaresJournal
 
A Heuristic Approach for optimization of Non Linear process using Firefly Alg...
A Heuristic Approach for optimization of Non Linear process using Firefly Alg...A Heuristic Approach for optimization of Non Linear process using Firefly Alg...
A Heuristic Approach for optimization of Non Linear process using Firefly Alg...
IJERA Editor
 
Particle Swarm Optimization Application In Power System
Particle Swarm Optimization Application In Power SystemParticle Swarm Optimization Application In Power System
Particle Swarm Optimization Application In Power System
Ministry of New & Renewable Energy, Govt of India
 
R4101112115
R4101112115R4101112115
R4101112115
IJERA Editor
 
IRJET- Economic Load Dispatch using Metaheuristic Algorithms
IRJET-  	  Economic Load Dispatch using Metaheuristic AlgorithmsIRJET-  	  Economic Load Dispatch using Metaheuristic Algorithms
IRJET- Economic Load Dispatch using Metaheuristic Algorithms
IRJET Journal
 
Neural Network Based Individual Classification System
Neural Network Based Individual Classification SystemNeural Network Based Individual Classification System
Neural Network Based Individual Classification System
IRJET Journal
 
Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...
Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...
Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...
Editor IJCATR
 
Particle swarm optimization
Particle swarm optimizationParticle swarm optimization
Particle swarm optimizationHanya Mohammed
 
An Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and OperationAn Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and Operation
IDES Editor
 
Voltage Stability Improvement by Reactive Power Rescheduling Incorporating P...
Voltage Stability Improvement by Reactive Power Rescheduling  Incorporating P...Voltage Stability Improvement by Reactive Power Rescheduling  Incorporating P...
Voltage Stability Improvement by Reactive Power Rescheduling Incorporating P...
IJMER
 
Titus Lungu Honors Thesis
Titus Lungu Honors ThesisTitus Lungu Honors Thesis
Titus Lungu Honors ThesisTitus Lungu
 
L010225762
L010225762L010225762
L010225762
IOSR Journals
 
Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...
Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...
Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...
IRJET Journal
 
Fv3610681072
Fv3610681072Fv3610681072
Fv3610681072
IJERA Editor
 
Ijciet 10 01_161
Ijciet 10 01_161Ijciet 10 01_161
Ijciet 10 01_161
IAEME Publication
 
Proposing a scheduling algorithm to balance the time and cost using a genetic...
Proposing a scheduling algorithm to balance the time and cost using a genetic...Proposing a scheduling algorithm to balance the time and cost using a genetic...
Proposing a scheduling algorithm to balance the time and cost using a genetic...
Editor IJCATR
 
Modeling and implementation of a proportional derivative controller for elect...
Modeling and implementation of a proportional derivative controller for elect...Modeling and implementation of a proportional derivative controller for elect...
Modeling and implementation of a proportional derivative controller for elect...
Alexander Decker
 
Introduction to particle swarm optimization
Introduction to particle swarm optimizationIntroduction to particle swarm optimization
Introduction to particle swarm optimization
Mrinmoy Majumder
 
Function projective synchronization
Function projective synchronizationFunction projective synchronization
Function projective synchronization
ijcseit
 

What's hot (19)

PSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOT
PSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOTPSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOT
PSO APPLIED TO DESIGN OPTIMAL PD CONTROL FOR A UNICYCLE MOBILE ROBOT
 
A Heuristic Approach for optimization of Non Linear process using Firefly Alg...
A Heuristic Approach for optimization of Non Linear process using Firefly Alg...A Heuristic Approach for optimization of Non Linear process using Firefly Alg...
A Heuristic Approach for optimization of Non Linear process using Firefly Alg...
 
Particle Swarm Optimization Application In Power System
Particle Swarm Optimization Application In Power SystemParticle Swarm Optimization Application In Power System
Particle Swarm Optimization Application In Power System
 
R4101112115
R4101112115R4101112115
R4101112115
 
IRJET- Economic Load Dispatch using Metaheuristic Algorithms
IRJET-  	  Economic Load Dispatch using Metaheuristic AlgorithmsIRJET-  	  Economic Load Dispatch using Metaheuristic Algorithms
IRJET- Economic Load Dispatch using Metaheuristic Algorithms
 
Neural Network Based Individual Classification System
Neural Network Based Individual Classification SystemNeural Network Based Individual Classification System
Neural Network Based Individual Classification System
 
Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...
Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...
Presenting a new Ant Colony Optimization Algorithm (ACO) for Efficient Job Sc...
 
Particle swarm optimization
Particle swarm optimizationParticle swarm optimization
Particle swarm optimization
 
An Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and OperationAn Application of Genetic Programming for Power System Planning and Operation
An Application of Genetic Programming for Power System Planning and Operation
 
Voltage Stability Improvement by Reactive Power Rescheduling Incorporating P...
Voltage Stability Improvement by Reactive Power Rescheduling  Incorporating P...Voltage Stability Improvement by Reactive Power Rescheduling  Incorporating P...
Voltage Stability Improvement by Reactive Power Rescheduling Incorporating P...
 
Titus Lungu Honors Thesis
Titus Lungu Honors ThesisTitus Lungu Honors Thesis
Titus Lungu Honors Thesis
 
L010225762
L010225762L010225762
L010225762
 
Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...
Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...
Hybrid Gravitational Search Flower Pollination Algorithm for Combined Economi...
 
Fv3610681072
Fv3610681072Fv3610681072
Fv3610681072
 
Ijciet 10 01_161
Ijciet 10 01_161Ijciet 10 01_161
Ijciet 10 01_161
 
Proposing a scheduling algorithm to balance the time and cost using a genetic...
Proposing a scheduling algorithm to balance the time and cost using a genetic...Proposing a scheduling algorithm to balance the time and cost using a genetic...
Proposing a scheduling algorithm to balance the time and cost using a genetic...
 
Modeling and implementation of a proportional derivative controller for elect...
Modeling and implementation of a proportional derivative controller for elect...Modeling and implementation of a proportional derivative controller for elect...
Modeling and implementation of a proportional derivative controller for elect...
 
Introduction to particle swarm optimization
Introduction to particle swarm optimizationIntroduction to particle swarm optimization
Introduction to particle swarm optimization
 
Function projective synchronization
Function projective synchronizationFunction projective synchronization
Function projective synchronization
 

Similar to IRJET- PSO based PID Controller for Bidirectional Inductive Power Transfer System

Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Editor IJARCET
 
Optimization of Unit Commitment Problem using Classical Soft Computing Techni...
Optimization of Unit Commitment Problem using Classical Soft Computing Techni...Optimization of Unit Commitment Problem using Classical Soft Computing Techni...
Optimization of Unit Commitment Problem using Classical Soft Computing Techni...
IRJET Journal
 
Feature selection using modified particle swarm optimisation for face recogni...
Feature selection using modified particle swarm optimisation for face recogni...Feature selection using modified particle swarm optimisation for face recogni...
Feature selection using modified particle swarm optimisation for face recogni...
eSAT Journals
 
Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336Editor IJARCET
 
Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336Editor IJARCET
 
Optimization of automatic voltage regulator by proportional integral derivati...
Optimization of automatic voltage regulator by proportional integral derivati...Optimization of automatic voltage regulator by proportional integral derivati...
Optimization of automatic voltage regulator by proportional integral derivati...
eSAT Journals
 
IRJET- Swarm Optimization Technique for Economic Load Dispatch
IRJET- Swarm Optimization Technique for Economic Load DispatchIRJET- Swarm Optimization Technique for Economic Load Dispatch
IRJET- Swarm Optimization Technique for Economic Load Dispatch
IRJET Journal
 
Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...
Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...
Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...
IRJET Journal
 
Software Effort Estimation Using Particle Swarm Optimization with Inertia Weight
Software Effort Estimation Using Particle Swarm Optimization with Inertia WeightSoftware Effort Estimation Using Particle Swarm Optimization with Inertia Weight
Software Effort Estimation Using Particle Swarm Optimization with Inertia Weight
Waqas Tariq
 
Application of optimization algorithms for classification problem
Application of optimization algorithms for classification  problemApplication of optimization algorithms for classification  problem
Application of optimization algorithms for classification problem
IJECEIAES
 
Optimization of FLC Using PSO – FF Hybrid Algorithm Using DSTATCOM for Powe...
Optimization of FLC Using PSO  –  FF Hybrid Algorithm Using DSTATCOM for Powe...Optimization of FLC Using PSO  –  FF Hybrid Algorithm Using DSTATCOM for Powe...
Optimization of FLC Using PSO – FF Hybrid Algorithm Using DSTATCOM for Powe...
YogeshIJTSRD
 
A REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHM
A REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHMA REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHM
A REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHM
IAEME Publication
 
MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...
MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...
MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...
Nooria Sukmaningtyas
 
IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...
IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...
IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...
IRJET Journal
 
IRJET- Proposed System for Animal Recognition using Image Processing
IRJET-  	  Proposed System for Animal Recognition using Image ProcessingIRJET-  	  Proposed System for Animal Recognition using Image Processing
IRJET- Proposed System for Animal Recognition using Image Processing
IRJET Journal
 
DriP PSO- A fast and inexpensive PSO for drifting problem spaces
DriP PSO- A fast and inexpensive PSO for drifting problem spacesDriP PSO- A fast and inexpensive PSO for drifting problem spaces
DriP PSO- A fast and inexpensive PSO for drifting problem spaces
Zubin Bhuyan
 
Survey on Artificial Neural Network Learning Technique Algorithms
Survey on Artificial Neural Network Learning Technique AlgorithmsSurvey on Artificial Neural Network Learning Technique Algorithms
Survey on Artificial Neural Network Learning Technique Algorithms
IRJET Journal
 
Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...
Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...
Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...
IRJET Journal
 
Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...
Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...
Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...
IRJET Journal
 

Similar to IRJET- PSO based PID Controller for Bidirectional Inductive Power Transfer System (20)

Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138Volume 2-issue-6-2130-2138
Volume 2-issue-6-2130-2138
 
Optimization of Unit Commitment Problem using Classical Soft Computing Techni...
Optimization of Unit Commitment Problem using Classical Soft Computing Techni...Optimization of Unit Commitment Problem using Classical Soft Computing Techni...
Optimization of Unit Commitment Problem using Classical Soft Computing Techni...
 
Feature selection using modified particle swarm optimisation for face recogni...
Feature selection using modified particle swarm optimisation for face recogni...Feature selection using modified particle swarm optimisation for face recogni...
Feature selection using modified particle swarm optimisation for face recogni...
 
Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336
 
Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336Ijarcet vol-2-issue-7-2333-2336
Ijarcet vol-2-issue-7-2333-2336
 
Optimization of automatic voltage regulator by proportional integral derivati...
Optimization of automatic voltage regulator by proportional integral derivati...Optimization of automatic voltage regulator by proportional integral derivati...
Optimization of automatic voltage regulator by proportional integral derivati...
 
IRJET- Swarm Optimization Technique for Economic Load Dispatch
IRJET- Swarm Optimization Technique for Economic Load DispatchIRJET- Swarm Optimization Technique for Economic Load Dispatch
IRJET- Swarm Optimization Technique for Economic Load Dispatch
 
Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...
Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...
Model Order Reduction of an ISLANDED MICROGRID using Single Perturbation, Dir...
 
Software Effort Estimation Using Particle Swarm Optimization with Inertia Weight
Software Effort Estimation Using Particle Swarm Optimization with Inertia WeightSoftware Effort Estimation Using Particle Swarm Optimization with Inertia Weight
Software Effort Estimation Using Particle Swarm Optimization with Inertia Weight
 
Application of optimization algorithms for classification problem
Application of optimization algorithms for classification  problemApplication of optimization algorithms for classification  problem
Application of optimization algorithms for classification problem
 
Optimization of FLC Using PSO – FF Hybrid Algorithm Using DSTATCOM for Powe...
Optimization of FLC Using PSO  –  FF Hybrid Algorithm Using DSTATCOM for Powe...Optimization of FLC Using PSO  –  FF Hybrid Algorithm Using DSTATCOM for Powe...
Optimization of FLC Using PSO – FF Hybrid Algorithm Using DSTATCOM for Powe...
 
A REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHM
A REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHMA REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHM
A REVIEW OF PARTICLE SWARM OPTIMIZATION (PSO) ALGORITHM
 
MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...
MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...
MPPT for Photovoltaic System Using Multi-objective Improved Particle Swarm Op...
 
IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...
IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...
IRJET- Fuel Cost Reduction for Thermal Power Generator by using G.A, PSO, QPS...
 
40120130405025
4012013040502540120130405025
40120130405025
 
IRJET- Proposed System for Animal Recognition using Image Processing
IRJET-  	  Proposed System for Animal Recognition using Image ProcessingIRJET-  	  Proposed System for Animal Recognition using Image Processing
IRJET- Proposed System for Animal Recognition using Image Processing
 
DriP PSO- A fast and inexpensive PSO for drifting problem spaces
DriP PSO- A fast and inexpensive PSO for drifting problem spacesDriP PSO- A fast and inexpensive PSO for drifting problem spaces
DriP PSO- A fast and inexpensive PSO for drifting problem spaces
 
Survey on Artificial Neural Network Learning Technique Algorithms
Survey on Artificial Neural Network Learning Technique AlgorithmsSurvey on Artificial Neural Network Learning Technique Algorithms
Survey on Artificial Neural Network Learning Technique Algorithms
 
Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...
Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...
Hybrid Model using Unsupervised Filtering Based on Ant Colony Optimization an...
 
Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...
Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...
Artificial Intelligent and meta-heuristic Control Based DFIG model Considered...
 

More from IRJET Journal

TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
IRJET Journal
 
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURESTUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
IRJET Journal
 
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
IRJET Journal
 
Effect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil CharacteristicsEffect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil Characteristics
IRJET Journal
 
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
IRJET Journal
 
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
IRJET Journal
 
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
IRJET Journal
 
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
IRJET Journal
 
A REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADASA REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADAS
IRJET Journal
 
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
IRJET Journal
 
P.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD ProP.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD Pro
IRJET Journal
 
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
IRJET Journal
 
Survey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare SystemSurvey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare System
IRJET Journal
 
Review on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridgesReview on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridges
IRJET Journal
 
React based fullstack edtech web application
React based fullstack edtech web applicationReact based fullstack edtech web application
React based fullstack edtech web application
IRJET Journal
 
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
IRJET Journal
 
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
IRJET Journal
 
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
IRJET Journal
 
Multistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic DesignMultistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic Design
IRJET Journal
 
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
IRJET Journal
 

More from IRJET Journal (20)

TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
 
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURESTUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
 
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
 
Effect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil CharacteristicsEffect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil Characteristics
 
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
 
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
 
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
 
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
 
A REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADASA REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADAS
 
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
 
P.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD ProP.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD Pro
 
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
 
Survey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare SystemSurvey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare System
 
Review on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridgesReview on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridges
 
React based fullstack edtech web application
React based fullstack edtech web applicationReact based fullstack edtech web application
React based fullstack edtech web application
 
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
 
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
 
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
 
Multistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic DesignMultistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic Design
 
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
 

Recently uploaded

Design and Analysis of Algorithms-DP,Backtracking,Graphs,B&B
Design and Analysis of Algorithms-DP,Backtracking,Graphs,B&BDesign and Analysis of Algorithms-DP,Backtracking,Graphs,B&B
Design and Analysis of Algorithms-DP,Backtracking,Graphs,B&B
Sreedhar Chowdam
 
The role of big data in decision making.
The role of big data in decision making.The role of big data in decision making.
The role of big data in decision making.
ankuprajapati0525
 
在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样
在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样
在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样
obonagu
 
Democratizing Fuzzing at Scale by Abhishek Arya
Democratizing Fuzzing at Scale by Abhishek AryaDemocratizing Fuzzing at Scale by Abhishek Arya
Democratizing Fuzzing at Scale by Abhishek Arya
abh.arya
 
block diagram and signal flow graph representation
block diagram and signal flow graph representationblock diagram and signal flow graph representation
block diagram and signal flow graph representation
Divya Somashekar
 
CME397 Surface Engineering- Professional Elective
CME397 Surface Engineering- Professional ElectiveCME397 Surface Engineering- Professional Elective
CME397 Surface Engineering- Professional Elective
karthi keyan
 
Standard Reomte Control Interface - Neometrix
Standard Reomte Control Interface - NeometrixStandard Reomte Control Interface - Neometrix
Standard Reomte Control Interface - Neometrix
Neometrix_Engineering_Pvt_Ltd
 
Water Industry Process Automation and Control Monthly - May 2024.pdf
Water Industry Process Automation and Control Monthly - May 2024.pdfWater Industry Process Automation and Control Monthly - May 2024.pdf
Water Industry Process Automation and Control Monthly - May 2024.pdf
Water Industry Process Automation & Control
 
road safety engineering r s e unit 3.pdf
road safety engineering  r s e unit 3.pdfroad safety engineering  r s e unit 3.pdf
road safety engineering r s e unit 3.pdf
VENKATESHvenky89705
 
Forklift Classes Overview by Intella Parts
Forklift Classes Overview by Intella PartsForklift Classes Overview by Intella Parts
Forklift Classes Overview by Intella Parts
Intella Parts
 
Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...
Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...
Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...
AJAYKUMARPUND1
 
Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)
Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)
Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)
MdTanvirMahtab2
 
MCQ Soil mechanics questions (Soil shear strength).pdf
MCQ Soil mechanics questions (Soil shear strength).pdfMCQ Soil mechanics questions (Soil shear strength).pdf
MCQ Soil mechanics questions (Soil shear strength).pdf
Osamah Alsalih
 
Immunizing Image Classifiers Against Localized Adversary Attacks
Immunizing Image Classifiers Against Localized Adversary AttacksImmunizing Image Classifiers Against Localized Adversary Attacks
Immunizing Image Classifiers Against Localized Adversary Attacks
gerogepatton
 
COLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdf
COLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdfCOLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdf
COLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdf
Kamal Acharya
 
DESIGN A COTTON SEED SEPARATION MACHINE.docx
DESIGN A COTTON SEED SEPARATION MACHINE.docxDESIGN A COTTON SEED SEPARATION MACHINE.docx
DESIGN A COTTON SEED SEPARATION MACHINE.docx
FluxPrime1
 
Planning Of Procurement o different goods and services
Planning Of Procurement o different goods and servicesPlanning Of Procurement o different goods and services
Planning Of Procurement o different goods and services
JoytuBarua2
 
The Benefits and Techniques of Trenchless Pipe Repair.pdf
The Benefits and Techniques of Trenchless Pipe Repair.pdfThe Benefits and Techniques of Trenchless Pipe Repair.pdf
The Benefits and Techniques of Trenchless Pipe Repair.pdf
Pipe Restoration Solutions
 
Top 10 Oil and Gas Projects in Saudi Arabia 2024.pdf
Top 10 Oil and Gas Projects in Saudi Arabia 2024.pdfTop 10 Oil and Gas Projects in Saudi Arabia 2024.pdf
Top 10 Oil and Gas Projects in Saudi Arabia 2024.pdf
Teleport Manpower Consultant
 
Final project report on grocery store management system..pdf
Final project report on grocery store management system..pdfFinal project report on grocery store management system..pdf
Final project report on grocery store management system..pdf
Kamal Acharya
 

Recently uploaded (20)

Design and Analysis of Algorithms-DP,Backtracking,Graphs,B&B
Design and Analysis of Algorithms-DP,Backtracking,Graphs,B&BDesign and Analysis of Algorithms-DP,Backtracking,Graphs,B&B
Design and Analysis of Algorithms-DP,Backtracking,Graphs,B&B
 
The role of big data in decision making.
The role of big data in decision making.The role of big data in decision making.
The role of big data in decision making.
 
在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样
在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样
在线办理(ANU毕业证书)澳洲国立大学毕业证录取通知书一模一样
 
Democratizing Fuzzing at Scale by Abhishek Arya
Democratizing Fuzzing at Scale by Abhishek AryaDemocratizing Fuzzing at Scale by Abhishek Arya
Democratizing Fuzzing at Scale by Abhishek Arya
 
block diagram and signal flow graph representation
block diagram and signal flow graph representationblock diagram and signal flow graph representation
block diagram and signal flow graph representation
 
CME397 Surface Engineering- Professional Elective
CME397 Surface Engineering- Professional ElectiveCME397 Surface Engineering- Professional Elective
CME397 Surface Engineering- Professional Elective
 
Standard Reomte Control Interface - Neometrix
Standard Reomte Control Interface - NeometrixStandard Reomte Control Interface - Neometrix
Standard Reomte Control Interface - Neometrix
 
Water Industry Process Automation and Control Monthly - May 2024.pdf
Water Industry Process Automation and Control Monthly - May 2024.pdfWater Industry Process Automation and Control Monthly - May 2024.pdf
Water Industry Process Automation and Control Monthly - May 2024.pdf
 
road safety engineering r s e unit 3.pdf
road safety engineering  r s e unit 3.pdfroad safety engineering  r s e unit 3.pdf
road safety engineering r s e unit 3.pdf
 
Forklift Classes Overview by Intella Parts
Forklift Classes Overview by Intella PartsForklift Classes Overview by Intella Parts
Forklift Classes Overview by Intella Parts
 
Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...
Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...
Pile Foundation by Venkatesh Taduvai (Sub Geotechnical Engineering II)-conver...
 
Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)
Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)
Industrial Training at Shahjalal Fertilizer Company Limited (SFCL)
 
MCQ Soil mechanics questions (Soil shear strength).pdf
MCQ Soil mechanics questions (Soil shear strength).pdfMCQ Soil mechanics questions (Soil shear strength).pdf
MCQ Soil mechanics questions (Soil shear strength).pdf
 
Immunizing Image Classifiers Against Localized Adversary Attacks
Immunizing Image Classifiers Against Localized Adversary AttacksImmunizing Image Classifiers Against Localized Adversary Attacks
Immunizing Image Classifiers Against Localized Adversary Attacks
 
COLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdf
COLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdfCOLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdf
COLLEGE BUS MANAGEMENT SYSTEM PROJECT REPORT.pdf
 
DESIGN A COTTON SEED SEPARATION MACHINE.docx
DESIGN A COTTON SEED SEPARATION MACHINE.docxDESIGN A COTTON SEED SEPARATION MACHINE.docx
DESIGN A COTTON SEED SEPARATION MACHINE.docx
 
Planning Of Procurement o different goods and services
Planning Of Procurement o different goods and servicesPlanning Of Procurement o different goods and services
Planning Of Procurement o different goods and services
 
The Benefits and Techniques of Trenchless Pipe Repair.pdf
The Benefits and Techniques of Trenchless Pipe Repair.pdfThe Benefits and Techniques of Trenchless Pipe Repair.pdf
The Benefits and Techniques of Trenchless Pipe Repair.pdf
 
Top 10 Oil and Gas Projects in Saudi Arabia 2024.pdf
Top 10 Oil and Gas Projects in Saudi Arabia 2024.pdfTop 10 Oil and Gas Projects in Saudi Arabia 2024.pdf
Top 10 Oil and Gas Projects in Saudi Arabia 2024.pdf
 
Final project report on grocery store management system..pdf
Final project report on grocery store management system..pdfFinal project report on grocery store management system..pdf
Final project report on grocery store management system..pdf
 

IRJET- PSO based PID Controller for Bidirectional Inductive Power Transfer System

  • 1. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072 © 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2119 PSO BASED PID CONTROLLER FOR BIDIRECTIONAL INDUCTIVE POWER TRANSFER SYSTEM B.Balaki1, Dr.K.Yasoda2 1ME-Power Systems Engineering, Department of Electrical and Electronics Engineering, Government College of Technology, Coimbatore, Tamil nadu, India 2Assistant Professor, Department of Electrical and Electronics Engineering, Government College of Technology, Coimbatore, Tamil nadu, India ---------------------------------------------------------------------***--------------------------------------------------------------------- Abstract - This paper presents the optimal proportional- integral-derivative (PID) controller for a Bidirectional inductive power transfer (IPT) system using multiobjective Particle Swarm Optimization (PSO). Theobjectiveofthepaper is to analyze the power flow in Bidirectional inductive power transfer systems and to design and implement the optimal parameters of PID controller. The optimal PID control parameters are applied for a composition control system. The performance of PSO- tuned controller is dependent on nature of the objective function and with the determination of parameters of PID controller basedPSOisobserved. Simulated performance analysis of the proposed PSO-based PID controller is compared with other well-known tuning method to investigate the optimal response and the best balance between performance and robustness. Finally, design parameters for bidirectional IPT system, implemented with a PSO-based PID controller, which uses a multiobjective fitness function, are presented to demonstrate the validity, performance and effectiveness of the optimum controller design. Key Words: Proportional-integral-derivative (PID), Inductive power transfer system (IPT), Particle swarm optimization (PSO), genetic algorithm (GA) 1. INTRODUCTION PID control is the most ancient and the strongest control method in process industries. With the advancement in technology control systems are becoming more and more complex day by day. Conventional PID control is not able to solve such complex problems. In recent years many intelligent controllers have been introduced such as fuzzy PID controller, neural network and so on. Theintelligent PID controllers having the properties such as self-adaptability, self-learning ability and self-organization are able tocontrol complex systems. PID controller is widely used in industrial control systems. PID controller calculates the error between set point value and measured response. The objective of PID controller is to minimize the generating error. PIDcontroller calculation involvesthreetermsproportional, derivativeand integral. The purpose of proportional term is to determine the reaction of current error, integrating term determines the reaction of sum of current error and derivative term determines the rate of error generating. The objectiveofPID controller tuning is to design such a controller which meet the desired closed loop performance. A PID controller improves the transient response of the system by reducing the overshoot in the step response, and by reducing the settling and rise time. Standard methods of PID tuning involve Ziegler Nichols, Corecon’s,AstromandHagglund and many other techniques. This paper presents soft computing technique for designing an intelligent PID controller. 2. PARTICLE SWARM OPTIMIZATION Particle swarm optimization has been used here for the tuning of PID controller. PSO isa populationbasedstochastic optimization algorithm which is first proposed by Eberhart and Kennedy in 1995.This technique is derived from research on biological organism such as bird flocking and fish schooling. Craig Reynolds (1987) showed that flock is simply the result of the interaction between thebehaviorsof individual birds. To simulate a flock we simulate the behavior of an individual bird. He concluded that to build a simulated bird flock model followingthreesimple rulesmust be followed: Velocity Matching, centering of bird flock and avoid collisions. Work of Kennedy and Eberhart was influenced by Heppner and Germander’s (1990) work on simulated behavior of bird. 2.1 PSO Flowchart Steps In PSO a number of particles are placed in the search space of some problem. Each particleintheswarmevaluates the objective function at its current location. Each particle then move through the search space accordingtothehistory of its own current and best location of neighborhood in the swarm on each iteration. The next iteration takes place after all particles have been moved. In PSO swarm moves like a bird flock searching for food. Each individual intheswarm is composed of three d-dimensional vectors, where d is the dimension of the search space. Three vectors arethecurrent position xi, the previous best position pi, and the velocity vi. The PSO algorithm based on the concept that individual member refine their knowledge about the search space by social interaction. In PSO each member is called particle and
  • 2. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072 © 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2120 population is called swarm. The term ‘swarm’ means irregular movement of particles. Particle swarm optimization is a member of swarm intelligence familyit has some advantages over other intelligent optimization techniques: 1) It is simple to implement 2) There are fewer parameters to adjust. 3) It has more effective memory capability 4) It uses a relatively small population 5) It is fast 6) PSO is more effective in maintaining diversity of swarm and lead to fast convergence These advantages have given it popularity to solve nonlinear optimization problems in the field of evolutionary computation. PSO have been successfully applied in many areas of system design, system modeling, system identification, signal processing, pattern recognition, robotic applications. The algorithm of PSO include following steps: 1.Initialize the swarm by assigning random position and velocity to each particle. 2. Evaluate fitness function for each particle. 3. Compare the current fitness value with the pbest value of the particleinhistory. 4. If current fitness value is better than the previous best value (pbest), then set this value as current pbest. 5. Now best evaluated value of pbest is set as gbest value. 6. Update the velocity and position of the particles according to the equation 5 and 6. 7. Repeat the steps 2 to 6 until sufficiently good stopping criterion is met such as maximum number of iterations or best fitness value. Particle Swarm Optimization (PSO), an evolutionary algorithm for optimization is extended to determine if natural selection, or survival-of-the fittest, can enhance the ability of the PSO algorithm to escape from local optima. To simulate selection, many simultaneous, parallel PSO algorithms, each one a swarm, operate on a test problem. Simple rules are developed to implement selection. The ability of this so-called DarwinianPSOtoescapelocal optima is evaluated by comparing a singleswarmanda similarset of swarms, differing primarily in the absence of the selection mechanism, operating on the same test problem. The selection process is shown to be capable of evolving the best type of particle velocity control, which is a problem specific design choice of the PSO algorithm A particular algorithm may work well on one problem but may fail on another problem. If an algorithm could be designed to adapt to the fitness function, adjusting itself to the fitness landscape, a more robust algorithm with wider applicability, without a need for problem specific engineering would result. Strategies for avoiding local optima include stretching of Parsopoulos and other convexification strategies. Nature points to a way that may help circumvent local optima. We propose a strategy based on natural selection in which, when a search tends to a local optimum, the search in that area is simply discarded and another area is searched instead. This is the type of search designed and analyzed in this paper. A swarm consists of several particles.Eachparticlekeeps track of its own attributes. The most important attribute is their current positions which are represented by n- dimensional vectors. The position of the particles corresponds to potential solutionsofthecostfunctionwhich is to be minimized. Another attribute of the particle is current velocity which keeps track of the current speed and direction of travel by the particles. Each particle has a current fitness value which is obtained by evaluating the error function of the particles current position. Eachparticle has to remember its own personal bestpositionsothatit can be used to guide the construction of new solutions. The best overall positions among all particles are recorded. This position is used for termination of the algorithm. Fig -1: Flowchart of PSO algorithm in bidirectional IPT system 2.2 PID using PSO Algorithm Objective of tuning method is to find a set of controller parameters which gives better results. The objective of PID controller is to adjust parameters like that system perform better in the wide range of operating conditions. Start For each particle’s position (p), evaluate fitness Initialize particles with random position and velocity vectors If fitness (p) is better than fitness (pBest) then set pBest=p Iterate until all Particle Exhaust Iterate until all Particle Exhaust Set best of pbest as gbest Update particles velocity and position Stop
  • 3. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072 © 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2121 Fig -2: Block diagram for PSO Based PID tuned controller 2.3 PID controller design To design PID controller with PSO some parameters and fitness function are required. Particle swarm optimization algorithm is population based techniquesofirstofall haveto produce initial swarm of particles in search space represented by a matrix of dimension swarm size. Swarm size is the number of particles. Maximum number of iterations has been used here. However more number of iterations produce better results but for study and comparison between different performance indices iterations have been used in this paper. ZN method may cause high overshoots, largeoscillations, and longer settling times for higher order systems. The bidirectional IPT system, being a higher order resonant network falls into this category and the task of tuning PID gains for this system is, therefore, a major challenge. One of the most efficient methodsof tuningPIDparametersforsuch systems is through direct optimization, whichoftenrequires a solution to a non-convex problem. Various other methods such as refined ZN and pole placement have also been proposed to obtain the optimum PID parameters. PSO must have a fitness evaluation function to decide the better and best positions, the function can take the particle’s position and assigns it a fitness value. Then the objective is to optimize the fitness function. In general, the fitness function is pre-defined and is depend on the problem.Fig.5showsthe simulation output for the PID controller. It istheresultofthe controller during tuning for the IPT systems. 3. BIDIRECTIONAL IPT SYSTEM Fig. 3 shows a typical bidirectional IPTsystem,consisting of a primary and a secondary side. The secondary circuit, which receives power from the primary through an air gap, is typically referred to as the pickup. The primary and the pickup use identical electronic circuitry, comprising a converter, an inductor–capacitor–inductor (LCL) resonant network with a series capacitor and a dedicated controller. The controllers are independent of each other and operate the converters on both sides to regulate the power flow across the air gap. The primary controller operates the primary-side converter, which is connected to the LCL resonate network to produce a constant sinusoidal current at a desired frequency f0 intheprimarywinding,represented by the coil Lpt . This primary winding is commonly referred to as the primary track or the primary pad in IPT applications. The LCL circuits on both sidesofthesystem are tuned to the frequency of track current ipt generated by the converter on the primary side. In a bidirectional IPT system, the magnitude and/or phase angle of the voltage vector produced by the pickup converter can be controlled with respect to the voltage vector produced by the primary converter to regulate the magnitude and direction of power flow, as described later. Assume that the primary-side converter of the bidirectional IPT system, shown in Fig. 3, produces a reference sinusoidal voltage Vpi∠0atanangularfrequencyω, and the track current ipt is held constant by the primary-side controller. Since the inductor Lpt is magnetically coupled to the secondary or the pickup coil Lst , a voltage is induced across Lst due to ipt. The induced voltage Vsr in the pickup coil can be given by, Vsr= j*ω*M*ipt (1) where M represents the mutual inductance between the windings Lpt and Lst and can be given by, M = k*Lpt*Lst (2) where k is the coupling coefficient of the system, which typically is in the range of 0.1–0.3. As such, the coupling between the primary and secondary of an IPT system is significantly less than that of a traditional transformer or an induction motor, which have coupling coefficients greater than 0.95. M = k*√Lpt*Lst (3) The pickup may be operated as a source or a sink by the controller and, despite the mode of operation,thevoltage Vpr reflected onto the track can be expressed by, Vpr = j*ω*M*ist (4) Fig -3: Equivalent circuit representation of a bidirectional IPT system Under these conditions, it can be shown that thecurrents ipi and ipt of the primary are given by, ipi = j Vpr (5) ωLpt Initialize parameters PSO Algorithm Design PID controller Design Bidirectional PID Controller Analyze Performance
  • 4. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072 © 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2122 ipt = −j Vpi (6) ωLpt Similarly, the input and output currents of the pickup circuit can be given by, isi = j Vsr (7) ωLst ist = −j Vsi (8) ωLst Solving for isi using, ipi = j MVpr (9) ωLpt If the equivalent ac voltage of the input voltage to the pickup side converter is given by Vsi ∠ − θ, then the power input Psi of the pickup is given by Psi = Re : { Vsi (isi)* } (10) Substituting (6) into (8) Psi = M | Vsi | | Vpi | sin (θ) (11) Lst ωLpt It is evident from (11) that maximum power transfer takes place when the phase difference θ between the primary and pickup voltage vectors is ±90◦. A leading phase angle constitutes power transfer from the pickup to the primary, while a lagging phase angle enables powertransfer from the primary to the pickup. As evidentfrom (11),forany given Vpi and Vsi, the amount and direction of power flow between the primary and the pickup can be regulated by controlling both the magnitude and relative phase angle of the voltage vectors generated by the converters. 4. BIDIRECTIONAL IPT PICKUP-SIDECONTROLLER Decentralized controllercan beusedtocontrol thepower flow in a bidirectional IPT system. Therefore,thispaperonly presents the design and optimization of the pickup-side controller and the primary side of thesystemisoperated ata fixed phase angle using an open-loop controller. The pickup controller regulates the output power by measuring the power flowing into the load andcontrollingthemagnitude of the voltage Vsi applied to the pickup’s resonant network accordingly. A simplified diagram depicting how the magnitude of the voltage vsi is controlled is shown in Fig 4. The voltage Vpi applied to the input of the primary resonant network is shown in the top plot. The second and third waveforms show the switching signals applied to the switches in the left-hand leg of the full bridge, whereas the fourth and fifth waveforms show the control signals applied to the right-hand leg. As evident from Fig.4, switches in each leg are driven with complementary waveforms with a phase delay/advance of αs / 2 with respect to Vpi . The final plot shows the resultant voltage applied to the input of the pickup-side resonant network. As can be seen from Fig.3, by increasing the phase angle αs, the magnitude of the voltage Vsi can be increased, thus increasing the power flow while keeping the phase shift θ between the primary and pickup constant at 90◦. Fig -4: Switching waveforms for pickup-side controller The root-mean-square (RMS) value of the fundamental voltage component produced by thepickupconvertercanbe expressed as a function of the control variable αs through, Vsi = Vsin* 4 *sin (αs ) (12) √2π where Vsin is the dc voltage of the active load supplied by the pickup-side converter. Combining (12) with (10), the input power of the pickup can be given by Psi =8*M*Vpin*Vsin*sin (αp) *sin (αs)* sin (θ) (13) ωπ2 * Lpt *Lst where αp is the phase delay applied to the primary-side converter to control ipt and Vpin is the dc voltage applied to the primary side converter. Both αp and αs are time discrete variables with a sampling period tsamp equal to twice the converters switching frequency ω. 5. SIMULATION RESULTS The response of the bidirectional IPT system when following a step change in reference output power was investigated using MATLAB Simulink-based software
  • 5. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072 © 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2123 package. At 0 ms, a step change in the reference power level was introduced, where the power level was changed from 0 to −1 kW, which corresponds to power flowing in the forward direction from the primary to pickup. Under such conditions, the step response of the power flowing into the pickup-side converter. The response of a bidirectional IPT system to a step change in the power reference is somewhat different when the power flow is reversed. As such, it is essential to verify that the controller gains derived in the preceding section results in a stable and fast response when the power is flowing in the reverse direction (from the pickup to the primary). Similarly, to the response shown by the system when power was flowing in the forward direction, oscillations can be observed in the powerwhenthepickup is controlled derived using the ZN tuning method. However, the magnitudes of oscillations in the step responses are much smaller in comparison to the response yielded when the IPT system was transmitting powerinforwarddirection. Fig -5: PID controller tuned output for the bidirectional IPT system 5.1 PID controller design The objective function for PSO algorithm is calculated as power in terms of error. The fitness function plot as in Fig. 6 represents the fitness function of power transferred in bidirectional IPT system. It is calculated by the no. of populations and iterations in the algorithm. The objective function of the bidirectional IPT system using PSO algorithm is calculated by the following, Y= KP e (t) + KI ʃ e (t) dt +KD d/dt e (t) Y is the output from the PID controller for tuning the bidirectional IPT system. KP is the proportional error constant, KD is the derivative error constant and KI is the integral error constant. C(S) = U(S) / E(S) = KP + KI /S + KDS C(S) represents the transfer function of the IPT system with tuned PID controller. U(S) represents the output and E(S) represents the input for the general transfer functionof the system. Kp = 0.5; Ki = 0.05; Kd = 3 are the designed error values obtained for the PID controller to tune the bidirectional IPT systems.These are the error constants which acts as the objective functions for the system to perform analysisinthis paper. Fig 6 represents the fitness function plot forthedesigned PID control parameters of the PSO algorithm.PSOiteratively less compared to other algorithm techniques and so in this graph the obtained fitness is effective with less number of iterations and populations of the system. Fig -6: Fitness function of PSO algorithm 5.2 MATLAB coding results Data= [-8.9454150197628479 0.10119999999999998 - 0.006333881644934803]; Minimized Data= [-0.006333881644934803 - 8.9454150197628479]; Psi = 1.537254777568402; T = 360; Tdc = 0.624; Tf = 1000; Ti = 0.10119999999999998; er = -0.059569137078034018; er1= 2.0365063896576885E-5; er2 = 5.8387519707991942E-5; ist = 31432.467291003421; Vpi = 439.86028856145924; Vsi = 439.86028856145924;
  • 6. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072 © 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2124 w = 0.12725695259515554; Here, T represents the phase shifts and integral time period of oscillation of the PID controller. Tdc represents the derivative time of the controller. k is the coupling co- efficient. Ti is the initial time period and Tf is the final time period for the controller in the bidirectional IPT systems. The errors are represented as er, er1, er2. Ist is the interference calculated for the bidirectional IPT system. Psi is the simulated power transferred to the system. Vpi is the induced voltage in the primary where as Vsi is the induced voltage in the pickup side (secondary) controller and w is the switching angular frequency. 5.3 Comparison on analysis between GA and PSO The proposed PSO algorithm is compared with earlier popular techniques such as genetic algorithm (GA). In Fig 7 show the fitness function comparison between GA and PSO. PSO is comparatively effective as it requires minimum iteration than GA to obtain the fitness of the system. Fig -7: Fitness function of GA and PSO algorithm Table 1 shows the effective parameter comparison between GA and PSO algorithms. With infer to the table,PSO is more effective than GSO in all terms of parameters analysis of the system. Fig 8 & 9 shows the bidirectional power transfer of the IPT systems. It represents the forward and reverse direction of the PSO based PID controller of the bidirectional IPT system. Fig 10 & 11 shows the interference or disturbances that are take in consideration in the IPT system. The trapezoidal form of plot represents the interference in forward direction whereas triangle form represents the interference in reverse direction. Table -1: Comparison between GA and PSO Parameters Comparative Analysis GA based PID controller PSO based PID controller Parameters Comparative Analysis GA based PID controller PSO based PID controller Fitness function value 0.089 0.077 Population 100 100 Rise Time (ms) 0.40 0.31 Settling Time (ms) 0.61 0.20 Peak overshoot (%) 1.22 1.55 Simulated Power (kw) 1.0 1.537 Fig -8: Power transfer in forward direction Fig -9: Power transfer in reverse direction
  • 7. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 06 Issue: 05 | May 2019 www.irjet.net p-ISSN: 2395-0072 © 2019, IRJET | Impact Factor value: 7.211 | ISO 9001:2008 Certified Journal | Page 2125 Fig -10: Interference in forward direction Fig -11: Interference in reverse direction 6. CONCLUSION Bidirectional IPT systems are essentially higher order systems and therefore conventional approachesofdesigning PID controllers, especially those based on ZN and various model reduction techniques do not yield satisfactory performance. Therefore, a systematic approach based on PSO has been proposed to tune the PID parameters. The parameters of PID controller along with interference have been analyzed and simulated using PSO. Simulated performance results of GA and PSO based PID controller has been compared to show the effectiveness with less iterative time. The results of simulation convincingly illustrate that PSO-based PID controller, which used effective objective functions, offers the best balance between performance and robustness. REFERENCES [1] Michael J. Neath, Akshya K. Swain, Udaya K. Madawala,and Duleepa J. Thrimawithana (2015), “An Optimal PID Controller for a Bidirectional Inductive Power Transfer System Using Multiobjective Genetic Algorithm”, IEEETransactionsonPowerElectronics,vol. 29, no. 3 [2] Yusoff, T.A.F.K., Atan, M.F., Rahman, N.A., Salleh,S.F.,and Wahab, N.A. (2015), “Optimization of PID tuning using genetic algorithm”, Journal of Applied Science&Process Engineering. [3] C. Y. Huang, J. T. Boys, and G. A. Covic (2013), “LCL pickup circulating current controller for inductive power transfer systems,” IEEE Trans. Power Electron., vol. 28, no. 4, pp. 2081–2093. [4] Akshya K. Swain, Member, Michael J. Neath, Udaya K. Madawal, and Duleepa J. Thrimawithana (2012), “A Dynamic Multivariable State-Space Model for Bidirectional Inductive Power Transfer Systems”, IEEE Transactions on Power Electronics, vol. 27, no. 11. [5] M. P. Kazmierkowski and A. J. Moradewicz (2012), “Unplugged but connected:Reviewofcontactlessenergy transfer systems,” IEEE Ind. Electron. Mag.,vol. 6, no. 4, pp. 47–55 [6] U. K. Madawala and D. J. Thrimawithana (2012), “New technique for inductive power transfer using a single controller,” IET Power Electron., vol. 5, no. 2, pp. 248– 256. [7] U. K. Madawala and D. J. Thrimawithana (2012), “Modular-based inductive power transfer system for high-power applications,” IET Power Electron.,vol. 5, no. 7, pp. 1119–1126 [8] U. K.Madawala andD. J. Thrimawithana (2011),“Current sourced bi-directional inductivepowertransfersystem,” IET Power Electron., vol. 4, no. 4,pp. 471–480. [9] J.Huh, S. W. Lee,W. Y. Lee, G. H. Cho, and C. T.Rim(2011), “Narrow-width inductive power transfer system for online electrical vehicles,” IEEE Trans.Power Electron., vol. 26, no. 12, pp. 3666–3679. [10] U. K. Madawala and D. J. Thrimawithana (2011), “A bidirectional inductivepower interface for electric vehicles in V2G systems,” IEEE Trans. Ind.Electron., vol. 58, no. 10, pp. 4789–4796.