DEVELOPMENT OF A SELF BALANCING BICYCLE ROBOT

Size: px
Start display at page:

Download "DEVELOPMENT OF A SELF BALANCING BICYCLE ROBOT"

Transcription

1 SUMMER PROJECT May-June, 2011 DEVELOPMENT OF A SELF BALANCING BICYCLE ROBOT BY SUBHOJIT GHOSH AND RAJAT ARORA Y9599 Y9464 Department of Mechanical Engineering Indian Institute of Technology Kanpur UNDER THE GUIDANCE OF: Prof. Bishakh Bhattacharya Department of Mechanical Engineering IIT Kanpur

2 ABSTRACT Two wheeled balancing robots are based on inverted pendulum configurations which rely upon dynamic balancing systems for balancing and manoeuvring. As the name suggest the robot would be a bicycle that can move forward or backward, controlled through a wireless remote, and at the same time autonomously balancing itself and avoid falling. Why not just make a 4-wheeled or 3-wheeled robot? The following are some reasons: A bicycle uses less track space as compared to any other vehicle. It is more flexible and easy to steer as compared to any other vehicle. It can cut through obstacles easier than a four wheeled bot. This technology can be extended to make a self balancing unicycle which is much better in terms of space and steer ability. Due to its low weight and greater steer ability, it can be made faster than a humanoid robot. This robot might be useful for transportation in research areas or mines where man or four wheeled robots cannot reach. In particular, the focus is on the electro-mechanical mechanisms & control algorithms required to enable the robot to perceive and act in real time for a dynamically changing world. The construction of sensors, filters and actuator system is a learning experience.

3 INTRODUCTION Two wheeled balancing robot is a classic engineering problem based on inverted pendulum and is much like trying to balance a broom on the tip of your finger. This challenging robotics, electronics, and controls problem is the basis of our study for this project. BALANCING PROCESS: PLAN OF ACTION The word balance, here, means that the inverted pendulum is in equilibrium state, i.e. its position is standing upright at 90 degrees. However, the system itself is not balanced, which means it keeps falling off, away from the vertical axis. The same concept is used here in the form of a Reaction Wheel Pendulum. A flywheel is attached to an electric motor whose speed can be controlled. Here we exploit the fact that when the motors apply torque to rotate the flywheel, they experience a reactionary torque themselves. Therefore, an accelerometer-gyroscopic inertial measurement unit is needed to provide the angular position or tilt of the robot base with respect to the vertical and input it to the microcontroller, which is programmed with a balancing algorithm. The microcontroller will provide a type of feedback signal through Pulse Width Modulation (PWM) control to the MOSFET reinforced L293 motor driver s H-Bridge circuit to turn the motor

4 clockwise or anticlockwise with appropriate speed and acceleration, based on the Proportional-Integral-Derivative (PID) control, thus balancing the robot. The code is written in C software (Code Vision AVR) and compiled for the Atmel ATMega16 microcontroller through AVR Studio, the MCU being interfaced with the sensors and motors. The main goal of the microcontroller is to fuse the wheel encoder, gyroscope and accelerometer sensors through a method called Kalman Filtering, to estimate the attitude of the platform and then to use this information to drive the reaction wheel in the direction to maintain an upright and balanced position. The basic idea for a two-wheeled dynamically balancing robot is pretty simple: move the actuator in a direction to counter the direction of fall. In practice this requires two feedback sensors: a tilt or angle sensor to measure the tilt of the robot with respect to gravity, an accelerometer to calibrate the gyro thus minimizing the drift. Two terms are used to balance the robot. These are 1) the tilt angle and 2) its first derivative, the angular velocity. These two measurements are summed together through Kalman Filtering and fed back to the actuator which produces the counter torque required to balance the robot through PID. Thus the robot can be classified into the following parts: Mechanical Model Inertial sensors Logical processing unit Actuators (Wireless Drive-Motor and Flywheel Control)

5 COMPONENTS REQUIRED Atmega 16 Microcontroller with Development Board Atmega16 Development Board with LCD L293 Motor Driver 16 x 2 Liquid Crystal Display (LCD) MOSFET Reinforced L293 Motor Driver Development Board 7805 Voltage Regulator PS2 Wireless Module (for driving) 5V to 3.3V Logic Level Converter Breakout Board: BOB BOB (Sparkfun)

6 USB based STK500 Programmer for AVR MCUs (with Atmega8 and ICs) STK500 Programmer Connectors and Wires, other tools, Lithium ion batteries. Aluminium Angles Mica Sheet Mechanical Accessories: Couplers, Bushings, Shafts, Pulleys, Track-belts, Sprockets, Chains 2 Thin Tyres of Diameter 9-12 cm. Flywheel (Lathed) High Torque 300 RPM DC Motor operating at 24V(Mech- Tex) Low Torque DC Motor for Driving (12V) Inertial Measurement Unit (IMU) from Sparkfun: 5 Degree of Freedom Analog Combo Board with Triple Axis Accelerometer ADXL335 and Dual Axis Gyroscope IDG DOF IMU Combo Board

7 MECHANICAL MODEL The whole bicycle is constructed with the help of aluminium angles and mica sheet. The mica sheet portions allow for drivemotor mounting and keeping electrical circuitry. The cycle is low-lying so as to make its centre of mass low. Flywheel is made of mild steel, and it is sufficiently heavy enough to provide enough reactionary torque in the high torque motor attached to the vertical aluminium angles. Reaction Wheel The front wheel is free and attached with the help of a threaded axle and bushings. As the bicycle had to be kept thin, with its centre of mass low and exactly in the plane of the bicycle, so the driving motor had to be attached parallel to the axis of the driven wheel. The rear wheel is driven by the drive-motor with the help of a link system. Both chain-sprocket system as well as track beltpulley system can be used. These accessories are attached to the wheel s axle with the help of couplers.

8 Mechanical Model Prototype Mechanical Designing (Initial) Schematic of the Robot:

9 INERTIAL MEASUREMENT UNIT: TILT SENSOR MODULE Tilt sensing is the crux of this project and the most difficult part as well. The inertial sensors used here (in IMU Combo board) are: Triple Axis Accelerometer ADXL335 Dual Axis Gyroscope IDG500 An accelerometer measures the acceleration in specific directions. We can measure the direction of gravity w.r.t the accelerometer and get the tilt angle w.r.t the vertical. It is free from drifts and other errors. The angle of tilt can be measured from the acceleration along x-direction as follows: A x = g sin θ (θ is the angle w.r.t vertical) A z = g cos θ (A x, A z are accelerations in x and z directions) For small angles, A x = g θ So, θ = K * A x (K is a constant) We use this formula since inverse trigonometric calculations in the MCU may be time consuming. The accelerometer outputs an analog voltage V a, and acceleration can be measured by the formula: Acceleration = (V a V at zero tilt )/Sensitivity (in V/ g ) This approach is correct, but only for slow angular velocities, at high angular velocities the accelerometer tilt angle begins to lag giving wrong tilt data.

10 This problem is solved by using a Gyroscope. It would measure angular velocity and angle can be found by integrating. The rate gyro measures angular velocity and outputs a voltage V g : V g = ω + f(t) + e g Where f(t) represents the effect of temperature and e g represents error, which is not known. So the correct formula is: Angular Velocity ω = (V g V at zero tilt )/Sensitivity [in V/(deg/s)] But this approach fails at slow angular velocities due to gyroscopic drift (small errors in slow velocities integrate and accumulate into a big error). In reality, we do not have static conditions, but dynamic conditions. So in case of dynamic accelerations, the accelerometer and gyroscope outputs are combined together using the Kalman Filtering Method. The Kalman filter is a mathematical method named after Rudolf E. Kalman. Its purpose is to use measurements that are observed over time that contain noise (random variations) and other inaccuracies, and produce values that tend to be closer to the true values of the measurements and their associated calculated values. A x = g sin θ - δv x /δt θ = K * (Ax + rώ) (For small θ, ώ t is angular acceleration) For calculating the integrals and derivatives, PID algorithm is: Calculation of θ t by integration; (suffix t stands for time t) θ t = θ t-1 + ω*δt Calculation of ώ t by differentiation; ώ t = ( ω t ω t-1 )/ δt

11 The code for Kalman Filtering is as follows: static const double dt = 0.032; static double P[2][2] = {{ 1, 0 },{ 0, 1 }}; double angle; double q_bias; double rate; static const double R_angle = 0.300; static const double Q_angle = 0.001; static const double Q_gyro = 0.003; void state_update(const double q) { double Pdot[2][2]; Pdot[0] [0] = Q_angle - P[0][1] - P[1][0]; /* 0,0 */ Pdot[0] [1] = - P[1][1]; /* 0,1 */ Pdot[1] [0] = - P[1][1]; /* 1,0 */ Pdot[0] [0] = Q_gyro; /* 1,1 */ /* Stores our unbiased gyro estimate */ rate = q; angle += q * dt; P[0][0] += Pdot[0] [0]* dt; P[0][1] += Pdot[0] [1]* dt; P[1][0] += Pdot[1] [0]* dt; P[1][1] += Pdot[1] [1]* dt; } void kalman_update(double angle_m) { double angle_err; double C_0 = 1; double PCt_0, PCt_1; double E, K_0, K_1, t_0, t_1;

12 angle_err = angle_m - angle; PCt_0 = C_0 * P[0][0]; /* + C_1 * P[0][1] = 0 */ PCt_1 = C_0 * P[1][0]; /* + C_1 * P[1][1] = 0 */ E = R_angle + C_0 * PCt_0; K_0 = PCt_0 / E; K_1 = PCt_1 / E; t_0 = PCt_0; /* C_0 * P[0][0] + C_1 * P[1][0] */ t_1 = C_0 * P[0][1]; /* + C_1 * P[1][1] = 0 */ P[0][0] -= K_0 * t_0; P[0][1] -= K_0 * t_1; P[1][0] -= K_1 * t_0; P[1][1] -= K_1 * t_1; Angle += K_0 * angle_err; q_bias += K_1 * angle_err; } void main(void) { int x, y, z, dv, ocr, w, anglef=0; float g,angle2=0,diff=0,integral=0,k; long zx; char a[10];// Declare your local variables here while (1) { x=read_adc(3)-330; y=read_adc(2)-330; z=read_adc(1)-330; w=(285-read_adc(0)); zx=z*sqrt(x*x/z/z+1.0);

13 g=atan2(y,zx)*70; kalman_update(g); state_update(w*1.466); if(anglef==3) { anglef=0; // display angle on LCD lcd_clear(); sprintf(a,"%0.2f",g); lcd_puts(a); lcd_gotoxy(0,1); sprintf(a,"%0.2f",angle); lcd_puts(a); } anglef++; delay_ms(4); //delay statement }; }//end of code Schematic of the Sensor Module

14 LOGICAL PROCESSING UNIT The processing unit used is Atmel ATMega16 microcontroller unit which is a versatile EEPROM. It has four I/O (Input/Output) ports, onboard ADC (Analog to Digital Converter) and PWM (Pulse Width Modulation) outputs for motor control. It can be programmed easily with minimum hardware requirements which make it extremely popular in robotics applications. Here it performs the following functions: ADC conversion of outputs of Rate Gyro and Accelerometer Processing the input signals Periodic recalibration of gyro Display of angle & other data. Control of actuator unit Schematic of the processing unit is as shown:

15 Circuit Diagram:

16 ALGORITHM: The algorithm for the controller is as follows: Step1: Initialize the values of rate gyro bias and accelerometer bias for zero value of θ & ω. Step2: Measure the value of voltage of gyro and accelerometer outputs and store those values as ω and A x. Step3: Integrate the rate gyro reading by: θ t = θ t-1 + ω*δt Differentiate the rate gyro reading by: ώ t = (ω t ω t-1 )/ δt δt in each case is assumed to be constant and is equal to the cycle time. Step4: Calculate the raw angle and gravity angle and compute the error value. Step5: Update the raw angle by: θ stabilized = θ raw angle + constant* (θ gravity angle θ raw angle ) Constant is taken as 0.2 Step6: We calculate the torque required to restore balance: τ = constant * sin θ (or τ = constant * θ for small angles) Step7: We obtain the direction of rotation of the reaction wheel: If θ < 0, counter-clockwise If θ > 0, clockwise Step8: Send the output to the DC motor attached to the reaction wheel. Step9: Repeat steps (2-8)

17 ACTUATOR UNIT: FLYWHEEL CONTROL As the robot tilts, we need to apply a restoring force to return the robot to vertical position. A reaction wheel pendulum model is followed for the balancing purpose. The components used are: High torque 24V DC motor A metallic reaction wheel 1μf,15V capacitor The model is as follows: Mathematical model of the system: For a displacement of θ, Here, τ = MgL c.g. sin θ+(m motor +m reaction wheel )L sin θ τ = Torque M = Mass of Robot g = Acceleration due to gravity L c.g. = Height of Centre of gravity of Robot L = Height of Centre of Reaction Wheel m motor =Mass of motor m reaction wheel =Mass of reaction wheel

18 For a DC motor: τ = Constant * I f (where I is current and f is the loss due to friction) So the equivalent model of the reaction wheel: Motor Control by Pulse Width Modulation: PWM output is basically a series of pulses with varying size in pulse width. This PWM signal is output from the H-bridge of the high current rating based MOSFET reinforced L293 circuit to control the motor. The difference in pulse length shows the different output of H-bridge circuit controlling the output speed of the motor based on the OCR (Output Compare Register) value. Pulse Width Modulation waveform: What actually happens by applying a PWM pulse is that the motor is switched ON and OFF at a given frequency. In this way, the motor reacts to the time average of the power supply. V motor average = (OCR/255) * V reference (V reference = 24V here)

19 The capacitor connected across the motor charges and discharges during the on and off time respectively, thus behaving like an integrator. The torque generated by the motor is a function of the average value of current supplied to it. It seems to be obvious that once we have angle we can rotate the flywheel with acceleration proportional to it, but that won't do the job. If that is done what actually will happen is that when there is a tilt the bike will cross the mean position and reach the other side till the same tilt angle. To fix this we need some kind of algorithm that can damp this periodic motion and make it stable at the mean position after some time. This is where PID (Proportional, Integral, Derivative) Controller comes to use. PID Control of Flywheel: The proportional term makes a change to the output that is proportional to the current error value. The proportional response can be adjusted by multiplying the error by a constant K p, called the proportional gain. The contribution from the integral term is proportional to both the magnitude of the error and the duration of the error. The integral in a PID controller is the sum of the instantaneous error over time and gives the accumulated offset that should have been corrected previously. The accumulated error is then multiplied by the integral gain (K i ) and added to the controller output. The derivative of the process error is calculated by determining the slope of the error over time and multiplying this rate of change by the derivative gain K d. The proportional, integral, and derivative terms are summed to calculate the output of the PID controller. Defining u(t) as the controller output, the final form of the PID algorithm is:

20 where: P out : Proportional term of output K p : Proportional gain, a tuning parameter K i : Integral gain, a tuning parameter K d : Derivative gain, a tuning parameter e: Error t: Time or instantaneous time (the present) We tune the PID controller by varying the constants K p, K d and K i and optimising them by any well known method (like the Ziegler Nichol s Method). Process Variable (PV) vs time: So, we use the PID method to control the flywheel for balancing. The PID Code is as follows: (The following code is inside the continuous while loop) dv = kp * angle + ki * integral + kd * diff; integral += angle; diff = angle previous_angle; previous_angle = angle; OC1A += dv; //OCR Value changed

21 DRIVING THE ROBOT The driving of the drive-motor, in order to rotate the rear wheel through the link system (chain-sprocket or pulley-track belt), is done with the help of the PS2 Wireless module, which contains a pre-programmed Atmega16A MCU that can drive up to 4 motors through 2 L298 motor-drivers, with the help of a wireless remote. The bicycle is can be in three states: Forward motion, backward motion and halt position. Changes among these gear states can be brought about by the wireless remote. Circuit Diagram of PS2 Wireless Module PS2 Wireless Module

22 PRESENT PHOTOS AND VIDEO LINK COMPLETED ROBOT: CIRCUITRY: TEST RUN VIDEO LINK:

23 FUTURE IMPROVEMENTS In future, the bicycle could be made to move not only forward and backward, but also steer sideways. The PS2 Wireless Module has slots for four motors, and can be made to control a servo motor which could be used to introduce the steering functionality on to the front wheel. The balancing can be made much more precise by introducing a rotating disc whose gyroscopic precession could be used for more accurate balancing. In addition, fuzzy logic controller can also be implemented to provide flexibility and accuracy in control.

24 ACKNOWLEDGEMENT We would like to express our deep sense of gratitude and respect to our supervisor Prof. Bishakh Bhattacharya, for his guidance, suggestions and support. We consider ourselves extremely lucky to be able to work under his guidance. We would also like to thank our friends who have helped us a lot. SUBHOJIT GHOSH AND RAJAT ARORA Y9599 Y9464 Department of Mechanical Engineering Indian Institute of Technology Kanpur See Code Next Page...

25 Code: /***************************************************** This program was produced by the CodeWizardAVR V Standard Automatic Program Generator Copyright Pavel Haiduc, HP InfoTech s.r.l. Project : Version : Date : Author : Subhojit Company : IITK Comments: Chip type : ATmega16 Program type : Application Clock frequency : MHz Memory model : Small External SRAM size : 0 Data Stack size : 256 *****************************************************/ #include <mega16.h> #include <delay.h> #include <stdio.h> #include <stdlib.h> #include <math.h> // Alphanumeric LCD Module functions #asm.equ lcd_port=0x15 ;PORTC #endasm #include <lcd.h> #define ADC_VREF_TYPE 0x00 // Read the AD conversion result unsigned int read_adc(unsigned char adc_input) { ADMUX=adc_input ADC_VREF_TYPE; // Start the AD conversion ADCSRA =0x40; // Wait for the AD conversion to complete while ((ADCSRA & 0x10)==0); ADCSRA =0x10;

26 return ADCW; } // Declare your global variables here int accx,accy,accz,ratey,ratex,omegax,oc0; int accx0,accy0,accz0,ratey0,ratex0; char ch[10]; float theta,theta2,angle,prev_angle,diff,integral,dv; float kp,kd,ki; void main(void) { // Declare your local variables here kp=1.5; kd=6.0; ki= ; // Input/Output Ports initialization // Port A initialization // Func7=In Func6=In Func5=In Func4=In Func3=In Func2=In Func1=In Func0=In // State7=T State6=T State5=T State4=T State3=T State2=T State1=T State0=T PORTA=0x00; DDRA=0x00; // Port B initialization // Func7=In Func6=In Func5=In Func4=In Func3=Out Func2=Out Func1=Out Func0=Out // State7=T State6=T State5=T State4=T State3=0 State2=0 State1=0 State0=0 PORTB=0x00; DDRB=0x0F; // Port C initialization // Func7=In Func6=In Func5=In Func4=In Func3=In Func2=In Func1=In Func0=In // State7=T State6=T State5=T State4=T State3=T State2=T State1=T State0=T PORTC=0x00; DDRC=0x00; // Port D initialization // Func7=In Func6=Out Func5=In Func4=In Func3=In Func2=In Func1=In Func0=In // State7=T State6=0 State5=T State4=T State3=T State2=T State1=T State0=T PORTD=0x00; DDRD=0x40; // Timer/Counter 0 initialization // Clock source: System Clock // Clock value: khz // Mode: Fast PWM top=ffh // OC0 output: Non-Inverted PWM

27 TCCR0=0x69; TCNT0=0x00; OCR0=0x00; // Timer/Counter 1 initialization // Clock source: System Clock // Clock value: Timer 1 Stopped // Mode: Normal top=ffffh // OC1A output: Discon. // OC1B output: Discon. // Noise Canceler: Off // Input Capture on Falling Edge // Timer 1 Overflow Interrupt: Off // Input Capture Interrupt: Off // Compare A Match Interrupt: Off // Compare B Match Interrupt: Off TCCR1A=0x00; TCCR1B=0x00; TCNT1H=0x00; TCNT1L=0x00; ICR1H=0x00; ICR1L=0x00; OCR1AH=0x00; OCR1AL=0x00; OCR1BH=0x00; OCR1BL=0x00; // Timer/Counter 2 initialization // Clock source: System Clock // Clock value: Timer 2 Stopped // Mode: Normal top=ffh // OC2 output: Disconnected ASSR=0x00; TCCR2=0x00; TCNT2=0x00; OCR2=0x00; // External Interrupt(s) initialization // INT0: Off // INT1: Off // INT2: Off MCUCR=0x00; MCUCSR=0x00; // Timer(s)/Counter(s) Interrupt(s) initialization TIMSK=0x00; // Analog Comparator initialization // Analog Comparator: Off // Analog Comparator Input Capture by Timer/Counter 1: Off ACSR=0x80;

28 SFIOR=0x00; // ADC initialization // ADC Clock frequency: khz // ADC Voltage Reference: AREF pin // ADC Auto Trigger Source: None ADMUX=ADC_VREF_TYPE; ADCSRA=0x86; // LCD module initialization lcd_init(16); delay_ms(1000); accx0=read_adc(0); accy0=read_adc(1); accz0=read_adc(2); ratex0=read_adc(3); ratey0=read_adc(4); lcd_gotoxy(0,0); itoa(accx0,ch); lcd_putsf("x="); lcd_gotoxy(2,0); lcd_puts(ch); lcd_gotoxy(6,0); itoa(accy0,ch); lcd_putsf("y"); lcd_gotoxy(7,0); lcd_puts(ch); lcd_gotoxy(11,0); itoa(accz0,ch); lcd_putsf("z="); lcd_gotoxy(13,0); lcd_puts(ch); lcd_gotoxy(2,1); itoa(ratex0,ch); lcd_putsf("rx="); lcd_gotoxy(5,1); lcd_puts(ch); lcd_gotoxy(9,1); itoa(ratey0,ch); lcd_putsf("ry="); lcd_gotoxy(12,1); lcd_puts(ch); delay_ms(5000); lcd_clear(); lcd_gotoxy(0,0); lcd_putsf("start"); delay_ms(1000); lcd_clear(); while (1) { // Place your code here lcd_clear(); accx=read_adc(0); accy=read_adc(1); accz=read_adc(2); ratex=read_adc(3); ratey=read_adc(4); theta=(float)(atan((float)((float)(accy-accy0)/(float)(accz-accy0))))*180.0/(22.0/7.0); lcd_gotoxy(0,0); ftoa(theta,2,ch); lcd_puts(ch); omegax=ratex0-ratex; theta2 = theta2+omegax*2.55*0.032; theta2=0.9*theta2+0.1*theta; lcd_gotoxy(0,1); ftoa(theta2,2,ch); lcd_puts(ch); angle=theta2; dv=kp*angle+ki*integral+kd*diff;

29 integral+=angle; diff=-angle+prev_angle; prev_angle=angle; oc0=(int)dv; if(oc0>=0) { if(oc0>255){oc0=255;} OCR0=(int)oc0; PORTB.0=0;PORTB.1=1; } else { if(oc0<-255){oc0=-255;} OCR0=(int)(-oc0); PORTB.0=1;PORTB.1=0; } lcd_gotoxy(9,1); lcd_putsf("ocr="); lcd_gotoxy(13,1); itoa(ocr0,ch); lcd_puts(ch); delay_ms(10); } };

Human-Robot Interaction Class Koosy Human-Robot Interaction Class

Human-Robot Interaction Class Koosy Human-Robot Interaction Class ATmega128 (8bit AVR Microprocessor) Human-Robot Interaction Class 2008. 4. 28 Koosy 1 Contents Micro Controller Unit Overview ATmega128 Features Necessary Tools General I/O External Interrupt 8bit/16bit

More information

University of Florida Department of Electrical and Computer Engineering EEL 5666 Intelligent Machines Design Laboratory. GatorVac Written Report 2

University of Florida Department of Electrical and Computer Engineering EEL 5666 Intelligent Machines Design Laboratory. GatorVac Written Report 2 University of Florida Department of Electrical and Computer Engineering EEL 5666 Intelligent Machines Design Laboratory GatorVac Written Report 2 By M. Gabriel Jiva July 8, 2003 Table of Contents Abstract..03

More information

Lawn Gator Autonomous Lawn Care Robot April 26, 2006 Michael Gregg EEL 5666C Intelligent Machine Design Lab

Lawn Gator Autonomous Lawn Care Robot April 26, 2006 Michael Gregg EEL 5666C Intelligent Machine Design Lab Lawn Gator Autonomous Lawn Care Robot April 26, 2006 Michael Gregg EEL 5666C Intelligent Machine Design Lab Table of Contents 1. Abstract 3 2. Executive Summary 4 3. Introduction 5 4. Integrated System

More information

Lab 5: Control and Feedback. Lab 5: Controls and feedback. Lab 5: Controls and Feedback

Lab 5: Control and Feedback. Lab 5: Controls and feedback. Lab 5: Controls and Feedback Lab : Control and Feedback Lab : Controls and feedback K K You may need a resistor other than exactly K for better sensitivity This embedded system uses the Photo sensor to detect the light intensity of

More information

Carlo Pascoe. University of Florida Department of Electrical Engineering EEL 5666 Intelligent Machines Design Laboratory

Carlo Pascoe. University of Florida Department of Electrical Engineering EEL 5666 Intelligent Machines Design Laboratory Carlo Pascoe University of Florida Department of Electrical Engineering EEL 5666 Intelligent Machines Design Laboratory Final Report: Automated Poker Dealer Table of Contents Title Page. 1 Table of Contents.

More information

CHAPTER 5 HARDWARE IMPLEMENTATION AND PERFORMANCE ANALYSIS OF CUK CONVERTER-BASED MPPT SYSTEM

CHAPTER 5 HARDWARE IMPLEMENTATION AND PERFORMANCE ANALYSIS OF CUK CONVERTER-BASED MPPT SYSTEM 94 CHAPTER 5 HARDWARE IMPLEMENTATION AND PERFORMANCE ANALYSIS OF CUK CONVERTER-BASED MPPT SYSTEM 5.1 INTRODUCTION In coming up with a direct control adaptive perturb and observer MPPT method with Cuk converter,

More information

Digital Braille Watch

Digital Braille Watch Digital Braille Watch Client: Colton and Holly Albrecht Advisor: Professor Walter Block Team members: Team leader Joel Gaston BSAC Ryan Kimmel BWIG Robert Bjerregaard Communications Allison McArton Date:

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

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

Auto-Balancing Two Wheeled Inverted Pendulum Robot

Auto-Balancing Two Wheeled Inverted Pendulum Robot Available online at www.ijiere.com International Journal of Innovative and Emerging Research in Engineering e-issn: 2394 3343 p-issn: 2394 5494 Auto-Balancing Two Wheeled Inverted Pendulum Robot Om J.

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

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

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

Introducing the Quadrotor Flying Robot

Introducing the Quadrotor Flying Robot Introducing the Quadrotor Flying Robot Roy Brewer Organizer Philadelphia Robotics Meetup Group August 13, 2009 What is a Quadrotor? A vehicle having 4 rotors (propellers) at each end of a square cross

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

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

MEM380 Applied Autonomous Robots I Winter Feedback Control USARSim

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

More information

Cleaning Robot Working at Height Final. Fan-Qi XU*

Cleaning Robot Working at Height Final. Fan-Qi XU* Proceedings of the 3rd International Conference on Material Engineering and Application (ICMEA 2016) Cleaning Robot Working at Height Final Fan-Qi XU* International School, Beijing University of Posts

More information

UNIVERSITY OF NORTH CAROLINA AT CHARLOTTE

UNIVERSITY OF NORTH CAROLINA AT CHARLOTTE UNIVERSITY OF NORTH CAROLINA AT CHARLOTTE Department of Electrical and Computer Engineering ECGR 4161/5196 Introduction to Robotics Experiment No. 4 Tilt Detection Using Accelerometer Overview: The purpose

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

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

ECE 511: MICROPROCESSORS

ECE 511: MICROPROCESSORS ECE 511: MICROPROCESSORS A project report on SNIFFING DOG Under the guidance of Prof. Jens Peter Kaps By, Preethi Santhanam (G00767634) Ranjit Mandavalli (G00819673) Shaswath Raghavan (G00776950) Swathi

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

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 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

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

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

10/21/2009. d R. d L. r L d B L08. POSE ESTIMATION, MOTORS. EECS 498-6: Autonomous Robotics Laboratory. Midterm 1. Mean: 53.9/67 Stddev: 7.

10/21/2009. d R. d L. r L d B L08. POSE ESTIMATION, MOTORS. EECS 498-6: Autonomous Robotics Laboratory. Midterm 1. Mean: 53.9/67 Stddev: 7. 1 d R d L L08. POSE ESTIMATION, MOTORS EECS 498-6: Autonomous Robotics Laboratory r L d B Midterm 1 2 Mean: 53.9/67 Stddev: 7.73 1 Today 3 Position Estimation Odometry IMUs GPS Motor Modelling Kinematics:

More information

An External Command Reading White line Follower Robot

An External Command Reading White line Follower Robot EE-712 Embedded System Design: Course Project Report An External Command Reading White line Follower Robot 09405009 Mayank Mishra (mayank@cse.iitb.ac.in) 09307903 Badri Narayan Patro (badripatro@ee.iitb.ac.in)

More information

Balancing Robot. Daniel Bauen Brent Zeigler

Balancing Robot. Daniel Bauen Brent Zeigler Balancing Robot Daniel Bauen Brent Zeigler December 3, 2004 Initial Plan The objective of this project was to design and fabricate a robot capable of sustaining a vertical orientation by balancing on only

More information

ATmega16A Microcontroller

ATmega16A Microcontroller ATmega16A Microcontroller Timers 1 Timers Timer 0,1,2 8 bits or 16 bits Clock sources: Internal clock, Internal clock with prescaler, External clock (timer 2), Special input pin 2 Features The choice of

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

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

MOBILE ROBOT LOCALIZATION with POSITION CONTROL

MOBILE ROBOT LOCALIZATION with POSITION CONTROL T.C. DOKUZ EYLÜL UNIVERSITY ENGINEERING FACULTY ELECTRICAL & ELECTRONICS ENGINEERING DEPARTMENT MOBILE ROBOT LOCALIZATION with POSITION CONTROL Project Report by Ayhan ŞAVKLIYILDIZ - 2011502093 Burcu YELİS

More information

Design and Impliment of Powertrain Control System for the All Terrian Vehicle

Design and Impliment of Powertrain Control System for the All Terrian Vehicle International Journal of Control, Energy and Electrical Engineering (CEEE) Copyright IPCO-2014 Design and Impliment of Powertrain Control System for the All Terrian Vehicle Khaled sailan #1, Prof. Dr.-Ing.

More information

Embedded Systems and Software. Analog to Digital Conversion

Embedded Systems and Software. Analog to Digital Conversion Embedded Systems and Software Analog to Digital Conversion Slide 1 Analog to Digital Conversion Analog or continuous signal Discrete-time or digital signal Other terms ADC, A/D Many different techniques

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

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 7: The motors of the robot

Chapter 7: The motors of the robot Chapter 7: The motors of the robot Learn about different types of motors Learn to control different kinds of motors using open-loop and closedloop control Learn to use motors in robot building 7.1 Introduction

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

PIC Functionality. General I/O Dedicated Interrupt Change State Interrupt Input Capture Output Compare PWM ADC RS232

PIC Functionality. General I/O Dedicated Interrupt Change State Interrupt Input Capture Output Compare PWM ADC RS232 PIC Functionality General I/O Dedicated Interrupt Change State Interrupt Input Capture Output Compare PWM ADC RS232 General I/O Logic Output light LEDs Trigger solenoids Transfer data Logic Input Monitor

More information

A3 Pro INSTRUCTION MANUAL. Oct 25, 2017 Revision IMPORTANT NOTES

A3 Pro INSTRUCTION MANUAL. Oct 25, 2017 Revision IMPORTANT NOTES A3 Pro INSTRUCTION MANUAL Oct 25, 2017 Revision IMPORTANT NOTES 1. Radio controlled (R/C) models are not toys! The propellers rotate at high speed and pose potential risk. They may cause severe injury

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

Mechatronics Laboratory Assignment 3 Introduction to I/O with the F28335 Motor Control Processor

Mechatronics Laboratory Assignment 3 Introduction to I/O with the F28335 Motor Control Processor Mechatronics Laboratory Assignment 3 Introduction to I/O with the F28335 Motor Control Processor Recommended Due Date: By your lab time the week of February 12 th Possible Points: If checked off before

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

RC Filters and Basic Timer Functionality

RC Filters and Basic Timer Functionality RC-1 Learning Objectives: RC Filters and Basic Timer Functionality The student who successfully completes this lab will be able to: Build circuits using passive components (resistors and capacitors) from

More information

Servo Tuning. Dr. Rohan Munasinghe Department. of Electronic and Telecommunication Engineering University of Moratuwa. Thanks to Dr.

Servo Tuning. Dr. Rohan Munasinghe Department. of Electronic and Telecommunication Engineering University of Moratuwa. Thanks to Dr. Servo Tuning Dr. Rohan Munasinghe Department. of Electronic and Telecommunication Engineering University of Moratuwa Thanks to Dr. Jacob Tal Overview Closed Loop Motion Control System Brain Brain Muscle

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

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

ARDUINO BASED CALIBRATION OF AN INERTIAL SENSOR IN VIEW OF A GNSS/IMU INTEGRATION

ARDUINO BASED CALIBRATION OF AN INERTIAL SENSOR IN VIEW OF A GNSS/IMU INTEGRATION Journal of Young Scientist, Volume IV, 2016 ISSN 2344-1283; ISSN CD-ROM 2344-1291; ISSN Online 2344-1305; ISSN-L 2344 1283 ARDUINO BASED CALIBRATION OF AN INERTIAL SENSOR IN VIEW OF A GNSS/IMU INTEGRATION

More information

Design and Implementation of AT Mega 328 microcontroller based firing control for a tri-phase thyristor control rectifier

Design and Implementation of AT Mega 328 microcontroller based firing control for a tri-phase thyristor control rectifier Design and Implementation of AT Mega 328 microcontroller based firing control for a tri-phase thyristor control rectifier 1 Mr. Gangul M.R PG Student WIT, Solapur 2 Mr. G.P Jain Assistant Professor WIT,

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

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

Final Report Metallocalizer

Final Report Metallocalizer Date: 12/08/09 Student Name: Fernando N. Coviello TAs : Mike Pridgen Thomas Vermeer Instructors: Dr. A. Antonio Arroyo Dr. Eric M. Schwartz Final Report Metallocalizer University of Florida Department

More information

Name & SID 1 : Name & SID 2:

Name & SID 1 : Name & SID 2: EE40 Final Project-1 Smart Car Name & SID 1 : Name & SID 2: Introduction The final project is to create an intelligent vehicle, better known as a robot. You will be provided with a chassis(motorized base),

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

3.3V regulator. JA H-bridge. Doc: page 1 of 7

3.3V regulator. JA H-bridge. Doc: page 1 of 7 Cerebot Reference Manual Revision: February 9, 2009 Note: This document applies to REV B-E of the board. www.digilentinc.com 215 E Main Suite D Pullman, WA 99163 (509) 334 6306 Voice and Fax Overview The

More information

Gesture Controlled Car

Gesture Controlled Car Gesture Controlled Car Chirag Gupta Department of ECE ITM University Nitin Garg Department of ECE ITM University ABSTRACT Gesture Controlled Car is a robot which can be controlled by simple human gestures.

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

Application Note: Using the Motor Driver on the 3pi Robot and Orangutan Robot Controllers

Application Note: Using the Motor Driver on the 3pi Robot and Orangutan Robot Controllers Application Note: Using the Motor Driver on the 3pi Robot and Orangutan Robot 1. Introduction..................................................... 2 2. Motor Driver Truth Tables.............................................

More information

SELF-BALANCING BOT USING CONCEPT OF INVERTED PENDULUM

SELF-BALANCING BOT USING CONCEPT OF INVERTED PENDULUM SELF-BALANCING BOT USING CONCEPT OF INVERTED PENDULUM Pratyusa kumar Tripathy (109EC0427) Department of Electronics and Communication Engineering National Institute of Technology Rourkela Rourkela- 769008,India

More information

AN ARDUINO CONTROLLED CHAOTIC PENDULUM FOR A REMOTE PHYSICS LABORATORY

AN ARDUINO CONTROLLED CHAOTIC PENDULUM FOR A REMOTE PHYSICS LABORATORY AN ARDUINO CONTROLLED CHAOTIC PENDULUM FOR A REMOTE PHYSICS LABORATORY J. C. Álvarez, J. Lamas, A. J. López, A. Ramil Universidade da Coruña (SPAIN) carlos.alvarez@udc.es, jlamas@udc.es, ana.xesus.lopez@udc.es,

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

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

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

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

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

MAE106 Laboratory Exercises Lab # 5 - PD Control of DC motor position

MAE106 Laboratory Exercises Lab # 5 - PD Control of DC motor position MAE106 Laboratory Exercises Lab # 5 - PD Control of DC motor position University of California, Irvine Department of Mechanical and Aerospace Engineering Goals Understand how to implement and tune a PD

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

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

MicroToys Guide: Motors A. Danowitz, A. Adibi December A rotary shaft encoder is an electromechanical device that can be used to

MicroToys Guide: Motors A. Danowitz, A. Adibi December A rotary shaft encoder is an electromechanical device that can be used to Introduction A rotary shaft encoder is an electromechanical device that can be used to determine angular position of a shaft. Encoders have numerous applications, since angular position can be used to

More information

Microcontroller: Timers, ADC

Microcontroller: Timers, ADC Microcontroller: Timers, ADC Amarjeet Singh February 1, 2013 Logistics Please share the JTAG and USB cables for your assignment Lecture tomorrow by Nipun 2 Revision from last class When servicing an interrupt,

More information

Mechatronics Engineering and Automation Faculty of Engineering, Ain Shams University MCT-151, Spring 2015 Lab-4: Electric Actuators

Mechatronics Engineering and Automation Faculty of Engineering, Ain Shams University MCT-151, Spring 2015 Lab-4: Electric Actuators Mechatronics Engineering and Automation Faculty of Engineering, Ain Shams University MCT-151, Spring 2015 Lab-4: Electric Actuators Ahmed Okasha, Assistant Lecturer okasha1st@gmail.com Objective Have a

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

RC Servo Interface. Figure Bipolar amplifier connected to a large DC motor

RC Servo Interface. Figure Bipolar amplifier connected to a large DC motor The bipolar amplifier is well suited for controlling motors for vehicle propulsion. Figure 12-45 shows a good-sized 24VDC motor that runs nicely on 13.8V from a lead acid battery based power supply. You

More information

ESE 350 Microcontroller Laboratory Lab 5: Sensor-Actuator Lab

ESE 350 Microcontroller Laboratory Lab 5: Sensor-Actuator Lab ESE 350 Microcontroller Laboratory Lab 5: Sensor-Actuator Lab The purpose of this lab is to learn about sensors and use the ADC module to digitize the sensor signals. You will use the digitized signals

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

SERVO MOTOR CONTROL TRAINER

SERVO MOTOR CONTROL TRAINER SERVO MOTOR CONTROL TRAINER UC-1780A FEATURES Open & closed loop speed and position control. Analog and digital control techniques. PC based instrumentation include oscilloscope, multimeter and etc. PC

More information

EXPERIMENT 6: Advanced I/O Programming

EXPERIMENT 6: Advanced I/O Programming EXPERIMENT 6: Advanced I/O Programming Objectives: To familiarize students with DC Motor control and Stepper Motor Interfacing. To utilize MikroC and MPLAB for Input Output Interfacing and motor control.

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

EEL5666C IMDL Spring 2006 Student: Andrew Joseph. *Alarm-o-bot*

EEL5666C IMDL Spring 2006 Student: Andrew Joseph. *Alarm-o-bot* EEL5666C IMDL Spring 2006 Student: Andrew Joseph *Alarm-o-bot* TAs: Adam Barnett, Sara Keen Instructor: A.A. Arroyo Final Report April 25, 2006 Table of Contents Abstract 3 Executive Summary 3 Introduction

More information

Introduction. Theory of Operation

Introduction. Theory of Operation Mohan Rokkam Page 1 12/15/2004 Introduction The goal of our project is to design and build an automated shopping cart that follows a shopper around. Ultrasonic waves are used due to the slower speed of

More information

FABO ACADEMY X ELECTRONIC DESIGN

FABO ACADEMY X ELECTRONIC DESIGN ELECTRONIC DESIGN MAKE A DEVICE WITH INPUT & OUTPUT The Shanghaino can be programmed to use many input and output devices (a motor, a light sensor, etc) uploading an instruction code (a program) to it

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

Object Detection for Collision Avoidance in ITS

Object Detection for Collision Avoidance in ITS Available online www.ejaet.com European Journal of Advances in Engineering and Technology, 2016, 3(5): 29-35 Research Article ISSN: 2394-658X Object Detection for Collision Avoidance in ITS Rupojyoti Kar

More information

IMPLEMENTATION OF QALU BASED SPWM CONTROLLER THROUGH FPGA. This Chapter presents an implementation of area efficient SPWM

IMPLEMENTATION OF QALU BASED SPWM CONTROLLER THROUGH FPGA. This Chapter presents an implementation of area efficient SPWM 3 Chapter 3 IMPLEMENTATION OF QALU BASED SPWM CONTROLLER THROUGH FPGA 3.1. Introduction This Chapter presents an implementation of area efficient SPWM control through single FPGA using Q-Format. The SPWM

More information

New Approach on Development a Dual Axis Solar Tracking Prototype

New Approach on Development a Dual Axis Solar Tracking Prototype Wireless Engineering and Technology, 2016, 7, 1-11 Published Online January 2016 in SciRes. http://www.scirp.org/journal/wet http://dx.doi.org/10.4236/wet.2016.71001 New Approach on Development a Dual

More information

Design of Joint Controller Circuit for PA10 Robot Arm

Design of Joint Controller Circuit for PA10 Robot Arm Design of Joint Controller Circuit for PA10 Robot Arm Sereiratha Phal and Manop Wongsaisuwan Department of Electrical Engineering, Faculty of Engineering, Chulalongkorn University, Bangkok, 10330, Thailand.

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

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

Distance Measurement of an Object by using Ultrasonic Sensors with Arduino and GSM Module

Distance Measurement of an Object by using Ultrasonic Sensors with Arduino and GSM Module IJSTE - International Journal of Science Technology & Engineering Volume 4 Issue 11 May 2018 ISSN (online): 2349-784X Distance Measurement of an Object by using Ultrasonic Sensors with Arduino and GSM

More information

Design and Development of Novel Two Axis Servo Control Mechanism

Design and Development of Novel Two Axis Servo Control Mechanism Design and Development of Novel Two Axis Servo Control Mechanism Shailaja Kurode, Chinmay Dharmadhikari, Mrinmay Atre, Aniruddha Katti, Shubham Shambharkar Abstract This paper presents design and development

More information

LINE MAZE SOLVING ROBOT

LINE MAZE SOLVING ROBOT LINE MAZE SOLVING ROBOT EEE 456 REPORT OF INTRODUCTION TO ROBOTICS PORJECT PROJECT OWNER: HAKAN UÇAROĞLU 2000502055 INSTRUCTOR: AHMET ÖZKURT 1 CONTENTS I- Abstract II- Sensor Circuit III- Compare Circuit

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

Autonomous Stair Climbing Algorithm for a Small Four-Tracked Robot

Autonomous Stair Climbing Algorithm for a Small Four-Tracked Robot Autonomous Stair Climbing Algorithm for a Small Four-Tracked Robot Quy-Hung Vu, Byeong-Sang Kim, Jae-Bok Song Korea University 1 Anam-dong, Seongbuk-gu, Seoul, Korea vuquyhungbk@yahoo.com, lovidia@korea.ac.kr,

More information

ACTUATORS AND SENSORS. Joint actuating system. Servomotors. Sensors

ACTUATORS AND SENSORS. Joint actuating system. Servomotors. Sensors ACTUATORS AND SENSORS Joint actuating system Servomotors Sensors JOINT ACTUATING SYSTEM Transmissions Joint motion low speeds high torques Spur gears change axis of rotation and/or translate application

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

Design and Implementation of FPGA Based Quadcopter

Design and Implementation of FPGA Based Quadcopter Design and Implementation of FPGA Based Quadcopter G Premkumar 1 SCSVMV, Kanchipuram, Tamil Nadu, INDIA R Jayalakshmi 2 Assistant Professor, SCSVMV, Kanchipuram, Tamil Nadu, INDIA Md Akramuddin 3 Project

More information

3-Degrees of Freedom Robotic ARM Controller for Various Applications

3-Degrees of Freedom Robotic ARM Controller for Various Applications 3-Degrees of Freedom Robotic ARM Controller for Various Applications Mohd.Maqsood Ali M.Tech Student Department of Electronics and Instrumentation Engineering, VNR Vignana Jyothi Institute of Engineering

More information