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

Size: px
Start display at page:

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

Transcription

1 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 Engineering, University of Moratuwa Sri Lanka 1 harsha@elect.mrt.ac.lk codexdj@gmail.com 3 sasareka@yahoo.com 4 haroos.mlhm@gmail.com 3 darshana.uom@gmail.com Abstract The Inverted Pendulum is one of the most challenging and important classical problems of Control Engineering. This paper presents a solution to this inherently unstable problem, with the pendulum being mounted on a cart that is moved by a belt spread between two pulleys. An optical encoder and a potentiometer are used to feedback the cart position and the pendulum angular displacement. The digital control of the system is developed using a microcontroller. The user can tune the parameters of the system through a user interface panel and observe the system response through a Computer Interface. The apparatus is intended to be used as a teaching tool to demonstrate the effects of Proportional (P), Integral (I), Derivative (D) controls separately as well as in combination, on control systems to engineering students and a practical was developed for this purpose. I. INTRODUCTION The Inverted Pendulum has been popular in the field of control engineering since it provides a good practice for prospective control engineers with features such as inherent instability. It is a non-linear system, yet can be approximated as a linear system if the operating range is small. The previous approaches toward solving this complicated problem involved three categories: 1. Simulation of inverted pendulum on a conveyor. Simulation of cart- mounted inverted pendulum 3. Implementation of cart-mounted inverted pendulum We have adopted the third approach in solving the Inverted Pendulum problem as presented in this paper. The apparatus involves a cart, able to move backwards and forwards, and a pendulum, hinged to the cart at the bottom of its length such that the pendulum can move in the same plane as the cart. That is, the pendulum mounted on the cart is free to fall along the cart's axis of motion. The pendulum is constrained to swing within predefined limits of ±45 degrees on either side of vertical axis. The system is to be controlled so that the pendulum remains balanced and upright, and is resistant to a impulse disturbance. The feedback signals are cart position and pendulum angle from the vertical axis. These signals are fed to the controller in which PID control is implemented. The required driving signals are then fed to the motor. The aim of the study is to stabilize the pendulum such that the position of the carriage on the track is controlled quickly and accurately and that the pendulum is always maintained tightly in its inverted position during such movements. The paper is arranged as follows: firstly the system modelling and control technique are discussed. Then the implementation with emphasis on mechanical model and electronic circuitry is presented. Finally the simulation results show the feasibility of the proposed technique II. METHODOLOGY The various stages of the work for accomplishing the task of controlling the Inverted Pendulum are as follows: Modeling the IP and linearizing the model for the operating range Understanding the inherit instability of the system Designing the PID controller and simulating it in MATLAB for proper tuning and verification and implementing with the PIC Finding optimum system parameters Designing and modifying the mechanical system Designing the electronic control system which consists of motor drivers, user interfaces, other interface and the central controller Integrating the subsystems together Implementing the controller on the physical IP model Testing the system and fine tuning the necessary parameters to improve the performance A. Mathematical model of Inverted Pendulum A complete theoretical model of the pendulum cart system can be developed using Lagrangian Dynamics where the equations of motion can be derived easily using Lagrange's equations [1]. Of course the parameters of the system should be measured accurately to be used in it. Refer Table 1 for the relevant parameters.

2 Simplification, rearranging and substitution of these equations leads to the equations that describe the motion of the inverted pendulum where x(t) is the position of the cart, θ(t) is the angle of the pendulum with respect to the vertical direction. TABLE I SYSTEM PARAMETERS Symbol Description Value M Mass of the Cart 710 g M Mass of the Pendulum 00 g b Friction of the Cart (Assumed) 0.00 N/m/s L Length of pendulum to Center of Gravity 90 cm I Moment of Inertia (Pendulum) 0.16 Kgm r Radius of Pulley 4.34 cm t M Time Constant of motor 0.5 s K M Gain of Motor rad/s/v K F Gain of Feedback 1 V/rad/s F Force applied to the cart x Cart Position Coordinate θ Pendulum Angle with the vertical B. Simulation of Model Fig. 1 Control block diagram of the whole system The model described by the above equations was created in the MATLAB/Simulink environment as a standalone block []. The Simulink scheme is shown in figure. Simulation based tuning of PID controller proved helpful and was quicker than hit and trial tuning. Effects of tuning P, I and D values on system response, as simulated in Simulink [3], is included in Section 3 Results. This could help in understanding the fundamentals behind PID controls as well. Equations obtained are nonlinear, but since the goal of a control system would be to keep the pendulum upright the equations can be linearized assuming that θ represents a small angle from the vertical upward direction. By considering the Laplace Transformation of those we can obtain the transfer functions, which are shown below. The transfer function of the pendulum angle: (s) G a ml s θ(s) q U(s) b(i ml ) (M m)mgl bmgl [1] 3 s s s q q q The transfer function of the cart position: (I ml ) mgl s X(s) q q G b (s) [] U(s) 4 b(i ml ) 3 (M m)mgl bmgl s s s s q q q q [(M m)(i ml U(s) K G 1(s) E(s) ) (ml) The overall transfer function of the actuation mechanism: m (M m)r s τ s 1 m E (s) = Error Voltage (s) = Angular Position of the Pendulum X(s) = Cart Position of the Pendulum U(s) = Force on the Pendulum ] [3] Fig. MATLAB simulation block diagram C. Physical Implementation 1) Mechanical Modifications: Two side barriers are being constructed to prevent the possible mechanical damage (bending, etc) to the pendulum upon falling off to sideways when unstable. The height of the each barrier is calculated by considering the pendulum length. ) Feedback Network: An accurate feedback network is essential in stabilizing the Inverted Pendulum system. For this purpose the sensor need to have a fast response and be noiseless such that the information retrieved from the sensor accurately reflects the state of the system. In the case of Inverted Pendulum, there are four parameters that govern the inverted pendulum system and that could be used for feedback in order to determine the controls necessary to stabilize the system: - Pendulum Angle - Angular velocity of Pendulum - Displacement of the cart - Velocity of the cart We decided to go along with the existing feedback system that measures the Angular displacement of the Pendulum via a

3 Linear Potentiometer and the cart position via an Incremental rotary encoder. Pendulum Angle Sensor - Potentiometer A linear potentiometer was used to measure the angular displacement of the pendulum. The potentiometer is attached to the pivot of the pendulum above the cart such that when the pendulum tilts, it also rotates the potentiometer shaft attached to the pivot, and we are able to know its angle through the feedback. When gathering information from the Pendulum Angle sensor it is required it that produces a variable voltage output that can be sampled by the controller platform. The Potentiometer used in the project gives 0V to 5V voltage according to the angle. The microcontroller will be programmed to use its internal Analog-to-Digital Converter (ADC) to convert the voltage outputs of the sensors into a binary representation which then can be converted into a usable measurement. It may be possible to incorporate faster and more accurate external ADCs, but it will require a larger I/O interface and accurate timing to guarantee good readings. Since the ADC s results will be within the range of (0-55) and its input analogue voltages from the potentiometer are within the range (0-5) volts for the angles of (0-360 ), we can obtain the resolution of the potentiometer such as: Resolution = 360 /56 = / 1 bit Or = 5/56 = V/ 1 bit = / V Ideally, the potentiometer would have little friction; though practical potentiometers will have some friction, which could influence the dynamics of the pendulum falling. More friction would slow down the reaction of the pendulum to any of the forces exerted on it, making it easier to balance working for our benefit. Cart Postion Sensor - Incremental Rotary Encoder An incremental rotary encoder was used to get the position of the cart on the length of the track. This encoder produces 1000 pulses per one revolution. The Encoder used was a Voltage output type giving out three outputs. The following fig 3 shows the clock diagrams of the encoder. According to the above clock diagrams two outputs (A and B) are required to count the pulses and get the direction. When the rising edge of output A high and output B is low, direction of the rotation is Clockwise. When the rising edge of output A and output B is high, direction of the rotation is Counter Clockwise. Output Z is an Index pulse that can be used to count the number of rotations. CCS C compiler was used to program the microcontroller. As mentioned earlier the encoder generates 1000 ppr and our motor rotates about 3600rpm. Thus the encoder will generate about 60,000 pulses in a second and in order to ensure maximum accuracy of the position of the cart it is vital to count all the pulses without losing any of the pulses. Therefore, to determine the cart position using the incremental encoder, the interrupt service routines (ISR) in the PIC is used. As there are several ISR in the microcontroller, we had to identify which one of them to be used. By default, the port B s pin B0 was assigned to detect external interrupts. That was one of the choices we had. Also, another service routine was available to detect the change in port B (pin B4- B7). In both cases, each time that the particular situation occurs, the user specified coding is executed. The difference in two is that the Pin B0 only detects either the rising or falling edge on PIN B0, but not both, where as the latter ISR detects any edge on any pin. It is clear that the latter ones gives more attention to pulses coming in and will improve the accuracy and resolution of the position; so we selected the nd method. We had channels A, B as outputs from the encoder, we assigned pins from port B (PIN B4 & PIN B3) to read those pulses, as they were close (single pin header) to each other and available. Whenever a level change is detected at PIN B4, it will compare the values at PIN B4 & PIN B3. If PIN B4 is high and PIN B is low, a long data typed variable will be incremented by 1 (single pulse to clock wise direction), and if PIN B4 is high and PIN B3 is also high, the same variable will be decremented by 1 (single pulse to counter clock wise direction). So ultimately the variable can be used to determine the position of the cart if the initial position of the cart is known. Since the variable is handled and updated by the ISR, it s value can be read any time in the main function. Figure.6 Clock Diagrams of Encoder output Direction of rotation: Clockwise as viewed from the shaft Direction of rotation: Counter clockwise as viewed from the shaft Fig 3 Clock Diagrams of Encoder output

4 Since the number of instructions in the ISR is not very long, the number of clock cycles interrupted is not significant and will not create a latency problem, hence will not affect the main algorithm. 3). Electronic Design Basically, the three main Circuits used were: Control circuit Board, motor driving Circuit to drive the DC motors according to the required acceleration and Interface circuit to display the output value and take to PID value for controlling. Control Circuit Board : This is the main circuit used to carry out the controlling algorithm with taking necessary inputs. A serial communication through MAX33 level converter is included on the board for computer interface and it is used to give P, I and D values and plot the angle measurement as a function of time. 5V DC power supply need to run the system can be given by a rechargeable battery or power supply unit. To maintain the constant voltage this circuit uses LM7805 voltage regulator so the circuit can handle Output Current up to 1A with up to 18V DC. Motor Drive Circuit In this project 75V, A brushed DC motor was used. This motor was drawing fairly high current during the PWM switching, with an average of A and peaks reaching up to 4 A and also since it takes high voltage, we designed motor drive for 6 A and 100V capable circuit keeping a safety margin. It is designed with MOSFETs because it has few advantages over BJTs and power transistors such as: fast switching and minimum power dissipations and is operated at 4 khz. The motor is controlled by an H-bridge which is driven by the PIC16F877A MOTOR CONTROL PWM MODULE. Therefore H-bridge was design with separate Circuit due to 75V DC and three 1V DC separate power supply requirement. This circuit consist with logic for proper control by PIC16F877A. Switching techniques are used to control the amount of power delivered to the motor by using pulse width modulator (PWM). The motor control circuit consist two main parts H-bridge Circuit and Logical Circuit. H-bridge circuit Design This circuit mainly contains four MOSFETs as shown in figure (14), N-channel IRF540N were used (Refer Appendix 3 for IRF540N Data sheet). It is 100V, A. Freewheeling diodes were added in order to protect the MOSFETs from back emf generated by the motor in the form of spikes. It can handle 4A current. Heat sinks hinged to the MOSFETs were also added to provide cooling for the MOSFETs. To Bias the MOSFET it is necessary to maintain the voltage between the Gate to Source (V GS ) so in the H-Bridge to achieve this we used different grounds for four MOSFETs therefore four 1V DC supply was used in this circuit. The direction of the current is controlled by the direction signal; two MOSFETs will be switched on at the same time while the other two remain off. To Bias the MOSFETs it is need 15V voltage but the signals from the microcontroller system are 0-5V so These signals converted to 0-15V to bias the MOSFETs using the Optocouples [4N35]. This operation controls the direction of rotation of the DC motor. On the other hand the PWM signal controls the speed of the DC motor. Pulse-width modulation control works by switching the power supplied to the motor on and off very rapidly. If the switching frequency is high enough, the output signal appears to be the average voltage of the PWM which is proportional to the duty cycle and the motor runs at a steady speed. By adjusting the duty cycle of the signal the average power can be varied, and hence the motor speed. In the logical circuit having three input from PIC16f877 to control the direction, delay and PWM signal. Speed of the motor is controlled from the Pulse Width Modulation (Pin RC) and direction is controlled from the signal of the direction pin (Pin RC3). When the direction of the motor is change, there should be a delay that should be higher than the time taken to discharge the capacitance of the MOSFETs. Otherwise the MOSFETs will burn due to switching MOSFETs are on simultaneously. So when the motor wants to change the direction, 5 microsecond delay is set from the pin C4. Through the logic circuit get out put as PWM clockwise and PWM counter clockwise. Those signals are sent to the H- bridge circuit. Interface Circuit User Interface circuit consist of 3 varistors, 6 push buttons, 3 indicators and finally the Liquid Crystal Display (LCD). Varistors are being used to vary Kp, Ki & Kd parameters of Fig 4 Logical and H-Bridge circuit

5 the controller. They are interfaced through the A/D module s channel 0- of the microcontroller. The push buttons are in 3x sets, where on set is used to increment, decrement & Enter the values of PID constants and the other set is used to issue START, STOP & RESET commands for the system. Switch s microcontroller side is grounded through a pull up resistor to prevent floating and hence creating unnecessary fluctuations. The LCD is used to view the parameters (Kp,Ki,Kd) systems states ( Working.. ) and messages( Please Enter ). States are also shown by the blinking LEDs on the panel as At work RED; Ready - GREEN. 3) User Interface: A user interface was designed, so that the user can carry out following functions; - Set, view and amend the values for K P, K I, K d - Reset the system - Indicate the system status - Give Starting command - Check the communicate status with the PC (RS 3) 16 x Parallel LCD with backlight is used to view all the changes being made (before starting) and will also display the status at operation. Input devices used are varistors & push buttons. In addition several indicator LEDs are used. All the instructions on entering values and other functions can also be viewed on the LCD. 4) Computer Interface It is more convenient to use a computer interface in the IP setup since it serves the requirement of varying the P, I and D values and observing the behaviour of the control theory through a single interface by the plot and the facility to compare the result with MatLab simulation result was arranged so user can get the good understanding of the controller behaviour. For the communication between the computer interface and the setup, serial communication, RF communication or Bluetooth technology can be used. The control circuit of the setup is designed to facilitate with serial communication. But, due to financial restrictions the RF unit required for RF communication is not installed in the setup. Controlling of the setup can be easily done through this computer interface. User can vary the P, I and D values respectively in text box provided in the interface if the user enter the wrong value the warning message will appear.the user can feed PID value to the control program by simply clicking the Send button. The Start button starts executing the control program and start to read the data from the controller and plot in the practical variation graph, A graph is plotted with the pendulum angle against time at the same time it is plot the practical simulation impulse response for respective P, I, D value So, the user can clearly see how the pendulum arm is behaving and how much time it takes to get balanced. By comparing these graphs which were plotted for different P, I and D values, one can get a better understanding about the effect of P, I and D values on the balancing of the pendulum arm, while the Stop button terminates the program and close the serial port. Optionally Clear button is providing to reset the plot graph and PID value. 5) System Integration Finally all the subsystems mechanical, electronic, controller and feedback network were gathered to produce the IP system. The individual modules (blocks) were solo tested, and their functionality according to specifications was also verified. Experimental test were fully performed and proved to be a success. D. Flowchart of algorithm. The overall flowchart of the Microcontroller algorithm is shown below [7]. III. Fig. 5 Flow chart of Algorithm RESULTS AND DISCUSSION The implementation of PID control method is done by adjusting the value of gain K p, K i, K d in order to get the best response of the system. Effects of tuning P, I and D values on system response, as simulated in Simulink, are summarized below. Fig 6 Effects of tuning P, I and D on response

6 Using the suitable value of K P =0, K I =50, K D =1, the pendulum s angle is satisfactorily achieved as shown in the following figures Figure 7 and Figure 8. The step response of the system is shown in the following Figure. The step starting time is 1 s and the step value is 100. Sample time is 0.5 s. A. Impulse Response The impulse response of the system is shown in the following figure. The settling time is 0.74 s. IV. CONCLUSION As a conclusion, the simulation results demonstrate that the inverted pendulum system can be stabilized successfully by implementing the PID control method. Furthermore, the simulation based tuning of PID controller proves that the apparatus can be used as a teaching tool to teach the characteristics of Proportional (P), Integral (I), Derivative (D), PI, PD and PID controls and their effects on control systems. Fig 7 Impulse Response for Pendulum s angle for K P =0, K I =50, K D =1 B. Step Response ACKNOWLEDGMENT We wish to acknowledge Dr. Harsha Abeykoon our project supervisor and to Dr. J.P. Karunadasa, Head of the Department of Electrical Engineering, University of Moratuwa for giving us technical advice and for guiding and inspiring us throughout the project to make all these project works possible. We are also thankful to all the academic and non academic staff of the Department of Electrical Engineering, University of Moratuwa for all the assistance given to make this project a success. REFERENCES [1] Williams, James H. Jr., Fundamentals of Applied Dynamics, John Wiley & Sons, New York, [] [] Harold Klee, Simulation of Dynamic Systems with Matlab and Simulink, University of Central Florida, Orlando, USA, pp , [3] [3] F C Teng, Real time control using Matlab Simulink, IEEE, pp , 000 [4] [4] Power Semiconductor Applications, DC Motor Control, Philips Semiconductors, February006. [5] [5] Martin P. Bates, Programming 8-bit Microcontrollers in C, 007 [6] [6] D. Ibrahim : Advanced PIC Microcontroller Projects in C, nd ed. Addison-Oxford, 008. [7] [7] John Charais, Ruan Lourens, Software PID Control using Microchip PIC, Microchip Technology.Inc, 004. Fig 8 Step Response for Pendulum s angle for K P =0, K I =50, K D =1

Lab 5: Inverted Pendulum PID Control

Lab 5: Inverted Pendulum PID Control Lab 5: Inverted Pendulum PID Control In this lab we will be learning about PID (Proportional Integral Derivative) control and using it to keep an inverted pendulum system upright. We chose an inverted

More information

CHAPTER 3 APPLICATION OF THE CIRCUIT MODEL FOR PHOTOVOLTAIC ENERGY CONVERSION SYSTEM

CHAPTER 3 APPLICATION OF THE CIRCUIT MODEL FOR PHOTOVOLTAIC ENERGY CONVERSION SYSTEM 63 CHAPTER 3 APPLICATION OF THE CIRCUIT MODEL FOR PHOTOVOLTAIC ENERGY CONVERSION SYSTEM 3.1 INTRODUCTION The power output of the PV module varies with the irradiation and the temperature and the output

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

CHAPTER 2 PID CONTROLLER BASED CLOSED LOOP CONTROL OF DC DRIVE

CHAPTER 2 PID CONTROLLER BASED CLOSED LOOP CONTROL OF DC DRIVE 23 CHAPTER 2 PID CONTROLLER BASED CLOSED LOOP CONTROL OF DC DRIVE 2.1 PID CONTROLLER A proportional Integral Derivative controller (PID controller) find its application in industrial control system. It

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

Pulse-Width-Modulation Motor Speed Control with a PIC (modified from lab text by Alciatore)

Pulse-Width-Modulation Motor Speed Control with a PIC (modified from lab text by Alciatore) Laboratory 14 Pulse-Width-Modulation Motor Speed Control with a PIC (modified from lab text by Alciatore) Required Components: 1x PIC 16F88 18P-DIP microcontroller 3x 0.1 F capacitors 1x 12-button numeric

More information

DEPARTMENT OF ELECTRICAL AND ELECTRONIC ENGINEERING BANGLADESH UNIVERSITY OF ENGINEERING & TECHNOLOGY EEE 402 : CONTROL SYSTEMS SESSIONAL

DEPARTMENT OF ELECTRICAL AND ELECTRONIC ENGINEERING BANGLADESH UNIVERSITY OF ENGINEERING & TECHNOLOGY EEE 402 : CONTROL SYSTEMS SESSIONAL DEPARTMENT OF ELECTRICAL AND ELECTRONIC ENGINEERING BANGLADESH UNIVERSITY OF ENGINEERING & TECHNOLOGY EEE 402 : CONTROL SYSTEMS SESSIONAL Experiment No. 1(a) : Modeling of physical systems and study of

More information

ME375 Lab Project. Bradley Boane & Jeremy Bourque April 25, 2018

ME375 Lab Project. Bradley Boane & Jeremy Bourque April 25, 2018 ME375 Lab Project Bradley Boane & Jeremy Bourque April 25, 2018 Introduction: The goal of this project was to build and program a two-wheel robot that travels forward in a straight line for a distance

More information

Design of a Simulink-Based Control Workstation for Mobile Wheeled Vehicles with Variable-Velocity Differential Motor Drives

Design of a Simulink-Based Control Workstation for Mobile Wheeled Vehicles with Variable-Velocity Differential Motor Drives Design of a Simulink-Based Control Workstation for Mobile Wheeled Vehicles with Variable-Velocity Differential Motor Drives Kevin Block, Timothy De Pasion, Benjamin Roos, Alexander Schmidt Gary Dempsey

More information

DC SERVO MOTOR CONTROL SYSTEM

DC SERVO MOTOR CONTROL SYSTEM DC SERVO MOTOR CONTROL SYSTEM MODEL NO:(PEC - 00CE) User Manual Version 2.0 Technical Clarification /Suggestion : / Technical Support Division, Vi Microsystems Pvt. Ltd., Plot No :75,Electronics Estate,

More information

CHAPTER-5 DESIGN OF DIRECT TORQUE CONTROLLED INDUCTION MOTOR DRIVE

CHAPTER-5 DESIGN OF DIRECT TORQUE CONTROLLED INDUCTION MOTOR DRIVE 113 CHAPTER-5 DESIGN OF DIRECT TORQUE CONTROLLED INDUCTION MOTOR DRIVE 5.1 INTRODUCTION This chapter describes hardware design and implementation of direct torque controlled induction motor drive with

More information

CHAPTER 4 CONTROL ALGORITHM FOR PROPOSED H-BRIDGE MULTILEVEL INVERTER

CHAPTER 4 CONTROL ALGORITHM FOR PROPOSED H-BRIDGE MULTILEVEL INVERTER 65 CHAPTER 4 CONTROL ALGORITHM FOR PROPOSED H-BRIDGE MULTILEVEL INVERTER 4.1 INTRODUCTION Many control strategies are available for the control of IMs. The Direct Torque Control (DTC) is one of the most

More information

Jaguar Motor Controller (Stellaris Brushed DC Motor Control Module with CAN)

Jaguar Motor Controller (Stellaris Brushed DC Motor Control Module with CAN) Jaguar Motor Controller (Stellaris Brushed DC Motor Control Module with CAN) 217-3367 Ordering Information Product Number Description 217-3367 Stellaris Brushed DC Motor Control Module with CAN (217-3367)

More information

Brushed DC Motor Microcontroller PWM Speed Control with Optical Encoder and H-Bridge

Brushed DC Motor Microcontroller PWM Speed Control with Optical Encoder and H-Bridge Brushed DC Motor Microcontroller PWM Speed Control with Optical Encoder and H-Bridge L298 Full H-Bridge HEF4071B OR Gate Brushed DC Motor with Optical Encoder & Load Inertia Flyback Diodes Arduino Microcontroller

More information

Design and Construction of Synchronizing Check Relay

Design and Construction of Synchronizing Check Relay Design and Construction of Synchronizing Check Relay M.J.A.A.I.Jayawardene,, R.W.Jayawickrama, M.D.R.K.Karunarathna,S.A.P.U.Karunaratne, W.S.Lakmal Abstract This document contains an introduction about

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

Lab 23 Microcomputer-Based Motor Controller

Lab 23 Microcomputer-Based Motor Controller Lab 23 Microcomputer-Based Motor Controller Page 23.1 Lab 23 Microcomputer-Based Motor Controller This laboratory assignment accompanies the book, Embedded Microcomputer Systems: Real Time Interfacing,

More information

EE 314 Spring 2003 Microprocessor Systems

EE 314 Spring 2003 Microprocessor Systems EE 314 Spring 2003 Microprocessor Systems Laboratory Project #9 Closed Loop Control Overview and Introduction This project will bring together several pieces of software and draw on knowledge gained in

More information

Penn State Erie, The Behrend College School of Engineering

Penn State Erie, The Behrend College School of Engineering Penn State Erie, The Behrend College School of Engineering EE BD 327 Signals and Control Lab Spring 2008 Lab 9 Ball and Beam Balancing Problem April 10, 17, 24, 2008 Due: May 1, 2008 Number of Lab Periods:

More information

Figure 1: Unity Feedback System. The transfer function of the PID controller looks like the following:

Figure 1: Unity Feedback System. The transfer function of the PID controller looks like the following: Islamic University of Gaza Faculty of Engineering Electrical Engineering department Control Systems Design Lab Eng. Mohammed S. Jouda Eng. Ola M. Skeik Experiment 3 PID Controller Overview This experiment

More information

νµθωερτψυιοπασδφγηϕκλζξχϖβνµθωερτ ψυιοπασδφγηϕκλζξχϖβνµθωερτψυιοπα σδφγηϕκλζξχϖβνµθωερτψυιοπασδφγηϕκ χϖβνµθωερτψυιοπασδφγηϕκλζξχϖβνµθ

νµθωερτψυιοπασδφγηϕκλζξχϖβνµθωερτ ψυιοπασδφγηϕκλζξχϖβνµθωερτψυιοπα σδφγηϕκλζξχϖβνµθωερτψυιοπασδφγηϕκ χϖβνµθωερτψυιοπασδφγηϕκλζξχϖβνµθ θωερτψυιοπασδφγηϕκλζξχϖβνµθωερτψ υιοπασδφγηϕκλζξχϖβνµθωερτψυιοπασδ φγηϕκλζξχϖβνµθωερτψυιοπασδφγηϕκλζ ξχϖβνµθωερτψυιοπασδφγηϕκλζξχϖβνµ EE 331 Design Project Final Report θωερτψυιοπασδφγηϕκλζξχϖβνµθωερτψ

More information

Hydraulic Actuator Control Using an Multi-Purpose Electronic Interface Card

Hydraulic Actuator Control Using an Multi-Purpose Electronic Interface Card Hydraulic Actuator Control Using an Multi-Purpose Electronic Interface Card N. KORONEOS, G. DIKEAKOS, D. PAPACHRISTOS Department of Automation Technological Educational Institution of Halkida Psaxna 34400,

More information

Project Proposal. Low-Cost Motor Speed Controller for Bradley ECE Department Robots L.C.M.S.C. By Ben Lorentzen

Project Proposal. Low-Cost Motor Speed Controller for Bradley ECE Department Robots L.C.M.S.C. By Ben Lorentzen Project Proposal Low-Cost Motor Speed Controller for Bradley ECE Department Robots L.C.M.S.C. By Ben Lorentzen Advisor Dr. Gary Dempsey Bradley University Department of Electrical Engineering December

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

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

DC motor control using arduino

DC motor control using arduino DC motor control using arduino 1) Introduction: First we need to differentiate between DC motor and DC generator and where we can use it in this experiment. What is the main different between the DC-motor,

More information

Design of double loop-locked system for brush-less DC motor based on DSP

Design of double loop-locked system for brush-less DC motor based on DSP International Conference on Advanced Electronic Science and Technology (AEST 2016) Design of double loop-locked system for brush-less DC motor based on DSP Yunhong Zheng 1, a 2, Ziqiang Hua and Li Ma 3

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

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

Experiment Of Speed Control for an Electric Trishaw Based on PID Control Algorithm

Experiment Of Speed Control for an Electric Trishaw Based on PID Control Algorithm International Journal of Mechanical & Mechatronics Engineering IJMME-IJENS Vol:17 No:02 38 Experiment Of Speed Control for an Electric Trishaw Based on PID Control Algorithm Shahrizal Saat 1 *, Mohd Nabil

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

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

2.017 DESIGN OF ELECTROMECHANICAL ROBOTIC SYSTEMS Fall 2009 Lab 4: Motor Control. October 5, 2009 Dr. Harrison H. Chin

2.017 DESIGN OF ELECTROMECHANICAL ROBOTIC SYSTEMS Fall 2009 Lab 4: Motor Control. October 5, 2009 Dr. Harrison H. Chin 2.017 DESIGN OF ELECTROMECHANICAL ROBOTIC SYSTEMS Fall 2009 Lab 4: Motor Control October 5, 2009 Dr. Harrison H. Chin Formal Labs 1. Microcontrollers Introduction to microcontrollers Arduino microcontroller

More information

Using Magnetic Sensors for Absolute Position Detection and Feedback. Kevin Claycomb University of Evansville

Using Magnetic Sensors for Absolute Position Detection and Feedback. Kevin Claycomb University of Evansville Using Magnetic Sensors for Absolute Position Detection and Feedback. Kevin Claycomb University of Evansville Using Magnetic Sensors for Absolute Position Detection and Feedback. Abstract Several types

More information

UNIT 2: DC MOTOR POSITION CONTROL

UNIT 2: DC MOTOR POSITION CONTROL UNIT 2: DC MOTOR POSITION CONTROL 2.1 INTRODUCTION This experiment aims to show the mathematical model of a DC motor and how to determine the physical parameters of a DC motor model. Once the model is

More information

PWM, ALT, HALT, HAST.

PWM, ALT, HALT, HAST. CLOSED LOOP IMPLEMENTATION OF SPEED CONTROL OF A BRUSHED PMDC MOTOR OF AN X-RAY SYSTEM AND VALIDATION OF RELIABILITY OF THE CONTROLLER Mutum Meenakshi Devi 1, V Chayapathy 2 Dept. of Electrical and Electronics

More information

Effective Teaching Learning Process for PID Controller Based on Experimental Setup with LabVIEW

Effective Teaching Learning Process for PID Controller Based on Experimental Setup with LabVIEW Effective Teaching Learning Process for PID Controller Based on Experimental Setup with LabVIEW Komal Sampatrao Patil & D.R.Patil Electrical Department, Walchand college of Engineering, Sangli E-mail :

More information

L E C T U R E R, E L E C T R I C A L A N D M I C R O E L E C T R O N I C E N G I N E E R I N G

L E C T U R E R, E L E C T R I C A L A N D M I C R O E L E C T R O N I C E N G I N E E R I N G P R O F. S L A C K L E C T U R E R, E L E C T R I C A L A N D M I C R O E L E C T R O N I C E N G I N E E R I N G G B S E E E @ R I T. E D U B L D I N G 9, O F F I C E 0 9-3 1 8 9 ( 5 8 5 ) 4 7 5-5 1 0

More information

CIS009-2, Mechatronics Signals & Motors

CIS009-2, Mechatronics Signals & Motors CIS009-2, Signals & Motors Bedfordshire 13 th December 2012 Outline 1 2 3 4 5 6 7 8 3 Signals Two types of signals exist: 4 Bedfordshire 52 Analogue signal In an analogue signal voltages and currents continuously

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

Design of stepper motor position control system based on DSP. Guan Fang Liu a, Hua Wei Li b

Design of stepper motor position control system based on DSP. Guan Fang Liu a, Hua Wei Li b nd International Conference on Machinery, Electronics and Control Simulation (MECS 17) Design of stepper motor position control system based on DSP Guan Fang Liu a, Hua Wei Li b School of Electrical Engineering,

More information

Ball Balancing on a Beam

Ball Balancing on a Beam 1 Ball Balancing on a Beam Muhammad Hasan Jafry, Haseeb Tariq, Abubakr Muhammad Department of Electrical Engineering, LUMS School of Science and Engineering, Pakistan Email: {14100105,14100040}@lums.edu.pk,

More information

A Do-and-See Approach for Learning Mechatronics Concepts

A Do-and-See Approach for Learning Mechatronics Concepts Proceedings of the 5 th International Conference of Control, Dynamic Systems, and Robotics (CDSR'18) Niagara Falls, Canada June 7 9, 2018 Paper No. 124 DOI: 10.11159/cdsr18.124 A Do-and-See Approach for

More information

Development of a MATLAB Data Acquisition and Control Toolbox for BASIC Stamp Microcontrollers

Development of a MATLAB Data Acquisition and Control Toolbox for BASIC Stamp Microcontrollers Chapter 4 Development of a MATLAB Data Acquisition and Control Toolbox for BASIC Stamp Microcontrollers 4.1. Introduction Data acquisition and control boards, also known as DAC boards, are used in virtually

More information

The Discussion of this exercise covers the following points: Angular position control block diagram and fundamentals. Power amplifier 0.

The Discussion of this exercise covers the following points: Angular position control block diagram and fundamentals. Power amplifier 0. Exercise 6 Motor Shaft Angular Position Control EXERCISE OBJECTIVE When you have completed this exercise, you will be able to associate the pulses generated by a position sensing incremental encoder with

More information

Laboratory 11. Pulse-Width-Modulation Motor Speed Control with a PIC

Laboratory 11. Pulse-Width-Modulation Motor Speed Control with a PIC Laboratory 11 Pulse-Width-Modulation Motor Speed Control with a PIC Required Components: 1 PIC16F88 18P-DIP microcontroller 3 0.1 F capacitors 1 12-button numeric keypad 1 NO pushbutton switch 1 Radio

More information

Micro Controller Based Ac Power Controller

Micro Controller Based Ac Power Controller Wireless Sensor Network, 9, 2, 61-121 doi:1.4236/wsn.9.112 Published Online July 9 (http://www.scirp.org/journal/wsn/). Micro Controller Based Ac Power Controller S. A. HARI PRASAD 1, B. S. KARIYAPPA 1,

More information

Where: (J LM ) is the load inertia referred to the motor shaft. 8.0 CONSIDERATIONS FOR THE CONTROL OF DC MICROMOTORS. 8.

Where: (J LM ) is the load inertia referred to the motor shaft. 8.0 CONSIDERATIONS FOR THE CONTROL OF DC MICROMOTORS. 8. Where: (J LM ) is the load inertia referred to the motor shaft. 8.0 CONSIDERATIONS FOR THE CONTROL OF DC MICROMOTORS 8.1 General Comments Due to its inherent qualities the Escap micromotor is very suitable

More information

6. HARDWARE PROTOTYPE AND EXPERIMENTAL RESULTS

6. HARDWARE PROTOTYPE AND EXPERIMENTAL RESULTS 6. HARDWARE PROTOTYPE AND EXPERIMENTAL RESULTS Laboratory based hardware prototype is developed for the z-source inverter based conversion set up in line with control system designed, simulated and discussed

More information

Lab 3 Swinging pendulum experiment

Lab 3 Swinging pendulum experiment Lab 3 Swinging pendulum experiment Agenda Time 10 min Item Review agenda Introduce the swinging pendulum experiment and apparatus 95 min Lab activity I ll try to give you a 5- minute warning before the

More information

Lab 2: Quanser Hardware and Proportional Control

Lab 2: Quanser Hardware and Proportional Control I. Objective The goal of this lab is: Lab 2: Quanser Hardware and Proportional Control a. Familiarize students with Quanser's QuaRC tools and the Q4 data acquisition board. b. Derive and understand a model

More information

Step vs. Servo Selecting the Best

Step vs. Servo Selecting the Best Step vs. Servo Selecting the Best Dan Jones Over the many years, there have been many technical papers and articles about which motor is the best. The short and sweet answer is let s talk about the application.

More information

Microcontroller Based Closed Loop Speed and Position Control of DC Motor

Microcontroller Based Closed Loop Speed and Position Control of DC Motor International Journal of Engineering and Advanced Technology (IJEAT) ISSN: 2249 8958, Volume-3, Issue-5, June 2014 Microcontroller Based Closed Loop Speed and Position Control of DC Motor Panduranga Talavaru,

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

Rotary Motion Servo Plant: SRV02. Rotary Experiment #02: Position Control. SRV02 Position Control using QuaRC. Student Manual

Rotary Motion Servo Plant: SRV02. Rotary Experiment #02: Position Control. SRV02 Position Control using QuaRC. Student Manual Rotary Motion Servo Plant: SRV02 Rotary Experiment #02: Position Control SRV02 Position Control using QuaRC Student Manual Table of Contents 1. INTRODUCTION...1 2. PREREQUISITES...1 3. OVERVIEW OF FILES...2

More information

7 Lab: Motor control for orientation and angular speed

7 Lab: Motor control for orientation and angular speed Prelab Participation Lab Name: 7 Lab: Motor control for orientation and angular speed Control systems help satellites to track distant stars, airplanes to follow a desired trajectory, cars to travel at

More information

GE 320: Introduction to Control Systems

GE 320: Introduction to Control Systems GE 320: Introduction to Control Systems Laboratory Section Manual 1 Welcome to GE 320.. 1 www.softbankrobotics.com 1 1 Introduction This section summarizes the course content and outlines the general procedure

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

Chapter 10 Digital PID

Chapter 10 Digital PID Chapter 10 Digital PID Chapter 10 Digital PID control Goals To show how PID control can be implemented in a digital computer program To deliver a template for a PID controller that you can implement yourself

More information

Servo Tuning Tutorial

Servo Tuning Tutorial Servo Tuning Tutorial 1 Presentation Outline Introduction Servo system defined Why does a servo system need to be tuned Trajectory generator and velocity profiles The PID Filter Proportional gain Derivative

More information

CHAPTER-III MODELING AND IMPLEMENTATION OF PMBLDC MOTOR DRIVE

CHAPTER-III MODELING AND IMPLEMENTATION OF PMBLDC MOTOR DRIVE CHAPTER-III MODELING AND IMPLEMENTATION OF PMBLDC MOTOR DRIVE 3.1 GENERAL The PMBLDC motors used in low power applications (up to 5kW) are fed from a single-phase AC source through a diode bridge rectifier

More information

Observer-based Engine Cooling Control System (OBCOOL) Project Proposal. Students: Andrew Fouts & Kurtis Liggett. Advisor: Dr.

Observer-based Engine Cooling Control System (OBCOOL) Project Proposal. Students: Andrew Fouts & Kurtis Liggett. Advisor: Dr. Observer-based Engine Cooling Control System (OBCOOL) Project Proposal Students: Andrew Fouts & Kurtis Liggett Advisor: Dr. Gary Dempsey Date: December 09, 2010 1 Introduction Control systems exist in

More information

Four Quadrant Speed Control of DC Motor with the Help of AT89S52 Microcontroller

Four Quadrant Speed Control of DC Motor with the Help of AT89S52 Microcontroller Four Quadrant Speed Control of DC Motor with the Help of AT89S52 Microcontroller Rahul Baranwal 1, Omama Aftab 2, Mrs. Deepti Ojha 3 1,2, B.Tech Final Year (Electronics and Communication Engineering),

More information

Brushed DC Motor PWM Speed Control with the NI myrio, Optical Encoder, and H-Bridge

Brushed DC Motor PWM Speed Control with the NI myrio, Optical Encoder, and H-Bridge Brushed DC Motor PWM Speed Control with the NI myrio, Optical Encoder, and H-Bridge Motor Controller Brushed DC Motor / Encoder System K. Craig 1 Gnd 5 V OR Gate H-Bridge 12 V Bypass Capacitors Flyback

More information

Controlling DC Brush Motor using MD10B or MD30B. Version 1.2. Aug Cytron Technologies Sdn. Bhd.

Controlling DC Brush Motor using MD10B or MD30B. Version 1.2. Aug Cytron Technologies Sdn. Bhd. PR10 Controlling DC Brush Motor using MD10B or MD30B Version 1.2 Aug 2008 Cytron Technologies Sdn. Bhd. Information contained in this publication regarding device applications and the like is intended

More information

Exercise 5: PWM and Control Theory

Exercise 5: PWM and Control Theory Exercise 5: PWM and Control Theory Overview In the previous sessions, we have seen how to use the input capture functionality of a microcontroller to capture external events. This functionality can also

More information

EE 308 Spring S12 SUBSYSTEMS: PULSE WIDTH MODULATION, A/D CONVERTER, AND SYNCHRONOUS SERIAN INTERFACE

EE 308 Spring S12 SUBSYSTEMS: PULSE WIDTH MODULATION, A/D CONVERTER, AND SYNCHRONOUS SERIAN INTERFACE 9S12 SUBSYSTEMS: PULSE WIDTH MODULATION, A/D CONVERTER, AND SYNCHRONOUS SERIAN INTERFACE In this sequence of three labs you will learn to use the 9S12 S hardware sybsystem. WEEK 1 PULSE WIDTH MODULATION

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

Microcontroller Based Electric Expansion Valve Controller for Air Conditioning System

Microcontroller Based Electric Expansion Valve Controller for Air Conditioning System Microcontroller Based Electric Expansion Valve Controller for Air Conditioning System Thae Su Aye, and Zaw Myo Lwin Abstract In the air conditioning system, the electric expansion valve (EEV) is one of

More information

Lab 2: Introduction to Real Time Workshop

Lab 2: Introduction to Real Time Workshop Lab 2: Introduction to Real Time Workshop 1 Introduction In this lab, you will be introduced to the experimental equipment. What you learn in this lab will be essential in each subsequent lab. Document

More information

CSE 3215 Embedded Systems Laboratory Lab 5 Digital Control System

CSE 3215 Embedded Systems Laboratory Lab 5 Digital Control System Introduction CSE 3215 Embedded Systems Laboratory Lab 5 Digital Control System The purpose of this lab is to introduce you to digital control systems. The most basic function of a control system is to

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

Speed Rate Corrected Antenna Azimuth Axis Positioning System

Speed Rate Corrected Antenna Azimuth Axis Positioning System International Journal of Electronics Engineering Research. ISSN 0975-6450 Volume 9, Number 2 (2017) pp. 151-158 Research India Publications http://www.ripublication.com Speed Rate Corrected Antenna Azimuth

More information

Validation Document. ELEC 491 Capstone Proposal - Dynamic Projector Mount Project. Andy Kwan Smaran Karimbil Siamak Rahmanian Dante Ye

Validation Document. ELEC 491 Capstone Proposal - Dynamic Projector Mount Project. Andy Kwan Smaran Karimbil Siamak Rahmanian Dante Ye Validation Document ELEC 491 Capstone Proposal - Dynamic Projector Mount Project Andy Kwan Smaran Karimbil Siamak Rahmanian Dante Ye Executive Summary: The purpose of this document is to describe the tests

More information

EE 308 Spring Preparation for Final Lab Project Simple Motor Control. Motor Control

EE 308 Spring Preparation for Final Lab Project Simple Motor Control. Motor Control Preparation for Final Lab Project Simple Motor Control Motor Control A proportional integral derivative controller (PID controller) is a generic control loop feedback mechanism (controller) widely used

More information

A HARDWARE DC MOTOR EMULATOR VAGNER S. ROSA 1, VITOR I. GERVINI 2, SEBASTIÃO C. P. GOMES 3, SERGIO BAMPI 4

A HARDWARE DC MOTOR EMULATOR VAGNER S. ROSA 1, VITOR I. GERVINI 2, SEBASTIÃO C. P. GOMES 3, SERGIO BAMPI 4 A HARDWARE DC MOTOR EMULATOR VAGNER S. ROSA 1, VITOR I. GERVINI 2, SEBASTIÃO C. P. GOMES 3, SERGIO BAMPI 4 Abstract Much work have been done lately to develop complex motor control systems. However they

More information

Fuzzy Logic Controller on DC/DC Boost Converter

Fuzzy Logic Controller on DC/DC Boost Converter 21 IEEE International Conference on Power and Energy (PECon21), Nov 29 - Dec 1, 21, Kuala Lumpur, Malaysia Fuzzy Logic Controller on DC/DC Boost Converter N.F Nik Ismail, Member IEEE,Email: nikfasdi@yahoo.com

More information

Tarocco Closed Loop Motor Controller

Tarocco Closed Loop Motor Controller Contents Safety Information... 3 Overview... 4 Features... 4 SoC for Closed Loop Control... 4 Gate Driver... 5 MOSFETs in H Bridge Configuration... 5 Device Characteristics... 6 Installation... 7 Motor

More information

Brushed DC Motor Control. Module with CAN (MDL-BDC24)

Brushed DC Motor Control. Module with CAN (MDL-BDC24) Stellaris Brushed DC Motor Control Module with CAN (MDL-BDC24) Ordering Information Product No. MDL-BDC24 RDK-BDC24 Description Stellaris Brushed DC Motor Control Module with CAN (MDL-BDC24) for Single-Unit

More information

MOBILE ROBOT CRUISE CONTROLLER

MOBILE ROBOT CRUISE CONTROLLER University of Moratuwa B.Sc. Engineering Robotic Mini project 2006 MOBILE ROBOT CRUISE CONTROLLER By Cader M.F.M.A. (020046) Iynkaran N. (020153) Uthayasanker T. (020400) Department of electronic and telecommunication

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

EE 4314 Lab 3 Handout Speed Control of the DC Motor System Using a PID Controller Fall Lab Information

EE 4314 Lab 3 Handout Speed Control of the DC Motor System Using a PID Controller Fall Lab Information EE 4314 Lab 3 Handout Speed Control of the DC Motor System Using a PID Controller Fall 2012 IMPORTANT: This handout is common for all workbenches. 1. Lab Information a) Date, Time, Location, and Report

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

Lock Cracker S. Lust, E. Skjel, R. LeBlanc, C. Kim

Lock Cracker S. Lust, E. Skjel, R. LeBlanc, C. Kim Lock Cracker S. Lust, E. Skjel, R. LeBlanc, C. Kim Abstract - This project utilized Eleven Engineering s XInC2 development board to control several peripheral devices to open a standard 40 digit combination

More information

PYKC 7 March 2019 EA2.3 Electronics 2 Lecture 18-1

PYKC 7 March 2019 EA2.3 Electronics 2 Lecture 18-1 In this lecture, we will examine a very popular feedback controller known as the proportional-integral-derivative (PID) control method. This type of controller is widely used in industry, does not require

More information

MICROCONTROLLER BASED BOOST PID MUNAJAH BINTI MOHD RUBAEE

MICROCONTROLLER BASED BOOST PID MUNAJAH BINTI MOHD RUBAEE MICROCONTROLLER BASED BOOST PID MUNAJAH BINTI MOHD RUBAEE This thesis is submitted as partial fulfillment of the requirement for the award of Bachelor of Electrical Engineering (Power System) Faculty of

More information

CHAPTER 4 FUZZY BASED DYNAMIC PWM CONTROL

CHAPTER 4 FUZZY BASED DYNAMIC PWM CONTROL 47 CHAPTER 4 FUZZY BASED DYNAMIC PWM CONTROL 4.1 INTRODUCTION Passive filters are used to minimize the harmonic components present in the stator voltage and current of the BLDC motor. Based on the design,

More information

Speed Feedback and Current Control in PWM DC Motor Drives

Speed Feedback and Current Control in PWM DC Motor Drives Exercise 3 Speed Feedback and Current Control in PWM DC Motor Drives EXERCISE OBJECTIVE When you have completed this exercise, you will know how to improve the regulation of speed in PWM dc motor drives.

More information

The software developed for DC motor speed control system provides the user interface to

The software developed for DC motor speed control system provides the user interface to 5.1 Introduction The software developed for DC motor speed control system provides the user interface to enter the set point, tune controller parameters by using the Matrix type keypad and display the

More information

A PID Controller for Real-Time DC Motor Speed Control using the C505C Microcontroller

A PID Controller for Real-Time DC Motor Speed Control using the C505C Microcontroller A PID Controller for Real-Time DC Motor Speed Control using the C505C Microcontroller Sukumar Kamalasadan Division of Engineering and Computer Technology University of West Florida, Pensacola, FL, 32513

More information

Design and Implementation of FPGA-Based Robotic Arm Manipulator

Design and Implementation of FPGA-Based Robotic Arm Manipulator Design and Implementation of FPGABased Robotic Arm Manipulator Mohammed Ibrahim Mohammed Ali Military Technical College, Cairo, Egypt Supervisors: Ahmed S. Bahgat 1, Engineering physics department Mahmoud

More information

Robotic Swing Drive as Exploit of Stiffness Control Implementation

Robotic Swing Drive as Exploit of Stiffness Control Implementation Robotic Swing Drive as Exploit of Stiffness Control Implementation Nathan J. Nipper, Johnny Godowski, A. Arroyo, E. Schwartz njnipper@ufl.edu, jgodows@admin.ufl.edu http://www.mil.ufl.edu/~swing Machine

More information

ISSN Vol.05,Issue.01, January-2017, Pages:

ISSN Vol.05,Issue.01, January-2017, Pages: WWW.IJITECH.ORG ISSN 2321-8665 Vol.05,Issue.01, January-2017, Pages:0028-0032 Digital Control Strategy for Four Quadrant Operation of Three Phase BLDC Motor with Load Variations MD. HAFEEZUDDIN 1, KUMARASWAMY

More information

Rectilinear System. Introduction. Hardware

Rectilinear System. Introduction. Hardware Rectilinear System Introduction This lab studies the dynamic behavior of a system of translational mass, spring and damper components. The system properties will be determined first making use of basic

More information

International Journal of Advance Engineering and Research Development

International Journal of Advance Engineering and Research Development Scientific Journal of Impact Factor (SJIF): 4.14 International Journal of Advance Engineering and Research Development Volume 3, Issue 2, February -2016 e-issn (O): 2348-4470 p-issn (P): 2348-6406 SIMULATION

More information

CHAPTER 4 PI CONTROLLER BASED LCL RESONANT CONVERTER

CHAPTER 4 PI CONTROLLER BASED LCL RESONANT CONVERTER 61 CHAPTER 4 PI CONTROLLER BASED LCL RESONANT CONVERTER This Chapter deals with the procedure of embedding PI controller in the ARM processor LPC2148. The error signal which is generated from the reference

More information

PID, I-PD and PD-PI Controller Design for the Ball and Beam System: A Comparative Study

PID, I-PD and PD-PI Controller Design for the Ball and Beam System: A Comparative Study IJCTA, 9(39), 016, pp. 9-14 International Science Press Closed Loop Control of Soft Switched Forward Converter Using Intelligent Controller 9 PID, I-PD and PD-PI Controller Design for the Ball and Beam

More information

One-degree-of-freedom PID controlled Helicopter. PDE 2420 Control Systems

One-degree-of-freedom PID controlled Helicopter. PDE 2420 Control Systems One-degree-of-freedom PID controlled Helicopter PDE 2420 Control Systems Abdelati Zelbane Eduardo Abend M00374639 M00375571 Payam Rahmdel May 2013 Table of Contents 1. Introduction... 3 2. Description

More information

ECE 511: FINAL PROJECT REPORT GROUP 7 MSP430 TANK

ECE 511: FINAL PROJECT REPORT GROUP 7 MSP430 TANK ECE 511: FINAL PROJECT REPORT GROUP 7 MSP430 TANK Team Members: Andrew Blanford Matthew Drummond Krishnaveni Das Dheeraj Reddy 1 Abstract: The goal of the project was to build an interactive and mobile

More information

Design and Implementation of PID Controller for a two Quadrant Chopper Fed DC Motor Drive

Design and Implementation of PID Controller for a two Quadrant Chopper Fed DC Motor Drive Research Article International Journal of Current Engineering and Technology ISSN 0 0 INPRESSCO. All Rights Reserved. Available at http://inpressco.com/category/ijcet Design and Implementation of PID Controller

More information