Auto-Balancing Two Wheeled Inverted Pendulum Robot

Size: px
Start display at page:

Download "Auto-Balancing Two Wheeled Inverted Pendulum Robot"

Transcription

1 Available online at International Journal of Innovative and Emerging Research in Engineering e-issn: p-issn: Auto-Balancing Two Wheeled Inverted Pendulum Robot Om J. Sawant a, Shubhada Deshpande b, Ashish Lele a, Sejal Jamsandekar a and Rohit Patil a a Pursuing B.E., Department of Electronics, PVPPCOE, Sion, Mumbai, India b Professor, Department of Electronics, PVPPCOE, Sion, Mumbai, India ABSTRACT: The inverted pendulum platform is an example of classic unstable control system [4]. Although it is a fairly tested and documented concept, it draws attention of many researchers due to its application in auto balancing twowheeled robots. Auto balancing two wheeled robot is characterized by its ability to balance on coaxial two wheels and to spin on a smaller base space. This provides with enormous advantage to maneuver in small and tidy work spaces, which is a drawback issue in case of conventional four wheeled robots. The work presented here focuses on implementation of inverted pendulum auto balancing robot by means of a stable control system. This paper enlightens the use of Kalman filter and PID controller algorithms to achieve the desired stability of the inverted pendulum system by discrete digital algorithmic approach. Keywords: Inverted Pendulum, Control system, Kalman Filter, Sensor fusion, PID controller. I. INTRODUCTION A. Problem statement: Auto balancing two wheeled robot will come out as an effective and unconventional way of maneuverability which is needed in many robotic applications. However, inverted pendulum platform is an unstable control system and hence faces stability issues [3]. Various control system models are proposed to stabilize the IP system. The output of inertial sensors used is noisy and filtering of raw output of sensors is required before it is fed to the microcontroller for reliable performance. Also, due to the nonlinear behavior of control system, we face linear filtering problem of discrete data. Another major problem can be data sampling rate and computation time required by microcontroller to run control algorithm. Excessive computation delay leads to more time for correction of the tilt angle of inverted pendulum and leaves the system out of vertical equilibrium position. As compared to conventional robots, it is observed that the power required for driving DC motors to maintain equilibrium position is very high in case of auto balancing robots. Taking into consideration the higher design complexity and lower design flexibility, the cost of some components can lead to the question of cost effectiveness of entire project. B. Problem solving: The self-balancing robot structure is modeled on inverted pendulum problem. The goal of presented work will be to investigate the use of digital control algorithm implemented on a microcontroller as solution to above problem. The digital control algorithm used is Proportional-Integral-Derivative controller, which works to minimize the error and attain the vertical equilibrium position of the inverted pendulum to make the system stable. The sensors used are inertial sensors viz. accelerometer and gyroscope to give information about tilt angle of the inverted pendulum. To filter the noisy outputs of these sensors, the use of Kalman Filter algorithm is vital feature of this project. Kalman filter algorithm is estimating in nature and can also be used for fusing the outputs of both the sensors to give reliable tilt angle information. Over the period of time microcontrollers are providing versatile, quicker, cheaper and reliable options. This project will be built around a powerful but cost effective development board having ARM Cortex M0+ core microcontroller architecture. The Kalman Filter algorithm and PID controller logic will be implemented on the above said microcontroller. This provides the required cost effectiveness along with low power consumption. High torque DC motors will be used to drive the inverted pendulum to its vertical equilibrium and to balance entire physical structure. Keeping track of speed and direction of rotation of motors is important; because the same information is fed back to microcontroller in a feedback loop to minimize the error while achieving equilibrium. Frequency to voltage encoder such as tachometer can be used as feedback element to complete the closed loop digital control system. 163

2 II. PHYSICAL AND MATHEMATICAL MODEL As given in Joe: A mobile, inverted pendulum [2], considering the robot with its three degrees of freedom, it is able to rotate about its z axis (pitch). A movement described by angle θ P and corresponding angular velocity ω P. The linear motion of robot is given with X RM and velocity V RM. Additionally, the vehicle can rotate around its vertical axis (yaw) with the associated angle δ and angular velocity δ. Various disturbances are the forces acting on, the center of gravity (CG) of the vehicle, f dp, the center of the left wheel, f drl, the center of the right wheel, f drr. The vehicle is controlled by applying a torque C L and C R to the corresponding wheels. In order to successfully control the system, the state-space variables have to be quantified. X RM, V RM, δ and δ can be easily determined with the help of encoders mounted on the two wheels (provided θ P and ω P are known). Figure 1. Free-body diagram of robot [2] For developing an efficient control system for the robot, its mathematical model has to be designed. The following variables have been chosen to describe mathematical model of robot. J RL, J RR moment of inertia of the rotating masses with respect to the axis; M RL, M RR mass of the rotating masses connected to the left and right wheels; J Pθ moment of inertia of the chassis with respect to the axis; J Pδ moment of inertia of the chassis with respect to the axis; M P mass of the chassis; R radius of the wheels; D lateral distance between the contact patches of the wheels; L distance between the axis and the CG of the chassis. The following set of equations of motion can be obtained from free body diagram: For wheels x RLM RL= f drl H L + H TL y RLM RL = V TL M RLg - V L θ RLJ RL = C L H TLR For the Chassis x PM P = f dp + H R + H L y PM P = V R + V L M Pg + F Cθ θ PJ Pθ = (V R + V L).L.sinθ P (H R + H L).L.cosθ P (C L + C R) δ J Pδ = (H L H R)D/2 Where H L, H R, H TL, H TR, V L, V R, V TL, V TR represent the reaction forces acting on different parts of free body. Modifying equations 1 to 7 and then linearizing the result around the operating point (X RM = 0; θ P = 0 and δ = 0) the system s state-space representation can be written in matrix form as: 164

3 Figure 2. State-space representation This state-space representation can be used for designing control system. III. IMPLEMENTATION This part of the paper proposes the implementation of the Auto-Balancing Two Wheeled Robot. The task of balancing inverted pendulum is very complex if we try to derive a single Transfer Function equation considering the project as a single control system. This may be achieved theoretically but practical implementation will not be as per expectation. Due to the large number of physical unknown parameters governing the state of control system, the single transfer function approach would be impractical to achieve stability in real time implementation of project. To avoid this complexity we will break the control system into basic blocks. Every block dealing with the fixed number of variables and serving its successive block. The blocks used for implementation of project are specified with block diagram. A. Block Diagram: Figure 3. Block diagram B. Sensors: Sensors used in this project include accelerometer and gyroscope. These are inertial sensors used to provide tilt angle and rate of fall of angle i.e. angular rate. The data from the sensors will give sense of angular displacement of the inverted pendulum from its vertical zero equilibrium position. As the primary goal of this project is to maintain zero degree vertical angle of inverted pendulum, the measurement of instantaneous angle of structure becomes very important. The digital rate gyroscope gives information about instantaneous rate of change of angle. The rest state offset value of gyroscope must be measured and the device should be calibrated. But it is observed that gyroscope produces a significant drift when operating. This drift may be due to temperature or inherent characteristics of gyroscope itself. On the other hand, accelerometer gives absolute measure of tilt angle. But it is observed that the output signal is often corrupted with significant amount of noise. Generalized sensor equations: For Gyroscope ADC resol = V cc / 2 nbit GYRO resol = (ADC resol / GYRO sensitivity) GYRO offset = (V static. 2 nbit ) / V cc ANGULAR_RATE = (ADC resol GYRO offset). GYRO resol For Accelerometer ADC resol = V cc / 2 nbit 165

4 ACCL resol = ( 1g. ADC resol ) / 1000mV ACCL offset = (V offset. 2 nbit ) / V cc A x = (ADC resol ACCL offset). ACCL resol Pitch = sin -1 (A x/1g) From above discussion about sensors one can state that the use of any of the sensor alone to achieve tilt angle information is not sufficient in order to balance the robot. Because the information provided by sensors is insufficient and unreliable. To get rid of this problem, use of signal level sensor fusion becomes mandatory. Sensor fusion refers to combining output signals of sensors to give an improved and reliable signal. Kalman Filter is used for the same, which uses accelerometer signal to eliminate the drift problem in gyroscope output and gives accurate estimate of tilt angle and its derivative term. C. Kalman Filter: Kalman filter is basically recursive digital algorithm which can be used for estimation of state of any process [5] [6]. Due to its state estimating nature it provides reliable state estimate. Kalman filter also has a feature of minimizing mean square error. Hence it can be applied to control systems operating in noisy environment. Kalman filter processes the output signals from sensors and minimizes square error. Then this noise free signal can be fed to control system for reliable output response. Kalman filter estimates the state of discrete time controlled process given in linear stochastic difference equation form: x k = Ax k 1 + Bu k 1 + w k 1 Measurement: z k = Hx k + v k Random variables v k and w k are measurement noise and process noise respectively. They have normal probability distribution as: p(w) = N(0, Q) p(v) = N(0, R) Where Q is process noise covariance matrix and R is measurement noise covariance matrix. Matrices A and H are state matrices relating state of next time step and measurement state respectively. Matrix B is related to control input u of process x. Kalman filter equations can be distinguished in two states, predictions state and correction state. The prediction state is nothing but time updating phenomenon. In prediction state, considering current time state and error covariance estimate, new state is estimated. The correction state produces a feedback to generate estimate of next measurement. Table 1. Kalman filter equations Prediction state: Correction state: Estimation of state ahead Kalman Gain calculation x k = Ax k 1 + Bu k 1 K k = P k H T (HP k H T + R) 1 Estimation of Error Covariance ahead Measurement estimation P k = AP k 1 A T + Q X k = x k + K k (z k Hx k ) Error covariance update P k = (I K k H)P k D. PID controller: The digital control algorithm that is used to maintain the balance of the auto-balancing two wheel robot is the PID controller. The proportional, integral, and derivative (PID) controller is well known as a three term controller. The PID controller has been the popular choice in industrial process control. As micro-processors and micro-controllers have become popular in control engineering, the PID controller has become a popular embedded software implementation. The PID control algorithm is a simple algorithm that provides the necessary output system response to control a process. One unique feature of the PID controller is that it is capable of manipulating the process inputs based on the history and rate of 166

5 change of the signal. It uses closed loop control system approach. The algorithm is best suited when the process under control is modeled as a linear system. The PID controller consists of proportional, integral, and derivative terms. The KP, KI, and KD are referred as the proportional, integral, and derivative constants. The terms of the PID controller are summed up to create a controller output signal. Each term performs a different task in the control process. The controller terms also have different effects on the system output response. It is also referred as a negative feedback system. The basic idea of a negative feedback system is that it measures the process output y using a sensor. The measured process output gets subtracted from the reference set-point value to produce an error. The error is then fed into the PID controller, where the error gets processed in three ways. The error will be used on the PID controller to execute the proportional term, integral term reduces the steady state errors, and the derivative term handles overshoots. After the PID algorithm processes the error, the controller produces a control signal u. The PID control signal u will try to drive the process to the desired reference set-point value. In the case of the two wheel robot, the desired set-point value is the zero degree vertical position. Equations given below represents PID controller in continuous time domain. T D and T I are time constants for derivative and integral term respectively. error = ref y u(t) = K p (error(t) derror(dt) error(t)dt + T T D ) I 0 dt Where, K I = K P T I, K D = K P T D 1 derror(dt) u(t) = K p error(t) + K I error(t)dt + K D 0 dt Discrete PID controller algorithm: As we are implementing PID algorithm on a micro-controller, it is necessary to design the PID equations in discrete time domain. Trying to develop PID software algorithm that follows discrete time domain notations is practically not possible. Only approach to achieve PID controller algorithm in discrete time domain notations is by approximation of terms of PID controller equations in continuous time domain given above. The discrete representation of the controller makes it easier to implement the PID algorithm on a micro-controller The equations given below represents PID controller in discrete form: 1 error(t)dt T S error(k) 0 derror(t) dt k=1 error(k) error(k 1) T S u(k) = K p (error(k) + T S Where, K I = K P T S T I error(k) + T D T k=1 (error(k) error(k 1)) ) I T S K D = K P T D T S u(k) = K p error(k) + K I error(k) + K D (error(k) error(k 1)) k=1 E. DC MOTORS AND MOTOR DRIVER: The selection of motors is an important aspect in designing the Auto Balancing Robot System. The motors should have adequate torque rating and also should have appropriate RPM value for proper functioning of the self- balancing mechanism. Also, the motors should be of moderate voltage and current requirement to keep the power supply less bulky and make the driver circuit less complex. To suit the requirements of the project, two DC motors of the following specifications have been proposed: Maximum Supply Voltage: 9V DC Torque Rating: 2kg/cm RPM at no load: 100 The output current provided by the development board is of the order of a few miliamperes. The DC motors require a considerably high value of current to function which cannot be provided by the development board. Hence, a separate motor driver circuit is required so that adequate current can be supplied for proper functioning of the motors. 167

6 The motor driver circuit L298N is being used in this project. The circuit is a high voltage, high current dual full bridge driver. The features of the driver module are as follows [7] :. OPERATING SUPPLY VOLTAGE UP TO 46 V. TOTAL DC CURRENT UP TO 4 A. LOW SATURATION VOLTAGE. OVERTEMPERATURE PROTECTION. LOGICAL "0" INPUT VOLTAGE UP TO 1.5 V (HIGH NOISE IMMUNITY) F. Encoder: Encoder is an important block in the closed loop control system. It consists of a tachometer which measures the frequency of rotation of wheels and converts the frequency into corresponding voltage signal. Hence encoder is nothing but frequency to voltage converter. Voltage signal produced by encoder is fed as negative feedback to the PID controller. In this way encoder completes the negative feedback in PID controller. By comparing the signal given by encoder with the set-point condition, error will be calculated and then PID controller processes the error to minimize it. IV. CONCLUSION It can be concluded that, after implementation of this project, the stability of Auto-Balancing Two Wheeled Inverted Pendulum Robot can be achieved with improved response time. We have considered the system of robot as a classical control system and proposed the algorithmic approach to stabilize the system. Through this paper we are implementing Kalman filter algorithm and PID controller digital control algorithm on a micro-controller, which gives cost-effective option for solving Inverted Pendulum control system problem with reduced oscillations and improved stability. Our emphasis is on achieving zero degree vertical equilibrium of robot body when it is in rest or when it is in a straight line motion, in shortest possible time. Further study can be done on achieving the stability of robot while rotating about its vertical axis. ACKNOWLEDGMENT This work is supported by Department of Electronics Engineering, Padmabhushan Vasantdada Patil Pratishthan s College of Engineering, Sion, Mumbai. REFERENCES [1] Spong M.W., Hutchinson S., Vidyasagar M.: Robot modeling and control, Wiley, 2006 [2] F. Grasser, A. D Arrigo, S. Colombi, and A. Rufer, Joe: A mobile, inverted pendulum, IEEE Trans. Ind. Electron., vol. 49, no. 1, pp , Feb [3] Li Chaoquan, Gao Xueshan, Li Kejie, Smooth Control the Coaxial Self-Balance Robot under Impact Disturbances, International Journal of Advanced Robotic Systems, ISSN , pp Vol. 8, No. 2. (2011) [4] Kent H. Lundberg, James K. Roberge, Classical Dual-Inverted-Pendulum Control, THE 2003 IEEE CONFERENCE ON DECISION AND CONTROL, 2003 [5] R. E. Kalman, A New Approach to Linear Filtering and Prediction Problems, Transaction of the ASME Journal of Basic Engineering, pp (March 1960). [6] Welch & Bishop, An Introduction to the Kalman Filter, UNC-Chapel Hill, TR , July 24, 2006 [7] Data sheet, L298N Duel Full Bridge Driver, 168

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

Control System for a Segway

Control System for a Segway Control System for a Segway Jorge Morantes, Diana Espitia, Olguer Morales, Robinson Jiménez, Oscar Aviles Davinci Research Group, Militar Nueva Granada University, Bogotá, Colombia. Abstract In order to

More information

SELF BALANCING ROBOT. Article. 2 authors, including: Nabil Lathiff Microsoft

SELF BALANCING ROBOT. Article. 2 authors, including: Nabil Lathiff Microsoft See discussions, stats, and author profiles for this publication at: https://www.researchgate.net/publication/265227587 SELF BALANCING ROBOT Article CITATIONS 2 READS 7,256 2 authors, including: Nabil

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

Extended Kalman Filtering

Extended Kalman Filtering Extended Kalman Filtering Andre Cornman, Darren Mei Stanford EE 267, Virtual Reality, Course Report, Instructors: Gordon Wetzstein and Robert Konrad Abstract When working with virtual reality, one of the

More information

Dynamically Adaptive Inverted Pendulum Platfom

Dynamically Adaptive Inverted Pendulum Platfom Dynamically Adaptive Inverted Pendulum Platfom 2009 Colorado Space Grant Symposium Jonathon Cox Colorado State University Undergraduate in Electrical Engineering Email: csutke@gmail.com Web: www.campusaudio.com

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

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

TigreSAT 2010 &2011 June Monthly Report

TigreSAT 2010 &2011 June Monthly Report 2010-2011 TigreSAT Monthly Progress Report EQUIS ADS 2010 PAYLOAD No changes have been done to the payload since it had passed all the tests, requirements and integration that are necessary for LSU HASP

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

Robust Control Design for Rotary Inverted Pendulum Balance

Robust Control Design for Rotary Inverted Pendulum Balance Indian Journal of Science and Technology, Vol 9(28), DOI: 1.17485/ijst/216/v9i28/9387, July 216 ISSN (Print) : 974-6846 ISSN (Online) : 974-5645 Robust Control Design for Rotary Inverted Pendulum Balance

More information

FLCS V2.1. AHRS, Autopilot, Gyro Stabilized Gimbals Control, Ground Control Station

FLCS V2.1. AHRS, Autopilot, Gyro Stabilized Gimbals Control, Ground Control Station AHRS, Autopilot, Gyro Stabilized Gimbals Control, Ground Control Station The platform provides a high performance basis for electromechanical system control. Originally designed for autonomous aerial vehicle

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

Modeling And Pid Cascade Control For Uav Type Quadrotor

Modeling And Pid Cascade Control For Uav Type Quadrotor IOSR Journal of Dental and Medical Sciences (IOSR-JDMS) e-issn: 2279-0853, p-issn: 2279-0861.Volume 15, Issue 8 Ver. IX (August. 2016), PP 52-58 www.iosrjournals.org Modeling And Pid Cascade Control For

More information

Gesture Identification Using Sensors Future of Interaction with Smart Phones Mr. Pratik Parmar 1 1 Department of Computer engineering, CTIDS

Gesture Identification Using Sensors Future of Interaction with Smart Phones Mr. Pratik Parmar 1 1 Department of Computer engineering, CTIDS Gesture Identification Using Sensors Future of Interaction with Smart Phones Mr. Pratik Parmar 1 1 Department of Computer engineering, CTIDS Abstract Over the years from entertainment to gaming market,

More information

ANALYSIS OF V/f CONTROL OF INDUCTION MOTOR USING CONVENTIONAL CONTROLLERS AND FUZZY LOGIC CONTROLLER

ANALYSIS OF V/f CONTROL OF INDUCTION MOTOR USING CONVENTIONAL CONTROLLERS AND FUZZY LOGIC CONTROLLER ANALYSIS OF V/f CONTROL OF INDUCTION MOTOR USING CONVENTIONAL CONTROLLERS AND FUZZY LOGIC CONTROLLER Archana G C 1 and Reema N 2 1 PG Student [Electrical Machines], Department of EEE, Sree Buddha College

More information

Position Control of DC Motor by Compensating Strategies

Position Control of DC Motor by Compensating Strategies Position Control of DC Motor by Compensating Strategies S Prem Kumar 1 J V Pavan Chand 1 B Pangedaiah 1 1. Assistant professor of Laki Reddy Balireddy College Of Engineering, Mylavaram Abstract - As the

More information

Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control of DC Motor

Comparative Analysis of PID, SMC, SMC with PID Controller for Speed Control of DC Motor International ournal for Modern Trends in Science and Technology Volume: 02, Issue No: 11, November 2016 http://www.ijmtst.com ISSN: 2455-3778 Comparative Analysis of PID, SMC, SMC with PID Controller

More information

Sensors and Sensing Motors, Encoders and Motor Control

Sensors and Sensing Motors, Encoders and Motor Control Sensors and Sensing Motors, Encoders and Motor Control Todor Stoyanov Mobile Robotics and Olfaction Lab Center for Applied Autonomous Sensor Systems Örebro University, Sweden todor.stoyanov@oru.se 05.11.2015

More information

Active Vibration Isolation of an Unbalanced Machine Tool Spindle

Active Vibration Isolation of an Unbalanced Machine Tool Spindle Active Vibration Isolation of an Unbalanced Machine Tool Spindle David. J. Hopkins, Paul Geraghty Lawrence Livermore National Laboratory 7000 East Ave, MS/L-792, Livermore, CA. 94550 Abstract Proper configurations

More information

Modelling and Implementation of PID Control for Balancing of an Inverted Pendulum

Modelling and Implementation of PID Control for Balancing of an Inverted Pendulum International Journal of Automation, Control and Intelligent Systems Vol. 4, No. 4, 2018, pp. 43-53 http://www.aiscience.org/journal/ijacis ISSN: 2381-7526 (Print); ISSN: 2381-7534 (Online) Modelling and

More information

CHAPTER 4 PID CONTROLLER BASED SPEED CONTROL OF THREE PHASE INDUCTION MOTOR

CHAPTER 4 PID CONTROLLER BASED SPEED CONTROL OF THREE PHASE INDUCTION MOTOR 36 CHAPTER 4 PID CONTROLLER BASED SPEED CONTROL OF THREE PHASE INDUCTION MOTOR 4.1 INTRODUCTION Now a day, a number of different controllers are used in the industry and in many other fields. In a quite

More information

Design of an Intelligent Pressure Control System Based on the Fuzzy Self-tuning PID Controller

Design of an Intelligent Pressure Control System Based on the Fuzzy Self-tuning PID Controller Design of an Intelligent Pressure Control System Based on the Fuzzy Self-tuning PID Controller 1 Deepa S. Bhandare, 2 N. R.Kulkarni 1,2 Department of Electrical Engineering, Modern College of Engineering,

More information

Dynamically Adaptive Inverted Pendulum Platform

Dynamically Adaptive Inverted Pendulum Platform Dynamically Adaptive Inverted Pendulum Platform 2009 Space Grant Symposium Jonathon Cox Colorado State University Department Of Electrical Engineering 2515 Manet Ct. Fort Collins CO, 80526 Email: csutke@gmail.com

More information

Modeling, Simulation and Implementation of Speed Control of DC Motor Using PIC 16F877A

Modeling, Simulation and Implementation of Speed Control of DC Motor Using PIC 16F877A Modeling, Simulation and Implementation of Speed Control of DC Motor Using PIC 16F877A Payal P.Raval 1, Prof.C.R.mehta 2 1 PG Student, Electrical Engg. Department, Nirma University, SG Highway, Ahmedabad,

More information

Vehicle Speed Estimation Using GPS/RISS (Reduced Inertial Sensor System)

Vehicle Speed Estimation Using GPS/RISS (Reduced Inertial Sensor System) ISSC 2013, LYIT Letterkenny, June 20 21 Vehicle Speed Estimation Using GPS/RISS (Reduced Inertial Sensor System) Thomas O Kane and John V. Ringwood Department of Electronic Engineering National University

More information

Vibration Control of Flexible Spacecraft Using Adaptive Controller.

Vibration Control of Flexible Spacecraft Using Adaptive Controller. Vol. 2 (2012) No. 1 ISSN: 2088-5334 Vibration Control of Flexible Spacecraft Using Adaptive Controller. V.I.George #, B.Ganesh Kamath #, I.Thirunavukkarasu #, Ciji Pearl Kurian * # ICE Department, Manipal

More information

Comparative Study of PID and Fuzzy Controllers for Speed Control of DC Motor

Comparative Study of PID and Fuzzy Controllers for Speed Control of DC Motor Comparative Study of PID and Fuzzy Controllers for Speed Control of DC Motor Osama Omer Adam Mohammed 1, Dr. Awadalla Taifor Ali 2 P.G. Student, Department of Control Engineering, Faculty of Engineering,

More information

IMU Platform for Workshops

IMU Platform for Workshops IMU Platform for Workshops Lukáš Palkovič *, Jozef Rodina *, Peter Hubinský *3 * Institute of Control and Industrial Informatics Faculty of Electrical Engineering, Slovak University of Technology Ilkovičova

More information

Speed Control of DC Motor Using Fuzzy Logic Application

Speed Control of DC Motor Using Fuzzy Logic Application 2016 Published in 4th International Symposium on Innovative Technologies in Engineering and Science 3-5 November 2016 (ISITES2016 Alanya/Antalya - Turkey) Speed Control of DC Motor Using Fuzzy Logic Application

More information

ANNUAL OF NAVIGATION 16/2010

ANNUAL OF NAVIGATION 16/2010 ANNUAL OF NAVIGATION 16/2010 STANISŁAW KONATOWSKI, MARCIN DĄBROWSKI, ANDRZEJ PIENIĘŻNY Military University of Technology VEHICLE POSITIONING SYSTEM BASED ON GPS AND AUTONOMIC SENSORS ABSTRACT In many real

More information

INTERNATIONAL JOURNAL OF ELECTRICAL ENGINEERING & TECHNOLOGY (IJEET) TWO WHEELED SELF BALANCING ROBOT FOR AUTONOMOUS NAVIGATION

INTERNATIONAL JOURNAL OF ELECTRICAL ENGINEERING & TECHNOLOGY (IJEET) TWO WHEELED SELF BALANCING ROBOT FOR AUTONOMOUS NAVIGATION INTERNATIONAL JOURNAL OF ELECTRICAL ENGINEERING & TECHNOLOGY (IJEET) International Journal of Electrical Engineering and Technology (IJEET), ISSN 0976 6545(Print), ISSN 0976 6545(Print) ISSN 0976 6553(Online)

More information

Sensors and Sensing Motors, Encoders and Motor Control

Sensors and Sensing Motors, Encoders and Motor Control Sensors and Sensing Motors, Encoders and Motor Control Todor Stoyanov Mobile Robotics and Olfaction Lab Center for Applied Autonomous Sensor Systems Örebro University, Sweden todor.stoyanov@oru.se 13.11.2014

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

Design and Implementation of Inertial Navigation System

Design and Implementation of Inertial Navigation System Design and Implementation of Inertial Navigation System Ms. Pooja M Asangi PG Student, Digital Communicatiom Department of Telecommunication CMRIT College Bangalore, India Mrs. Sujatha S Associate Professor

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

Teaching Mechanical Students to Build and Analyze Motor Controllers

Teaching Mechanical Students to Build and Analyze Motor Controllers Teaching Mechanical Students to Build and Analyze Motor Controllers Hugh Jack, Associate Professor Padnos School of Engineering Grand Valley State University Grand Rapids, MI email: jackh@gvsu.edu Session

More information

FUZZY CONTROL FOR THE KADET SENIOR RADIOCONTROLLED AIRPLANE

FUZZY CONTROL FOR THE KADET SENIOR RADIOCONTROLLED AIRPLANE FUZZY CONTROL FOR THE KADET SENIOR RADIOCONTROLLED AIRPLANE Angel Abusleme, Aldo Cipriano and Marcelo Guarini Department of Electrical Engineering, Pontificia Universidad Católica de Chile P. O. Box 306,

More information

ME 461 Laboratory #5 Characterization and Control of PMDC Motors

ME 461 Laboratory #5 Characterization and Control of PMDC Motors ME 461 Laboratory #5 Characterization and Control of PMDC Motors Goals: 1. Build an op-amp circuit and use it to scale and shift an analog voltage. 2. Calibrate a tachometer and use it to determine motor

More information

A Searching Analyses for Best PID Tuning Method for CNC Servo Drive

A Searching Analyses for Best PID Tuning Method for CNC Servo Drive International Journal of Science and Engineering Investigations vol. 7, issue 76, May 2018 ISSN: 2251-8843 A Searching Analyses for Best PID Tuning Method for CNC Servo Drive Ferit Idrizi FMI-UP Prishtine,

More information

AUTOPILOT CONTROL SYSTEM - IV

AUTOPILOT CONTROL SYSTEM - IV AUTOPILOT CONTROL SYSTEM - IV CONTROLLER The data from the inertial measurement unit is taken into the controller for processing. The input being analog requires to be passed through an ADC before being

More information

Tracking Position Control of AC Servo Motor Using Enhanced Iterative Learning Control Strategy

Tracking Position Control of AC Servo Motor Using Enhanced Iterative Learning Control Strategy International Journal of Engineering Research and Development e-issn: 2278-67X, p-issn: 2278-8X, www.ijerd.com Volume 3, Issue 6 (September 212), PP. 26-33 Tracking Position Control of AC Servo Motor Using

More information

Glossary of terms. Short explanation

Glossary of terms. Short explanation Glossary Concept Module. Video Short explanation Abstraction 2.4 Capturing the essence of the behavior of interest (getting a model or representation) Action in the control Derivative 4.2 The control signal

More information

Simple Path Planning Algorithm for Two-Wheeled Differentially Driven (2WDD) Soccer Robots

Simple Path Planning Algorithm for Two-Wheeled Differentially Driven (2WDD) Soccer Robots Simple Path Planning Algorithm for Two-Wheeled Differentially Driven (2WDD) Soccer Robots Gregor Novak 1 and Martin Seyr 2 1 Vienna University of Technology, Vienna, Austria novak@bluetechnix.at 2 Institute

More information

Based on the ARM and PID Control Free Pendulum Balance System

Based on the ARM and PID Control Free Pendulum Balance System Available online at www.sciencedirect.com Procedia Engineering 29 (2012) 3491 3495 2012 International Workshop on Information and Electronics Engineering (IWIEE) Based on the ARM and PID Control Free Pendulum

More information

SELF STABILIZING PLATFORM

SELF STABILIZING PLATFORM SELF STABILIZING PLATFORM Shalaka Turalkar 1, Omkar Padvekar 2, Nikhil Chavan 3, Pritam Sawant 4 and Project Guide: Mr Prathamesh Indulkar 5. 1,2,3,4,5 Department of Electronics and Telecommunication,

More information

A Fast PID Tuning Algorithm for Feed Drive Servo Loop

A Fast PID Tuning Algorithm for Feed Drive Servo Loop American Scientific Research Journal for Engineering, Technology, and Sciences (ASRJETS) ISSN (Print) 233-440, ISSN (Online) 233-4402 Global Society of Scientific Research and Researchers http://asrjetsjournal.org/

More information

OughtToPilot. Project Report of Submission PC128 to 2008 Propeller Design Contest. Jason Edelberg

OughtToPilot. Project Report of Submission PC128 to 2008 Propeller Design Contest. Jason Edelberg OughtToPilot Project Report of Submission PC128 to 2008 Propeller Design Contest Jason Edelberg Table of Contents Project Number.. 3 Project Description.. 4 Schematic 5 Source Code. Attached Separately

More information

Fundamentals of Servo Motion Control

Fundamentals of Servo Motion Control Fundamentals of Servo Motion Control The fundamental concepts of servo motion control have not changed significantly in the last 50 years. The basic reasons for using servo systems in contrast to open

More information

A Machine Tool Controller using Cascaded Servo Loops and Multiple Feedback Sensors per Axis

A Machine Tool Controller using Cascaded Servo Loops and Multiple Feedback Sensors per Axis A Machine Tool Controller using Cascaded Servo Loops and Multiple Sensors per Axis David J. Hopkins, Timm A. Wulff, George F. Weinert Lawrence Livermore National Laboratory 7000 East Ave, L-792, Livermore,

More information

ISSN: (Online) Volume 2, Issue 1, January 2014 International Journal of Advance Research in Computer Science and Management Studies

ISSN: (Online) Volume 2, Issue 1, January 2014 International Journal of Advance Research in Computer Science and Management Studies ISSN: 2321-7782 (Online) Volume 2, Issue 1, January 2014 International Journal of Advance Research in Computer Science and Management Studies Research Paper Available online at: www.ijarcsms.com Fuzzy

More information

QUADROTOR ROLL AND PITCH STABILIZATION USING SYSTEM IDENTIFICATION BASED REDESIGN OF EMPIRICAL CONTROLLERS

QUADROTOR ROLL AND PITCH STABILIZATION USING SYSTEM IDENTIFICATION BASED REDESIGN OF EMPIRICAL CONTROLLERS QUADROTOR ROLL AND PITCH STABILIZATION USING SYSTEM IDENTIFICATION BASED REDESIGN OF EMPIRICAL CONTROLLERS ANIL UFUK BATMAZ 1, a, OVUNC ELBIR 2,b and COSKU KASNAKOGLU 3,c 1,2,3 Department of Electrical

More information

Optimal Control System Design

Optimal Control System Design Chapter 6 Optimal Control System Design 6.1 INTRODUCTION The active AFO consists of sensor unit, control system and an actuator. While designing the control system for an AFO, a trade-off between the transient

More information

Design and simulation of MEMS piezoelectric gyroscope

Design and simulation of MEMS piezoelectric gyroscope Available online at www.scholarsresearchlibrary.com European Journal of Applied Engineering and Scientific Research, 2014, 3 (2):8-12 (http://scholarsresearchlibrary.com/archive.html) ISSN: 2278 0041 Design

More information

Design of Accurate Navigation System by Integrating INS and GPS using Extended Kalman Filter

Design of Accurate Navigation System by Integrating INS and GPS using Extended Kalman Filter Design of Accurate Navigation System by Integrating INS and GPS using Extended Kalman Filter Santhosh Kumar S. A 1, 1 M.Tech student, Digital Electronics and Communication Systems, PES institute of technology,

More information

Design of Self-tuning PID Controller Parameters Using Fuzzy Logic Controller for Quad-rotor Helicopter

Design of Self-tuning PID Controller Parameters Using Fuzzy Logic Controller for Quad-rotor Helicopter Design of Self-tuning PID Controller Parameters Using Fuzzy Logic Controller for Quad-rotor Helicopter Item type Authors Citation Journal Article Bousbaine, Amar; Bamgbose, Abraham; Poyi, Gwangtim Timothy;

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

Modelling and Control of Hybrid Stepper Motor

Modelling and Control of Hybrid Stepper Motor I J C T A, 9(37) 2016, pp. 741-749 International Science Press Modelling and Control of Hybrid Stepper Motor S.S. Harish *, K. Barkavi **, C.S. Boopathi *** and K. Selvakumar **** Abstract: This paper

More information

Performance Analysis of Fuzzy Logic And PID Controller for PM DC Motor Drive Khalid Al-Mutib 1, N. M. Adamali Shah 2, Ebrahim Mattar 3

Performance Analysis of Fuzzy Logic And PID Controller for PM DC Motor Drive Khalid Al-Mutib 1, N. M. Adamali Shah 2, Ebrahim Mattar 3 Performance Analysis of Fuzzy Logic And PID Controller for PM DC Motor Drive Khalid Al-Mutib 1, N. M. Adamali Shah 2, Ebrahim Mattar 3 1 King Saud University, Riyadh, Saudi Arabia, muteb@ksu.edu.sa 2 King

More information

INDOOR HEADING MEASUREMENT SYSTEM

INDOOR HEADING MEASUREMENT SYSTEM INDOOR HEADING MEASUREMENT SYSTEM Marius Malcius Department of Research and Development AB Prospero polis, Lithuania m.malcius@orodur.lt Darius Munčys Department of Research and Development AB Prospero

More information

VECTOR CONTROL SCHEME FOR INDUCTION MOTOR WITH DIFFERENT CONTROLLERS FOR NEGLECTING THE END EFFECTS IN HEV APPLICATIONS

VECTOR CONTROL SCHEME FOR INDUCTION MOTOR WITH DIFFERENT CONTROLLERS FOR NEGLECTING THE END EFFECTS IN HEV APPLICATIONS VECTOR CONTROL SCHEME FOR INDUCTION MOTOR WITH DIFFERENT CONTROLLERS FOR NEGLECTING THE END EFFECTS IN HEV APPLICATIONS M.LAKSHMISWARUPA 1, G.TULASIRAMDAS 2 & P.V.RAJGOPAL 3 1 Malla Reddy Engineering College,

More information

DC Motor Speed Control using PID Controllers

DC Motor Speed Control using PID Controllers "EE 616 Electronic System Design Course Project, EE Dept, IIT Bombay, November 2009" DC Motor Speed Control using PID Controllers Nikunj A. Bhagat (08307908) nbhagat@ee.iitb.ac.in, Mahesh Bhaganagare (CEP)

More information

Rapid Prototyping of a Stand-Alone Embedded Controller for a Stabilized Motion Platform

Rapid Prototyping of a Stand-Alone Embedded Controller for a Stabilized Motion Platform Rapid Prototyping of a Stand-Alone Embedded Controller for a Stabilized Motion Platform Ruben de Schipper, Prof. Ka C. Cheo and Dr. G. E. Smid Electrical & Systems Eng. Dept. Oaland University Rochester,

More information

GE420 Laboratory Assignment 8 Positioning Control of a Motor Using PD, PID, and Hybrid Control

GE420 Laboratory Assignment 8 Positioning Control of a Motor Using PD, PID, and Hybrid Control GE420 Laboratory Assignment 8 Positioning Control of a Motor Using PD, PID, and Hybrid Control Goals for this Lab Assignment: 1. Design a PD discrete control algorithm to allow the closed-loop combination

More information

Application Note #2442

Application Note #2442 Application Note #2442 Tuning with PL and PID Most closed-loop servo systems are able to achieve satisfactory tuning with the basic Proportional, Integral, and Derivative (PID) tuning parameters. However,

More information

Disturbance rejection using feed-forward control system on self balancing robot

Disturbance rejection using feed-forward control system on self balancing robot Disturbance rejection using feed-forward control system on self balancing robot Barlian Henryranu Prasetio * and Wijaya Kurniawan Computer Engineering and Robotics Laboratory-Faculty of Computer Science-University

More information

Current Rebuilding Concept Applied to Boost CCM for PF Correction

Current Rebuilding Concept Applied to Boost CCM for PF Correction Current Rebuilding Concept Applied to Boost CCM for PF Correction Sindhu.K.S 1, B. Devi Vighneshwari 2 1, 2 Department of Electrical & Electronics Engineering, The Oxford College of Engineering, Bangalore-560068,

More information

Cohen-coon PID Tuning Method; A Better Option to Ziegler Nichols-PID Tuning Method

Cohen-coon PID Tuning Method; A Better Option to Ziegler Nichols-PID Tuning Method Cohen-coon PID Tuning Method; A Better Option to Ziegler Nichols-PID Tuning Method Engr. Joseph, E. A. 1, Olaiya O. O. 2 1 Electrical Engineering Department, the Federal Polytechnic, Ilaro, Ogun State,

More information

Comparisons of Different Controller for Position Tracking of DC Servo Motor

Comparisons of Different Controller for Position Tracking of DC Servo Motor Comparisons of Different Controller for Position Tracking of DC Servo Motor Shital Javiya 1, Ankit Kumar 2 Assistant Professor, Dept. of IC, Atmiya Institute of Technology & Science, Rajkot, Gujarat, India

More information

AE2610 Introduction to Experimental Methods in Aerospace

AE2610 Introduction to Experimental Methods in Aerospace AE2610 Introduction to Experimental Methods in Aerospace Lab #3: Dynamic Response of a 3-DOF Helicopter Model C.V. Di Leo 1 Lecture/Lab learning objectives Familiarization with the characteristics of dynamical

More information

Hybrid LQG-Neural Controller for Inverted Pendulum System

Hybrid LQG-Neural Controller for Inverted Pendulum System Hybrid LQG-Neural Controller for Inverted Pendulum System E.S. Sazonov Department of Electrical and Computer Engineering Clarkson University Potsdam, NY 13699-570 USA P. Klinkhachorn and R. L. Klein Lane

More information

Inverted Pendulum Swing Up Controller

Inverted Pendulum Swing Up Controller Dublin Institute of Technology ARROW@DIT Conference Papers School of Mechanical and Design Engineering 2011-09-29 Inverted Pendulum Swing Up Controller David Kennedy Dublin Institute of Technology, david.kennedy@dit.ie

More information

Implementing a Kalman Filter on FPGA Embedded Processor for Speed Control of a DC Motor Using Low Resolution Incremental Encoders

Implementing a Kalman Filter on FPGA Embedded Processor for Speed Control of a DC Motor Using Low Resolution Incremental Encoders , October 19-21, 2016, San Francisco, USA Implementing a Kalman Filter on FPGA Embedded Processor for Speed Control of a DC Motor Using Low Resolution Incremental Encoders Herman I. Veriñaz Jadan, Caril

More information

Optimized Tuning of PI Controller for a Spherical Tank Level System Using New Modified Repetitive Control Strategy

Optimized Tuning of PI Controller for a Spherical Tank Level System Using New Modified Repetitive Control Strategy International Journal of Engineering Research and Development e-issn: 2278-67X, p-issn: 2278-8X, www.ijerd.com Volume 3, Issue 6 (September 212), PP. 74-82 Optimized Tuning of PI Controller for a Spherical

More information

Experiment 9. PID Controller

Experiment 9. PID Controller Experiment 9 PID Controller Objective: - To be familiar with PID controller. - Noting how changing PID controller parameter effect on system response. Theory: The basic function of a controller is to execute

More information

INTRODUCTION TO KALMAN FILTERS

INTRODUCTION TO KALMAN FILTERS ECE5550: Applied Kalman Filtering 1 1 INTRODUCTION TO KALMAN FILTERS 1.1: What does a Kalman filter do? AKalmanfilterisatool analgorithmusuallyimplementedasa computer program that uses sensor measurements

More information

Type of loads Active load torque: - Passive load torque :-

Type of loads Active load torque: - Passive load torque :- Type of loads Active load torque: - Active torques continues to act in the same direction irrespective of the direction of the drive. e.g. gravitational force or deformation in elastic bodies. Passive

More information

Wheeled Mobile Robot Obstacle Avoidance Using Compass and Ultrasonic

Wheeled Mobile Robot Obstacle Avoidance Using Compass and Ultrasonic Universal Journal of Control and Automation 6(1): 13-18, 2018 DOI: 10.13189/ujca.2018.060102 http://www.hrpub.org Wheeled Mobile Robot Obstacle Avoidance Using Compass and Ultrasonic Yousef Moh. Abueejela

More information

Implementation of PIC Based Vehicle s Attitude Estimation System Using MEMS Inertial Sensors and Kalman Filter

Implementation of PIC Based Vehicle s Attitude Estimation System Using MEMS Inertial Sensors and Kalman Filter Implementation of PIC Based Vehicle s Attitude Estimation System Using MEMS Inertial Sensors and Kalman Filter Htoo Maung Maung Department of Electronic Engineering, Mandalay Technological University Mandalay,

More information

Sloshing Damping Control in a Cylindrical Container on a Wheeled Mobile Robot Using Dual-Swing Active-Vibration Reduction

Sloshing Damping Control in a Cylindrical Container on a Wheeled Mobile Robot Using Dual-Swing Active-Vibration Reduction Sloshing Damping Control in a Cylindrical Container on a Wheeled Mobile Robot Using Dual-Swing Active-Vibration Reduction Masafumi Hamaguchi and Takao Taniguchi Department of Electronic and Control Systems

More information

TEAM AERO-I TEAM AERO-I JOURNAL PAPER DELHI TECHNOLOGICAL UNIVERSITY Journal paper for IARC 2014

TEAM AERO-I TEAM AERO-I JOURNAL PAPER DELHI TECHNOLOGICAL UNIVERSITY Journal paper for IARC 2014 TEAM AERO-I TEAM AERO-I JOURNAL PAPER DELHI TECHNOLOGICAL UNIVERSITY DELHI TECHNOLOGICAL UNIVERSITY Journal paper for IARC 2014 2014 IARC ABSTRACT The paper gives prominence to the technical details of

More information

Dynamic Angle Estimation

Dynamic Angle Estimation Dynamic Angle Estimation with Inertial MEMS Analog Devices Bob Scannell Mark Looney Agenda Sensor to angle basics Accelerometer basics Accelerometer behaviors Gyroscope basics Gyroscope behaviors Key factors

More information

MEM01: DC-Motor Servomechanism

MEM01: DC-Motor Servomechanism MEM01: DC-Motor Servomechanism Interdisciplinary Automatic Controls Laboratory - ME/ECE/CHE 389 February 5, 2016 Contents 1 Introduction and Goals 1 2 Description 2 3 Modeling 2 4 Lab Objective 5 5 Model

More information

Construction and signal filtering in Quadrotor

Construction and signal filtering in Quadrotor Construction and signal filtering in Quadrotor Arkadiusz KUBACKI, Piotr OWCZAREK, Adam OWCZARKOWSKI*, Arkadiusz JAKUBOWSKI Institute of Mechanical Technology, *Institute of Control and Information Engineering,

More information

Chapter 5. Tracking system with MEMS mirror

Chapter 5. Tracking system with MEMS mirror Chapter 5 Tracking system with MEMS mirror Up to now, this project has dealt with the theoretical optimization of the tracking servo with MEMS mirror through the use of simulation models. For these models

More information

Application of Fuzzy Logic Controller in Shunt Active Power Filter

Application of Fuzzy Logic Controller in Shunt Active Power Filter IJIRST International Journal for Innovative Research in Science & Technology Volume 2 Issue 11 April 2016 ISSN (online): 2349-6010 Application of Fuzzy Logic Controller in Shunt Active Power Filter Ketan

More information

Design and Implementation of an Inverted Pendulum Controller to be used as a Lab Setup

Design and Implementation of an Inverted Pendulum Controller to be used as a Lab Setup Design and Implementation of an Inverted Pendulum Controller to be used as a Lab Setup Harsha Abeykoon, S.R.H. Mudunkotuwa, Malithi Gunawardana, Haroos Mohamed, Darshana Mannapperuma Department of Electrical

More information

Position Control of AC Servomotor Using Internal Model Control Strategy

Position Control of AC Servomotor Using Internal Model Control Strategy Position Control of AC Servomotor Using Internal Model Control Strategy Ahmed S. Abd El-hamid and Ahmed H. Eissa Corresponding Author email: Ahmednrc64@gmail.com Abstract: This paper focuses on the design

More information

Controlling of Permanent Magnet Brushless DC Motor using Instrumentation Technique

Controlling of Permanent Magnet Brushless DC Motor using Instrumentation Technique Scientific Journal of Impact Factor(SJIF): 3.134 International Journal of Advance Engineering and Research Development Volume 2,Issue 1, January -2015 e-issn(o): 2348-4470 p-issn(p): 2348-6406 Controlling

More information

istand I can Stand SPECIAL SENSOR REPORT

istand I can Stand SPECIAL SENSOR REPORT istand I can Stand SPECIAL SENSOR REPORT SUBRAT NAYAK UFID: 5095-9761 For EEL 5666 - Intelligent Machines Design Laboratory (Spring 2008) Department of Electrical and Computer Engineering University of

More information

Neural network based data fusion for vehicle positioning in

Neural network based data fusion for vehicle positioning in 04ANNUAL-345 Neural network based data fusion for vehicle positioning in land navigation system Mathieu St-Pierre Department of Electrical and Computer Engineering Université de Sherbrooke Sherbrooke (Québec)

More information

3DM -CV5-10 LORD DATASHEET. Inertial Measurement Unit (IMU) Product Highlights. Features and Benefits. Applications. Best in Class Performance

3DM -CV5-10 LORD DATASHEET. Inertial Measurement Unit (IMU) Product Highlights. Features and Benefits. Applications. Best in Class Performance LORD DATASHEET 3DM -CV5-10 Inertial Measurement Unit (IMU) Product Highlights Triaxial accelerometer, gyroscope, and sensors achieve the optimal combination of measurement qualities Smallest, lightest,

More information

ADVANCED DC-DC CONVERTER CONTROLLED SPEED REGULATION OF INDUCTION MOTOR USING PI CONTROLLER

ADVANCED DC-DC CONVERTER CONTROLLED SPEED REGULATION OF INDUCTION MOTOR USING PI CONTROLLER Asian Journal of Electrical Sciences (AJES) Vol.2.No.1 2014 pp 16-21. available at: www.goniv.com Paper Received :08-03-2014 Paper Accepted:22-03-2013 Paper Reviewed by: 1. R. Venkatakrishnan 2. R. Marimuthu

More information

Two Wheels Balancing Robot with Line Following Capability Nor Maniha Abdul Ghani, Faradila Naim, Tan Piow Yon

Two Wheels Balancing Robot with Line Following Capability Nor Maniha Abdul Ghani, Faradila Naim, Tan Piow Yon Two Wheels Balancing Robot with Line Following Capability Nor Maniha Abdul Ghani, Faradila Naim, Tan Piow Yon Abstract This project focuses on the development of a line follower algorithm for a Two Wheels

More information

Two Wheels Balancing Robot with Line Following Capability Nor Maniha Abdul Ghani, Faradila Naim, Tan Piow Yon

Two Wheels Balancing Robot with Line Following Capability Nor Maniha Abdul Ghani, Faradila Naim, Tan Piow Yon Two Wheels Balancing Robot with Line Following Capability Nor Maniha Abdul Ghani, Faradila Naim, Tan Piow Yon Abstract This project focuses on the development of a line follower algorithm for a Two Wheels

More information

BALANCING A TWO WHEELED ROBOT

BALANCING A TWO WHEELED ROBOT University of Southern Queensland Faculty of Engineering and Surveying BALANCING A TWO WHEELED ROBOT A dissertation submitted by Kealeboga Mokonopi In fulfilment of the requirements of Courses ENG4111

More information

SRV02-Series Rotary Experiment # 3. Ball & Beam. Student Handout

SRV02-Series Rotary Experiment # 3. Ball & Beam. Student Handout SRV02-Series Rotary Experiment # 3 Ball & Beam Student Handout SRV02-Series Rotary Experiment # 3 Ball & Beam Student Handout 1. Objectives The objective in this experiment is to design a controller for

More information

Intelligent Learning Control Strategies for Position Tracking of AC Servomotor

Intelligent Learning Control Strategies for Position Tracking of AC Servomotor Intelligent Learning Control Strategies for Position Tracking of AC Servomotor M.Vijayakarthick 1 1Assistant Professor& Department of Electronics and Instrumentation Engineering, Annamalai University,

More information

Advanced Servo Tuning

Advanced Servo Tuning Advanced Servo Tuning Dr. Rohan Munasinghe Department of Electronic and Telecommunication Engineering University of Moratuwa Servo System Elements position encoder Motion controller (software) Desired

More information