Controlling an Equilibrist Lego Robot

Size: px
Start display at page:

Download "Controlling an Equilibrist Lego Robot"

Transcription

1 Proceedings of the World Congress on Engineering 05 Vol I WCE 05, July - 3, 05, London, U.K. Controlling an Equilibrist Lego Robot Vinicius Silva, Pedro Leite, Filoena Soares, Gil Lopes, João Sena Esteves and Paulo Garrido Abstract This paper describes the design and ipleentation of a self-balancing two-wheeled robot, the Equilibrist Robot. The syste is siilar to the classical unstable, non-linear echanical control proble of an inverted pendulu on a cart. Using the Linear Quadratic Regulator ethod and PID for state feedbac, this paper shows a control algorith that solves this proble. This control is able to reject disturbances and stabilize the syste using a gyroscope. The control algorith is ipleented using Matlab and C- prograing. The Equilibrist anages to stabilize itself in an upright position, reject disturbances and change its position. Index Ters Inverted Pendulu, Linear Quadratic Regulator, Servo and Regulator Control, Lego Robot. M I. INTRODUCTION obile robots have been the focus of study aong the scientific counity. Their practical applications range fro search and rescue activities, aterials handling and entertainent, aong others []. The two-wheeled inverted pendulu (TWIP) robot is a specific configuration of obile robots that has been receiving special attention. In fact, their particular structure, unstable dynaic perforance, and nonlinearity ae the the ideal platfor to deonstrate and test different nonlinear control theories []. TWIP has been applied in different areas, fro coercial application to educational and research purposes. The Segway Personal Transporter [] is a well-nown exaple of a coercial product. Segway s robotics platfors are applied to different aret segents including: research and developent, indoor/outdoor navigation and path planning, industrial autoation, and defence applications. In [3], the authors present an ebedded and standalone inverted pendulu with two piezoelectric drives designed as teaching aid for Mechatronics courses. The platfor cobines Mechanics, Electronics and Process Control Manuscript received March 3, 05; revised April 06, 05. This wor has been supported by FCT - Fundação para a Ciência e Tecnologia in the scope of the project: PEst-UID/CEC/0039/03. Vinicius Siva is with the Industrial Electronics Departent, Capus de Azuré, Guiarães, Portugal (a653@aluni.uinho.pt). Pedro Leite is with the Industrial Electronics Departent, Capus de Azuré, Guiarães, Portugal (a666@alunos.uinho.pt). Filoena Soares is with the Industrial Electronics Departent, Algoriti R&D Center, Engineering School, Capus de Azuré, Guiarães, Portugal, (corresponding author phone: ; fax: ; e-ail: fsoares@dei.uinho.pt). Gil Lopes is with the Algoriti R&D Center, Engineering School, Capus de Azuré, Guiarães, Portugal, (gil@dei.uinho.pt). João Sena Esteves is with the Industrial Electronics Departent, Algoriti R&D Center, Engineering School, Capus de Azuré, Guiarães, Portugal, (sena@dei.uinho.pt). Paulo Garrido is with the Industrial Electronics Departent, Algoriti R&D Center, Engineering School, Capus de Azuré, Guiarães, Portugal, (pgarrido@dei.uinho.pt). ISBN: ISSN: (Print); ISSN: (Online) topics where the students can understand and test the ain principles of piezoelectric aterials, echanics, electricity and control theory as well as progra and control the syste with three independent icroprocessors. An application of the inverted pendulu syste focused on bioechanics is presented in [4]. The goal of the study was to ipleent an accurate control algorith (Fuzzy control) to regulate the speed of the robotic device, LOKOMAT [5], intended for rehabilitation of patients with lower extreity paralysis. The application was first virtually siulated and tested in Matlab to verify proper operation. An analogy was perfored between the robotic device and the inverted pendulu syste: the pendulu ovable ass atches with legs ass, and the pendulu ass with torso ass. Hence, to control LOKOMAT, the patient only needs to bend his/her torso. A LOKOMAT syste can be adapted to any user as it has a calibration routine (introduction of patient data height and weight) before running the fuzzy control algorith. There have been other TWIP architectures successfully designed and constructed. Jianhai et. al. (04) [6] proposed a two-wheeled, self-balancing robot using 6-axis MEMS sensors MPU6050 to easure its posture (algorith for sensor fusion of 3-axis gyroscope and 3-axis acceleroeter). The copleent filter (integrating the data of the gyroscope and acceleroeter) was designed in order to achieve a ore accurate inclination angle. A 6-bit MCU ipleents the PID control algorith to calculate the required control voltage for the otors, to adjust the robot s posture and eep the body balanced. The PID paraeters were tested through experients. In [7], the authors present the control ethod of cobining LQR and PID for a two-wheeled self-balancing robot that successfully overcoes the ipact of the constraints on the linearized syste. Juang and Lu (03) [8] report the design, construction and control of a two-wheeled self-balancing robot based on a pair of DC otors, an Arduino icrocontroller board, a single-axis gyroscope and a -axis acceleroeter. Also, a copleentary filter was ipleented to copensate the gyro drifts. PID and LQR-based PI-PD control designs were perfored on the linearized equations of otion. Experiental results showed that self-balancing can be achieved with PI-PD control in the vicinity of the upright position. The perforance of the inverted pendulu platfor when feedbac force is provided has been reported in [9]. This study presents a virtual pendulu syste based on OpenGL controlled with a joystic. The dynaical odel of the syste was obtained though atheatical anipulation and the feedbac force was introduced into the syste, providing an interactive operation ode. In [0], a two-wheeled self-balancing robot transporter odel was established. Kineatic and dynaic odels WCE 05

2 Proceedings of the World Congress on Engineering 05 Vol I WCE 05, July - 3, 05, London, U.K. were developed as well as two control ethods: the Proportional, Integral and Derivative (PID) algorith and the Linear Quadratic Regulator (LQR). The control objectives includes self-balancing (preventing syste fro falling down when it oves forward or bacward) and yaw rotation (steering angle regulation when it turns left or right). PID is used to control self-balancing and yaw rotation and LQR is used to control self-balancing only. The controllers perforance was tested using Matlab siulations. Results point out a better perforance of LQR than PID for self-balancing control. Vasudevan et. al. (05) [] presented a study on the design for wheeled inverted pendulu (WIP) platfors highlighting the effect of the design choices on the balancing perforance. In particular, they analysed the effect of soft viscoelastic tires (soft tires enhances balancing perforance); the effect of pitch rate and wheel velocity filters (suggestions for design of filters); the existence of a self-tuning liit-cycle copensation algorith; the effects of torque and velocity control of WIP otors; the effect of otor gearing on WIP dynaics. The overall goal was to define electroechanical design trade-offs to design and ipleent an efficient WIP platfor. This paper shows the design and ipleentation of a self-balancing Lego robot (Equilibrist Robot), which is an unstable syste. The odel is based on the inverted pendulu balancing on two wheels. This wor shows the atheatical equations of the odel as well as the full ipleentation of a control syste stabilizing the robot. The ais of this project includes: stabilize in an upright position; reject disturbances; forward otion, controlled via Bluetooth; avoid obstacles. II. TWO-WHEEL STRUCTURE The behaviour of this syste, the self-balancing robot, is siilar to the classical echanical syste of an inverted pendulu on a cart. It is a well-nown syste and its popularity derives in part fro the fact that it is unstable without control. The fundaental principle within this control syste can be found in any industrial applications, such as stability control of waling robots. A. Lego Robot Configuration The robot was built using Lego Mindstors, Lego NXT, which is an educational product released by Lego. The structure was priarily designed with the aid of the Lego odelling progra, Lego Digital Designer. The Equilibrist Lego Robot is presented in Fig.. The hardware included in the Lego NXT consists of two icrocontrollers, a aster 3-bit (Atel AT9SAM7) and a secondary 8-bit (ATega48), Bluetooth counication odule, display, USB counication, aong other characteristics. The NXT version used in this wor is equipped with a 3-bit ARM7 icroprocessor running the RobotC firware. Table I presents the list of paraeters and corresponding nuerical values considered in this wor for the Equilibrist Robot. Fig.. Configuration of the Equilibrist Lego Robot. TABLE I LIST OF PARAMETERS AND NUMERICAL VALUES USED Paraeter Value Description M = 0.5 [g] Body weight W = 0.4 [] Body width D = [] Body depth H = 0.67 [] Body height = [g] Wheel weight R = 0.03 [] Wheel radius L=H/ [] Distance of the centre of ass to the wheels axis J ψ = ML^/3 [g ] Body pitch inertia oent J ϕ = [g ] Body yaw inertia oent M(W +D )/ J = 0E 5 [g ] DC otor inertia oent R = 6.69 [Ω] DC otor resistance K b = [V sec/rad] EMF constant K t = 0.37 [N/A] DC otor torque constant N = Gear ratio f = 0.00 [N/(rad/s)] Friction coefficient between body and DC otor f w = 0 Friction coefficient between wheel and floor g = 9.8 [/sec ] Gravity acceleration The paraeters used for the DC otors were found in [], [3]. The expressions for the body pitch and yaw oents of inertia and the values for the friction coefficients were also taen fro [], [3]. B. Gyro Sensor The sensor used in this wor was a Gyroscope fro Dexter Industries. The proble of using a gyroscope is that its value drifts over tie. In Fig the drift of the angular position is visible. In order to solve this proble a recursive filter was ipleented following equation (): offset a * O( ) ( a ) * O ( ) () where O() is the current value being read and O( ) is the previous one. The gyro filtered value is constantly updated by adding a percentage of the previous and the current gyro values. To deterine the angular velocity, the signal fro the gyro was used directly after applying the recursive filter. In order to reconstruct the angle, the gyroscope signal was integrated. Through trial and error procedure, a value of a = 0.99 in the filter was found to correct the angle ISBN: ISSN: (Print); ISSN: (Online) WCE 05

3 Proceedings of the World Congress on Engineering 05 Vol I WCE 05, July - 3, 05, London, U.K. estiates. In Fig 3 the integration of gyroscope easureent with the filter ipleentation is shown: the angular position value is approxiately zero when the gyro is stationary. 0 0 A A ( 3, ) A ( 4, ) A ( 3, 3 ) A ( 4, 3 ) B B ( 3 ) B ( 3 ) B ( 4 ) B ( 4 ) 0 A ( 3, 4 ) A ( 4, 4 ) (4) (5) Fig.. Integration of gyroscope easureents without filter: initially the angular position is zero (gyro stationary); after altering the position of the gyro sensor the stationary value has drifted. Fig.3. Integration of gyroscope easureents with filter: the angular position value is approxiately zero when the gyro is stationary. C. Bluetooth counication The NXT has the possibility to counicate via Bluetooth with a PC, obile phones or others NXTs. In this wor, Bluetooth counication was used to control the position of the robot. The protocol used was based on the Lego protocol and it can be found in [4]. III. MATHEMATICAL MODEL The atheatical odel used in this project was based on the NXTway-GS docuentation. For ore details see [] and [3]. A. Open Loop The state-space vector considers the otor angle, the body angle, the otor velocity and the body velocity as state-space variables (). () x The state-space equation and atrices are shown in (3), (4) and (5), where u is the vector of the two voltages applied to the otors. A x B u (3) x where: alpha = n* K /R beta = n* K * K /R tp = beta + f E_ = ( * + M) * R E_ = M * L * R - * E_ = M * L t dete = E_ * E_ - E_ A (3,3) A (4,4) B (4) = - * = - alpha t w b + J = - * (tp + f n + * J * J + * n w * J A (3,) = - g * M * L * E_/detE A (4,) = g * M * L * E_/detE A (3,4) = * beta * ( E_ + E_ beta * ( E_ + E_ B (3) = alpha * ( E_ + E_ * ( E_ + E_ + * n * E_ + beta * E_ A (4,3) = * (tp * E_ + beta * E_ * J The open loop response was siulated in Matlab with different initial conditions. The syste showed an unstable behaviour. B. Closed Loop: Linear Quadratic Regulator The Linear Quadratic Regulator (LQR) ethod was ipleented to stabilize and control the syste and reduce steady-state errors by providing feedbac weighting for the input paraeters. Considering syste inputs and outputs (4 th order syste), and noting that there is now an additional state due to an integrator being included in the feedbac loop of the body pitch variable, atrices A and B are then defined as: (6) A 0 A ( 3, ) A ( 3, 3 ) A ( 3, 4 ) 0 0 A ( 4, ) A ( 4, 3 ) A ( 4, 4 ) (7) B B ( 3 ) B ( 3 ) B ( 4 ) B ( 4 ) 0 0 and the feedbac equation (8) u Kx x (8) The reason why there are two identical feedbac control ISBN: ISSN: (Print); ISSN: (Online) WCE 05

4 Proceedings of the World Congress on Engineering 05 Vol I WCE 05, July - 3, 05, London, U.K. signals is that the control action is divided between two actuators, and due to the syetry, the sae gains are used for the left and right controller. Using the NXTway-GS docuentations, the following Q and R atrices were used []: x (9) Q x R (0) The LQR function in Matlab was then used to deterine specified weights for each of the controller feedbacs. The feedbac controller weightings are listed in Table II. The closed-loop step response is shown in Fig. 4. TABLE II LIST OF GAINS. Variable Gain Value Motor Angle Gyro Angle 48.9 Motor Velocity Gyro Velocity Integral Gain IV. IMPLEMENTATION During the ipleentation of the Equilibrist Robot soe considerations were taen into account regarding sapling frequency definition, controller perforance, tass priority and requisites for servo coand ipleentation. Fig.5. Final control diagra: C ψ is a atrix whose output is the inclination angle of the robot, ψ. K i is the integral gain to iniize the error of the pitch angle and K f is the vector with the LQR gains. The Proportional-Derivative (PD) controller has the ability to predict the tendency of future errors of the syste response. In order to increase the stability of the syste, a PD controller was added (Fig. 6). This iproved the robot s response to disturbances. The proportional constant K p was deterined using a Matlab script, and the derivative constant K d, was found by trial and error (nowing that it ight have a low value because it directly aplifies process noise). Fig.6. PD controller applied to the error fro the first part of the controller (Fig. 5). The controller gains were afterwards adjusted in siulation environent (Table III). TABLE III LIST OF THE CONTROLLER GAINS OBTAINED IN SIMULATION Gain Value Proportional Gain K p Integral gain K Derivative Gain K d Saturation 00 B. Tass priority Fig. 7 presents the tass priority definition for the Equilibrist platfor. At the top of the pyraid is the highest priority tas decreasing to the low level priority at the botto. The highest priority tas is the control routine that regulates the robot s angular position. Fig.4. Closed-loop step response. A. Control Syste The sapling frequency used (which was the sae frequency used for updating the controller) was 00 Hz. The sapling frequency was chosen based on the results fro the LQR siulation shown in the previous chapter. The final control diagra is shown in Fig. 5. Fig.7. Tas priorities: the highest priority is at the top of the pyraid. The ediu priority tass are obstacles avoidance and Bluetooth counication, both executed on regular intervals of 00 s, since they are not essential to ISBN: ISSN: (Print); ISSN: (Online) WCE 05

5 Proceedings of the World Congress on Engineering 05 Vol I WCE 05, July - 3, 05, London, U.K. equilibriu, yet, they are ore iportant than local and reote interface. At the botto of the pyraid are the two final tass where the tie is not critical, so they are executed when there is not any high priority tass to execute. C. Servo control and Reote Interface The Equilibrist platfor allows changing the position of the robot by changing the reference. Also, it is possible to turn the robot by applying a specific coand value to one of the otors. A graphical user interface (Fig. 8) was developed which allows the control of the servo position of the robot. This interface was based on [5] with the addition of arrow buttons, stop button and Turn text box. Several tests were perfored in the Equilibrist platfor: the static test, the disturbance test and the servo coand function. A. Static Test Fig. 0 to Fig. 3 show the state variables profiles for the Equilibrist without disturbances nor reference changing. The coand profile is presented in Fig. 4. Analysing the graphics it is possible to conclude that the controller perfors well as the velocity and body pitch is around zero. Fig.0. Body pitch angle. Fig.. Body pitch angular velocity. Fig.8. The servo position of the Equilibrist can be changed through the blue arrows and stop button or via the two text boxes ( Int to send and Turn ). V. EXPERIMENTAL RESULTS Fig. 9 shows the ipleented robot configuration. If the body is in a positive slope (body leaning forward), the coand value applied to the otor is negative (due to orientation of the otor) and thus goes forward to copensate for the tilt. If the body is with a negative slope (body leaning bacwards), the coand value applied to the otor is positive (due to orientation of the otor) and thus goes bac to copensate for the tilt. Fig.. DC otor angle. Fig.3. DC otor angular velocity. Fig.4. Coand value. Fig.9. Direction of wheels rotation according to body lean. The controller gains were adjusted in the Equilibrist platfor taing into account the real world constraints (Table IV). TABLE IV LIST OF THE CONTROLLER GAINS EXPERIMENTALLY ADJUSTED Gain Value Proportional Gain K p Integral gain K 5.5 Derivative Gain K d Saturation 00 B. Disturbance Test In the disturbance test, an extra ass was placed on the Equilibrist, but the syste anaged to successfully respond and go bac to the equilibriu position (Fig. 5 to Fig. 8). Fig. 9 shows the coand profile ipleented. Fig.5. Body pitch angle ψ. ISBN: ISSN: (Print); ISSN: (Online) WCE 05

6 Proceedings of the World Congress on Engineering 05 Vol I WCE 05, July - 3, 05, London, U.K. Fig.6. Body pitch angular velocity. LQR siulation, the PD controller constants were deterined by Matlab (K p ) and by trial and error (K d ). The syste tass were prioritized in order to enable a good perforance of the whole syste and the experients revealed that the robot perfored well, even when subjected to an external ass disturbance. REFERENCES Fig.7. DC otor angle θ. Fig.8. DC otor angular velocity. Fig.9. Coand value. C. Servo Coand Test The robot reference position was changed through the developed interface under Bluetooth counication. The Equilibrist anage to follow the new reference and aintain equilibriu (Fig. 0). Fig.0. Servo controller: reference variation. [] R. P. M. Chan, K. A. Stol, and C. R. Halyard, Review of odelling and control of two-wheeled robots, Annual Reviews in Control,vol. 37, pp , 03. [] Segway: accessed on March 05. [3] R. Bansevicius, A. Lipnicas, V. Jusa, and V. Raudonis, Piezoelectric Inverted Pendulu as a Teaching Aid for Mechatronics Courses, IEEE International Worshop on Intelligent Data Acquisition and Advanced Coputing Systes: Technology and Applications, -3 Septeber 009, Rende (Cosenza), Italy. [4] G. Figueroa-Flores, A. Leal-Naranjo, C. R. Torres-San Miguel, G. Urriolagoitia-Sosa, and G. Urriolagoitia-Calderón, Ipleentation of an Intelligent Controller into a Robotic Device for Rehabilitation Intended for Lower Extreity Paralysis Patients, Journal of Cheical, Biological and Physical Sciences, special Issue, Section C; 30 Nov Vol. 4, No. 5, pp. 5-7, 04. [5] Looat: accessed on March 05. [6] J. Han, X. Li, and Q. Qin, Design of Two-Wheeled Self-Balancing Robot Based on Sensor Fusion Algorith, Int. J. of Autoation Technology, Vol.8, No., 04. [7] L. Sun and J. Gan, Researching of Two-Wheeled Self-Balancing Robot Base on LQR Cobined with PID, nd International Worshop on Intelligent Systes and Applications (ISA), -3 May, Wuhan, 00. [8] H. Juang and K. Lu, Design and Control of a Two-Wheel Self- Balancing Robot using the Arduino Microcontroller Board, 0th IEEE International Conference on Control and Autoation (ICCA), Hangzhou, China, June -4, 03. [9] J. Hua, Y. Cui, P. Shi, Y. Yang, and H. Li Force Feedbac Assisted Balancing of Inverted Pendulu under Manual Control, Fourth International Conference on Intelligent Control and Inforation Processing (ICICIP), June 9, Beijing, China, 03. [0] W. An and Y. Li, Siulation and Control of a Two-wheeled Selfbalancing Robot, Proceeding of the IEEE International Conference on Robotics and Bioietics (ROBIO), Shenzhen, China, Dec. 03. [] H. Vasudevan, A. M. Dollar, and J.B. Morrell, Design for control of wheeled inverted pendulu platfors, Journal of Mechaniss and Robotics, Noveber 05, Volue 7, Issue 4, 05. [] Y. Yaaoto. NXTway-GS (Self-balancing two Wheeled Robot) Controller Design, NXTway-GS--self-balancing-two-wheeled-robot--controller-design, accessed on Noveber 04. [3] GELway - A self-balancing robot, accessed on Noveber 04 [4] LEGO counication protocol, robot/downloads/detail?nae=appendix%0- LEGO%0MINDSTORMS%0NXT%0Counication%0protoco l.pdf, accessed on January 05 [5] Counicating with LEGO NXT via Bluetooth in C, LEGO-NXT-via-Bluetooth-in-C#, accessed on January 05 VI. CONCLUSION This paper described the design and ipleentation of a self-balancing two-wheeled robot. By using the Linear Quadratic Regulator ethod and PID controller for state feedbac, robot equilibriu was successfully achieved. The atheatical odel used for this robot was siulated in both open and closed loop configurations and used to base the hardware and software ipleentation, the design of the inertial syste, and the paraeters used in control. An interface and the counication protocol were also described. With a sapling frequency of 00 Hz chosen by ISBN: ISSN: (Print); ISSN: (Online) WCE 05

Laboratory Manual for DC Servo System Control Platform

Laboratory Manual for DC Servo System Control Platform Laboratory Manual for DC Servo Syste Control Platfor GSMT Series V1.01 2012.06 www.googoltech.co.cn 2012 Googol Technology. All rights reserved Copyrights Stateent All rights are reserved by The shall

More information

Torsion System. Encoder #3 ( 3 ) Third encoder/disk for Model 205a only. Figure 1: ECP Torsion Experiment

Torsion System. Encoder #3 ( 3 ) Third encoder/disk for Model 205a only. Figure 1: ECP Torsion Experiment Torsion Syste Introduction This lab experient studies dynaics of a torsional syste with single and ultiple degrees of freedo. The effects of various control configurations are studied in later part of

More information

Precise Indoor Localization System For a Mobile Robot Using Auto Calibration Algorithm

Precise Indoor Localization System For a Mobile Robot Using Auto Calibration Algorithm Precise Indoor Localization Syste For a Mobile Robot Using Auto Calibration Algorith Sung-Bu Ki, JangMyung Lee, and I.O. Lee : Pusan National University, http://robotics.ee.pusan.ac.r, : Ninety syste Abstract:

More information

Parameter Identification of Transfer Functions Using MATLAB

Parameter Identification of Transfer Functions Using MATLAB Paraeter Identification of Transfer Functions Using MATLAB Mato Fruk, Goran Vujisić, Toislav Špoljarić Departent of Electrical Engineering The Polytechnic of Zagreb Konavoska, Zagreb, Croatia ato.fruk@tvz.hr,

More information

SELF-BALANCING MOBILE ROBOT TILTER

SELF-BALANCING MOBILE ROBOT TILTER Tomislav Tomašić Andrea Demetlika Prof. dr. sc. Mladen Crneković ISSN xxx-xxxx SELF-BALANCING MOBILE ROBOT TILTER Summary UDC 007.52, 62-523.8 In this project a remote controlled self-balancing mobile

More information

EXPERIMENTATION FOR ACTIVE VIBRATION CONTROL

EXPERIMENTATION FOR ACTIVE VIBRATION CONTROL CHPTER - 6 EXPERIMENTTION FOR CTIVE VIBRTION CONTROL 6. INTRODUCTION The iportant issues in vibration control applications are odeling the sart structure with in-built sensing and actuation capabilities

More information

Applied Digital Control: Optimization for System Identification and Controller Design

Applied Digital Control: Optimization for System Identification and Controller Design Applied Digital Control: Optiization for Syste Identification and Controller Design David G. Wilson Mechanical Engineering University of New Mexico 1. wilson@e.un.edu 2. starr@un.edu 2/27/2006 Lecture

More information

Modeling and Parameter Identification of a DC Motor Using Constraint Optimization Technique

Modeling and Parameter Identification of a DC Motor Using Constraint Optimization Technique IOSR Journal of Mechanical and Civil Engineering (IOSR-JMCE) e-issn: 2278-684,p-ISSN: 2320-334X, Volue 3, Issue 6 Ver. II (Nov. - Dec. 206), PP 46-56 www.iosrjournals.org Modeling and Paraeter Identification

More information

Power Improvement in 64-Bit Full Adder Using Embedded Technologies Er. Arun Gandhi 1, Dr. Rahul Malhotra 2, Er. Kulbhushan Singla 3

Power Improvement in 64-Bit Full Adder Using Embedded Technologies Er. Arun Gandhi 1, Dr. Rahul Malhotra 2, Er. Kulbhushan Singla 3 Power Iproveent in 64-Bit Full Adder Using Ebedded Technologies Er. Arun Gandhi 1, Dr. Rahul Malhotra 2, Er. Kulbhushan Singla 3 1 Departent of ECE, GTBKIET, Chhapianwali Malout, Punjab 2 Director, Principal,

More information

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists 4,1 116, 12M Open access books available International authors and editors Downloads Our authors

More information

SECURITY AND BER PERFORMANCE TRADE-OFF IN WIRELESS COMMUNICATION SYSTEMS APPLICATIONS

SECURITY AND BER PERFORMANCE TRADE-OFF IN WIRELESS COMMUNICATION SYSTEMS APPLICATIONS Latin Aerican Applied Research 39:187-192 (2009) SECURITY AND BER PERFORMANCE TRADE-OFF IN WIRELESS COMMUNICATION SYSTEMS APPLICATIONS L. ARNONE, C. GONZÁLEZ, C. GAYOSO, J. CASTIÑEIRA MOREIRA and M. LIBERATORI

More information

POWER QUALITY ASSESSMENT USING TWO STAGE NONLINEAR ESTIMATION NUMERICAL ALGORITHM

POWER QUALITY ASSESSMENT USING TWO STAGE NONLINEAR ESTIMATION NUMERICAL ALGORITHM POWER QUALITY ASSESSENT USING TWO STAGE NONLINEAR ESTIATION NUERICAL ALGORITH Vladiir Terzia ABB Gerany vadiir.terzia@de.abb.co Vladiir Stanoevic EPS Yugoslavia vla_sta@hotail.co artin axiini ABB Gerany

More information

PID CONTROL FOR TWO-WHEELED INVERTED PENDULUM (WIP) SYSTEM

PID CONTROL FOR TWO-WHEELED INVERTED PENDULUM (WIP) SYSTEM PID CONTROL FOR TWO-WHEELED INVERTED PENDULUM (WIP) SYSTEM Bogdan Grămescu, Constantin Niţu, Nguyen Su Phuong Phuc, Claudia Irina Borzea University POLITEHNICA of Bucharest 313, Splaiul Independentei,

More information

A soft decision decoding of product BCH and Reed-Müller codes for error control and peak-factor reduction in OFDM

A soft decision decoding of product BCH and Reed-Müller codes for error control and peak-factor reduction in OFDM A soft decision decoding of product BCH and Reed-Müller codes for error control and pea-factor reduction in OFDM Yves LOUET *, Annic LE GLAUNEC ** and Pierre LERAY ** * PhD Student and ** Professors, Departent

More information

Embedded Robust Control of Self-balancing Two-wheeled Robot

Embedded Robust Control of Self-balancing Two-wheeled Robot Embedded Robust Control of Self-balancing Two-wheeled Robot L. Mollov, P. Petkov Key Words: Robust control; embedded systems; two-wheeled robots; -synthesis; MATLAB. Abstract. This paper presents the design

More information

A New Localization and Tracking Algorithm for Wireless Sensor Networks Based on Internet of Things

A New Localization and Tracking Algorithm for Wireless Sensor Networks Based on Internet of Things Sensors & Transducers 203 by IFSA http://www.sensorsportal.co A New Localization and Tracking Algorith for Wireless Sensor Networks Based on Internet of Things, 2 Zhang Feng, Xue Hui-Feng, 2 Zhang Yong-Heng,

More information

Design and Implementation of Serial Port Ultrasonic Distance Measurement System Based on STC12 Jian Huang

Design and Implementation of Serial Port Ultrasonic Distance Measurement System Based on STC12 Jian Huang International Conference on Education, Manageent and Coputer Science (ICEMC 2016) Design and Ipleentation of Serial Port Ultrasonic Distance Measureent Syste Based on STC12 Jian Huang Xijing University,

More information

Adaptive Harmonic IIR Notch Filter with Varying Notch Bandwidth and Convergence Factor

Adaptive Harmonic IIR Notch Filter with Varying Notch Bandwidth and Convergence Factor Journal of Counication and Coputer (4 484-49 doi:.765/548-779/4.6. D DAVID PUBLISHING Adaptive Haronic IIR Notch Filter with Varying Notch Bandwidth and Convergence Factor Li Tan, Jean Jiang, and Liango

More information

Design of Pretension Tubular Rope Machine Control System Based on RBFNN Tuning PID

Design of Pretension Tubular Rope Machine Control System Based on RBFNN Tuning PID 06 International Conference on Coputer, Mechatronics and Electronic Engineering (CMEE 06) ISBN: 978--60595-406-6 Design of Pretension ubular Rope Machine Control Syste Based on RBFNN uning PID Hui LI and

More information

Department of Mechanical and Aerospace Engineering, Case Western Reserve University, Cleveland, OH, 2

Department of Mechanical and Aerospace Engineering, Case Western Reserve University, Cleveland, OH, 2 Subission International Conference on Acoustics, Speech, and Signal Processing (ICASSP ) PARAMETRIC AND NON-PARAMETRIC SIGNAL ANALYSIS FOR MAPPING AIR FLOW IN THE EAR-CANALTO TONGUE MOVEMENT: A NEW STRATEGY

More information

Assignment 9 Ball and Beam Design Project

Assignment 9 Ball and Beam Design Project EE-371 CONTROL SYSTEMS LABORATORY Assignent 9 Ball and Bea Design Project Purpose The objectives of this project are: To obtain a atheatical odel and a linearized odel of the ball and bea syste. Design

More information

ELEC2202 Communications Engineering Laboratory Frequency Modulation (FM)

ELEC2202 Communications Engineering Laboratory Frequency Modulation (FM) ELEC Counications Engineering Laboratory ---- Frequency Modulation (FM) 1. Objectives On copletion of this laboratory you will be failiar with: Frequency odulators (FM), Modulation index, Bandwidth, FM

More information

Nano positioning control for dual stage using minimum order observer

Nano positioning control for dual stage using minimum order observer Journal of Mechanical Science and Technology 26 (3) (212) 941~947 www.springerlink.co/content/1738-494x DOI 1.17/s1226-11-1252-8 Nano positioning control for dual stage using iniu order observer Hong Gun

More information

TESTING OF ADCS BY FREQUENCY-DOMAIN ANALYSIS IN MULTI-TONE MODE

TESTING OF ADCS BY FREQUENCY-DOMAIN ANALYSIS IN MULTI-TONE MODE THE PUBLISHING HOUSE PROCEEDINGS OF THE ROMANIAN ACADEMY, Series A, OF THE ROMANIAN ACADEMY Volue 5, Nuber /004, pp.000-000 TESTING OF ADCS BY FREQUENCY-DOMAIN ANALYSIS IN MULTI-TONE MODE Daniel BELEGA

More information

Developing Active Sensor Networks with Micro Mobile Robots: Distributed Node Localization

Developing Active Sensor Networks with Micro Mobile Robots: Distributed Node Localization Developing Active Networks with Micro Mobile Robots: Distributed Node Localization Weihua Sheng and Gira Tewolde Kettering University/Forerly GMI Flint, MI 484 Eail: wsheng@kettering.edu Abstract Top-down

More information

Secondary-side-only Simultaneous Power and Efficiency Control in Dynamic Wireless Power Transfer System

Secondary-side-only Simultaneous Power and Efficiency Control in Dynamic Wireless Power Transfer System 069060 Secondary-side-only Siultaneous Power and Efficiency Control in Dynaic Wireless Power Transfer Syste 6 Giorgio ovison ) Daita Kobayashi ) Takehiro Iura ) Yoichi Hori ) ) The University of Tokyo,

More information

ACCURATE DISPLACEMENT MEASUREMENT BASED ON THE FREQUENCY VARIATION MONITORING OF ULTRASONIC SIGNALS

ACCURATE DISPLACEMENT MEASUREMENT BASED ON THE FREQUENCY VARIATION MONITORING OF ULTRASONIC SIGNALS XVII IMEKO World Congress Metrology in 3rd Millenniu June 22 27, 2003, Dubrovnik, Croatia ACCURATE DISPLACEMENT MEASUREMENT BASED ON THE FREQUENCY VARIATION MONITORING OF ULTRASONIC SIGNALS Ch. Papageorgiou

More information

A Wireless Transmission Technique for Remote Monitoring and Recording System on Power Devices by GPRS Network

A Wireless Transmission Technique for Remote Monitoring and Recording System on Power Devices by GPRS Network Proceedings of the 6th WSEAS International Conference on Instruentation, Measureent, Circuits & Systes, Hangzhou, China, April 15-17, 007 13 A Wireless Transission Technique for Reote Monitoring and Recording

More information

CHAPTER 2 POSITION SERVO DRIVE OF BLDC MOTOR FOR SINGLE LINK ROBOTIC ARM

CHAPTER 2 POSITION SERVO DRIVE OF BLDC MOTOR FOR SINGLE LINK ROBOTIC ARM 22 CHAPTER 2 POSITION SERVO DRIVE OF BLDC MOTOR FOR SINGLE LINK ROBOTIC ARM 2.1 INTRODUCTION An industrial autoation involves robotic to handle aterials in different environents with different pay loads

More information

EFFECTS OF MASKING ANGLE AND MULTIPATH ON GALILEO PERFORMANCES IN DIFFERENT ENVIRONMENTS

EFFECTS OF MASKING ANGLE AND MULTIPATH ON GALILEO PERFORMANCES IN DIFFERENT ENVIRONMENTS 1 EFFECTS OF MASKING ANGLE AND MULTIPATH ON GALILEO PERFORMANCES IN DIFFERENT ENVIRONMENTS M. Malicorne*, M. Bousquet**, V. Calettes*** SUPAERO, 1 avenue Edouard Belin BP 43, 3155 Toulouse Cedex, France.

More information

SAMPLING PERIOD ASSIGNMENT FOR NETWORKED CONTROL SYSTEMS BASED ON THE PLANT OPERATION MODE

SAMPLING PERIOD ASSIGNMENT FOR NETWORKED CONTROL SYSTEMS BASED ON THE PLANT OPERATION MODE SAMPLING PERIOD ASSIGNMENT FOR NETWORKED CONTROL SYSTEMS BASED ON THE PLANT OPERATION MODE Daniel A. Perez, Ubirajara F. Moreno, Carlos B. Montez, Tito L. M. Santos PGEAS - Prograa de Pós-Graduação e Engenharia

More information

Design of a Radioactive Source Sampler Based on CPAC

Design of a Radioactive Source Sampler Based on CPAC IJCSI International Journal of Coputer Science Issues, Vol. 0, Issue, No, March 03 ISSN (Print): 694-084 ISSN (Online): 694-0784 www.ijcsi.org Design of a Radioactive Source Sapler Based on CPAC Bin Yang,

More information

Embedded Control Project -Iterative learning control for

Embedded Control Project -Iterative learning control for Embedded Control Project -Iterative learning control for Author : Axel Andersson Hariprasad Govindharajan Shahrzad Khodayari Project Guide : Alexander Medvedev Program : Embedded Systems and Engineering

More information

Comparison Between PLAXIS Output and Neural Network in the Guard Walls

Comparison Between PLAXIS Output and Neural Network in the Guard Walls Coparison Between PLAXIS Output and Neural Network in the Guard Walls Ali Mahbod 1, Abdolghafar Ghorbani Pour 2, Abdollah Tabaroei 3, Sina Mokhtar 2 1- Departent of Civil Engineering, Shahid Bahonar University,

More information

DSI3 Sensor to Master Current Threshold Adaptation for Pattern Recognition

DSI3 Sensor to Master Current Threshold Adaptation for Pattern Recognition International Journal of Signal Processing Systes Vol., No. Deceber 03 DSI3 Sensor to Master Current Threshold Adaptation for Pattern Recognition David Levy Infineon Austria AG, Autootive Power Train Systes,

More information

Robust Acceleration Control of Electrodynamic Shaker Using µ Synthesis

Robust Acceleration Control of Electrodynamic Shaker Using µ Synthesis Proceedings of the 44th IEEE Conference on Decision and Control, and the European Control Conference 5 Seville, Spain, Deceber -5, 5 WeIC8. Robust Acceleration Control of Electrodynaic Shaker Using µ Synthesis

More information

THE IMPLEMENTATION OF PERMANENT MAGNET SYNCHRONOUS MOTOR SPEED TRACKING BASED ON ONLINEARTIFICIAL NEURAL NETWORK

THE IMPLEMENTATION OF PERMANENT MAGNET SYNCHRONOUS MOTOR SPEED TRACKING BASED ON ONLINEARTIFICIAL NEURAL NETWORK ISSN 1819-668 26-213 AsianResearch PublishingNetwork (ARPN).Allrights reserved. www.arpnjournals.co THE IMPLEMENTATION OF PERMANENT MAGNET SYNCHRONOUS MOTOR SPEED TRACKING BASED ON ONLINEARTIFICIAL NEURAL

More information

New Adaptive Linear Combination Structure for Tracking/Estimating Phasor and Frequency of Power System

New Adaptive Linear Combination Structure for Tracking/Estimating Phasor and Frequency of Power System 28 Journal of Electrical Engineering & echnology Vol. 5, No., pp. 28~35, 2 New Adaptive Linear Cobination Structure for racking/estiating Phasor and Frequency of Power Syste Choowong-Wattanasakpubal and

More information

AccuBridge TOWARDS THE DEVELOPMENT OF A DC CURRENT COMPARATOR RATIO STANDARD

AccuBridge TOWARDS THE DEVELOPMENT OF A DC CURRENT COMPARATOR RATIO STANDARD AccuBridge TOWARD THE DEVELOPMENT OF A DC CURRENT COMPARATOR RATO TANDARD Duane Brown,Andrew Wachowicz, Dr. hiping Huang 3 Measureents nternational, Prescott Canada duanebrown@intl.co, Measureents nternational,

More information

Hand Gesture Recognition and Its Application in Robot Control

Hand Gesture Recognition and Its Application in Robot Control IJCSI International Journal of Coputer Science Issues, Volue 13, Issue 1, January 016 www.ijcsi.org 10 Hand Gesture Recognition and Its Application in Robot Control Pei-Guo Wu 1 and Qing-Hu Meng 1 Inforation

More information

Implementation of Adaptive Viterbi Decoder

Implementation of Adaptive Viterbi Decoder Ipleentation of Adaptive Viterbi Decoder Devendra Made #1 VIII Se B.E.(Etrx) K.D.K.College of Engineering, Nagpur, Maharashtra(I) Asst. Prof. R.B. Khule *2 M.Tech V.L.S.I. K.D.K.College of Engineering,

More information

Modeling and Control of a Robot Arm on a Two Wheeled Moving Platform Mert Onkol 1,a, Cosku Kasnakoglu 1,b

Modeling and Control of a Robot Arm on a Two Wheeled Moving Platform Mert Onkol 1,a, Cosku Kasnakoglu 1,b Applied Mechanics and Materials Vols. 789-79 (15) pp 735-71 (15) Trans Tech Publications, Switzerland doi:1.8/www.scientific.net/amm.789-79.735 Modeling and Control of a Robot Arm on a Two Wheeled Moving

More information

NINTH INTERNATIONAL CONGRESS ON SOUND AND VIBRATION, ICSV9 PASSIVE CONTROL OF LAUNCH NOISE IN ROCKET PAYLOAD BAYS

NINTH INTERNATIONAL CONGRESS ON SOUND AND VIBRATION, ICSV9 PASSIVE CONTROL OF LAUNCH NOISE IN ROCKET PAYLOAD BAYS first nae & faily nae: Rick Morgans Page nuber: 1 NINTH INTERNATIONAL CONGRESS ON SOUND AND VIBRATION, ICSV9 PASSIVE CONTROL OF LAUNCH NOISE IN ROCKET PAYLOAD BAYS Rick Morgans, Ben Cazzolato, Anthony

More information

An Automatic Control Strategy of Strip Width in Cold Rolling

An Automatic Control Strategy of Strip Width in Cold Rolling Advanced Materials Research Subitted: 204-06-04 ISSN: 662-8985, Vols. 004-005, pp 22-225 Accepted: 204-06-08 doi:0.4028/www.scientific.net/amr.004-005.22 Online: 204-08-3 204 Trans Tech Publications, Switzerland

More information

Advances in Military Technology Vol. 7, No. 1, June Requirements for Control System of Mobile Free Space Optical Link

Advances in Military Technology Vol. 7, No. 1, June Requirements for Control System of Mobile Free Space Optical Link AiMT Advances in Military Technology Vol. 7, No. 1, June 01 Requireents for Control Syste of Mobile Free Space Optical Link J. Čižár * and J. Něeček Departent of Aerospace Electrical Systes, University

More information

Real-Time Attitude Determination of a Nanosatellite Using GPS Signal-to-Noise Ratio Observations

Real-Time Attitude Determination of a Nanosatellite Using GPS Signal-to-Noise Ratio Observations Real-Tie Attitude Deterination of a Nanosatellite Using GPS Signal-to-Noise Ratio Oservations The University of Teas at Austin Shaun M. Stewart Greg N. Holt FASTRAC Mission Foration Autonoy Spacecraft

More information

Dynamic Model Displacement for Model-mediated Teleoperation

Dynamic Model Displacement for Model-mediated Teleoperation Dynaic Model Displaceent for Model-ediated Teleoperation Xiao Xu Giulia Paggetti Eckehard Steinbach Institute for Media Technology, Technische Universität München, Munich, Gerany ABSTRACT In this paper,

More information

of an Efficient Electric

of an Efficient Electric Page00038 Abstract EVS5 Shenzhen, China, Nov 5-9, 010 Researches and Development of an Efficient Electric Personal Mover for City Commuters Cao Sijia 1, Huang Yagang 1, Zhang Youtong 1, Zhao Dong 1, Liu

More information

Selective Harmonic Elimination for Multilevel Inverters with Unbalanced DC Inputs

Selective Harmonic Elimination for Multilevel Inverters with Unbalanced DC Inputs Selective Haronic Eliination for Multilevel Inverters with Unbalanced DC Inputs Abstract- Selective haronics eliination for the staircase voltage wavefor generated by ultilevel inverters has been widely

More information

Track-Before-Detect for an Active Towed Array Sonar

Track-Before-Detect for an Active Towed Array Sonar 17-20 Noveber 2013, Victor Harbor, Australia Track-Before-Detect for an Active Towed Array Sonar Han X. Vu (1,2), Sauel J. Davey (1,2), Fiona K. Fletcher (1), Sanjeev Arulapala (1,2), Richard Elle (1)

More information

Mismatch error correction for time interleaved analog-to-digital converter over a wide frequency range

Mismatch error correction for time interleaved analog-to-digital converter over a wide frequency range Misatch error correction for tie interleaved analog-to-digital converter over a wide frequency range Zouyi Jiang,,2 Lei Zhao,,2,a) Xingshun Gao,2, Ruoshi Dong,2, Jinxin Liu,2, and Qi An,2 State Key Laboratory

More information

This is an author-deposited version published in: Eprints ID: 5737

This is an author-deposited version published in:   Eprints ID: 5737 Open Archive Toulouse Archive Ouverte (OATAO) OATAO is an open access repository that collects the work of Toulouse researchers and akes it freely available over the web where possible. This is an author-deposited

More information

Keywords: Equivalent Instantaneous Inductance, Finite Element, Inrush Current.

Keywords: Equivalent Instantaneous Inductance, Finite Element, Inrush Current. Discriination of Inrush fro Fault Currents in Power Transforers Based on Equivalent Instantaneous Inductance Technique Coupled with Finite Eleent Method Downloaded fro ijeee.iust.ac.ir at 5:47 IRST on

More information

Segway Robot Designing And Simulating, Using BELBIC

Segway Robot Designing And Simulating, Using BELBIC IOSR Journal of Computer Engineering (IOSR-JCE) e-issn: 2278-0661,p-ISSN: 2278-8727, Volume 18, Issue 5, Ver. II (Sept - Oct. 2016), PP 103-109 www.iosrjournals.org Segway Robot Designing And Simulating,

More information

PREDICTING SOUND LEVELS BEHIND BUILDINGS - HOW MANY REFLECTIONS SHOULD I USE? Apex Acoustics Ltd, Gateshead, UK

PREDICTING SOUND LEVELS BEHIND BUILDINGS - HOW MANY REFLECTIONS SHOULD I USE? Apex Acoustics Ltd, Gateshead, UK PREDICTING SOUND LEVELS BEHIND BUILDINGS - HOW MANY REFLECTIONS SHOULD I USE? W Wei A Cooke J Havie-Clark Apex Acoustics Ltd, Gateshead, UK Apex Acoustics Ltd, Gateshead, UK Apex Acoustics Ltd, Gateshead,

More information

Research Article Novel Design for Reduction of Transformer Size in Dynamic Voltage Restorer

Research Article Novel Design for Reduction of Transformer Size in Dynamic Voltage Restorer Research Journal of Applied Sciences, Engineering and Technology 8(19): 057-063, 014 DOI:10.1906/rjaset.8.1198 ISSN: 040-7459; e-issn: 040-7467 014 Maxwell Scientific Publication Corp. Subitted: April

More information

A Robust Scheme for Distributed Control of Power Converters in DC Microgrids with Time-Varying Power Sharing

A Robust Scheme for Distributed Control of Power Converters in DC Microgrids with Time-Varying Power Sharing A Robust Schee for Distributed Control of Power Converters in DC Microgrids with Tie-Varying Power Sharing Mayank Baranwal,a, Alireza Askarian,b, Srinivasa M. Salapaka,c and Murti V. Salapaka,d Abstract

More information

Detection of Faults in Power System Using Wavelet Transform and Independent Component Analysis

Detection of Faults in Power System Using Wavelet Transform and Independent Component Analysis Detection of Faults in Power Syste Using Wavelet Transfor and Independent Coponent Analysis 1 Prakash K. Ray, 2 B. K. Panigrahi, 2 P. K. Rout 1 Dept. of Electrical and Electronics Engineering, IIIT, Bhubaneswar,

More information

A simple charge sensitive preamplifier for experiments with a small number of detector channels

A simple charge sensitive preamplifier for experiments with a small number of detector channels A siple charge sensitive preaplifier for experients with a sall nuber of detector channels laudio Arnaboldi and Gianluigi Pessina Istituto Nazionale di Fisica Nucleare (INFN) Università degli Studi di

More information

ELECTROMAGNETIC COVERAGE CALCULATION IN GIS

ELECTROMAGNETIC COVERAGE CALCULATION IN GIS ELECTROMAGNETIC COVERAGE CALCULATION IN GIS M. Uit Guusay 1, Alper Sen 1, Uut Bulucu 2, Aktul Kavas 2 1 Yildiz Technical University, Departent of Geodesy and Photograetry Engineering, Besiktas, Istanbul,

More information

Dual-Band Channel Measurements for an Advanced Tyre Monitoring System

Dual-Band Channel Measurements for an Advanced Tyre Monitoring System Dual-Band Channel Measureents for an Advanced Tyre Monitoring Syste Gregor Lasser and Christoph F. Mecklenbräuker Vienna University of Technology Institute of Counications and Radio-Frequency Engineering

More information

Compensated Single-Phase Rectifier

Compensated Single-Phase Rectifier Copensated Single-Phase Rectifier Jānis DoniĦš Riga Technical university jdonins@gail.co Abstract- Paper describes ethods of rectified DC pulsation reduction adding a ensation node to a single phase rectifier.

More information

WIPL-D Pro: What is New in v12.0?

WIPL-D Pro: What is New in v12.0? WIPL-D Pro: What is New in v12.0? Iproveents/new features introduced in v12.0 are: 1. Extended - Extree Liits a. Extreely LOW contrast aterials b. Extended resolution for radiation pattern c. Extreely

More information

Alternative Encoding Techniques for Digital Loudspeaker Arrays

Alternative Encoding Techniques for Digital Loudspeaker Arrays Alternative Encoding Techniques for Digital Loudspeaer Arrays Fotios Kontoichos, Nicolas Alexander Tatlas, and John Mourjopoulos Audio and Acoustic Technology Group, Wire Counications Laboratory, Electrical

More information

ANALYSIS AND SIMULATION OF PULSE TRANSFORMER CONSIDERING LEAKAGE INDUCTANCE AND CAPACITANCE

ANALYSIS AND SIMULATION OF PULSE TRANSFORMER CONSIDERING LEAKAGE INDUCTANCE AND CAPACITANCE ANALYSIS AND SIMULATION OF PULSE TRANSFORMER CONSIDERING LEAKAGE INDUCTANCE AND CAPACITANCE ABOLFAZL VAHEDI, HOSSEIN HEYDARI, and FARAMARZ FAGHIHI Electrical Engineering Departent, High Voltage & Magnetic

More information

Switching Transients of Low Cost Two Speed Drive for Single-Phase Induction Machine

Switching Transients of Low Cost Two Speed Drive for Single-Phase Induction Machine Switching Transients of Low Cost Two Speed Drive for Single-Phase Induction Machine L. Woods, A. Hoaifar, F. Fatehi M. Choat, T. Lipo CA&T State University University of Wisconsin-Madison Greensboro, C

More information

PARAMETER OPTIMIZATION OF THE ADAPTIVE MVDR QR-BASED BEAMFORMER FOR JAMMING AND MULTIPATH SUPRESSION IN GPS/GLONASS RECEIVERS

PARAMETER OPTIMIZATION OF THE ADAPTIVE MVDR QR-BASED BEAMFORMER FOR JAMMING AND MULTIPATH SUPRESSION IN GPS/GLONASS RECEIVERS PARAMETER OPTIMIZATION OF THE ADAPTIVE MVDR QR-BASED BEAMFORMER FOR JAMMING AND MULTIPATH SUPRESSION IN GPS/GLONASS RECEIVERS V. Behar 1, Ch. Kabakchiev 2, G. Gaydadjiev 3, G.Kuzanov 4, P. Ganchosov 5

More information

LUENBERGER ALGORITHM BASED HARMONICS ESTIMATOR FOR FRONT END RECTIFIER AND PWM-VSI

LUENBERGER ALGORITHM BASED HARMONICS ESTIMATOR FOR FRONT END RECTIFIER AND PWM-VSI LUENBERGER ALGORITHM BASED HARMONICS ESTIMATOR FOR FRONT END RECTIFIER AND PWM-VSI P Ajay-D-Vial Raj R.Sundaraurthy S Jeevananthan M.Sudhakaran Departent of Electrical and Electronics Engineering, Pondicherry

More information

Ignition and monitoring technique for plasma processing of multicell superconducting radio frequency cavities

Ignition and monitoring technique for plasma processing of multicell superconducting radio frequency cavities Ignition and onitoring technique for plasa processing of ulticell superconducting radio frequency cavities Marc Doleans Oak Ridge ational Laboratory, Oak Ridge, Tennessee 3783, USA E ail: doleans@ornl.gov

More information

APPLICATION OF THE FAN-CHIRP TRANSFORM TO HYBRID SINUSOIDAL+NOISE MODELING OF POLYPHONIC AUDIO

APPLICATION OF THE FAN-CHIRP TRANSFORM TO HYBRID SINUSOIDAL+NOISE MODELING OF POLYPHONIC AUDIO 6th European Signal Processing Conference (EUSIPCO 8), Lausanne, Switzerland, August 5-9, 8, copyright by EURASIP APPLICATION OF THE FAN-CHIRP TRANSFORM TO HYBRID SINUSOIDAL+NOISE MODELING OF POLYPHONIC

More information

899: DESIGN AND BUILD A BALLBOT

899: DESIGN AND BUILD A BALLBOT THE UNIVERSITY OF ADELAIDE FACULTY OF ENGINEERING, COMPUTER & MATHEMATICAL SCIENCES SCHOOL OF MECHANICAL ENGINEERING MECH ENG 435: MECHATRONICS HONOURS PROJECT 899: DESIGN AND BUILD A BALLBOT Final Report

More information

Modeling Beam forming in Circular Antenna Array with Directional Emitters

Modeling Beam forming in Circular Antenna Array with Directional Emitters International Journal of Research in Engineering and Science (IJRES) ISSN (Online): 2320-9364, ISSN (Print): 2320-9356 Volue 5 Issue 3 ǁ Mar. 2017 ǁ PP.01-05 Modeling Bea foring in Circular Antenna Array

More information

Fiber Bragg grating based four-bit optical beamformer

Fiber Bragg grating based four-bit optical beamformer Fiber Bragg grating based four-bit optical beaforer Sean Durrant a, Sergio Granieri a, Azad Siahakoun a, Bruce Black b a Departent of Physics and Optical Engineering b Departent of Electrical and Coputer

More information

Control System Design for Tricopter using Filters and PID controller

Control System Design for Tricopter using Filters and PID controller Control System Design for Tricopter using Filters and PID controller Abstract The purpose of this paper is to present the control system design of Tricopter. We have presented the implementation of control

More information

Real Time Etch-depth Measurement Using Surface Acoustic Wave Sensor

Real Time Etch-depth Measurement Using Surface Acoustic Wave Sensor Australian Journal of Basic and Applied Sciences, (8): -7, 1 ISSN 1991-8178 Real Tie Etch-depth Measureent Using Surface Acoustic Wave Sensor 1 Reza Hosseini, Navid Rahany, 3 Behrad Soltanbeigi, Rouzbeh

More information

Position Control of Servo Systems using PID Controller Tuning with Soft Computing Optimization Techniques

Position Control of Servo Systems using PID Controller Tuning with Soft Computing Optimization Techniques Position Control of Servo Systems using PID Controller Tuning with Soft Computing Optimization Techniques P. Ravi Kumar M.Tech (control systems) Gudlavalleru engineering college Gudlavalleru,Andhra Pradesh,india

More information

PID based controller design for attitude stabilization of Quad-rotor

PID based controller design for attitude stabilization of Quad-rotor Australian Journal of Basic and Applied Sciences, 8(4) Special 24, Pages: -5 PID based controller design for attitude stabilization of Quad-rotor M. Hassan Tanveer, 2 D. Hazry, 3 S. Faiz Ahed, 4 M. Karan

More information

Implementation of Wideband Digital Beam Forming in the E-band

Implementation of Wideband Digital Beam Forming in the E-band Ipleentation of Wideband Digital Bea Foring in the E-band Val Dyadyuk, Xiaojing Huang, Leigh Stokes, Joseph Pathikulangara ICT Centre, CSIRO, PO Box 76, Epping, NSW, Sydney, Australia This paper reports

More information

A Preprocessing Method to Increase High Frequency Response of A Parametric Loudspeaker

A Preprocessing Method to Increase High Frequency Response of A Parametric Loudspeaker A Preprocessing Method to Increase High Frequency Response of A Paraetric Loudspeaker Chuang Shi * and Woon-Seng Gan Digital Processing Laboratory School of Electrical and Electronic Engineering Nanyang

More information

Intermediate-Node Initiated Reservation (IIR): A New Signaling Scheme for Wavelength-Routed Networks with Sparse Conversion

Intermediate-Node Initiated Reservation (IIR): A New Signaling Scheme for Wavelength-Routed Networks with Sparse Conversion Interediate-Node Initiated Reservation IIR): A New Signaling Schee for Wavelength-Routed Networks with Sparse Conversion Kejie Lu, Jason P. Jue, Tiucin Ozugur, Gaoxi Xiao, and Irich Chlatac The Center

More information

Analysis of wind farm islanding experiment

Analysis of wind farm islanding experiment Downloaded fro orbit.dtu.dk on: Apr 4, 19 Analysis of wind far islanding experient Pedersen, Jørgen Kaas; Pedersen, Knud Ole Helgesen; Poulsen, Niels Kjølstad; Akke, Magnus Published in: I E E E Transactions

More information

Experiment 7: Frequency Modulation and Phase Locked Loops October 11, 2006

Experiment 7: Frequency Modulation and Phase Locked Loops October 11, 2006 Experient 7: Frequency Modulation and Phase ocked oops October 11, 2006 Frequency Modulation Norally, we consider a voltage wave for with a fixed frequency of the for v(t) = V sin(ω c t + θ), (1) where

More information

EQUALIZED ALGORITHM FOR A TRUCK CABIN ACTIVE NOISE CONTROL SYSTEM

EQUALIZED ALGORITHM FOR A TRUCK CABIN ACTIVE NOISE CONTROL SYSTEM EQUALIZED ALGORITHM FOR A TRUCK CABIN ACTIVE NOISE CONTROL SYSTEM Guangrong Zou, Maro Antila, Antti Lanila and Jari Kataja Sart Machines, VTT Technical Research Centre of Finland P.O. Box 00, FI-0 Tapere,

More information

Kalman Filtering for NLOS Mitigation and Target Tracking in Indoor Wireless Environment

Kalman Filtering for NLOS Mitigation and Target Tracking in Indoor Wireless Environment 16 Kalan Filtering for NLOS Mitigation and Target Tracking in Indoor Wireless Environent Chin-Der Wann National Sun Yat-Sen University Taiwan 1. Introduction Kalan filter and its nonlinear extension, extended

More information

An improved Active Islanding Detection Technology for Grid-connected Solar Photovoltaic System

An improved Active Islanding Detection Technology for Grid-connected Solar Photovoltaic System An iproved Active Islanding Detection Technology for Grid-connected Solar Photovoltaic Syste H. T. Yang, P. C. Peng, T. Y. Tsai, and Y. Y. Hong Abstract--Solar photovoltaic (PV) generation has drawn ore

More information

Direct F 0 Control of an Electrolarynx based on Statistical Excitation Feature Prediction and its Evaluation through Simulation

Direct F 0 Control of an Electrolarynx based on Statistical Excitation Feature Prediction and its Evaluation through Simulation INTERSPEECH 2014 Direct F 0 Control of an Electrolarynx based on Statistical Excitation Prediction and its Evaluation through Siulation Kou Tanaka, Tooki Toda, Graha Neubig, Sakriani Sakti, Satoshi Nakaura

More information

Evaluation of Steady-State and Dynamic Performance of a Synchronized Phasor Measurement Unit

Evaluation of Steady-State and Dynamic Performance of a Synchronized Phasor Measurement Unit 01 IEEE Electrical Power and Energy Conference Evaluation of Steady-State and Dynaic Perforance of a Synchronized Phasor Measureent Unit Dinesh Rangana Gurusinghe, Graduate Student Meber, IEEE, Athula

More information

Study and Implementation of Complementary Golay Sequences for PAR reduction in OFDM signals

Study and Implementation of Complementary Golay Sequences for PAR reduction in OFDM signals Study and Ipleentation of Copleentary Golay Sequences for PAR reduction in OFDM signals Abstract In this paper soe results of PAR reduction in OFDM signals and error correction capabilities by using Copleentary

More information

POD-001 PolaDetect. Operation Manual

POD-001 PolaDetect. Operation Manual POD-001 PolaDetect In-line high speed polarieter Operation Manual August 31, 2005 General Photonics Corp. Ph: (909) 590-5473 5228 Edison Ave. Fax: (909) 902-5536 Chino, CA 91710 USA www.generalphotonics.co

More information

Additive Synthesis, Amplitude Modulation and Frequency Modulation

Additive Synthesis, Amplitude Modulation and Frequency Modulation Additive Synthesis, Aplitude Modulation and Frequency Modulation Pro Eduardo R Miranda Varèse-Gastproessor eduardo.iranda@btinternet.co Electronic Music Studio TU Berlin Institute o Counications Research

More information

Novel Multilevel Inverter Carrier-Based PWM Method

Novel Multilevel Inverter Carrier-Based PWM Method 98 IEEE TRANSACTIONS ON INDUSTRY APPLICATIONS, VOL. 5, NO. 5, SEPTEMBER/OCTOBER 999 Novel Multilevel Inverter Carrier-Based PWM Method Leon M. Tolbert, Senior Meber, IEEE, and Thoas G. Habetler, Senior

More information

Carlson Software Inc. 102 West 2 nd Street Maysville, KY m Phone: (606) Fax: (606)

Carlson Software Inc. 102 West 2 nd Street Maysville, KY m Phone: (606) Fax: (606) Page 1 of 18 Field-to-Finish, SurvCE and Hardware Updated 1/26/2017 Survey Field-to-Finish, in Carlson Survey and SurvCE Minnesota Surveyor s Conference February 8-9, 2017 Bruce Carlson, PE President bcarlson@carlsonsw.co

More information

An orthogonal multi-beam based MIMO scheme. for multi-user wireless systems

An orthogonal multi-beam based MIMO scheme. for multi-user wireless systems An orthogonal ulti-bea based IO schee for ulti-user wireless systes Dong-chan Oh o and Yong-Hwan Lee School of Electrical Engineering and IC, Seoul ational University Kwana P.O. Box 34, Seoul, 151-600,

More information

Overlapped frequency-time division multiplexing

Overlapped frequency-time division multiplexing April 29, 16(2): 8 13 www.sciencedirect.co/science/journal/158885 he Journal of China Universities of Posts and elecounications www.buptjournal.cn/xben Overlapped frequency-tie division ultiplexing JIANG

More information

MEM380 Applied Autonomous Robots I Winter Feedback Control USARSim

MEM380 Applied Autonomous Robots I Winter Feedback Control USARSim MEM380 Applied Autonomous Robots I Winter 2011 Feedback Control USARSim Transforming Accelerations into Position Estimates In a perfect world It s not a perfect world. We have noise and bias in our acceleration

More information

OTC Statistics of High- and Low-Frequency Motions of a Moored Tanker. sensitive to lateral loading such as the SAL5 and

OTC Statistics of High- and Low-Frequency Motions of a Moored Tanker. sensitive to lateral loading such as the SAL5 and OTC 61 78 Statistics of High- and Low-Frequency Motions of a Moored Tanker by J.A..Pinkster, Maritie Research Inst. Netherlands Copyright 1989, Offshore Technology Conference This paper was presented at

More information

IMPROVING THE ACCURACY OF THE ELECTRO HYDRAULIC SERVOMECHANISMS BY ADDITIONAL FEEDBACKS

IMPROVING THE ACCURACY OF THE ELECTRO HYDRAULIC SERVOMECHANISMS BY ADDITIONAL FEEDBACKS THE PUBLISHING HOUSE PROCEEDINGS OF THE ROMNIN CDEMY, Series, OF THE ROMNIN CDEMY Volue, Nuber /9, pp. IMPROVING THE CCURCY OF THE ELECTRO HYDRULIC SERVOMECHNISMS BY DDITIONL FEEDBCKS Nicolae VSILIU, Constantin

More information

A Decentralized Architecture for Multi-Robot Systems Based on the Null-Space-Behavioral Control with Application to Multi-Robot Border Patrolling

A Decentralized Architecture for Multi-Robot Systems Based on the Null-Space-Behavioral Control with Application to Multi-Robot Border Patrolling DOI 1.17/s1846-12-9783-5 A Decentralized Architecture for Multi-Robot Systes Based on the Null-Space-Behavioral Control with Application to Multi-Robot Border Patrolling Alessandro Marino Lynne E. Parker

More information

Fundamental study for measuring microflow with Michelson interferometer enhanced by external random signal

Fundamental study for measuring microflow with Michelson interferometer enhanced by external random signal Bulletin of the JSME Journal of Advanced Mechanical Design, Systes, and Manufacturing Vol.8, No.4, 2014 Fundaental study for easuring icroflow with Michelson interferoeter enhanced by external rando signal

More information

ROBUST UNDERWATER LOCALISATION OF ULTRA LOW FREQUENCY SOURCES IN OPERATIONAL CONTEXT

ROBUST UNDERWATER LOCALISATION OF ULTRA LOW FREQUENCY SOURCES IN OPERATIONAL CONTEXT ROBUST UNDERWATER LOCALISATION OF ULTRA LOW FREQUENCY SOURCES IN OPERATIONAL CONTEXT M. Lopatka a, B. Nicolas a, G. Le Touzé a,b, X. Cristol c, B. Chalindar c, J. Mars a, D. Fattaccioli d a GIPSA-Lab /DIS/

More information