Time-Optimal Cornering Trajectory Planning for Differential-Driven Wheeled Mobile Robots with Motor Current and Voltage Constraints

Size: px
Start display at page:

Download "Time-Optimal Cornering Trajectory Planning for Differential-Driven Wheeled Mobile Robots with Motor Current and Voltage Constraints"

Transcription

1 Time-Optimal Cornering Trajectory Planning for Differential-Driven Wheeled Mobile Robots ith Motor Current and Voltage Constraints Yunjeong Kim Department of Electrical Engineering KAIST Daejeon, Kaist Byung Kook Kim Department of Electrical Engineering KAIST Daejeon, Kaist Abstract We derive time-optimal cornering trajectory planning algorithm for differential-driven heeled mobile robots(dwmrs) satisfying both battery voltage and armature current constraints. We use mobile robot s dynamics, hich includes motor dynamics. We divide our collision-free cornering trajectory planning algorithm into three sections, in each of hich to subsections are contained. We obtain a time-optimal trajectory by applying bangbang principles in all subsections hich have not ahieved in previous orks. Either current bounded or voltage bounded control input is utilized in each subsection to produce time-optimal trajectory ith continuous velocity. Simulation results are provided to validate the effectiveness of the proposed algorithm and compared ith extreme control algorithm(eca) in [4]. I. INTRODUCTION During the past decades, extensive research efforts have been devoted to plan collision-free paths for DWMRs since DWMRs are increasingly used in industrial and service robotics. One of the key challenges for DWMRs is a trajectory planning hich generates an off-line velocity profile connecting the desired initial and final configurations ith obstacle avoidance. There are numerous researches of trajectory planning for DWMRs considering kinematics only in [1], [7] and [8], hich is simple in calculating but poor performance. Most researches considering dynamic model of DWMRs confined to dynamic constraints of input torques only or just limitations of velocities/accelerations [9],[11]. Since motors are used in actuating DWMRs, e also need to consider motor armature current constraint as ell as battery voltage constraint. Otherise, DWMR cannot track the desired velocity commands due to current and voltage constraints. Furthermore, planning trajectory using direct control input instead of torque is suitable for DWMRs motion planning since e don t need any extra motor-torque or current controller [],[4],[5],[6],[13]. Hence, it is essentially required to plan efficient trajectory algorithm for DWMRs considering not only dynamics but also motor current and voltage constraints ith direct control input. This paper proposes a time-optimal mobile robot velocity trajectory generation algorithm for DWMRs, hich satisfies Fig. 1: Structure of DWMR initial and final postures as ell as motor s armature voltage and current constraints. We consider the bound of pathdeviation D so that obstacle avoidance is considered implicitly ith collision check algorithm. To validate the proposed algorithm, e conducted various simulations, and compared the results ith ECA in [4]. The remainder of this paper is organized as follos. Section represents the problem statement for minimum-time trajectory planning ith DWMR dynamics and voltage and current constraints, and Section 3 describes time-optimal trajectory planning algorithm. In Section 4, simulation results hich demonstrate the effectiveness of our proposed approaches are presented ith comparison to ECA. The paper concludes ith Section 5. II. PROBLEM STATEMENT A. Dynamic Model for DWMRs including DC Motors[4] We consider a DWMR hich has symmetrical structure driven by to identical DC motors as shon in Fig. 1. Dynamic relation beteen angular velocity and motor torque considering inertia and viscous friction becomes J d dt + F v = τ (1)

2 here = [ R L ] T is the angular velocity vector of heels, τ = [τ R τ L ] T is the motor toque of heels, F v is viscous friction coefficient, and J is equivalent inertia matrix of motors hich has J 1 and J as its component. For details, see [1]. Underscript nd L correspond to right and left motors, respectively. In addition, neglecting inductance of armature circuits of motors, e can obtain simple dynamics of both motors such as i = V s u K b ρ () here is armature resistance, i = [i R i L ] T is armature current vector, V s is battery voltage, u = [u R u L ] T is normalized voltage vector (equivalent to PWM duty ratios), K b is backemf constant, and ρ is gear ratio. Also the relation beteen armature current and motor torque is τ = K t ρi (3) here K t is torque constant. In order to transform dynamics into uncorrelated form ith regard to translational and rotational velocities, define change of variables as i + i R+i L, u + u R+u L i i R i L, u u R u L (4), and use kinematics of DWMRs[3] such as ṗ = cosθ sinθ v (5) 1 and v = [ r r r b b r, ] (6) here p = [x y θ] T is DWMR s posture vector, v = [v ] T is velocity vector, v and are translational and rotational velocity, respectively, r is a radius of driving heels, and b is distance beteen the to heels as shon in Fig. 1. After substituting (3) and () into (1) and changing variables using (4) ith (6), e can obtain mobile robot dynamics including motors, in hich v and are uncorrelated ith regard to {i +,u + } and {i,u } as [ ][ Jv dv ] [ ] [ ][ ] dt v rkt ρ i + J d + F v = rk dt t ρ i (7) b [ ] [ ] i + Vs [ ] [ ] i = u + Kb ρ [ ] u rv s v (8) V s bk b ρ rv s here J v = J 1 + J, J = J 1 J. We can define state z(t) [x(t) y(t) θ(t) v(t) (t)] T. B. Voltage and Current Constraints[4] In practice, battery in DWMR has voltage constraint v V s and motors have current constraint i i max. Hoever, since the final control inputs are PWM duty ratio u and v = V s u, the voltage constraint can be expressed as u u max = 1. Hence the voltage and current constraints become u j u max, i j i max, j = R,L (9) or Fig. : Corner configuration ith path deviation u + + u u max, i + + i i max. (1) C. Problem Statement Problem: Consider a DWMR ith dynamics including actuator motors having battery voltage and current constraints, hich should perform cornering motion as shon in Fig.. Find the reference velocity trajectory {[v r (t), r (t)], t t f } minimizing final time t f under constraints: i) Initial and final state: z s = [x s y s θ s ] T (11) z f = [x f y f θ f f ree ] T. (1) ii) Inner path deviation D Note that obstacle avoidance is considered implicitly by the inner path deviation. Assumption 1: Assume that L is long enough for the DWMR to reach the maximum velocity before starting rotational motion. Assumption : Assume that L is long enough for the DWMR to have zero rotational and maximum translational velocity hen it arrives at final destination. III. TIME-OPTIMAL CORNERING TRAJECTORY PLANING ALGORITHM A. Sections and Subsections We divide our control algorithm for cornering motion into three sections. DWMR has translational motion only in the first section S 1. In the second section S, DWMR increases its rotational velocity (RV) hile decreasing its translational velocity (TV) for cornering motion. Finally, for reaching final configuration in section S 3, DWMR decreases its RV and increases its TV. In case that DWMR has a sudden change of input, the current is saturated ith its maximum value before the voltage. Hence each section (S m, m = 1,,3) is divided into to subsections: current constant section(ccs, S m1 ) here current is saturated as a constant value and voltage constant section(vcs, S m ) here DWMR has constant voltage input as shon in Fig. 3. We use bang-bang or at least one

3 Fig. 3: Control input and velocity profile bang-bang control in each section for time-optimal solution. Bang-bang control means that control inputs have loer or upper bound values of their input and at least one bang-bang control means that more than one control input have bangbang input[1][13]. B. Algorithm Time-Optimal Cornering (TOC) TP Algorithm is established as follos. TOC TP Algorithm Set u =.5, u L =, u U = 1, and serch for the optimal u using binary search ith tolerance utol by performing the folloing steps. Step 1. Solve S 1 Planning, S Planning, S 31 Planning, and S 3 Planning ith updated u. Step. Carry out the collision check algorithm. Step 3. Calculate u and update u L or u U as { u =.5(uU u ), u L u, if collision occurs u =.5(u L u ), u U u, otherise. Step 4. If u > u tol, update u u + u and goto Step 1. Step 5. Solve S 11 Planning and S 1 Planning. The overall flo chart of TOC is shon in Fig. 4. C. Reference Profile in CCS and VCS In CCS (S m1 ), motors have constant current as their inputs. Hence e can obtain the folloing velocity profile from (7) such as Fig. 4: Flo chart of TOC Algorithm ẇ + a i = b i i m1, (13) v + a i vv = b i vi + m1, (14) here a i = F v J, b i = rk tρ bj, a i v = F v J v, b i v = rk tρ J v. For t (m 1) < t t m1 (m = 1,,3), (13) and (14) are solved as (t) = ((t (m 1) ) m1, )e ai (t t (m 1) ) + m1,. (15) v(t) = (v(t (m 1) ) v m1, )e ai v(t t (m 1) ) + v m1,. (16) here m1, = bi a i i m1, v m1, = bi v a i i+ v m1. In VCS (S m ), since constant voltage input is applied to each motor, e can obtain an equation using (7),(8) as ẇ + a u = b u u m, (17) v + a u vv = b u vu + m, (18) here a u = F v J + ρ K t K b J, b u = rk tρv s b J, a u v = F v J v + ρ K t K b J v, b u v = rk t ρv s J v. For t m1 < t t m (m = 1,,3), (17) and (18) are solved as (t) = ((t m1 ) m, )e au (t t m1 ) + m,. (19) v(t) = (v(t m1 ) v m, )e au v(t t m1 ) + v m,. () here m, = bu a u u m, v m, = bu v a u v u+ m. D. CCS Planning In DC motor circuits, motor armature current exceeds its maximum value hen there is abrupt change of inputs. In this

4 case, the current should be saturated ith its maximum value until the applied input doesn t cause the current to overflo. Hence, e can plan CCS by determining the unknons i + m1, i m1, T m1 satisfying u m1 (t m1) + u + m1 (t m1) = u max, (1) u m1 (t m1) = u m. () (1) is derived from the condition that voltage constraint should be satisfied in CCS. Meeting the voltage constraint s condition, u + m1 (t) + u m1 (t) u max for t (m 1) < t t m1, the equality holds in the end of each CCS for the time optimal planning. In addition, e can obtain () since the voltage input is a continuous function inside each section. 1) S 11 Planning: Since the angular velocity is zero in S 1n, i R 1n = il 1n. Then u 11 (t 11) = u 1 = is satisfied. Using (8) and (16), (1) and () become i + 11 V + K bρ v(t 11 ) = u max, (3) =. (4) For bang-bang control input, let i R 11 = il 11 = i max. From (3), the unknon T 1 is determined as T 1 = 1 a i ln v K b ρ rv s K b ρ rv s b i v a i v i max b i v a i v i max + V s i max u max. (5) ) S 1 Planning: In S 1, (1) and () are expressed as u 1 (t 1) + u + 1 (t 1) = u max, u 1 (t 1) = u. (6) Since DWMR begins to turn left in S 1, i L 1 is saturated as i L 1 = i max, and from Assumption 1, e obtain v(t 11 ) = v max. The unknons i R 1 and T 1 are related as i 1 V + bk bρ (t 1 ) S rv s + i + 1 V + K bρ v(t 1 ) = u max, i 1 V + bk bρ (t 1 ) = u S rv, (7) s here i + 1 = ir 1 i max, i 1 = ir 1 +i max, (t 1 ) = 1, e ai T 1 + 1,, and v(t 1 ) = (v max v 1, )e ai vt 1 + v 1,. In (7), e can find i R 1 and T 1 using to variable Neton method. 3) S 31 and T Planning: In S 31, since DWMR sitches its motion from rotaional one to translational one and i L 31 = i max, (1) and () are expressed as i 31 V + bk bρ (t 31 ) S rv s + i + 31 V + K bρ v(t 31 ) = u max i 31 V + bk bρ (t 31 ) = u 3 (8) using (8), (15)-() and i L 31 = i max, here i + 31 = ir 31 +i max, i 31 = i R 31 i max and (t 31 ),(t 31 ) can be obtained from (19), (). In contrast to S 1 planning of hich initial translational and rotational velocity in the section are knon as v max and respectly, the initial velocity (t ) and v(t ) in S 31 are correlated ith the parameters in S. Since e kno T 1, i 1 and u because of the algorithm procedure as shon in Fig. 4, the unknons are i R 31, T 31 and T. Since the number of the unknons is three, e need one more condition hich can be obtained from θ f θ s = θ 1 + θ + θ 31 + θ 3 (9) here θ mn, for m =,3, n = 1,, is the resultant turning angle in S mn hich can be obtained by the area of the angular velocity profile in each section. Due to Assumption, θ 3 can be approximated as t3 θ 3 = t 31 (t)dt (t)dt t 31 (3) Hence, (9) becomes θ f θ s t1 t 1 (t)dt + t t 1 (t)dt + = 1, a i (1 e ai T 1 a i T 1 ) + (t 1) a u + (t ) a i + (t ) a u t31 t (t)dt + (1 e au T ), a u (1 e au T a u T ) (1 e ai T 31 ) 31, a i (1 e ai T 31 a i T 31 ) t 31 (t)dt (31) hich is composed of the unknons i R 31, T 31 and T. From (8) and (31), e can find i R 31, T 31 and T by three variable Neton method. E. VCS Planning In CCS Planning, e use at least one bang-bang control to determine the constant current inputs hich fulfill to conditions at the same time: 1) the motor voltage is bounded in CCS and ) voltage input is continuous in each section. Since VCS is folloed by CCS, e don t need to consider the boundedness of armature current in VCS. Hence e can use bang-bang control not at least bang-bang control such that u + m + u m = u max. (3) 1) S 1 Planning: For planning S 1, e should find constant voltage control inputs and time interval in S 1. Since the rotational velocity (t) is assumed to be zero in S 1n for n = 1,, e obtain u 1 = from (7). Using (3), e get u + 1 = u max (33) Since S 1 is planned last, the remaining x distance s 1 after planning S n and S 3n, for n = 1,, as shon in Fig. is the resultant distance of movement x 1n in S 1n for n = 1, such that [13] s 1 = x 11 + x 1 (34)

5 here s 1 = (L + Dtan θ f θ s ) x + y sin((θ f θ s ) atan( y, x)) sin(π (θ f θ s )) x 11 = 1 a i v v 11, (1 e ai vt 11 ) + v 11, T 11 x 1 = 1 a u (v(t 11 ) v 1, )(1 e au vt 1 ) + v 1, T 1. v Since (34) has only one unkon variable T 1, e can determine T 1 using one variable Neton method. ) S 3 Planning: DWMR decelarates its rotational velocity hile accerlating translational velocity in S 3. Hence the bangbang control inputs for time-optimal is u + 3 = u max, u 3 = (35) In Fig., x and y are total x and y distance in S n and S 3n for n = 1,. If T 3 is determined as a certain initial value, e can obtain x and y using (5) by numerical methods. Also e have s = (L + Dtan θ f θ s ) x + y sin(atan( y, x)) sin(π (θ f θ s )) from Fig.. If some value of T 3 is same as its real value, s becomes zero. To find T 3, e set Neton function f (T 3 ) as s. Also e can assume that the first derivation of Neton function f (T 3 ) is v max from Assumption. Hence e can obtain T 3 using one variable Neton method. 3) Determination of u : For bang-bang control, u + + u = u max. (36) Hence e need to determine only u since u+ can be obtained from (36). u should be chosen properly so that both timeoptimal condition and collision-avoidance can be achieved. The bigger u enables to turn sharper, but the smaller u enables to turn inside the corner. For time-optimal control, DWMR should make a turn as close to the edge of the corner as possible. In addition, obstacles can be avoided by choosing u ith collision check algorithm considering the bound of path-deviation D as shon in Fig.. IV. SIMULATION RESULTS To illustrate the effectiveness of the proposed optimal solutions, e applied it to the time-optimal trajectory planning problem of the X-bot robot hich has parameters in TABLE I. The simulation results are compared ith the results of ECA[4], here near-optimal arc trajectory section is used. Figs. 5 to Fig. 6 sho the result of TOC TP Algorithm hen z s = [ ] T,z f = [ f ree ] T and D =.3. We get the total time t f =.694 s. Fig. 5 shos planned trajectory. We can see that current and voltage constraints are satisfied and at least one bang-bang control is applied in each subsection for time optimal control in Fig. 6. To compare total time of TOC ith that of ECA, e performed the simulations for various path-deviation D and path-length L Parameter Value Paramete Value i max.5 A V s 17 V u max 1 K t ρ.53 V/(rad/s) F v.49 Nm/(rad/s) K b ρ.486 V/(rad/s) b.1545 m 5.33 Ω r.36 m m 3.1 kg t.1 m I.9 kgm l.175 m I.4 kgm TABLE I: Parameters of X-bot TOC ECA D(m) L(m) TOC(s) ECA(s) TOC 1(%) TABLE II: Comparison of total time for various D and L as shon in Table II. The values in the final column represent percentage difference of the total time ith respect to that of ECA. TOC TP algorithm can save up to 3.91% of the total time compared ith ECA. Since TOC TP algorithm can save time hen DWMR turns the corner, the ratio is increased for a shorter displacement L. In ECA, DWMR needs a longer time for rotation about shorter D because of the assumption that translational velocity in rotational section is constant. Hence, the improved time ratio of TOC compared ith ECA increases for shorter L and D. V. CONCLUSION In this paper, e investigate the time-optimal trajectory planning problem for DWMRs considering motor current and voltage constraints. The time-optimal control input is designed to satisfy initial and final states ith a given bound of path-deviation D. We divide our control algorithm into three sections ith to subsections consisted of CCS and VCS. In CCS, current values of the to heels are determined by at least one bang-bang control, and each subsection duration is also obtained using the continuous velocity and bounded voltage condition in CCS. In VCS, e use bang-bang control and initial and final states condition to determine the voltage control input and the duration. We utilized the folloing to minor assumptions: 1) e neglect inductance of armature circuits, ) the path distance L is long enough for DWMR to reach the maximum velocity before starting rotational motion, and to have zero rotational and maximum translational velocity at final destination. Then e can obtain a time-optimal trajectory planning solution, here u is selected for timeoptimality by binary search ith collision check algorithm. Simulation results sho that proposed algorithm not only satisfies armature current and voltage constraints but also gives time savings, up to 3.9% compared ith ECA. ACKNOWLEDGMENT This ork as supported by Ministry of Knoledge Economy under Human Resources Development Program for Convergence Robot Specialists.

6 R L u =u1=umax 1 R L u =u3=umax y(m).3 u R u =umax u R u L x(m) Fig. 5: Planned trajectory APPENDIX Collision Check Algorithm Collision check algorithm is conducted after S 1,S,S 31,S 3 is planned. Hence e kno x(k) and y(k) for k 1 k k 3 here k mn, m = 1,,3,n = 1,, represents discrete time in the end of section S mn. In Fig., e find k such that θ k becomes θ p using binary search algorithm. We compare D p = D/cos((θ f θ s )/) ith d hich is distance beteent (x p,y p ) and (x c,y c ) so that e can recognize hether collision occurs or not. Hence, collision check algorithm is established by doing folloing steps. Step 1. Set k L = k 1,k U = k 3,k =.5(k L + k U ). Step. Calculate k and update k L or k U as { k =.5(kU k), k L k, if cosθ k < cosθ p k =.5(k L k), k U k, otherise. Step 3. If k 1, update k as k k + k and goto Step. Step 4. Calculate d = (x c x(k)) + (y c y(k)). { Collision occurs, if d Dp Collision doesn t occur, otherise. REFERENCES [1] B. Qin, Y. C. Soh, M. Xie, and D. Wang, Optimal trajectory generation for heeled mobile robot, in Proc. 5th Int. Conf. Comput. Integr. Manuf,, pp ,. [] C. H. Kim and B. K. Kim, Minimum-energy translational trajectory generation for differential-driven heeled mobile robots, Journal of Intelligent and Robotic Systems,, pp , Mar., 7. [3] J. C. Alexander and J. H. Maddocks, On the kinematics of heeled mobile robots, International Journal of Robotics Research, vol. 8, no.5, pp. 15-7, Oct., [4] J. S. Choi and B. K. Kim, Near-time-optimal trajectory planning for heeled mobile robots ith translational and rotational sections, IEEE Trans. Robot. Autom., vol. 17, no.1, pp. 85-9, Feb., 1. [5] J. S. Choi, Trajectory planning and folloing for mobile robots ith current and voltage constraints, Ph.D s thesis, KAIST, Dae-jeon, Korea, 1. [6] J. S. Kim and B. K. Kim, Minimum-time grid coverage trajectory planning algorithm for mobile robots ith battery voltage constraints, Int. Conf. Control and systems,, pp , Oct., 1. [7] L. Labakhua, U. Nunes, R. Rodriguies, and S. F atima Leite, Smooth trajectory planning for fully automated passenger vehicles-spline and clothoid based methods and its simulation, in Proc. Int. Donf. Informat. Control, Autom. Robot, pp , 6. [8] M. Hentschel, D. Lecking, and B. Wagner, Deterministic path planning and navigation for an autonomous fork lift truck in Proc. 6th IFAC Symp. Intell. Auton. Veh. pp.1-6, 8. v(m/s) i(a) t(s) (a) Left and right motor voltage input R L L i =i11=imax i =imax t(s) (b) Left and right motor current t(s) v (c) Translational and rotational velocity profile Fig. 6: Input and velocity profile of TOC TP algorithm: z f = [ f ree ] T,D =.3 [9] M. Haddad, W. Khalil, and H. E. Lehtihet, Trajectory planning of unicycle mobile robots ith a trapezoidal-velocity constraint, IEEE Trans. on Robotics, vol. 6, No. 5, pp , 1. [1] P. E. Jacobs, A. Rege, and J. P. Laumond, Non-holonomic motion planning for Hilare-like mobie robots, in Proc. Int. Symp. Intelligent Robotics, pp , Jan., [11] W. Wu, H. Chen, and P. -Y. Woo, Time optimal path planning for a heeled mobile robot, J. Robot. Syst, vol. 17, no. 11, pp , [1] X. Yun and Y. Yamamoto, Internal dynamics of a heeled mobile robot, in Proc. IEEE Int. Conf. Intelligent Robots and Systems,, pp , July, [13] Y. J. Byeon, Near-minimum-time cornering trajectory planning and control ith the motor actuating voltage constraint for differential-driven heeled mobile robot, Master s thesis, KAIST, Dae-jeon, Korea, 1. i R i L (rad/s)

OVER THE past 20 years, the control of mobile robots has

OVER THE past 20 years, the control of mobile robots has IEEE TRANSACTIONS ON CONTROL SYSTEMS TECHNOLOGY, VOL. 18, NO. 5, SEPTEMBER 2010 1199 A Simple Adaptive Control Approach for Trajectory Tracking of Electrically Driven Nonholonomic Mobile Robots Bong Seok

More information

Design of Fuzzy Logic Control System for Segway Type Mobile Robots

Design of Fuzzy Logic Control System for Segway Type Mobile Robots Original Article International Journal of Fuzzy Logic and Intelligent Systems Vol. 15, No. 2, June 2015, pp. 126-131 http://dx.doi.org/10.5391/ijfis.2015.15.2.126 ISSNPrint) 1598-2645 ISSNOnline) 2093-744X

More information

E11 Lecture 13: Motors. Professor Lape Fall 2010

E11 Lecture 13: Motors. Professor Lape Fall 2010 E11 Lecture 13: Motors Professor Lape Fall 2010 Overview How do electric motors work? Electric motor types and general principles of operation How well does your motor perform? Torque and power output

More information

Feedback Control Systems

Feedback Control Systems ME Homework #0 Feedback Control Systems Last Updated November 06 Text problem 67 (Revised Chapter 6 Homework Problems- attached) 65 Chapter 6 Homework Problems 65 Transient Response of a Second Order Model

More information

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics

Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics Real-time Motion Control of a Nonholonomic Mobile Robot with Unknown Dynamics TIEMIN HU and SIMON X. YANG ARIS (Advanced Robotics & Intelligent Systems) Lab School of Engineering, University of Guelph

More information

Manufacturing Equipment Control

Manufacturing Equipment Control QUESTION 1 An electric drive spindle has the following parameters: J m = 2 1 3 kg m 2, R a = 8 Ω, K t =.5 N m/a, K v =.5 V/(rad/s), K a = 2, J s = 4 1 2 kg m 2, and K s =.3. Ignore electrical dynamics

More information

CONTROL OF THE NONHOLONOMIC INTEGRATOR

CONTROL OF THE NONHOLONOMIC INTEGRATOR June 6, 25 CONTROL OF THE NONHOLONOMIC INTEGRATOR R. N. Banavar (Work done with V. Sankaranarayanan) Systems & Control Engg. Indian Institute of Technology, Bombay Mumbai -INDIA. banavar@iitb.ac.in Outline

More information

State Space Representation

State Space Representation ME Homework #6 State Space Representation Last Updated September 6 6. From the homework problems on the following pages 5. 5. 5.6 5.7. 5.6 Chapter 5 Homework Problems 5.6. Simulation of Linear and Nonlinear

More information

MECH 3140 Final Project

MECH 3140 Final Project MECH 3140 Final Project Final presentation will be held December 7-8. The presentation will be the only deliverable for the final project and should be approximately 20-25 minutes with an additional 10

More information

1 Introduction. Control 2:

1 Introduction. Control 2: Introduction Kinematics of Wheeled Mobile Robots (No legs here. They ork like arms. We e seen arms already) For control purposes, the kinematics of heeled mobile robots (WMRs) that e care about are the

More information

MODEL IDENTIFICATION OF A FOUR WHEELED OMNI-DIRECTIONAL MOBILE ROBOT. the Department of Electrical and Computer Engineering

MODEL IDENTIFICATION OF A FOUR WHEELED OMNI-DIRECTIONAL MOBILE ROBOT. the Department of Electrical and Computer Engineering MODEL IDENTIFICATION OF A FOUR WHEELED OMNI-DIRECTIONAL MOBILE ROBOT André Scolari Conceição, A. Paulo Moreira Paulo J. Costa Department of Electrical and Computer Engineering University of Porto - Porto

More information

DC Motor Position: System Modeling

DC Motor Position: System Modeling 1 of 7 01/03/2014 22:07 Tips Effects TIPS ABOUT BASICS INDEX NEXT INTRODUCTION CRUISE CONTROL MOTOR SPEED MOTOR POSITION SUSPENSION INVERTED PENDULUM SYSTEM MODELING ANALYSIS DC Motor Position: System

More information

Trajectory Planning Using High-Order Polynomials under Acceleration Constraint

Trajectory Planning Using High-Order Polynomials under Acceleration Constraint Journal of Optimization in Industrial Engineering (07) -6 Trajectory Planning Using High-Order Polynomials under Acceleration Constraint Hossein Barghi Jond a,*,vasif V. Nabiyev b, Rifat Benveniste c a

More information

Experimental Implementation of Flocking Algorithms in Wheeled Mobile Robots

Experimental Implementation of Flocking Algorithms in Wheeled Mobile Robots 5 American Control Conference June 8-, 5. Portland, OR, USA FrC.4 Experimental Implementation of Flocking Algorithms in Wheeled Mobile Robots A. Regmi, R. Sandoval, R. Byrne, H. Tanner #, and C.T. Abdallah

More information

Rigid Manipulator Control

Rigid Manipulator Control Rigid Manipulator Control The control problem consists in the design of control algorithms for the robot motors, such that the TCP motion follows a specified task in the cartesian space Two types of task

More information

Line following of a mobile robot

Line following of a mobile robot Line following of a mobile robot May 18, 004 1 In brief... The project is about controlling a differential steering mobile robot so that it follows a specified track. Steering is achieved by setting different

More information

Power Assist H Control of Shift Lever with Spring Connected Link

Power Assist H Control of Shift Lever with Spring Connected Link Extended Summary pp.33 40 Power Assist H Control of Shift Lever with Spring Connected Link Mitsuo Hirata Member (Utsunomiya University) Tsutomu Ogiwara Non-member (Utsunomiya University) Hitoshi Okamoto

More information

Tutorial 1 - Drive fundamentals and DC motor characteristics

Tutorial 1 - Drive fundamentals and DC motor characteristics University of New South Wales School of Electrical Engineering & elecommunications ELEC4613 ELECRIC DRIVE SYSEMS utorial 1 - Drive fundamentals and DC motor characteristics 1. In the hoist drive system

More information

Overview of motors and motion control

Overview of motors and motion control Overview of motors and motion control. Elements of a motion-control system Power upply High-level controller ow-level controller Driver Motor. Types of motors discussed here; Brushed, PM DC Motors Cheap,

More information

Robot Manipulator Control. Hesheng Wang Dept. of Automation

Robot Manipulator Control. Hesheng Wang Dept. of Automation Robot Manipulator Control Hesheng Wang Dept. of Automation Introduction Industrial robots work based on the teaching/playback scheme Operators teach the task procedure to a robot he robot plays back eecute

More information

INC 341 Feedback Control Systems: Lecture 3 Transfer Function of Dynamic Systems II

INC 341 Feedback Control Systems: Lecture 3 Transfer Function of Dynamic Systems II INC 341 Feedback Control Systems: Lecture 3 Transfer Function of Dynamic Systems II Asst. Prof. Dr.-Ing. Sudchai Boonto Department of Control Systems and Instrumentation Engineering King Mongkut s University

More information

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT

CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT Journal of Computer Science and Cybernetics, V.31, N.3 (2015), 255 265 DOI: 10.15625/1813-9663/31/3/6127 CONTROL OF ROBOT CAMERA SYSTEM WITH ACTUATOR S DYNAMICS TO TRACK MOVING OBJECT NGUYEN TIEN KIEM

More information

Positioning Servo Design Example

Positioning Servo Design Example Positioning Servo Design Example 1 Goal. The goal in this design example is to design a control system that will be used in a pick-and-place robot to move the link of a robot between two positions. Usually

More information

Predictive Cascade Control of DC Motor

Predictive Cascade Control of DC Motor Volume 49, Number, 008 89 Predictive Cascade Control of DC Motor Alexandru MORAR Abstract: The paper deals with the predictive cascade control of an electrical drive intended for positioning applications.

More information

Design a SSV. Small solar vehicle. Case SSV part 1

Design a SSV. Small solar vehicle. Case SSV part 1 1 Design a SSV Small solar vehicle Case SSV part 1 2 Contents 1. The characteristics of the solar panel... 4 2. Optimal gear ratio... 10 3. Bisection method... 14 4. Sankey diagrams... 18 A) Sankey diagram

More information

Fast Seek Control for Flexible Disk Drive Systems

Fast Seek Control for Flexible Disk Drive Systems Fast Seek Control for Flexible Disk Drive Systems with Back EMF and Inductance Chanat La-orpacharapan and Lucy Y. Pao Department of Electrical and Computer Engineering niversity of Colorado, Boulder, CO

More information

DcMotor_ Model Help File

DcMotor_ Model Help File Name of Model: DcMotor_021708 Author: Vladimir L. Chervyakov Date: 2002-10-26 Executable file name DcMotor_021708.vtm Version number: 1.0 Description This model represents a Nonlinear model of a permanent

More information

FEEDBACK CONTROL SYSTEMS

FEEDBACK CONTROL SYSTEMS FEEDBAC CONTROL SYSTEMS. Control System Design. Open and Closed-Loop Control Systems 3. Why Closed-Loop Control? 4. Case Study --- Speed Control of a DC Motor 5. Steady-State Errors in Unity Feedback Control

More information

Analysis of fluid induced vibration of cryogenic pipes in consideration of the cooling effect

Analysis of fluid induced vibration of cryogenic pipes in consideration of the cooling effect Journal of Mechanical Science and Technology (8) 375~385 Journal of Mechanical Science and Technology.springerlink.com/content/1738-494x DOI 1.17/s16-8-55-7 Analysis of fluid induced vibration of cryogenic

More information

Analysis of Nonlinear Characteristics of Turbine Governor and Its Impact on Power System Oscillation

Analysis of Nonlinear Characteristics of Turbine Governor and Its Impact on Power System Oscillation Energy and Poer Engineering, 203, 5, 746-750 doi:0.4236/epe.203.54b44 Published Online July 203 (http://.scirp.org/journal/epe) Analysis of Nonlinear Characteristics of Turbine Governor and Its Impact

More information

THE ROTATING CONSTRAINED BAR: DERIVATION OF THE GOVERNING EQUATIONS OF MOTION AND NUMERICAL SIMULATIONS

THE ROTATING CONSTRAINED BAR: DERIVATION OF THE GOVERNING EQUATIONS OF MOTION AND NUMERICAL SIMULATIONS Proceedings of COBEM 7 Copyright 7 by ABCM 9th International Congress of Mechanical Engineering November -9, 7, Brasília, DF THE ROTATING CONSTRAINED BAR: DERIVATION OF THE GOVERNING EQUATIONS OF MOTION

More information

An Improved Driving Scheme in an Electrophoretic Display

An Improved Driving Scheme in an Electrophoretic Display International Journal of Engineering and Technology Volume 3 No. 4, April, 2013 An Improved Driving Scheme in an Electrophoretic Display Pengfei Bai 1, Zichuan Yi 1, Guofu Zhou 1,2 1 Electronic Paper Displays

More information

Online Identification And Control of A PV-Supplied DC Motor Using Universal Learning Networks

Online Identification And Control of A PV-Supplied DC Motor Using Universal Learning Networks Online Identification And Control of A PV-Supplied DC Motor Using Universal Learning Networks Ahmed Hussein * Kotaro Hirasawa ** Jinglu Hu ** * Graduate School of Information Science & Electrical Eng.,

More information

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot

Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Cross-Coupling Control for Slippage Minimization of a Four-Wheel-Steering Mobile Robot Maxim Makatchev Dept. of Manufacturing Engineering and Engineering Management City University of Hong Kong Hong Kong

More information

ET3-7: Modelling I(V) Introduction and Objectives. Electrical, Mechanical and Thermal Systems

ET3-7: Modelling I(V) Introduction and Objectives. Electrical, Mechanical and Thermal Systems ET3-7: Modelling I(V) Introduction and Objectives Electrical, Mechanical and Thermal Systems Objectives analyse and model basic linear dynamic systems -Electrical -Mechanical -Thermal Recognise the analogies

More information

The basic principle to be used in mechanical systems to derive a mathematical model is Newton s law,

The basic principle to be used in mechanical systems to derive a mathematical model is Newton s law, Chapter. DYNAMIC MODELING Understanding the nature of the process to be controlled is a central issue for a control engineer. Thus the engineer must construct a model of the process with whatever information

More information

arxiv: v2 [cs.ro] 9 May 2017

arxiv: v2 [cs.ro] 9 May 2017 Distributed Formation Control of Nonholonomic Mobile Robots by Bounded Feedback in the Presence of Obstacles Thang Nguyen and Hung M. La arxiv:174.4566v2 [cs.ro] 9 May 217 Abstract The problem of distributed

More information

Towards Optimal Computation of Energy Optimal Trajectory for Mobile Robots

Towards Optimal Computation of Energy Optimal Trajectory for Mobile Robots Third International Conference on Advances in Control and Optimization of Dynamical Systems Towards Optimal Computation of Energy Optimal Trajectory for Mobile Robots Manas Chaudhari Leena Vachhani Rangan

More information

An adaptive sliding mode control scheme for induction motor drives

An adaptive sliding mode control scheme for induction motor drives An adaptive sliding mode control scheme for induction motor drives Oscar Barambones, Patxi Alkorta, Aitor J. Garrido, I. Garrido and F.J. Maseda ABSTRACT An adaptive sliding-mode control system, which

More information

Control of Mobile Robots

Control of Mobile Robots Control of Mobile Robots Regulation and trajectory tracking Prof. Luca Bascetta (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Organization and

More information

Real-Time Obstacle Avoidance for trailer-like Systems

Real-Time Obstacle Avoidance for trailer-like Systems Real-Time Obstacle Avoidance for trailer-like Systems T.A. Vidal-Calleja, M. Velasco-Villa,E.Aranda-Bricaire. Departamento de Ingeniería Eléctrica, Sección de Mecatrónica, CINVESTAV-IPN, A.P. 4-74, 7,

More information

Robotics I. Test November 29, 2013

Robotics I. Test November 29, 2013 Exercise 1 [6 points] Robotics I Test November 9, 013 A DC motor is used to actuate a single robot link that rotates in the horizontal plane around a joint axis passing through its base. The motor is connected

More information

Robot Control Basics CS 685

Robot Control Basics CS 685 Robot Control Basics CS 685 Control basics Use some concepts from control theory to understand and learn how to control robots Control Theory general field studies control and understanding of behavior

More information

CHARACTERIZATION OF ULTRASONIC IMMERSION TRANSDUCERS

CHARACTERIZATION OF ULTRASONIC IMMERSION TRANSDUCERS CHARACTERIZATION OF ULTRASONIC IMMERSION TRANSDUCERS INTRODUCTION David D. Bennink, Center for NDE Anna L. Pate, Engineering Science and Mechanics Ioa State University Ames, Ioa 50011 In any ultrasonic

More information

Rotational & Rigid-Body Mechanics. Lectures 3+4

Rotational & Rigid-Body Mechanics. Lectures 3+4 Rotational & Rigid-Body Mechanics Lectures 3+4 Rotational Motion So far: point objects moving through a trajectory. Next: moving actual dimensional objects and rotating them. 2 Circular Motion - Definitions

More information

CALCULATION OF STEAM AND WATER RELATIVE PERMEABILITIES USING FIELD PRODUCTION DATA, WITH LABORATORY VERIFICATION

CALCULATION OF STEAM AND WATER RELATIVE PERMEABILITIES USING FIELD PRODUCTION DATA, WITH LABORATORY VERIFICATION CALCULATION OF STEAM AND WATER RELATIVE PERMEABILITIES USING FIELD PRODUCTION DATA, WITH LABORATORY VERIFICATION Jericho L. P. Reyes, Chih-Ying Chen, Keen Li and Roland N. Horne Stanford Geothermal Program,

More information

Slip Mitigation Control for an Electric Powered Wheelchair

Slip Mitigation Control for an Electric Powered Wheelchair Slip Mitigation Control for an Electric Powered Wheelchair Oscar Chuy*, Emmanuel G. Collins*, and Camilo Ordonez* Jorge Candiotti**, Hongwu Wang**, and Rory Cooper** Abstract Most wheelchairs have low

More information

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT

NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT NONLINEAR PATH CONTROL FOR A DIFFERENTIAL DRIVE MOBILE ROBOT Plamen PETROV Lubomir DIMITROV Technical University of Sofia Bulgaria Abstract. A nonlinear feedback path controller for a differential drive

More information

(Refer Slide Time: 00:01:30 min)

(Refer Slide Time: 00:01:30 min) Control Engineering Prof. M. Gopal Department of Electrical Engineering Indian Institute of Technology, Delhi Lecture - 3 Introduction to Control Problem (Contd.) Well friends, I have been giving you various

More information

Structural Synthesis and Configuration Analysis of Broken Strands Repair Operation Metamorphic Mechanism

Structural Synthesis and Configuration Analysis of Broken Strands Repair Operation Metamorphic Mechanism Structural Synthesis and Configuration Analysis of Broken Strands Repair Operation Metamorphic Mechanism Q Yang, H G Wang and S J Li SRUCURAL SYNHESIS AND CONFIGURAION ANALYSIS OF BROKEN SRANDS REPAIR

More information

On the stability of nonholonomic multi-vehicle formation

On the stability of nonholonomic multi-vehicle formation Abstract On the stability of nonholonomic multi-vehicle formation Lotfi Beji 1, Mohamed Anouar ElKamel 1, Azgal Abichou 2 1 University of Evry (IBISC EA 4526), 40 rue du Pelvoux, 91020 Evry Cedex, France

More information

Target tracking and classification for missile using interacting multiple model (IMM)

Target tracking and classification for missile using interacting multiple model (IMM) Target tracking and classification for missile using interacting multiple model (IMM Kyungwoo Yoo and Joohwan Chun KAIST School of Electrical Engineering Yuseong-gu, Daejeon, Republic of Korea Email: babooovv@kaist.ac.kr

More information

Tracking Control of a Mobile Robot using a Neural Dynamics based Approach

Tracking Control of a Mobile Robot using a Neural Dynamics based Approach Tracking ontrol of a Mobile Robot using a Neural ynamics based Approach Guangfeng Yuan, Simon X. Yang and Gauri S. Mittal School of Engineering, University of Guelph Guelph, Ontario, NG W, anada Abstract

More information

A turbulence closure based on the maximum entropy method

A turbulence closure based on the maximum entropy method Advances in Fluid Mechanics IX 547 A turbulence closure based on the maximum entropy method R. W. Derksen Department of Mechanical and Manufacturing Engineering University of Manitoba Winnipeg Canada Abstract

More information

Final Exam April 30, 2013

Final Exam April 30, 2013 Final Exam Instructions: You have 120 minutes to complete this exam. This is a closed-book, closed-notes exam. You are allowed to use a calculator during the exam. Usage of mobile phones and other electronic

More information

Fundamentals of DC Testing

Fundamentals of DC Testing Fundamentals of DC Testing Aether Lee erigy Japan Abstract n the beginning of this lecture, Ohm s la, hich is the most important electric la regarding DC testing, ill be revieed. Then, in the second section,

More information

m e l 2, m 2 elbow tip θ 2 l 1, m 1 elbow joint θ 1 elbow joint

m e l 2, m 2 elbow tip θ 2 l 1, m 1 elbow joint θ 1 elbow joint TIME-OPTIMAL CONTROL OF ROBOTIC MANIPULATORS MODELLED WITH ACTUATOR DYNAMICS J. O. Pedro Λ;1 M. Mthethwa Λ O. T. Nyandoro ΛΛ Λ School of Mechanical, Industrial and Aeronautical Engineering ΛΛ School of

More information

Robust Speed Controller Design for Permanent Magnet Synchronous Motor Drives Based on Sliding Mode Control

Robust Speed Controller Design for Permanent Magnet Synchronous Motor Drives Based on Sliding Mode Control Available online at www.sciencedirect.com ScienceDirect Energy Procedia 88 (2016 ) 867 873 CUE2015-Applied Energy Symposium and Summit 2015: ow carbon cities and urban energy systems Robust Speed Controller

More information

Texas A & M University Department of Mechanical Engineering MEEN 364 Dynamic Systems and Controls Dr. Alexander G. Parlos

Texas A & M University Department of Mechanical Engineering MEEN 364 Dynamic Systems and Controls Dr. Alexander G. Parlos Texas A & M University Department of Mechanical Engineering MEEN 364 Dynamic Systems and Controls Dr. Alexander G. Parlos Lecture 6: Modeling of Electromechanical Systems Principles of Motor Operation

More information

A Novel Method on Disturbance Analysis and Feed-forward Compensation in Permanent Magnet Linear Motor System

A Novel Method on Disturbance Analysis and Feed-forward Compensation in Permanent Magnet Linear Motor System A Novel Method on Disturbance Analysis and Feed-forward Compensation in Permanent Magnet Linear Motor System Jonghwa Kim, Kwanghyun Cho, Hojin Jung, and Seibum Choi Department of Mechanical Engineering

More information

Quanser NI-ELVIS Trainer (QNET) Series: QNET Experiment #02: DC Motor Position Control. DC Motor Control Trainer (DCMCT) Student Manual

Quanser NI-ELVIS Trainer (QNET) Series: QNET Experiment #02: DC Motor Position Control. DC Motor Control Trainer (DCMCT) Student Manual Quanser NI-ELVIS Trainer (QNET) Series: QNET Experiment #02: DC Motor Position Control DC Motor Control Trainer (DCMCT) Student Manual Table of Contents 1 Laboratory Objectives1 2 References1 3 DCMCT Plant

More information

Lab 3: Quanser Hardware and Proportional Control

Lab 3: Quanser Hardware and Proportional Control Lab 3: Quanser Hardware and Proportional Control The worst wheel of the cart makes the most noise. Benjamin Franklin 1 Objectives The goal of this lab is to: 1. familiarize you with Quanser s QuaRC tools

More information

ECEN 420 LINEAR CONTROL SYSTEMS. Lecture 6 Mathematical Representation of Physical Systems II 1/67

ECEN 420 LINEAR CONTROL SYSTEMS. Lecture 6 Mathematical Representation of Physical Systems II 1/67 1/67 ECEN 420 LINEAR CONTROL SYSTEMS Lecture 6 Mathematical Representation of Physical Systems II State Variable Models for Dynamic Systems u 1 u 2 u ṙ. Internal Variables x 1, x 2 x n y 1 y 2. y m Figure

More information

Trajectory Planning and Control of an Underactuated Dynamically Stable Single Spherical Wheeled Mobile Robot

Trajectory Planning and Control of an Underactuated Dynamically Stable Single Spherical Wheeled Mobile Robot Trajectory Planning and Control of an Underactuated Dynamically Stable Single Spherical Wheeled Mobile Robot Umashankar Nagarajan, George Kantor and Ralph L. Hollis Abstract The ballbot is a dynamically

More information

Multi-Objective Trajectory Planning of Mobile Robots Using Augmented Lagrangian

Multi-Objective Trajectory Planning of Mobile Robots Using Augmented Lagrangian CSC 007 6-8 May Marraech Morocco /0 Multi-Objective rajectory Planning of Mobile Robots Using Augmented Lagrangian Amar Khouhi Luc Baron and Mare Balazinsi Mechanical Engineering Dept. École Polytechnique

More information

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws

Lecture 13 REVIEW. Physics 106 Spring What should we know? What should we know? Newton s Laws Lecture 13 REVIEW Physics 106 Spring 2006 http://web.njit.edu/~sirenko/ What should we know? Vectors addition, subtraction, scalar and vector multiplication Trigonometric functions sinθ, cos θ, tan θ,

More information

Lecture II: Rigid-Body Physics

Lecture II: Rigid-Body Physics Rigid-Body Motion Previously: Point dimensionless objects moving through a trajectory. Today: Objects with dimensions, moving as one piece. 2 Rigid-Body Kinematics Objects as sets of points. Relative distances

More information

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels

Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Vehicle Dynamics of Redundant Mobile Robots with Powered Caster Wheels Yuan Ping Li * and Teresa Zielinska and Marcelo H. Ang Jr.* and Wei Lin * National University of Singapore, Faculty of Engineering,

More information

Mathematical Modeling and Dynamic Simulation of a Class of Drive Systems with Permanent Magnet Synchronous Motors

Mathematical Modeling and Dynamic Simulation of a Class of Drive Systems with Permanent Magnet Synchronous Motors Applied and Computational Mechanics 3 (2009) 331 338 Mathematical Modeling and Dynamic Simulation of a Class of Drive Systems with Permanent Magnet Synchronous Motors M. Mikhov a, a Faculty of Automatics,

More information

Introduction To Resonant. Circuits. Resonance in series & parallel RLC circuits

Introduction To Resonant. Circuits. Resonance in series & parallel RLC circuits Introduction To esonant Circuits esonance in series & parallel C circuits Basic Electrical Engineering (EE-0) esonance In Electric Circuits Any passive electric circuit ill resonate if it has an inductor

More information

Reducing Age-of-Information for Computation-Intensive Messages via Packet Replacement

Reducing Age-of-Information for Computation-Intensive Messages via Packet Replacement Reducing Age-of-Information for Computation-Intensive Messages via Packet Replacement arxiv:191.4654v1 [cs.it] 15 Jan 19 Jie Gong, Qiaobin Kuang, Xiang Chen and Xiao Ma School of Data and Computer Science,

More information

ME 375 Final Examination Thursday, May 7, 2015 SOLUTION

ME 375 Final Examination Thursday, May 7, 2015 SOLUTION ME 375 Final Examination Thursday, May 7, 2015 SOLUTION POBLEM 1 (25%) negligible mass wheels negligible mass wheels v motor no slip ω r r F D O no slip e in Motor% Cart%with%motor%a,ached% The coupled

More information

Randomized Smoothing Networks

Randomized Smoothing Networks Randomized Smoothing Netorks Maurice Herlihy Computer Science Dept., Bron University, Providence, RI, USA Srikanta Tirthapura Dept. of Electrical and Computer Engg., Ioa State University, Ames, IA, USA

More information

Discrete-Time Series Identification of Sliding Dynamic Friction in Industrial Robotic Joints

Discrete-Time Series Identification of Sliding Dynamic Friction in Industrial Robotic Joints 23 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS) November 3-7 23. Tokyo Japan Discrete-Time Series Identification of Sliding Dynamic Friction in Industrial Robotic Joints Michael

More information

Roots Blower with Gradually Expanding Outlet Gap: Mathematical Modelling and Performance Simulation Yingjie Cai 1, a, Ligang Yao 2, b

Roots Blower with Gradually Expanding Outlet Gap: Mathematical Modelling and Performance Simulation Yingjie Cai 1, a, Ligang Yao 2, b 2nd International Conference on Advances in Mechanical Engineering and Industrial Informatics (AMEII 216) Roots Bloer ith Gradually Exanding Outlet Ga: Mathematical Modelling and Performance Simulation

More information

Mechatronics Engineering. Li Wen

Mechatronics Engineering. Li Wen Mechatronics Engineering Li Wen Bio-inspired robot-dc motor drive Unstable system Mirko Kovac,EPFL Modeling and simulation of the control system Problems 1. Why we establish mathematical model of the control

More information

Safe Joint Mechanism using Inclined Link with Springs for Collision Safety and Positioning Accuracy of a Robot Arm

Safe Joint Mechanism using Inclined Link with Springs for Collision Safety and Positioning Accuracy of a Robot Arm 1 IEEE International Conference on Robotics and Automation Anchorage Convention District May 3-8, 1, Anchorage, Alaska, USA Safe Joint Mechanism using Inclined Link with Springs for Collision Safety and

More information

A FORCE BALANCE TECHNIQUE FOR MEASUREMENT OF YOUNG'S MODULUS. 1 Introduction

A FORCE BALANCE TECHNIQUE FOR MEASUREMENT OF YOUNG'S MODULUS. 1 Introduction A FORCE BALANCE TECHNIQUE FOR MEASUREMENT OF YOUNG'S MODULUS Abhinav A. Kalamdani Dept. of Instrumentation Engineering, R. V. College of Engineering, Bangalore, India. kalamdani@ieee.org Abstract: A new

More information

Probability Map Building of Uncertain Dynamic Environments with Indistinguishable Obstacles

Probability Map Building of Uncertain Dynamic Environments with Indistinguishable Obstacles Probability Map Building of Uncertain Dynamic Environments with Indistinguishable Obstacles Myungsoo Jun and Raffaello D Andrea Sibley School of Mechanical and Aerospace Engineering Cornell University

More information

Underwater vehicles: a surprising non time-optimal path

Underwater vehicles: a surprising non time-optimal path Underwater vehicles: a surprising non time-optimal path M. Chyba Abstract his paper deals with the time-optimal problem for a class of underwater vehicles. We prove that if two configurations at rest can

More information

Rotational Systems, Gears, and DC Servo Motors

Rotational Systems, Gears, and DC Servo Motors Rotational Systems Rotational Systems, Gears, and DC Servo Motors Rotational systems behave exactly like translational systems, except that The state (angle) is denoted with rather than x (position) Inertia

More information

CENG 5210 Advanced Separation Processes. Reverse osmosis

CENG 5210 Advanced Separation Processes. Reverse osmosis Reverse osmosis CENG 510 Advanced Separation Processes In osmosis, solvent transports from a dilute solute or salt solution to a concentrated solute or salt solution across a semipermeable membrane hich

More information

Response of NiTi SMA wire electrically heated

Response of NiTi SMA wire electrically heated , 06037 (2009) DOI:10.1051/esomat/200906037 Oned by the authors, published by EDP Sciences, 2009 Response of NiTi SMA ire electrically heated C. Zanotti a, P. Giuliani, A. Tuissi 1, S. Arnaboldi 1, R.

More information

Designing Information Devices and Systems II Fall 2018 Elad Alon and Miki Lustig Homework 7

Designing Information Devices and Systems II Fall 2018 Elad Alon and Miki Lustig Homework 7 EECS 16B Designing Information Devices and Systems II Fall 2018 Elad Alon and Miki Lustig Homework 7 This homework is due on October 17, 2018 at 11:59pm Self grades are due on October 22, 2018 at 11:59pm

More information

Design and Control of Variable Stiffness Actuation Systems

Design and Control of Variable Stiffness Actuation Systems Design and Control of Variable Stiffness Actuation Systems Gianluca Palli, Claudio Melchiorri, Giovanni Berselli and Gabriele Vassura DEIS - DIEM - Università di Bologna LAR - Laboratory of Automation

More information

Fuzzy modeling and control of rotary inverted pendulum system using LQR technique

Fuzzy modeling and control of rotary inverted pendulum system using LQR technique IOP Conference Series: Materials Science and Engineering OPEN ACCESS Fuzzy modeling and control of rotary inverted pendulum system using LQR technique To cite this article: M A Fairus et al 13 IOP Conf.

More information

Ieee Transactions On Circuits And Systems I: Fundamental Theory And Applications, 2003, v. 50 n. 5, p

Ieee Transactions On Circuits And Systems I: Fundamental Theory And Applications, 2003, v. 50 n. 5, p Title Modeling, analysis, and experimentation of chaos in a switched reluctance drive system Author(s) Chau, KT; Chen, JH Citation Ieee Transactions On Circuits And Systems I: Fundamental Theory And Applications,

More information

A Hierarchical Model Predictive Tracking Control for Independent Four- Wheel Driving/Steering Vehicles with Coaxial Steering Mechanism

A Hierarchical Model Predictive Tracking Control for Independent Four- Wheel Driving/Steering Vehicles with Coaxial Steering Mechanism Journal of Physics: Conference Series PAPER OPEN ACCESS A Hierarchical Model Predictive Tracking Control for Independent Four- Wheel Driving/Steering Vehicles with Coaxial Steering Mechanism To cite this

More information

Alternative non-linear predictive control under constraints applied to a two-wheeled nonholonomic mobile robot

Alternative non-linear predictive control under constraints applied to a two-wheeled nonholonomic mobile robot Alternatie non-linear predictie control under constraints applied to a to-heeled nonholonomic mobile robot Gaspar Fontineli Dantas Júnior *, João Ricardo Taares Gadelha *, Carlor Eduardo Trabuco Dórea

More information

Design, realization and modeling of a two-wheeled mobile pendulum system

Design, realization and modeling of a two-wheeled mobile pendulum system Design, realization and modeling of a two-wheeled mobile pendulum system ÁKOS ODRY 1, ISTVÁN HARMATI, ZOLTÁN KIRÁLY 1, PÉTER ODRY 1 1 Department of Control Engineering and Information Technology, College

More information

Robust Controller Design for Speed Control of an Indirect Field Oriented Induction Machine Drive

Robust Controller Design for Speed Control of an Indirect Field Oriented Induction Machine Drive Leonardo Electronic Journal of Practices and Technologies ISSN 1583-1078 Issue 6, January-June 2005 p. 1-16 Robust Controller Design for Speed Control of an Indirect Field Oriented Induction Machine Drive

More information

Lab 5a: Pole Placement for the Inverted Pendulum

Lab 5a: Pole Placement for the Inverted Pendulum Lab 5a: Pole Placement for the Inverted Pendulum November 1, 2011 1 Purpose The objective of this lab is to achieve simultaneous control of both the angular position of the pendulum and horizontal position

More information

Noise - irrelevant data; variability in a quantity that has no meaning or significance. In most cases this is modeled as a random variable.

Noise - irrelevant data; variability in a quantity that has no meaning or significance. In most cases this is modeled as a random variable. 1.1 Signals and Systems Signals convey information. Systems respond to (or process) information. Engineers desire mathematical models for signals and systems in order to solve design problems efficiently

More information

Tracking control strategy for the standard N-trailer mobile robot geometrically motivated approach

Tracking control strategy for the standard N-trailer mobile robot geometrically motivated approach Tracking control strategy for the standard N-trailer mobile robot geometrically motivated approach The paper presented during 8 th International Workshop RoMoCo, Bukowy Dworek, Poland, June 5-7, Maciej

More information

Motion Control. Laboratory assignment. Case study. Lectures. compliance, backlash and nonlinear friction. control strategies to improve performance

Motion Control. Laboratory assignment. Case study. Lectures. compliance, backlash and nonlinear friction. control strategies to improve performance 436-459 Advanced Control and Automation Motion Control Lectures traditional CNC control architecture modelling of components dynamic response of axes effects on contouring performance control strategies

More information

Translational vs Rotational. m x. Connection Δ = = = = = = Δ = = = = = = Δ =Δ = = = = = 2 / 1/2. Work

Translational vs Rotational. m x. Connection Δ = = = = = = Δ = = = = = = Δ =Δ = = = = = 2 / 1/2. Work Translational vs Rotational / / 1/ Δ m x v dx dt a dv dt F ma p mv KE mv Work Fd / / 1/ θ ω θ α ω τ α ω ω τθ Δ I d dt d dt I L I KE I Work / θ ω α τ Δ Δ c t s r v r a v r a r Fr L pr Connection Translational

More information

Enhancing Generalization Capability of SVM Classifiers with Feature Weight Adjustment

Enhancing Generalization Capability of SVM Classifiers with Feature Weight Adjustment Enhancing Generalization Capability of SVM Classifiers ith Feature Weight Adjustment Xizhao Wang and Qiang He College of Mathematics and Computer Science, Hebei University, Baoding 07002, Hebei, China

More information

Appendix W. Dynamic Models. W.2 4 Complex Mechanical Systems. Translational and Rotational Systems W.2.1

Appendix W. Dynamic Models. W.2 4 Complex Mechanical Systems. Translational and Rotational Systems W.2.1 Appendix W Dynamic Models W.2 4 Complex Mechanical Systems W.2.1 Translational and Rotational Systems In some cases, mechanical systems contain both translational and rotational portions. The procedure

More information

Chapter three. Mathematical Modeling of mechanical end electrical systems. Laith Batarseh

Chapter three. Mathematical Modeling of mechanical end electrical systems. Laith Batarseh Chapter three Mathematical Modeling of mechanical end electrical systems Laith Batarseh 1 Next Previous Mathematical Modeling of mechanical end electrical systems Dynamic system modeling Definition of

More information

Rotational Kinematics

Rotational Kinematics Rotational Kinematics Rotational Coordinates Ridged objects require six numbers to describe their position and orientation: 3 coordinates 3 axes of rotation Rotational Coordinates Use an angle θ to describe

More information