A MATHEMATICAL MODEL OF A LEGO DIFFERENTIAL DRIVE ROBOT. University of Glasgow o Department of Aerospace Engineering, University of Glasgow

Size: px
Start display at page:

Download "A MATHEMATICAL MODEL OF A LEGO DIFFERENTIAL DRIVE ROBOT. University of Glasgow o Department of Aerospace Engineering, University of Glasgow"

Transcription

1 A MATHEMATICAL MODEL OF A LEGO DIFFERENTIAL DRIVE ROBOT Kevin J Worrall + and Euan W McGookin o + Department of Electronic and Electrical Engineering, University of Glasgow o Department of Aerospace Engineering, University of Glasgow {K.Worrall; E.McGookin}@elec.gla.ac.uk Abstract: This paper details the development of a model for a mobile robot constructed from Lego Mindstorms. Equations representing the dynamics and kinematics of the robot are derived. In addition, the motors and wheels are represented in the model. The development of a multi rate simulation is described. Data from an IMU attached to the robot enables validation of the model using analogue matching and integral least squares. The result of the validation is that the model is a suitable representation of the robot. A method of controlling the robot is developed, using PID controllers and a Line Of Sight Autopilot. Copyright 2002 USTRATH Keywords: Mobile robots, Nonlinear model, Simulation, Validation, PID 1. INTRODUCTION Within the field of control engineering mathematical models of systems are commonplace, (Frankin et al, 1991). Mathematical models allow testing of controllers and algorithms in controlled circumstances, (Murray-Smith, 1995). Many different systems are chosen to be modelled for reasons of expense or safety, (Murray-Smith, 1995). Mobile robots are complex electromechanical devices that can be very difficult to construct and control efficiently. The associated complexities of altering code or testing ancillary systems in situ can be time consuming and potentially dangerous. It is widely recognised that simulations of robots can be used to develop designs (e.g. controllers), (Nehmzow, 2003; Lune, et al., 2005; Michel, 2004), quickly and test prototypes repeatedly without the difficulty of practical installation. For a mathematical model to be used there has to be trust in it and knowledge that it has been validated. Many companies that produce robots provide simulation packages (MobileRobots, 2006; Michel, 2004), though well documented and extremely versatile packages, no validation evidence is present. There is also literature concerned with the development of mobile robots; Liu et al, (2003), and Williams et al, (2002), develop models for omnidirectional robots; Albagul and Wahyudi, (2004), Bisgaard et al, (2005), and Campion et al (1996) develop models for standard wheeled robots. However none of these papers present validation data with the exception of Williams et al (2002) which shows experimental evidence of the friction term they have derived. This paper presents the development of a model and of a multi rate simulator for a wheeled mobile robot. Validation of the model using experimental data is described with results. The mobile robot is

2 constructed using Lego Mindstorms (Lego, 2006). Lego Mindstorms is designed to allow children develop and program their own creations made from Lego by using the supplied sensors, motors and programmable brick, the RCX. Though initially developed for use in the home it has found its way into schools and universities, as a valuable teaching and research aid, within the fields of robotics, control and mechatronics, as it enables fast prototyping. The outline of the paper is as follows; Section 2 provides a description of the robot that this paper is based on. The model of the robot and the model of the wheels are also defined. This section concludes by providing a complete state space model. The need for a multi rate simulation is explained in Section 3. Section 4 explains and shows a subset of the results from the validation procedure and Section 5 describes the control of the robot. Section 6 concludes the paper. 2. MOBILE ROBOT The robot used is constructed from Lego and can be seen in Figure 1. Lego has been chosen as it enables quick construction of the mobile robot. The robot is a two wheeled differential drive robot, where each wheel is driven independently. Forward motion is produced by both wheels been driven at the same rate, turning right is achieved by driving the left wheel at a higher rate than the right wheel and vice versa for turning left. This type of robot can spin on the spot by driving one wheel forward and the second wheel in the opposite direction at the same rate. It should be noted that a ball wheel is attached at the front of the robot to supply balance. An Inertia Measurement Unit, IMU, is used to sense the surge and sway accelerations and the yaw rate. This data is read from the sensors by the RCX which logs the data. The data is then transferred via the Lego Mindstorms Infra red tower to a PC. Fig. 2. References frames associated with the mobile robot. This rest of this section defines the mathematical model of the mobile robot. The development is split into three distinct steps; Dynamics, Kinematics and the Wheel model. 2.1 Dynamics The full body fixed dynamics equation of any 3 degree of freedom system can be stated as Equation (1), (Fossen 1994), with the origin of the body fixed frame coinciding with the centre of gravity of the robot, Figure 2. M. ν& + C(ν).ν + D(ν). ν = τ (1) Where M is the mass and inertia matrix, C(ν) is the coriolis terms, D(ν) is the Damping Matrix, ν is the velocities vector and τ is the force and moment vector. Since this model only considers surge, sway and yaw motion, τ represents forces X and Y and torque N. Rigid Body Dynamics ( M. ν& + C(ν). ν ); These two terms combined provide the rigid body equations of motion (Fossen, 1994). The equations are shown in Equations (2)-(4) and the derivations can be found in (Fossen, 1994). m (u& vr ) = X (2) m (v& + ur) = Y (3) J r& = N (4) Where m is the mass of the robot (kg), u and v are velocities (ms -1 ) in the x and y directions, r is the rotational velocity (rad -1 ) about the z axis and J is the moment of inertia (kg m -2 ) of the robot. Damping (D); This term describes the forces and moments that are acting in the opposite direction from the direction of motion. The robot is a ground vehicle with damping forces caused by air drag and friction. Fig. 1. Lego differential drive robot. The IMU can be seen on the top of the robot. The batteries seen on the top are used to power the IMU. Air resistance acting upon the robot causes air drag. The equation for this is shown in Equation (5), (Hoerner, 1965). F = 0.5 C A ρ V (5) ar d 2

3 Where F ar is the Force generated by air drag, C d represents the Drag Coefficient, A is the surface area presented to current direction of travel, ρ is the density of the material the robot is travelling through, in this case air, and V is the velocity which must be the velocity acting in the opposite direction from F ar. The drag coefficient is a number based on the shape of the robot. Assuming the robot to be a box shape the drag coefficient is determined to be 0.89, (Hoerner, 1965). Friction; is not included in the dynamic section of the robot. Instead friction is included as part of the wheel equations, Section 2.3. Force and Moment Matrix; This term is made up of the following [X, Y, N] T. These terms are the input forces and moments to the model and are given by the following Equations (6)-(8). X = (F + F ) cos ( β) (6) left right Y = (F + F ) sin ( β) (7) left right N = (F left F right ) moment_arm (8) Where β is the slip angle, explained below, F left and F right are the forces generated by the left and right wheels and the moment_arm (0.007m) is the distance between the centre of the wheel and the line of action that the centre of gravity lies on. Slip angle; The slip angle in the model of mobile robots has been the topic of many publications with Shekhar (1997), Balakrishna and Ghosal (1995), Williams et al (2002) and Bisgaard et al (2005), some of the more major papers. This paper takes a more simplicity look at the problem of slip. Slip is calculated using Equation (9) and is the relationship between the forward velocity and the sway velocity. This has been found, though experimental evidence, to be an acceptable method of calculating slip. -1 v β = sin (9) 2 2 ( (u v ) Where v is the sway velocity and u is the surge velocity. When the denominator is zero, β is assumed to be zero. 2.2 Kinematics The kinematics are concerned with the geometric aspects of motion, with regards to linear and angular velocities of the robot relative to the earth fixed frame, (Fossen, 1994). In order to map the bodyfixed velocities to the inertially fixed earth frame, a transformation matrix is required. This is represented in Equation (10). x& p cosψ = y& p sinψ ψ& 0 sinψ cosψ 0 0 u 0 v 1 r (10) This can also be represented by Equation (11). 2.3 Motor and Wheel Model & η = R( η). ν (11) The robot model has two inputs: the force generated by each wheel. To calculate these forces the actuators, in this case two Lego DC motors, need to be modelled along with the tires that are being used. The motors are standard DC motors and as such the standard equations of DC motors can be used to represent them. Equation (12) represents the electromechanics of the motor, (Frankin et al, 1991). di ( R I) (Ke ω) + Va = dt L (12) Where R = 22Ω, L = 0.01H, K e = , I is the current (A), ω is the wheel angular velocity (rad s -1 ) and V a = input voltage (V). The mechanical equation for the motor contains the friction term for the robot. The robot runs on wheels and as a result the friction is classed as rolling friction, (Jellet, 1872). The coefficient for rolling friction is obtained from tables in various books Jellet (1872), and Young & Freedman (2000), are two examples. For the simulation the value chosen is that of rubber tires on a concrete surface, a value in the range of , (Young & Freedman, 2000). The friction equation is Equation (13). F f = m g σ (wheel _ r ω) (13) Where F f is the frictional force generated, m is the mass of robot, σ, represents the Friction Coefficient, g is gravity, wheel_r is the radius of the wheel (m) and ω is the wheel angular velocity (rad s -1 ). The final term, ( wheel_ r ω), has the effect of scaling the frictional term to suit the current wheel velocity. This term was included in the equation after experimental evidence indicated that a scaling factor was necessary. Jellet (1872) suggests that the friction coefficient is related to the current velocity. The mechanical equation for the motors is given in Equation (14). dω (Kt I) (bs ω) (sign( ω) Ff wheel _r) = (14) dt J Where dω/dt is the angular acceleration (rad s -2 ), K t = , b s = e -5, I is the current (A), ω is the wheel angular velocity (rad s -1 ), F f is the frictional force, wheel_r is the radius of the wheel (m) and J = e -4 kg m Forces Generated The equation used to calculate the driving force from a rotating wheel is Equation (15).

4 F = T / wheel _ r (15) Where F is the force generated (N), T is the torque of the wheel (Nm) and wheel_r the radius of the wheel (m). Since the wheel radius is known the torque needs to be calculated. Equation (16) is used to calculate the torque. T T = T (( stall max ) ω) (16) ω abs max Where T is the torque of the wheel (Nm), T max is the current maximum torque that can be generated, Equation (17), T stall is the stall torque of the motor, ω absmax is the absolute maximum angular velocity the motor can run at and ω is the current angular velocity. V T in max = ( ) T V stall (17) max Where V in = input voltage (V), V max is the maximum voltage that can be applied to the motor and T stall is the stall torque of the motor. 2.4 Full State Space Model The full state space model can be seen in Equation (18). ν& M(D + C) 0 τ( ξ) ν 0 x& = R( ) 0 0. η & = η η + 0.Va 0 0 F( ) B ' (18) ξ ξ ξ & Where M(D+C) represents the rigid body dynamics and the damping, F(ξ) represents the equations of the motors and wheels, B is the input distribution matrix for the motors, Equation (19), and Va is the input to the model, i.e. the voltages to the motors. 1 0 B ' = L (19) 0 1 L 3. MULTI-RATE SIMULATION Two mathematical models have been derived; the robot and the motors. The robot model inputs are generated by the motor model. The need for two models became apparent during initial testing of a model that contained both the motors and the robot, as the dynamics of the motors respond extremely quickly to an input as compared to that of the robot. If the motors and the robot were modelled separately they could have different time periods, hence the development of multi-rate simulation. The motor step size was chosen to be s. The robot step size is 0.003s as this is the smallest time period that the RCX can log the sensor data at. This allows a direct comparison of the data between the simulation results and the physical robot. Since the two models are running at different rates the efficiency of the simulation is increased as only a small part of the Fig. 3. Structure of multi rate simulator code is run per iteration of the simulation. The structure of the multi rate simulator can be seen in Figure (3). 4. VALIDATION Validation is required to prove that the model is a good representation of the physical robot, without accurate validation the model is of little use (Murray- Smith, 1995) and the results produced will have no value. Two validation methods are introduced. 4.1 Analogue Matching Analogue matching, also termed visual inspection, is an established method of model validation (Gray, 1992), where the output from the model is compared to experimental data graphically by superimposing the plots (Gray, 1992). As the model is altered the output is compared to that of the results from the physical robot and the data that best fits the experimental data indicates the model and parameters that represent the physical robot best. 4.2 Integral Least Squares A quantitative measure of the models accuracy is required. This will provide further evidence that the model is a suitable representation of the physical robot. The measure is achieved by using Equation (20). This method is based on a suggestion in Murray-Smith (1995). = 2 Qm ( error ) (20) Where error is the difference between the data from the robot and the data from the simulator. Each output can be quantitative measured in this way. 4.3 Manoeuvres A set of simple manoeuvres were carried out on the robot. The manoeuvres chosen are: Straight line for a set length of time with motors at half power (7s)

5 1m forward Spin on spot both motors half power (The rotational velocity at full power is out with the range of the sensor) Spin on spot one motor on, second motor off These manoeuvres provide the experimental data, through the IMU, required to validate the model. 4.4 Results A subset of the validation results from the analogue matching can be seen in Figures (4) and (5). The figures show the experimental data, the simulation data and the error between them. The value from the integral least square is also shown on the Figures. It can be seen from the results that the model is a good representation of the physical robot. However some discrepancies exist, this is because all the parameters require low values of ILS and the ILS values shown are the best case for these parameters taking into consideration all the other parameters. Fig. 5. r over 7 seconds with motors running on half power and in opposite directions. 5. CONTROL OF SIMULATED ROBOT To show that the model can be used as a base for the development of controllers a controller is developed. With the forward velocity and the heading controlled, the robot can head in any direction and at any velocity up to the maximum velocity of the robot. 5.1 Controller development PID; Two PID controllers have been developed, one to control the forward velocity of the robot and a second to control the heading of the robot. The combined output from the PID s is used to control the voltages to the motors. The general continuous equation for the PID controller is shown in Equation (21). t de(t) Y (t) = Kp.e(t) + Ki. e(t)dt + Kd. (21) dt Where e(t) is the current error (difference between desired output and actual output), Kp, Ki, Kd are constants and Y(t) is the output. o Line Of Sight Autopilot; A method of directing the robot is required and the Line of Sight, LOS, Autopilot was chosen, (M c Gookin et al, 2000). This method uses waypoints to direct the robot and when the robot reaches one waypoint the next waypoint is selected. To detect if the robot has reached a waypoint each waypoint has an acceptance radius, which has a value equal to half the length of the robot. When the robot is within the acceptance radius of a waypoint the next waypoint is selected and the new heading calculated. To calculate the heading for the next waypoint Equation (22), (M c Gookin et al, 2000), is used. Figure (6) shows the waypoint concept and Figure (7) shows the final controller structure. Fig. 4. u over 7 seconds with motors set at half power. y wp y 1 pos ψ = tan (22) x wp x pos Fig. 6. Waypoint Concept

6 Fig. 7. Controller structure Fig. 8. Simulation run of the robot. It can be seen that the simulated robot navigates the waypoints. 5.2 Simulation Results A simulation was run with the following parameters, u = 1ms -1, t=60s, starting point (0, 0) and waypoints at [(1, 1) (1,-1) (0,-0.5) (-1.3,-0.7) (0, 0.2) (-0.1, 1.1) (-0.3, 1.5) (1.5, -1)]. The results of the run can be seen in Figures (8). It can be seen in that the robot navigates the waypoints in the correct order. 6. CONCLUSION This paper has presented a mathematical model of a differential drive robot built from Lego Mindstorms. The dynamics and kinematics of the mathematical model are described. With a complete mathematical model and a multi-rate simulation validation has been carried out using analogue matching and integral least square. The results from the validation show the model is a suitable representation of the physical robot. Using two PID controllers and a LOS Autopilot the simulation shows that the robot can be controlled easily. The model provides a basis for the development of control methodologies and navigation heuristics that can be applied to a mobile robot of this type. REFERENCES Albagul, A. and Wahyudi, (2004), Dynamic Modelling and Adpative Traction Control for Mobile Robots, International Journal of Advanced Robotic Systems, 1-3, pp Balakrishna, R., and Ghosal, A., (1995), Modeling of Slip for Wheeled Mobile Robots, IEEE Trans Robotics and Automation, 11-1, pp Bisgaard, M., Vinther, D., Ostergaard, K., Bendtsen, Jan. and Izadi-Zamanabadi, R., (2005), Sensor Fusion and Model Verification for a Mobile Robot, Proc 16 th IASTED Intl Conf Modelling and Simulation, 1, pp Campion, G., Bastin, G., and D Andrea-Novel, B., (1996), Structural Properties and Classification of Kinematic and Dynamic Models of Wheeled Mobile Robots, In IEEE Trans Robotics and Automation, 12-1, pp47-62 Frankin, G.F., Powell, J.D. and Emami-Naeini, A., (1991). Feedback Control of Dynamic Systems, 2 nd Edition, Addison Wesley Fossen, T.I., (1994). Guidance and Control of Ocean Vehicles, Wiley & Sons Ltd Gray, G., (1992) Development and Validation of Nonlinear Models for Helicoptor Dynamics, PhD Thesis, Department of Electronic and Electrical Engineering, University of Glasgow Hoerner, S.F., (1965), Fluid-dynamic drag: practical information on aerodynamic drag and hydrodynamic resistance, Brick Town, New Jersey Jellet, J., (1872). Theory of Friction, M c Millian & Co M c Gookin, E., Murray-Smith, D.J., Li, Y. and Fossen, T.I., (2000). The Optimization of a Tanker Autopilot Control System Using Genetic Algorithms, Trans Institute of Measurement and Control, 22-2, pp MobileRobots, (2006), Website: mobilerobots.com/, 15/2/2006 Lego, (2006). Official Lego Mindstorms Web Page: 9/2/2006 Liu Y., Wu X., Zhu J.J. and Lew J., (2003). Omni-Directional Mobile Robot Controller Design by Trajectory Linearization, In Proceedings 2003 American Control Conference, 4, pp Lune, T., Spiess, K., and Röfer, T., (2005). SimRobot A General Physical Robot Simulator and its Application in RoboCup, In Robocup 2005: Robot Soccer World Cup IX, Lectures in Artificial Intelligence, Springer Michel, O., (2004), WebotsTM: Professional Mobile Robot Simulation, International Journal of Advanced Robotic Systems, 1-1, pp Murray-Smith, DJ., (1995). Continuous System Simulation, Chapman & Hall, Cambridge Shekhar, S., (1997), Wheel Rolling Constrints and Slip in Mobile Robots, In Proceddings IEEE Int Conf Robotics and Automation, 3, pp Nehmzow, U., (2003). Mobile Robotics: A Practical Introduction, 2nd Edition, Springer, London Williams, R.L., Carter, B., Gallina, P. and Rosati, G., (2002). Dynamic Model with Slip for Wheeled Omnidirectional Robots, IEEE Transactions on Robotics and Automation, 18-3, pp Young, H.D. and Freedman, R.A., (2000). University Physics, 10 th Edition, Addison Wesley

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION

AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION AUTONOMOUS PLANETARY ROVER CONTROL USING INVERSE SIMULATION Kevin Worrall (1), Douglas Thomson (1), Euan McGookin (1), Thaleia Flessa (1) (1)University of Glasgow, Glasgow, G12 8QQ, UK, Email: kevin.worrall@glasgow.ac.uk

More information

A Simplified Vehicle and Driver Model for Vehicle Systems Development

A Simplified Vehicle and Driver Model for Vehicle Systems Development A Simplified Vehicle and Driver Model for Vehicle Systems Development Martin Bayliss Cranfield University School of Engineering Bedfordshire MK43 0AL UK Abstract For the purposes of vehicle systems controller

More information

Design of a Three-Axis Rotary Platform

Design of a Three-Axis Rotary Platform Design of a Three-Axis Rotary Platform William Mendez, Yuniesky Rodriguez, Lee Brady, Sabri Tosunoglu Mechanics and Materials Engineering, Florida International University 10555 W Flagler Street, Miami,

More information

Robust Controller Design for an Autonomous Underwater Vehicle

Robust Controller Design for an Autonomous Underwater Vehicle DRC04 Robust Controller Design for an Autonomous Underwater Vehicle Pakpong Jantapremjit 1, * 1 Department of Mechanical Engineering, Faculty of Engineering, Burapha University, Chonburi, 20131 * E-mail:

More information

This was written by a designer of inertial guidance machines, & is correct. **********************************************************************

This was written by a designer of inertial guidance machines, & is correct. ********************************************************************** EXPLANATORY NOTES ON THE SIMPLE INERTIAL NAVIGATION MACHINE How does the missile know where it is at all times? It knows this because it knows where it isn't. By subtracting where it is from where it isn't

More information

SIMULATION ENVIRONMENT PROPOSAL, ANALYSIS AND CONTROL OF A STEWART PLATFORM MANIPULATOR

SIMULATION ENVIRONMENT PROPOSAL, ANALYSIS AND CONTROL OF A STEWART PLATFORM MANIPULATOR SIMULATION ENVIRONMENT PROPOSAL, ANALYSIS AND CONTROL OF A STEWART PLATFORM MANIPULATOR Fabian Andres Lara Molina, Joao Mauricio Rosario, Oscar Fernando Aviles Sanchez UNICAMP (DPM-FEM), Campinas-SP, Brazil,

More information

CHAPTER 3 MATHEMATICAL MODEL

CHAPTER 3 MATHEMATICAL MODEL 38 CHAPTER 3 MATHEMATICAL MODEL 3.1 KINEMATIC MODEL 3.1.1 Introduction The kinematic model of a mobile robot, represented by a set of equations, allows estimation of the robot s evolution on its trajectory,

More information

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI

Chapter 4 Dynamics. Part Constrained Kinematics and Dynamics. Mobile Robotics - Prof Alonzo Kelly, CMU RI Chapter 4 Dynamics Part 2 4.3 Constrained Kinematics and Dynamics 1 Outline 4.3 Constrained Kinematics and Dynamics 4.3.1 Constraints of Disallowed Direction 4.3.2 Constraints of Rolling without Slipping

More information

COMPARISON OF TWO FINITE ELEMENT MODELS OF BRISTLES OF GUTTER BRUSHES FOR STREET SWEEPING

COMPARISON OF TWO FINITE ELEMENT MODELS OF BRISTLES OF GUTTER BRUSHES FOR STREET SWEEPING Proceedings of the 4 th International Conference on Fracture Fatigue and Wear, pp. 22-226, 25 COMPARISON OF TWO FINITE ELEMENT MODELS OF BRISTLES OF GUTTER BRUSHES FOR STREET SWEEPING M.M. Abdel-Wahab,

More information

A Hardware-In-the-Loop Simulation and Test for Unmanned Ground Vehicle on Indoor Environment

A Hardware-In-the-Loop Simulation and Test for Unmanned Ground Vehicle on Indoor Environment Available online at www.sciencedirect.com Procedia Engineering 29 (2012) 3904 3908 2012 International Workshop on Information and Electronics Engineering (IWIEE) A Hardware-In-the-Loop Simulation and Test

More information

Torque Distribution and Slip Minimization in an Omnidirectional Mobile Base

Torque Distribution and Slip Minimization in an Omnidirectional Mobile Base Torque Distribution and Slip Minimization in an Omnidirectional Mobile Base Yuan Ping Li, Denny Oetomo, Marcelo H. Ang Jr.* National University of Singapore 1 ent Ridge Crescent, Singapore 1196 *mpeangh@nus.edu.sg

More information

CMPUT 412 Motion Control Wheeled robots. Csaba Szepesvári University of Alberta

CMPUT 412 Motion Control Wheeled robots. Csaba Szepesvári University of Alberta CMPUT 412 Motion Control Wheeled robots Csaba Szepesvári University of Alberta 1 Motion Control (wheeled robots) Requirements Kinematic/dynamic model of the robot Model of the interaction between the wheel

More information

Gesture Recognition Aplication based on Dynamic Time Warping (DTW) FOR Omni-Wheel Mobile Robot

Gesture Recognition Aplication based on Dynamic Time Warping (DTW) FOR Omni-Wheel Mobile Robot Gesture Recognition Aplication based on Dynamic Time Warping (DTW) FOR Omni-Wheel Mobile Robot Indra Adji Sulistijono, Gama Indra Kristianto Indra Adji Sulistijono is with the Department of Mechatronics

More information

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa

Cecilia Laschi The BioRobotics Institute Scuola Superiore Sant Anna, Pisa University of Pisa Master of Science in Computer Science Course of Robotics (ROB) A.Y. 2016/17 cecilia.laschi@santannapisa.it http://didawiki.cli.di.unipi.it/doku.php/magistraleinformatica/rob/start Robot

More information

MECHATRONICS SYSTEM ENGINEERING FOR CAE/CAD, MOTION CONTROL AND DESIGN OF VANE ACTUATORS FOR WATER ROBOT APPLICATIONS

MECHATRONICS SYSTEM ENGINEERING FOR CAE/CAD, MOTION CONTROL AND DESIGN OF VANE ACTUATORS FOR WATER ROBOT APPLICATIONS MECHATRONICS SYSTEM ENGINEERING FOR CAE/CAD, MOTION CONTROL AND DESIGN OF VANE ACTUATORS FOR WATER ROBOT APPLICATIONS Finn CONRAD and Francesco ROLI Department of Mechanical Engineering, Technical University

More information

Robotics (Kinematics) Winter 1393 Bonab University

Robotics (Kinematics) Winter 1393 Bonab University Robotics () Winter 1393 Bonab University : most basic study of how mechanical systems behave Introduction Need to understand the mechanical behavior for: Design Control Both: Manipulators, Mobile Robots

More information

Learning Inverse Dynamics: a Comparison

Learning Inverse Dynamics: a Comparison Learning Inverse Dynamics: a Comparison Duy Nguyen-Tuong, Jan Peters, Matthias Seeger, Bernhard Schölkopf Max Planck Institute for Biological Cybernetics Spemannstraße 38, 72076 Tübingen - Germany Abstract.

More information

Attitude Control for Small Satellites using Control Moment Gyros

Attitude Control for Small Satellites using Control Moment Gyros Attitude Control for Small Satellites using Control Moment Gyros V Lappas a, Dr WH Steyn b, Dr CI Underwood c a Graduate Student, University of Surrey, Guildford, Surrey GU 5XH, UK b Professor, University

More information

FORCE CONTROL OF LINK SYSTEMS USING THE PARALLEL SOLUTION SCHEME

FORCE CONTROL OF LINK SYSTEMS USING THE PARALLEL SOLUTION SCHEME FORCE CONTROL OF LIN SYSTEMS USING THE PARALLEL SOLUTION SCHEME Daigoro Isobe Graduate School of Systems and Information Engineering, University of Tsukuba 1-1-1 Tennodai Tsukuba-shi, Ibaraki 35-8573,

More information

DETERMINING suitable types, number and locations of

DETERMINING suitable types, number and locations of 108 IEEE TRANSACTIONS ON INSTRUMENTATION AND MEASUREMENT, VOL. 47, NO. 1, FEBRUARY 1998 Instrumentation Architecture and Sensor Fusion for Systems Control Michael E. Stieber, Member IEEE, Emil Petriu,

More information

Introduction to Robotics

Introduction to Robotics Introduction to Robotics Ph.D. Antonio Marin-Hernandez Artificial Intelligence Department Universidad Veracruzana Sebastian Camacho # 5 Xalapa, Veracruz Robotics Action and Perception LAAS-CNRS 7, av du

More information

EE565:Mobile Robotics Lecture 2

EE565:Mobile Robotics Lecture 2 EE565:Mobile Robotics Lecture 2 Welcome Dr. Ing. Ahmad Kamal Nasir Organization Lab Course Lab grading policy (40%) Attendance = 10 % In-Lab tasks = 30 % Lab assignment + viva = 60 % Make a group Either

More information

MTRX4700 Experimental Robotics

MTRX4700 Experimental Robotics MTRX 4700 : Experimental Robotics Lecture 2 Stefan B. Williams Slide 1 Course Outline Week Date Content Labs Due Dates 1 5 Mar Introduction, history & philosophy of robotics 2 12 Mar Robot kinematics &

More information

Redundancy Resolution by Minimization of Joint Disturbance Torque for Independent Joint Controlled Kinematically Redundant Manipulators

Redundancy Resolution by Minimization of Joint Disturbance Torque for Independent Joint Controlled Kinematically Redundant Manipulators 56 ICASE :The Institute ofcontrol,automation and Systems Engineering,KOREA Vol.,No.1,March,000 Redundancy Resolution by Minimization of Joint Disturbance Torque for Independent Joint Controlled Kinematically

More information

Dynamic Analysis of Manipulator Arm for 6-legged Robot

Dynamic Analysis of Manipulator Arm for 6-legged Robot American Journal of Mechanical Engineering, 2013, Vol. 1, No. 7, 365-369 Available online at http://pubs.sciepub.com/ajme/1/7/42 Science and Education Publishing DOI:10.12691/ajme-1-7-42 Dynamic Analysis

More information

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

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

More information

Centre for Autonomous Systems

Centre for Autonomous Systems Robot Henrik I Centre for Autonomous Systems Kungl Tekniska Högskolan hic@kth.se 27th April 2005 Outline 1 duction 2 Kinematic and Constraints 3 Mobile Robot 4 Mobile Robot 5 Beyond Basic 6 Kinematic 7

More information

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm

Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Acta Technica 61, No. 4A/2016, 189 200 c 2017 Institute of Thermomechanics CAS, v.v.i. Research on time optimal trajectory planning of 7-DOF manipulator based on genetic algorithm Jianrong Bu 1, Junyan

More information

Simulation-Based Design of Robotic Systems

Simulation-Based Design of Robotic Systems Simulation-Based Design of Robotic Systems Shadi Mohammad Munshi* & Erik Van Voorthuysen School of Mechanical and Manufacturing Engineering, The University of New South Wales, Sydney, NSW 2052 shadimunshi@hotmail.com,

More information

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education

Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education DIPARTIMENTO DI INGEGNERIA INDUSTRIALE Development of a Ground Based Cooperating Spacecraft Testbed for Research and Education Mattia Mazzucato, Sergio Tronco, Andrea Valmorbida, Fabio Scibona and Enrico

More information

Motion Control (wheeled robots)

Motion Control (wheeled robots) Motion Control (wheeled robots) Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground Definition of required motion -> speed control,

More information

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle K. Senthil Kumar, Mohammad Rasheed, and T.Anand Abstract Helicopter offers the capability of hover, slow forward movement, vertical take-off

More information

Interactive Educational Software for Dynamic Systems Control

Interactive Educational Software for Dynamic Systems Control Interactive Educational Software for Dynamic Systems Control José L. Lima 1, José C. Gonçalves, Paulo G. Costa 3, António P. Moreira 4 Abstract - This paper describes a tool for interactive learning that

More information

E80. Experimental Engineering. Lecture 9 Inertial Measurement

E80. Experimental Engineering. Lecture 9 Inertial Measurement Lecture 9 Inertial Measurement http://www.volker-doormann.org/physics.htm Feb. 19, 2013 Christopher M. Clark Where is the rocket? Outline Sensors People Accelerometers Gyroscopes Representations State

More information

General model and control of an n rotor helicopter

General model and control of an n rotor helicopter Downloaded from orbit.dtu.dk on: Jun 29, 218 General model and control of an n rotor helicopter Zsurzsan, Adriana Gabriela; Brogaard, Rune Yding; Andersen, Nils Axel; Ravn, Ole Published in: Journal of

More information

State Estimation and Parameter Identification of Flexible Manipulators Based on Visual Sensor and Virtual Joint Model

State Estimation and Parameter Identification of Flexible Manipulators Based on Visual Sensor and Virtual Joint Model Proceedings of the 2001 IEEE International Conference on Robotics & Automation Seoul, Korea May 21-26, 2001 State Estimation and Parameter Identification of Flexible Manipulators Based on Visual Sensor

More information

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T

10/11/07 1. Motion Control (wheeled robots) Representing Robot Position ( ) ( ) [ ] T 3 3 Motion Control (wheeled robots) Introduction: Mobile Robot Kinematics Requirements for Motion Control Kinematic / dynamic model of the robot Model of the interaction between the wheel and the ground

More information

Parallel Robots. Mechanics and Control H AMID D. TAG HI RAD. CRC Press. Taylor & Francis Group. Taylor & Francis Croup, Boca Raton London NewYoric

Parallel Robots. Mechanics and Control H AMID D. TAG HI RAD. CRC Press. Taylor & Francis Group. Taylor & Francis Croup, Boca Raton London NewYoric Parallel Robots Mechanics and Control H AMID D TAG HI RAD CRC Press Taylor & Francis Group Boca Raton London NewYoric CRC Press Is an Imprint of the Taylor & Francis Croup, an informs business Contents

More information

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3

Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Unit 2: Locomotion Kinematics of Wheeled Robots: Part 3 Computer Science 4766/6778 Department of Computer Science Memorial University of Newfoundland January 28, 2014 COMP 4766/6778 (MUN) Kinematics of

More information

DETERMINING PARETO OPTIMAL CONTROLLER PARAMETER SETS OF AIRCRAFT CONTROL SYSTEMS USING GENETIC ALGORITHM

DETERMINING PARETO OPTIMAL CONTROLLER PARAMETER SETS OF AIRCRAFT CONTROL SYSTEMS USING GENETIC ALGORITHM DETERMINING PARETO OPTIMAL CONTROLLER PARAMETER SETS OF AIRCRAFT CONTROL SYSTEMS USING GENETIC ALGORITHM Can ÖZDEMİR and Ayşe KAHVECİOĞLU School of Civil Aviation Anadolu University 2647 Eskişehir TURKEY

More information

Line of Sight Stabilization Primer Table of Contents

Line of Sight Stabilization Primer Table of Contents Line of Sight Stabilization Primer Table of Contents Preface 1 Chapter 1.0 Introduction 3 Chapter 2.0 LOS Control Architecture and Design 11 2.1 Direct LOS Stabilization 15 2.2 Indirect LOS Stabilization

More information

COPYRIGHTED MATERIAL INTRODUCTION CHAPTER 1

COPYRIGHTED MATERIAL INTRODUCTION CHAPTER 1 CHAPTER 1 INTRODUCTION Modern mechanical and aerospace systems are often very complex and consist of many components interconnected by joints and force elements such as springs, dampers, and actuators.

More information

Calibration of Inertial Measurement Units Using Pendulum Motion

Calibration of Inertial Measurement Units Using Pendulum Motion Technical Paper Int l J. of Aeronautical & Space Sci. 11(3), 234 239 (2010) DOI:10.5139/IJASS.2010.11.3.234 Calibration of Inertial Measurement Units Using Pendulum Motion Keeyoung Choi* and Se-ah Jang**

More information

Modelling and Control of an Autonomous Underwater Vehicle for Mobile Manipulation

Modelling and Control of an Autonomous Underwater Vehicle for Mobile Manipulation Modelling and Control of an Autonomous Underwater Vehicle for Mobile Manipulation Benedetto Allotta, Roberto Conti, Riccardo Costanzi, Francesca Giardi, Enrico Meli, Alessandro Ridolfi University of Florence,

More information

Time Optimal Trajectories for Bounded Velocity Differential Drive Robots

Time Optimal Trajectories for Bounded Velocity Differential Drive Robots Time Optimal Trajectories for Bounded Velocity Differential Drive Robots Devin J. Balkcom Matthew T. Mason Robotics Institute and Computer Science Department Carnegie Mellon University Pittsburgh PA 53

More information

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

We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists. International authors and editors We are IntechOpen, the world s leading publisher of Open Access books Built by scientists, for scientists 3,500 108,000 1.7 M Open access books available International authors and editors Downloads Our

More information

MDP646: ROBOTICS ENGINEERING. Mechanical Design & Production Department Faculty of Engineering Cairo University Egypt. Prof. Said M.

MDP646: ROBOTICS ENGINEERING. Mechanical Design & Production Department Faculty of Engineering Cairo University Egypt. Prof. Said M. MDP646: ROBOTICS ENGINEERING Mechanical Design & Production Department Faculty of Engineering Cairo University Egypt Prof. Said M. Megahed APPENDIX A: PROBLEM SETS AND PROJECTS Problem Set # Due 3 rd week

More information

Simulink Based Robot Arm Control Workstation. Figure 1-1 High Level Block Diagram

Simulink Based Robot Arm Control Workstation. Figure 1-1 High Level Block Diagram Introduction: This project consists of designing a software-based control workstation in the Simulink environment using the SimMechanics Toolbox. The Quanser robot arm system will be modeled using this

More information

Simulation of Soft Finger Contact Model with Rolling Effects in Point-Contact Haptic Interfaces

Simulation of Soft Finger Contact Model with Rolling Effects in Point-Contact Haptic Interfaces Simulation of Soft Finger Contact Model with Rolling Effects in Point-Contact Haptic Interfaces Gionata Salvietti 1, Monica Malvezzi 2, and Domenico Prattichizzo 1,2 1 Department of Advanced Robotics,

More information

2. Motion Analysis - Sim-Mechanics

2. Motion Analysis - Sim-Mechanics 2 Motion Analysis - Sim-Mechanics Figure 1 - The RR manipulator frames The following table tabulates the summary of different types of analysis that is performed for the RR manipulator introduced in the

More information

Table of Contents Introduction Historical Review of Robotic Orienting Devices Kinematic Position Analysis Instantaneous Kinematic Analysis

Table of Contents Introduction Historical Review of Robotic Orienting Devices Kinematic Position Analysis Instantaneous Kinematic Analysis Table of Contents 1 Introduction 1 1.1 Background in Robotics 1 1.2 Robot Mechanics 1 1.2.1 Manipulator Kinematics and Dynamics 2 1.3 Robot Architecture 4 1.4 Robotic Wrists 4 1.5 Origins of the Carpal

More information

A MECHATRONIC APPROACH OF THE WINDSHIELD WIPER MECHANISMS

A MECHATRONIC APPROACH OF THE WINDSHIELD WIPER MECHANISMS A MECHATRONIC APPROACH OF THE WINDSHIELD WIPER MECHANISMS Alexandru Cătălin Transilvania University of Braşov calex@unitbv.ro Keywords: windshield wiper mechanism, dynamic simulation, control system, virtual

More information

CONTROLO th Portuguese Conference on Automatic Control

CONTROLO th Portuguese Conference on Automatic Control CONTROLO 2008 8 th Portuguese Conference on Automatic Control University of Trás-os-Montes and Alto Douro, Vila Real, Portugal July 21-23, 2008 414 BALL AND BEAM VIRTUAL LABORATORY: A TEACHING AID IN AUTOMATIC

More information

Fuzzy Logic Approach for Hybrid Position/Force Control on Underwater Manipulator

Fuzzy Logic Approach for Hybrid Position/Force Control on Underwater Manipulator Fuzzy Logic Approach for Hybrid Position/Force Control on Underwater Manipulator Mohd Rizal Arshad, Surina Mat Suboh, Irfan Abd Rahman & Mohd Nasiruddin Mahyuddin USM Robotic Research Group (URRG), School

More information

Using Adams/View to Develop a Real-Time ROV Simulator

Using Adams/View to Develop a Real-Time ROV Simulator Using Adams/View to Develop a Real-Time ROV Simulator Marcelo Prado Gerson Brand Álvaro Costa Neto Multicorpos Engenharia John Hough MSC.Software Brazil Ricardo Capplonch Petrobrás Summary Introduction

More information

Autonomous Mobile Robots Using Real Time Kinematic Signal Correction and Global Positioning System Control

Autonomous Mobile Robots Using Real Time Kinematic Signal Correction and Global Positioning System Control Paper 087, IT 304 Autonomous Mobile Robots Using Real Time Kinematic Signal Correction and Global Positioning System Control Thongchai Phairoh, Keith Williamson Virginia State University tphairoh@vsu.edu

More information

Neuro-adaptive Formation Maintenance and Control of Nonholonomic Mobile Robots

Neuro-adaptive Formation Maintenance and Control of Nonholonomic Mobile Robots Proceedings of the International Conference of Control, Dynamic Systems, and Robotics Ottawa, Ontario, Canada, May 15-16 2014 Paper No. 50 Neuro-adaptive Formation Maintenance and Control of Nonholonomic

More information

Solving Tracking Problem of a Nonholonomic Wheel Mobile Robot Using Backstepping Technique

Solving Tracking Problem of a Nonholonomic Wheel Mobile Robot Using Backstepping Technique Solving Tracking Problem of a Nonholonomic Wheel Mobile Robot Using Backstepping Technique Solving Tracking Problem of a Nonholonomic Wheel Mobile Robot Using Backstepping Technique Noor Asyikin binti

More information

Practical Robotics (PRAC)

Practical Robotics (PRAC) Practical Robotics (PRAC) A Mobile Robot Navigation System (1) - Sensor and Kinematic Modelling Nick Pears University of York, Department of Computer Science December 17, 2014 nep (UoY CS) PRAC Practical

More information

Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots

Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots Brigham Young University BYU ScholarsArchive All Theses and Dissertations 2013-04-29 Modeling, Parameter Estimation, and Navigation of Indoor Quadrotor Robots Stephen C. Quebe Brigham Young University

More information

Flexible Modeling and Simulation Architecture for Haptic Control of Maritime Cranes and Robotic Arms

Flexible Modeling and Simulation Architecture for Haptic Control of Maritime Cranes and Robotic Arms Flexible Modeling and Simulation Architecture for Haptic Control of Maritime Cranes and Robotic Arms F. Sanfilippo, H. P. Hildre, V. Æsøy and H.X. Zhang Department of Maritime Technology and Operation

More information

Research and implementation of a simulation method of electric transmission line inspection using UAV based on virtual reality

Research and implementation of a simulation method of electric transmission line inspection using UAV based on virtual reality Acta Technica 6 (017), No. 6A, 7 36 c 017 Institute of Thermomechanics CAS, v.v.i. Research and implementation of a simulation method of electric transmission line inspection using UAV based on virtual

More information

Rotational3D Efficient modelling of 3D effects in rotational mechanics

Rotational3D Efficient modelling of 3D effects in rotational mechanics Rotational3D - Efficient Modelling of 3D Effects in Rotational Mechanics Rotational3D Efficient modelling of 3D effects in rotational mechanics Johan Andreasson Magnus Gäfvert Modelon AB Ideon Science

More information

Controlling the Motion of a Planar 3-DOF Manipulator Using PID Controllers

Controlling the Motion of a Planar 3-DOF Manipulator Using PID Controllers Controlling the Motion of a Planar -DOF Manipulator Using PID Controllers Thien Van NGUYEN*,1, Dan N. DUMITRIU 1,, Ion STROE 1 *Corresponding author *,1 POLITEHNICA University of Bucharest, Department

More information

Aircraft Stability and Performance 2nd Year, Aerospace Engineering. Dr. M. Turner

Aircraft Stability and Performance 2nd Year, Aerospace Engineering. Dr. M. Turner Aircraft Stability and Performance 2nd Year, Aerospace Engineering Dr. M. Turner Basic Info Timetable 15.00-16.00 Monday ENG LT1 16.00-17.00 Monday ENG LT1 Typical structure of lectures Part 1 Theory Part

More information

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS

Mobile Robotics. Mathematics, Models, and Methods. HI Cambridge. Alonzo Kelly. Carnegie Mellon University UNIVERSITY PRESS Mobile Robotics Mathematics, Models, and Methods Alonzo Kelly Carnegie Mellon University HI Cambridge UNIVERSITY PRESS Contents Preface page xiii 1 Introduction 1 1.1 Applications of Mobile Robots 2 1.2

More information

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

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

More information

Kinematics, Kinematics Chains CS 685

Kinematics, Kinematics Chains CS 685 Kinematics, Kinematics Chains CS 685 Previously Representation of rigid body motion Two different interpretations - as transformations between different coord. frames - as operators acting on a rigid body

More information

Dynamic Object Tracking Control for a Non-Holonomic Wheeled Autonomous Robot

Dynamic Object Tracking Control for a Non-Holonomic Wheeled Autonomous Robot Tamkang Journal of Science and Engineering, Vol. 12, No. 3, pp. 339 350 (2009) 339 Dynamic Object Tracking Control for a Non-Holonomic Wheeled Autonomous Robot Yin-Tien Wang 1 *, Yu-Cheng Chen 1 and Ming-Chun

More information

Trajectory planning of 2 DOF planar space robot without attitude controller

Trajectory planning of 2 DOF planar space robot without attitude controller ISSN 1 746-7233, England, UK World Journal of Modelling and Simulation Vol. 4 (2008) No. 3, pp. 196-204 Trajectory planning of 2 DOF planar space robot without attitude controller Rajkumar Jain, Pushparaj

More information

Mobile Robots Locomotion

Mobile Robots Locomotion Mobile Robots Locomotion Institute for Software Technology 1 Course Outline 1. Introduction to Mobile Robots 2. Locomotion 3. Sensors 4. Localization 5. Environment Modelling 6. Reactive Navigation 2 Today

More information

Testing the Possibilities of Using IMUs with Different Types of Movements

Testing the Possibilities of Using IMUs with Different Types of Movements 137 Testing the Possibilities of Using IMUs with Different Types of Movements Kajánek, P. and Kopáčik A. Slovak University of Technology, Faculty of Civil Engineering, Radlinského 11, 81368 Bratislava,

More information

Mobile Robot Kinematics

Mobile Robot Kinematics Mobile Robot Kinematics Dr. Kurtuluş Erinç Akdoğan kurtuluserinc@cankaya.edu.tr INTRODUCTION Kinematics is the most basic study of how mechanical systems behave required to design to control Manipulator

More information

Adaptive tracking control scheme for an autonomous underwater vehicle subject to a union of boundaries

Adaptive tracking control scheme for an autonomous underwater vehicle subject to a union of boundaries Indian Journal of Geo-Marine Sciences Vol. 42 (8), December 2013, pp. 999-1005 Adaptive tracking control scheme for an autonomous underwater vehicle subject to a union of boundaries Zool Hilmi Ismail 1

More information

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS

A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS A NOUVELLE MOTION STATE-FEEDBACK CONTROL SCHEME FOR RIGID ROBOTIC MANIPULATORS Ahmad Manasra, 135037@ppu.edu.ps Department of Mechanical Engineering, Palestine Polytechnic University, Hebron, Palestine

More information

Manipulator Dynamics: Two Degrees-of-freedom

Manipulator Dynamics: Two Degrees-of-freedom Manipulator Dynamics: Two Degrees-of-freedom 2018 Max Donath Manipulator Dynamics Objective: Calculate the torques necessary to overcome dynamic effects Consider 2 dimensional example Based on Lagrangian

More information

Fundamental problems in mobile robotics

Fundamental problems in mobile robotics ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Mobile & Service Robotics Kinematics Fundamental problems in mobile robotics Locomotion: how the robot moves in the environment Perception: how

More information

Lesson 1: Introduction to Pro/MECHANICA Motion

Lesson 1: Introduction to Pro/MECHANICA Motion Lesson 1: Introduction to Pro/MECHANICA Motion 1.1 Overview of the Lesson The purpose of this lesson is to provide you with a brief overview of Pro/MECHANICA Motion, also called Motion in this book. Motion

More information

LARGE MOTION CONTROL OF MOBILE MANIPULATORS INCLUDING VEHICLE SUSPENSION CHARACTERISTICS

LARGE MOTION CONTROL OF MOBILE MANIPULATORS INCLUDING VEHICLE SUSPENSION CHARACTERISTICS LARGE MOTION CONTROL OF MOBILE MANIPULATORS INCLUDING VEHICLE SUSPENSION CHARACTERISTICS ABSTRACT Conventional fixed-base controllers are shown not to perform well on mobile manipulators due to the dynamic

More information

CONTROL AND IMPLEMENTATION OF A SINGLE WHEEL HOLONOMIC VEHICLE RAFAEL PUERTA RAMÍREZ

CONTROL AND IMPLEMENTATION OF A SINGLE WHEEL HOLONOMIC VEHICLE RAFAEL PUERTA RAMÍREZ CONTROL AND IMPLEMENTATION OF A SINGLE WHEEL HOLONOMIC VEHICLE RAFAEL PUERTA RAMÍREZ BOGOTÁ D.C. PONTIFICIA UNIVERSIDAD JAVERIANA FACULTY OF ENGINEERING DEPARTMENT OF ELECTRONICS NOVEMBER 2013 1 Content

More information

AC : ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY

AC : ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY AC 2009-130: ADAPTIVE ROBOT MANIPULATORS IN GLOBAL TECHNOLOGY Alireza Rahrooh, University of Central Florida Alireza Rahrooh is aprofessor of Electrical Engineering Technology at the University of Central

More information

Encoder applications. I Most common use case: Combination with motors

Encoder applications. I Most common use case: Combination with motors 3.5 Rotation / Motion - Encoder applications 64-424 Intelligent Robotics Encoder applications I Most common use case: Combination with motors I Used to measure relative rotation angle, rotational direction

More information

Kinematics and dynamics analysis of micro-robot for surgical applications

Kinematics and dynamics analysis of micro-robot for surgical applications ISSN 1 746-7233, England, UK World Journal of Modelling and Simulation Vol. 5 (2009) No. 1, pp. 22-29 Kinematics and dynamics analysis of micro-robot for surgical applications Khaled Tawfik 1, Atef A.

More information

Singularity Analysis of an Extensible Kinematic Architecture: Assur Class N, Order N 1

Singularity Analysis of an Extensible Kinematic Architecture: Assur Class N, Order N 1 David H. Myszka e-mail: dmyszka@udayton.edu Andrew P. Murray e-mail: murray@notes.udayton.edu University of Dayton, Dayton, OH 45469 James P. Schmiedeler The Ohio State University, Columbus, OH 43210 e-mail:

More information

Dynamic Model With Slip for Wheeled Omnidirectional Robots

Dynamic Model With Slip for Wheeled Omnidirectional Robots IEEE TRANSACTIONS ON ROBOTICS AND AUTOMATION, VOL. 18, NO. 3, JUNE 2002 285 Dynamic Model With Slip for Wheeled Omnidirectional Robots Robert L. Williams, II, Member, IEEE, Brian E. Carter, Paolo Gallina,

More information

Kinematics Modeling of the Amigobot Robot

Kinematics Modeling of the Amigobot Robot Mechanics and Mechanical Engineering Vol. 4, No. (2) 57 64 c Technical University of Lodz Kinematics Modeling of the Amigobot Robot Tomasz Buratowski Department of Robotics and Mechatronics, AGH University

More information

Computer Kit for Development, Modeling, Simulation and Animation of Mechatronic Systems

Computer Kit for Development, Modeling, Simulation and Animation of Mechatronic Systems Computer Kit for Development, Modeling, Simulation and Animation of Mechatronic Systems Karol Dobrovodský, Pavel Andris, Peter Kurdel Institute of Informatics, Slovak Academy of Sciences Dúbravská cesta

More information

What Is SimMechanics?

What Is SimMechanics? SimMechanics 1 simulink What Is Simulink? Simulink is a tool for simulating dynamic systems with a graphical interface specially developed for this purpose. Physical Modeling runs within the Simulink environment

More information

Motion Planning for Dynamic Knotting of a Flexible Rope with a High-speed Robot Arm

Motion Planning for Dynamic Knotting of a Flexible Rope with a High-speed Robot Arm The 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems October 18-22, 2010, Taipei, Taiwan Motion Planning for Dynamic Knotting of a Flexible Rope with a High-speed Robot Arm Yuji

More information

Early Stage Design of a Spherical Underwater Robotic Vehicle

Early Stage Design of a Spherical Underwater Robotic Vehicle Early Stage Design of a Spherical Underwater Robotic Vehicle Soheil Zavari, Arttu Heininen, Jussi Aaltonen, Kari T.Koskinen Mechanical Engineering and Industrial Systems Tampere University of Technology

More information

Serially-Linked Parallel Leg Design for Biped Robots

Serially-Linked Parallel Leg Design for Biped Robots December 13-15, 24 Palmerston North, New ealand Serially-Linked Parallel Leg Design for Biped Robots hung Kwon, Jung H. oon, Je S. eon, and Jong H. Park Dept. of Precision Mechanical Engineering, School

More information

FACOLTÀ DI INGEGNERIA DELL INFORMAZIONE ELECTIVE IN ROBOTICS. Quadrotor. Motion Planning Algorithms. Academic Year

FACOLTÀ DI INGEGNERIA DELL INFORMAZIONE ELECTIVE IN ROBOTICS. Quadrotor. Motion Planning Algorithms. Academic Year FACOLTÀ DI INGEGNERIA DELL INFORMAZIONE ELECTIVE IN ROBOTICS Quadrotor Motion Planning Algorithms Prof. Marilena Vendittelli Prof. Jean-Paul Laumond Jacopo Capolicchio Riccardo Spica Academic Year 2010-2011

More information

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda**

DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER. Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** DYNAMIC POSITIONING OF A MOBILE ROBOT USING A LASER-BASED GONIOMETER Joaquim A. Batlle*, Josep Maria Font*, Josep Escoda** * Department of Mechanical Engineering Technical University of Catalonia (UPC)

More information

DYNAMICS OF SPACE ROBOTIC ARM DURING INTERACTIONS WITH NON COOPERATIVE OBJECTS

DYNAMICS OF SPACE ROBOTIC ARM DURING INTERACTIONS WITH NON COOPERATIVE OBJECTS DYNAMICS OF SPACE ROBOTIC ARM DURING INTERACTIONS WITH NON COOPERATIVE OBJECTS Karol Seweryn 1, Marek Banaszkiewicz 1, Bernd Maediger 2, Tomasz Rybus 1, Josef Sommer 2 1 Space Research Centre of the Polish

More information

SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS

SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS SUPPORTING LINEAR MOTION: A COMPLETE GUIDE TO IMPLEMENTING DYNAMIC LOAD SUPPORT FOR LINEAR MOTION SYSTEMS Released by: Keith Knight Catalyst Motion Group Engineering Team Members info@catalystmotiongroup.com

More information

Adaptive back-stepping control applied on octocopter under recoil disturbance

Adaptive back-stepping control applied on octocopter under recoil disturbance Journal of Engineering Science and Military Technologies ISSN: 2357-0954 DOI: 10.21608/ejmtc.2017.401.1004 Adaptive back-stepping control applied on octocopter under recoil disturbance GuangXue Zhang 1

More information

FlightGear application for flight simulation of a mini-uav

FlightGear application for flight simulation of a mini-uav FlightGear application for flight simulation of a mini-uav Tomáš Vogeltanz and Roman Jašek Citation: AIP Conference Proceedings 1648, 550014 (2015); doi: 10.1063/1.4912769 View online: http://dx.doi.org/10.1063/1.4912769

More information

S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT

S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT S-SHAPED ONE TRAIL PARALLEL PARKING OF A CAR-LIKE MOBILE ROBOT 1 SOE YU MAUNG MAUNG, 2 NU NU WIN, 3 MYINT HTAY 1,2,3 Mechatronic Engineering Department, Mandalay Technological University, The Republic

More information

Linear algebra deals with matrixes: two-dimensional arrays of values. Here s a matrix: [ x + 5y + 7z 9x + 3y + 11z

Linear algebra deals with matrixes: two-dimensional arrays of values. Here s a matrix: [ x + 5y + 7z 9x + 3y + 11z Basic Linear Algebra Linear algebra deals with matrixes: two-dimensional arrays of values. Here s a matrix: [ 1 5 ] 7 9 3 11 Often matrices are used to describe in a simpler way a series of linear equations.

More information

Rolling Locomotion of Deformable Tensegrity Structure

Rolling Locomotion of Deformable Tensegrity Structure 1 Rolling Locomotion of Deformable Tensegrity Structure M. SHIBATA and S. HIRAI Department of Robotics, Ritsumeikan University, Kusatsu, Shiga 525-8577, Japan E-mail: mizuho-s@se.ritsumei.ac.jp http://greenhand.web.infoseek.co.jp/school/english/index.html

More information