You are on page 1of 10

See discussions, stats, and author profiles for this publication at: https://www.researchgate.

net/publication/308088207

DC Motor Torque Control Using State Estimation

Article · January 2016


DOI: 10.2316/Journal.201.2016.3.201-2762

CITATION READS
1 4,649

7 authors, including:

Zanahul Farnaz Anuradha D. Abeysekara


University of Peradeniya University of Peradeniya
2 PUBLICATIONS   2 CITATIONS    6 PUBLICATIONS   14 CITATIONS   

SEE PROFILE SEE PROFILE

Shirantha Welikala Prabath Binduhewa


Boston University University of Peradeniya
25 PUBLICATIONS   188 CITATIONS    37 PUBLICATIONS   149 CITATIONS   

SEE PROFILE SEE PROFILE

Some of the authors of this publication are also working on these related projects:

Multispectral Imaging View project

Smart Grid Research View project

All content following this page was uploaded by Shirantha Welikala on 01 March 2018.

The user has requested enhancement of the downloaded file.


Control and Intelligent Systems, Vol. 44, No. 3, 2016

DC MOTOR TORQUE CONTROL


USING STATE ESTIMATION
Zanahul Farnaz,∗ Husain S. Sajith,∗∗ Anuradha D. Abeysekara,∗∗ Shirantha Welikala,∗∗
Prabath J. Binduhewa,∗∗ Parakrama B. Ekanayake,∗∗ and Lilantha Samaranayake∗∗

Abstract for precise control using simple controller and simple power
electronics [3]. It has a wide range of applications in au-
In most robotics and automation applications, DC motors play tomotive, aerospace, material processing, manufacturing,
a pivotal role as they have proven to be one of the easiest to etc., industries as well as in precise instrumentation.
control. Implementing feedback helps precise control with improved Typically, the DC motor is used for position servo [4],
noise performance and robustness against parameter variations. DC velocity servo, or torque control applications. Depending
motors with feedback control can be used for position, speed, or on the target application, the DC motors for control,
torque used for control. For closed loop position and speed control robotics, and automation applications have been equipped
applications, the position and speed of the DC motors can be with shaft-connected encoder for position feedback or a
obtained using an encoder connected to the shaft, which usually is tacho-generator for velocity feedback. For torque control
a cost-effective solution. Similarly, the electromagnetic torque of a applications and fast and precise state feedback control, it
DC motor can be obtained by using a shaft-connected torque sensor. is required to measure the electromagnetic torque of the
However, this is usually an expensive solution with additional power DC motor.
and interfacing requirements. Further, such torque sensors can It can be measured directly by a torque sensor
be too bulky to insert in a limited space environment and they attached to the shaft. However, this is an expensive
are generally sensitive to vibrations. To overcome these problems solution requiring additional power and interfacing. In
with a low-cost solution, we use a state estimator to estimate the addition, sometimes the torque sensor can be too bulky to
torque of the motor. We compare the performance of closed loop be implemented for certain applications.
state estimator with a Kalman filter implemented for the same Another alternative would be to use a current sensor to
purpose. In both cases, the input voltage to the motor and the measure the armature current and use the simple linear re-
speed output of the motor are the input to the state estimator, while lationship to find the electromagnetic torque. Requiring an
the estimated torque is the output of the estimator. The estimated additional current sensor and its integration are the draw-
torque output is used for closed loop torque control of the DC backs of this approach. In addition, the torque constant of
motor. The state estimators and the torque controller, containing the motor can vary with time and therefore requires cor-
pulse width modulation and PID controller, have been implemented rections from time to time [5], [6]. The most cost-effective
in low-cost microcontroller-based environment so that the solution approach would be to use the existing shaft-connected po-
can be developed for large-scale manufacturing and offered as a sition encoder or the tacho-generator feedback and use an
ready-made solution. estimation technique to find the electromagnetic torque of
the DC motor.
Key Words In this article, we use a state estimator to estimate
the electromagnetic torque of a DC motor using the speed
Closed loop control, DC motor, Kalman filter, state estimation, measurement and the input voltage measurement in real
torque control time. For the input voltage measurement, a simple voltage
divider is used and speed measurement is taken through
1. Introduction an optical shaft encoder.
A fuzzy control together with a PID control has been
Despite the introduction of attractive AC motor substitutes used in [7] to estimate the torque, which performs better
[1], [2], the DC motor still remains popular among control, than a PID controller alone. However, this method is not
robotics, and automation community as an ideal solution simple to implement in a low-cost microprocessor envi-
∗Sri Lanka Telecom Mobitel; e-mail:ahzfarnaz@hotmail.com ronment as in [8]. Sliding mode observer-based methods
∗∗Department of Electrical and Electronic Engineering Faculty have been used together with extended Kalman filter for
of Engineering, University of Peradeniya, Sri Lanka; e-mail: electromagnetic torque estimation of nonlinear brushless
{hssajith.eng, abeysekara.anuradha, shirantha27}@gmail.com,
{prabathb, mpb.ekanayake, lilantha}@ee.pdn.ac.lk
DC motors in [9] and for induction motors in [10], [11].
Recommended by Dr. Muhammad Tahir Khan Observer-based torque estimation for DC motors has been
(DOI: 10.2316/Journal.2016.3.201-2762) discussed in [12]. Torque estimation and control techniques
130
(e) mutual inductance is negligible, and (f) armature reac-
tion is negligible. Hence, the linear model of the motor can
be achieved by (1) to (3). Ke and Kt are back electromo-
tive constant and motor torque constant [19]. Substituting
(2) and (3) in (1) yields (4). Applying Newton’s second law
of motion to the rotational motion of the motor gives (5).

dia (t)
v(t) = Ra i(t) + La + e(t) (1)
Figure 1. DC motor schematic diagram. dt

e(t) = Ke ω(t) (2)


based on neural networks and fuzzy logic theories have
been done for switched reluctance motors in [13], [14] which
hints the possible directions this work can be extended. Tm (t) = Kt ia (t) (3)
A sensor less safety power window control system
consisting of a DC motor in an automotive application Ra La dTm (t)
where a Kalman filter is used to estimate the electromag- v(t) = Tm (t) + + Ke ω(t) (4)
Kt Kt dt
netic torque can be found in [15]. Recurrent fuzzy neural
network-based sensorless control mechanism for DC motor
dω(t)
speed and torque can be found in [16]. Optimal feedback Tm (t) − TL (t) − Bm ω(t) = Jm (5)
control of DC motors using speed and torque feedback can dt
be found in [17].
Hence the armature current measurement is eliminated
This article is organized as follows: Section 2 presents
from the dynamic equations. This leads to the derivation
the modelling of the DC motor in state space with torque
of the state space, where the speed ω(t) and the electro-
and speed as states. It also gives the design and simulation
magnetic torque Tm (t) will be the states.
implementation of the closed loop observer and Kalman
filter to estimate the electromagnetic torque. Section 3
2.2 State Space Model of the DC Servo Motor
describes the design and simulation and the hardware im-
plementations of the torque controller using the estimated
torque. Results have been presented in Section 4 and this By selecting the states as earlier, the supply voltage v(t)
article is concluded in Section 5. and the load or disturbance torque TL (t) as the inputs
and the speed as the output, the derived linearized model
2. Modelling and Design equations of the DC motor results in the state space model
given in (6) and (7).
This section presents the modelling details of the motor ⎡ dω(t) ⎤ ⎡ Bm 1 ⎤⎡ ⎤
and the design of the state estimator, namely the closed − ω(t)
⎢ dt ⎥ ⎢ JmJm ⎥⎢ ⎥
loop observer and the Kalman filter for the servo motor, ⎢ ⎥ =⎢ ⎥⎣ ⎦
followed by the torque controller design [18]. ⎣ ⎦ ⎣ K ·K Ra ⎦ T (t)
dTm (t) e t
− − m
dt La La
2.1 Dynamic Model of the DC Motor
⎡ 1 ⎤⎡ ⎤
0 − v(t)
A schematic diagram of a linearized lumped parameter ⎢ Jm ⎥⎢ ⎥
+⎣
Kt ⎦⎣ ⎦ (6)
model of a DC motor is shown in Fig. 1, where 0 TL (t)
La
v(t) – supply voltage (V); ia (t) – armature current (A);
⎡ ⎤ ⎡ ⎤
e(t) – back electromotive Tm (t) – motor electromagnetic  ω(t)  V (t)
y(t) = 1 0 ⎣ ⎦+ 0 0 ⎣ ⎦ (7)
force (V); torque (Nm); Tm (t) TL (t)
La – armature TL (t) – load torque (Nm);
inductance (H); 2.3 State Estimator: Closed Loop Observer Design
Ra – armature resistance Bm – viscous friction
As the observer is implemented digitally, its design has
(Ω); coefficient (kgm2 /s); also been carried out in the discrete domain. The state
ω(t) – motor shaft speed Jm – rotor inertia (kgm2 ). space model in Section 2.2 can be discretized with sampling
period h as in (8) and (9).
(rad/s);

x[k + 1] = Φx[k] + Γu[k] (8)


It is assumed that (a) symmetrical armature winding
is present, (b) there is no magnetic saturation, (c) hystere-
sis and eddy current losses are zero, (d) air-gap is uniform, y[k] = Cx[k] + Du[k] (9)
131
where Φ is the discrete system matrix, Γ is the discrete
input matrix, C = [1, 0], D = [0, 0], x[k] is the discrete state
vector, y[k] is the discrete output vector, and u[k] is the
discrete input vector. The Φ and Γ can be obtained by
(10) and (11).

Φ = eAh (10)
⎡ Bm 1 ⎤

h ⎢ Jm Jm ⎥
Γ = ∫ eAs Bds; A = ⎢

⎥;
0 Ke · Kt Ra ⎦
− −
La La
⎡ 1 ⎤ Figure 2. Simulink model of the closed loop observer.
0 −
⎢ Jm ⎥
B =⎢
⎣K

⎦ (11)
t algorithm [20] for the above system can be obtained as in
0 (18)–(22).
La

Here, h is the sampling period. For the above dis- Predictor step: Time update
cretized system, a closed loop observer with discrete ob-
server state x̂ and the closed loop observer gain matrix L Project the state estimates ahead:
can be designed as in (12) and (13).
x̂− [k] = Φx̂− [k − 1] + Γu[k] (18)
x̂[k + 1] = Φx̂[k] + Γu[k] + L(y[k] − C x̂[k]) (12)

y[k] = C x̂[k] (13) Project the error covariance ahead:

The estimation error of the closed loop observer x̃ is P − [k] = ΦP [k − 1]ΦT + Q (19)
given by (14).

x̃[k] = x[k] − x̂[k] (14)


Corrector step: Measurement update
which is used to design L, because the error dynamics of
the observer is given by (15). Compute the Kalman filter gain K:

x̂[k + 1] = (Φ − LC)x̃[k] (15) K[k] = P − [k]C T (CP − [k]C T + R)−1 (20)

To make observer error dynamics to be stable, the Update estimate x̂ with measurement:
eigenvalues should be located within the unit circle of the
complex z-plane. The observer gain matrix L has been
designed by using the principle of pole placement. The x̂[k] = x̂− [k] + K[k](y[k] − C x̂− [k]) (21)
poles of the closed loop observer have been placed such that
the error dynamics are a decade faster than the system, so
that the transient response will be smooth. The software
Update the error covariance P:
implementation of the observer using SimulinkT M blocks
is shown in Fig. 2.
P [k] = (I − K[k]C)P − [k] (22)
2.4 State Estimator: Kalman Filter Design
where Q = E[ηη T ] is the process noise covariance and
In the presence of plant noise η[k] and measurement noise R = E[νν T ] is the measurement noise covariance.
ν[k], the discrete time state space of the DC servo motor The software implementation of the Kalman filter us-
plant gets modified as in (16) and (17). ing Simulink blocks is shown in Fig. 3.

x[k + 1] = Φx[k] + Γu[k] + η[k] (16) 2.5 Design of the Torque Controller

y[k] = Cx[k] + Du[k] + ν[k] (17) The torque estimated by the state estimator was used to
design a torque controller for the system. Here, the input
The Kalman filter has two steps: (1) predictor step voltage to the motor was changed using a PID controller
and (2) corrector step. Accordingly, the Kalman filter followed by a H-bridge formed by MOSFETs to control
132
Figure 3. Simulink model of the Kalman filter.

the output torque of the system. The input u[k] which is in this study. The first part of the section describes the
mentioned in (6) was changed as, hardware modules used in this work and the second part
⎛ ⎞ describes the complete Simulink model of the simulation.
Vin
u[k] = ⎝ ⎠ (23)
Tm 3.1 Hardware Implementation

Here, Vin is given by


The controller for the motor was implemented using a
 
Ki −1
MOSFET driver circuit. The supply voltage to the motor
Vin = Kp + + Kd (1 − z ) (Tref − Test ) (24) is controlled using a PWM scheme and is measured at the
1 − z −1
same time. The velocity of the motor is obtained from
where Test is the estimated torque and Tref is the reference the optical shaft encoder which comes with the DC mo-
torque. Kp , Ki , and Kd are the gains in the PID controller tor. The supply voltage, which is in the range of 0–40 V,
in the usual notation. The torque controller was designed is scaled down using operational amplifier circuit. The
such that the poles of the closed loop torque control systems observer Kalman filter and the controller have been im-
are much slower than the poles of the state estimator. The plemented in the STM32F4 DiscoveryTM development kit,
software implementation of the controller using Simulink which is a state-of-the-art low-cost controller implemen-
blocks is shown in Fig. 4. tation platform. The STM32F4 Discovery development
kit consists of STM32F407VGT6 ARM Cortex-M4 32-byte
3. Implementation of Torque Controller microcontroller featuring 1 Mbytes of flash memory, 192
kbytes of RAM, which enables to port the implementation
This section describes simulation and hardware implemen- easily to a standalone single microcontroller in the future.
tation of the complete system consisting of the state esti- The physical arrangement of various components involved
mators and the torque controller for the DC motor used is shown in Figs. 5 and 6.
133
Figure 4. Simulink model of the torque controller.

digital module is used to measure the supply voltage to


the motor and a pulse width modulation capture module
is used to measure the pulse frequency generated from
the encoder. This frequency value is converted to speed.
Measuring the load torque is not feasible. Thus estimated
torque from the closed loop observer and Kalman filter
are fed into the respective modules assuming both the
estimated torque and the load torque are equal.
A UART transmission module is used to transmit the
measured values to the host PC. The closed loop observer
Figure 5. Block diagram of STM32F4 Discovery board and block and Kalman filter block have been used to estimate
motor connectivity. electromagnetic torque developed by the motor.

4. Results and Discussion


3.2 Implementation of Simulation using
Figure 8 compares the electromagnetic torque estimated
MATLABTM /Simulink
using closed loop observer and the Kalman filter with
the measured torque, when the load torque of the motor
To programme the STM32F4 Discovery development kit, is changed randomly by external means. The torque is
it is necessary to convert the closed loop observer shown measured by connecting a current sensor to measure the
in Fig. 2, the Kalman filter shown in Fig. 3, and the armature current and then by using (3). The results in Fig.
controller in Fig. 4 which are in Simulink blocks into their 8 show that the electromagnetic torque estimated using
corresponding C program code. In general, this task is a both methods follows the measured torque. The estimates
tedious process to convert the lines one by one. Instead, depend on the speed calculated using optical shaft encoder
“Waijung” [21] is a freely available Simulink block set that measurements and the measurements of the input voltage
can be used to generate the C code automatically from the to the DC motor. Figure 9 shows the variation of error
Simulink simulation models. in estimated torque which was found using the closed
The closed loop observer model and the Kalman fil- loop observer and the Kalman filter. It can be observed
ter model are implemented in the Simulink environment that the Kalman filter-based torque estimator has slightly
together with the “Waijung” Simulink block set as shown less error variation when compared with the closed loop
in Fig. 7. In this implementation, a regular analogue to observer-based torque estimator.
134
Figure 6. Hardware implementation at laboratory.

Figure 7. Simulink model embedded on the STM32F4 Discovery board.

135
Figure 8. Estimated torque using closed loop observer and Figure 11. Error in estimated speed using Kalman filter
Kalman filter. and closed loop observer.

Figure 9. Error in Estimated torque using closed loop Figure 12. Torque control for a given torque reference.
observer and Kalman filter.

Figure 10 compares the measured speed with the esti-


mated speed using the closed loop observer and the Kalman
filter, respectively. It can be observed that both estimates
follow the general trends in the speed, but the Kalman
filter follows it more accurately. As the estimates depend
on the speed output, it can be anticipated that the elec-
tromagnetic torque estimated using Kalman filter is more
accurate than the one using the closed loop observer. Fig-
ure 11 shows the error variation of the speed estimated
using the closed loop observer and the Kalman filter. It
can be seen that the error variation in Kalman filter is
much less than it is in closed loop observer.
Figure 12 shows the results of the torque controller im-
plementation. The reference torque is a square wave with
magnitude varying between 0 and 0.2 Nm as shown in the
lower figure. The corresponding estimated output torque
is shown in the upper figure. As can be observed, the out-
put torque closely follows the reference torque and hence
the torque control has been implemented successfully.
Figure 10. Comparison of the actual speed with the esti-
The minor fluctuations in the torque estimate are due to
mated speed using closed loop observer and Kalman filter.
the variations in the speed measurement.
136
5. Conclusion [11] A.D. Pai, L. Umanand, and N.J. Rao, Direct torque control
of induction motor with extended Kalman filter, Power Elec-
tronics and Motion Control Conference, 2000. Proceedings.
The electromagnetic torque of a DC servo motor has suc- IPEMC 2000. The Third International, Beijing, China, 1,
cessfully been estimated using both closed loop observer 2000, 132–137.
and Kalman filter. The influence of plant and mea- [12] G. Danny, Robust load disturbance torque estimation for a per-
surement noise could be reduced with the Kalman fil- manent magnet DC motor drive system, Doctoral Dissertation,
University of Windsor, Windsor, 2012.
ter. Both the initial designs which were implemented [13] P. Veena, R. Jeyabharath, and M. Rajaram, Performance
in MATLABTM /Simulink environment have been success- improvement of direct torque control for switched reluctance
fully implemented in low-cost hardware. The results show motor using neuro-fuzzy controller, Journal (201) Control
that torque estimated using hardware implemented esti- and Intelligent Systems, DOI: 10.2316/Journal.201.2010.3.201-
2118, 2010.
mators agrees well with the measured torque. Further, [14] R. Jeyabharath, P. Veena, and M. Rajaram, Modelling and
the estimated torque was used in DC motor torque control simulation of direct torque control for multi-phase switched
application using an outer PID torque controller. The re- reluctance motor drive, International Journal of Modelling and
Simulation, DOI: 10.2316/Journal.205.2010.2.205-5136, 2010.
sults show that the output torque profile follows the given
[15] J.H. Park, G.H. Choi, T.S. Yoon, and J.B. Park, A sensorless
reference torque profile with adequate accuracy. Hence, it safety power window control system in automotive applica-
is concluded that costly and bulky torque sensors can be tion, Control, Automation and Systems, 2008. ICCAS 2008.
replaced with torque estimators which are implemented in International Conference on, Seol, Korea, 2008, 1457–1461.
[16] J.L. Kuo and Z.S. Chang, Intelligent sensorless control of two-
cost-effective hardware, for DC servo motor applications. phase linear brushless DC motor based on a recurrent fuzzy
neural network, Journal (201) Control and Intelligent Systems,
Acknowledgement DOI: 10.2316/Journal.201.2008.2.201-1875, 2008.
[17] J.P. Jiang, S. Chen, and P.K. Sinha, Optimal feedback con-
trol of direct-current motors, Industrial Electronics, IEEE
The authors would like to thank the Department of Elec- Transactions on, 37(4), 1990, 269–274.
trical and Electronic Engineering, Faculty of Engineering [18] M. Gopal, Control Systems Principles and Design, 2nd ed.
University of Peradeniya, Sri Lanka for facilitating this (Delhi, India: Tata McGraw-Hill Education, 2002). ch 2,
147–260.
project. [19] M. Salah and M. Abdelati, Parameters identification of a per-
manent magnet DC motor, Proceeding (675) Modelling, Iden-
References tification, and Control, DOI: 10.2316/P.2010.675-085, 2010.
[20] K. Ogata, Modern Control Engineering, 5th ed. (Upper Saddle
[1] S. Purwar, I.N. Kar, and A.N. Jha, Adaptive fuzzy logic based River, NJ: Prentice Hall, 2010).
control of induction motor, International Journal of Control [21] MathWorks; Control System Design and Analysis in Simulink;
and Intelligent Systems, 35(2), 2007, 1591. http://in.mathworks.com/products/simcontrol/features.html
[2] P. Chatterjee, B.M. Karan, and P.K. Sinha, Intelligent drive #control-system-design-and-analysis-in-Simulink (accessed:
for induction motor control, International Journal of Control 02/03/2015).
and Intelligent Systems, 36(2), 2008, 1861.
[3] Á.O. de Guimarães, J.P. da Silva, and E.R.M. Dantas, Genetic Biographies
algorithm applied to control of DC motor with disturbance
rejection by feedforward action, Journal (201) Control and In- Zanahul Farnaz received the
telligent Systems, DOI: 10.2316/Journal.201.2015.1.201-2599, B.Sc. Eng. (Hon) specialized in
2015.
[4] A. Benmakhlouf, A. Louchene, and D. Djarah, Fuzzy logic
Electrical and Electronic Engi-
and modified crisp logic applied to a DC motor position neering from University of Per-
control, Journal (201) Control and Intelligent Systems, adeniya, Sri Lanka in 2015. Cur-
DOI: 10.2316/Journal.201.2010.3.201-2214, 2010. rently, he is working as an engineer
[5] J.W. Park, S.H. Hwang, and J.M. Kim, Sensorless control
of brushless DC motors with torque constant estimation for
from October 2015 at Sri Lanka
home appliances, Industry Applications, IEEE Transactions Telecom Mobitel. His research in-
on, 48(2), 2012, 677–684. terests are in the fields of control
[6] V.P. Lukic and J.B. Hall, A new approach to an optimal systems, robotics, Smart grid and
adaptive real time DC motor drive control, Proceeding (539)
Power and Energy Systems, 2007.
the Internet of Things (IoT). He
[7] D.T. Liem and K.K. Ahn, DC motor parameters identification is a student Member of the IEEE.
and sensorless torque estimation using fuzzy PID, Control,
Automation and Systems (ICCAS), 2012 12th International Husain S. Sajith received the
Conference on, Jeju, Korea, 2012, 76–81. B.Sc. Eng. degree in Electri-
[8] M. Zeinali, Learning controller design using fuzzy modeling, cal and Electronic Engineering
sliding mode control, and PID controller for robots, Pro-
ceeding (806) Power and Energy/(807) Intelligent Systems
in 2015 from University of Per-
and Control/(808) Technology for Education and Learning, adeniya, Sri Lanka. He is cur-
DOI: 10.2316/P.2013.807-047, 2013. rently working as an Electrical
[9] Y. Liu, Z.Q. Zhu, and D. Howe, Instantaneous torque es- Engineer in Watermaster Qatar
timation in sensorless direct-torque-controlled brushless DC
motors, Industry Applications, IEEE Transactions on, 42(5),
WLL. He is an Associate member
2006, 1275–1283. of the Institute of Engineers Sri
[10] D. Pai, P.R. Mangsuli, and N.J. Rao, Nonlinear observer based Lanka. His research interest in-
sensorless direct torque control of induction motor, Power cludes Robotics, Control Systems,
Electronics and Motion Control Conference, 2000. Proceedings.
IPEMC, The Third International, Beijing, China, 1, 2000,
Power system modeling and High
440–445. voltage insulation system.
137
Anuradha D. Abeysekara re- Parakrama B. Ekanayake ob-
ceived the B.Sc. Eng. degree tained his B.Sc. Eng. degree
in Electrical and Electronic in Electrical and Electronic En-
Engineering with First Class Hon- gineering from University of
ours from the Faculty of Engi- Peradeniya, Sri Lanka in 2006.
neering, University of Peradeniya, Subsequently, he obtained his
Sri Lanka in 2015. He is cur- Ph.D. degree from Texas Tech
rently working as a temporary University in 2011. Immediately
instructor from October 2015 at after his Ph.D. degree, he joined
the same university. His main as a faculty member at the De-
research interests include signal partment of Electrical and Elec-
processing, power systems, con- tronic Engineering, University of
trol, robotics, electronics, and embedded systems. He is a Peradeniya, Sri Lanka, where he still is. His current re-
student Member of the IEEE. search activities include blind source separation and blind
event separation, visual systems and sensor fusion tech-
Shirantha Welikala received the niques for mobile robots, bio-realistic modelling of visual
B.Sc. Eng. degree in Electri- systems, and coding of sensory information in biological
cal and Electronic Engineering systems. He is a Member of the IEEE.
with First Class Honours from
the Faculty of Engineering, Uni- Lilantha Samaranayake re-
versity of Peradeniya, Sri Lanka ceived his B.Sc. Eng. from Uni-
in 2015. He is currently working versity of Peradeniya, Sri Lanka
as a temporary instructor from in 2000 and Tech. Licentiate and
October 2015 at the same univer- Ph.D. degrees in Electrical Engi-
sity. His main research interests neering from the Royal Institute
include control systems, robotics, of Technology (KTH), Sweden
intelligent systems, automation, in 2003 and 2006, respectively.
electronics, embedded systems, and signal processing. He He has been a senior lecturer
is a student Member of the IEEE. in the Department of Electrical
and Electronic Engineering, Fac-
Prabath J. Binduhewa received ulty of Engineering, University of
B.Sc. Eng. specialized in Elec- Peradeniya, Sri Lanka since 2007. He was a research
trical and Electronic Engineer- fellow at the Kyushu Institute of Technology, Japan and
ing with First Class Honours at the Advanced Vehicle Engineering Centre, Cranfield
from University of Peradeniya, University, UK. He is a Senior Member of IEEE.
Sri Lanka in 2005. He earned the
degree of Doctor of Philosophy
from University of Manchester,
UK in June 2010. Thesis title
of his research is “Microsource
Interface for a MicroGrid”. He is
currently attached to the Depart-
ment of Electrical and Electronic Engineering, Faculty of
Engineering, University of Peradeniya as a senior lecturer.
He was working on MicroGrids and HVDC systems with the
Power Conversion Group of the University of Manchester
from October 2013 to December 2013.

138

View publication stats

You might also like