1 Introduction. Control 1:

Size: px
Start display at page:

Download "1 Introduction. Control 1:"

Transcription

1 1 1 Introduction Hierarchical Control for Mobile Robots Motive Autonomy Control Level We build controllers because: Real hardware ultimately responds to forces, energy, power, etc. whereas we are concerned with positions and velocities. Controllers map between the two using models. We use feedback because: Inevitable disturbances mean real systems do not, in fact, do exactly what they are told. Our models of how the system operates are imperfect due to approximations and lots of missing information. We use predictive modelling because: Real systems are low pass filters and modelling this allows us to anticipate their response and compensate beforehand. Underactuated systems cannot be moved in arbitrary directions but we can effect parallel parking using prediction.

2 1.1The Grand Hierarchy 2 Most real controllers for complex systems exhibit hierarchical structure. For a mobile robot, there is a hierarchy of control problems. 1.1 The Grand Hierarchy One reason for hierarchy is that its tough to be both smart and fast. Higher levels tend to be more abstract and deliberative while lower levels tend to be more quantitative and reactive. Another is its good software design practice. Humans find it easier to understand. Here is a hierarchy at the level of the entire system: Deliberative Autonomy Perceptive Autonomy Motive Autonomy Figure 1 Grand Hierarchy. The entire system is described here. Motive autonomy. Responsible for controlling the motion of the vehicle with respect to the environment. Requires feedback only of the motion state (position, heading, attitude, velocity) of the vehicle. Path following fits here. Perceptive Autonomy. (aka Reactive Autonomy). Responsible for responding to the immediate environment.

3 Requires feedback of the state of the environment (e.g. perception). May only need relative position estimates. Obstacle Avoidance fits here. Deliberative Autonomy. Responsible for achieving goals (aka the mission ). May use expansive models of the environment. Often needs absolute position estimates. Definitely uses a capacity to predict the conseqences of actions. Tends to do optimization. Global path planning fits here. 2 Motive Autonomy 3 1.1The Grand Hierarchy 2 Motive Autonomy Controllers can be classified along several axes of attributes. One disinction is what are you controlling: Articulation Control. Controls internal articulations. Examples include control of wheel velocities, steer angles, throttles, brakes, pan/tilt mechanisms. Based on internal motion feedback. Mobility Control. Controls the state of motion of the vehicle with respect to the environment. Based on bodily motion feedback. Another is at what level does the algorithm operate: Independent control level (SISO). This is the control of actuators as independent entities. Based on axis level feedback. Coordinated control level (MIMO). This is the control of the entire vehicle considered as one entity. Based on composite feedback generated from several components.

4 2.1 Controlled Variable The controlled variable varies by situation. position control forms and responds to errors in position coordinates. Used for pointing sensors and controlling steer angles, etc. differential or incremental position control accomplishes a measured change in position. Used for achieving small motions, perhaps based only on odometric feedback (because its better for measuring small motions than the alternatives). rate control forms and responds to errors in rate coordinates. As a separate matter, the positions and rates under control are not necessarily of the robot with respect to the world. For example, in formation control, the spacing between vehicles is measured and tweaked. 2 Motive Autonomy 4 2.1Controlled Variable Because many servos are implemented in software, it is possible to switch back and forth between speed and position control. This can be advantageous. You use velocity control for the long haul and then enter a position acquire and hold loops near the terminal position. 2.2 Requirements If it is necessary to move a precise distance or move to a precise location, then position control is likely called for. Speed control is normally fine for gross motions between resting positions. Velocity control can be important to critical in rare situations. For example lawn care and, floor care, care alot about the quality of the treatment process. On occasion, following a specified path is the whole issue. On others the path used to get somewhere is not important but the endpoint is critical.

5 On others, the path cannot be controlled because the end state predetermines the path through nonholonomic constraints. On others, massive deviation from the endpoint is possible (e.g. forktruck side shift tolerates crosstrack error) 2.3 Typical Motive Autonomy Hierarchy One hierarchy for motive autonomy that captures many of these ideas is like so: Path Following Control Trajectory Control Path Endpoint Control Instantaneous Ref. Pt. Control Instantaneous Axis Servos Level Path Control Level Endpoint Control Level Coordinated Control Level Independent Control Level Figure 2 A Control Hierarchy. Higher levels produce the reference signals for lower levels. Each layer in the hierarchy is implemented by supplying the reference signals (commands) to the immediately subordinate layer. 2 Motive Autonomy 5 2.3Typical Motive Autonomy Hierarchy It is also possible to access each layer directly as required by the application. The layers perform the following functions: Independent Control Level - Control the instantaneous state of each axis, where state may mean position or speed etc. Coordinated Control Level - Control the instantaneous state of the vehicle control point. May or may not be closed loop. Endpoint Control Level - Control the position of the vehicle at the end of a trajectory without regard for the path taken to get there. Used for goal acquisition and corrective trajectories. Path Control Level- Control the crosstrack error of the vehicle as it follows a path by servoing it to zero at some lookahead.

6 3 Independent Control Level The simplest positional capabilities of a vehicle can be implemented with PID (proportional-integral-derivative) loops. These loops are simple in the following respects: They consider only the instantaneous value of their reference inputs conducting no lookahead. They react simply to the current error signal. They are not coordinated with other servos that execute simultaneously. It is important to be clear on the difference between the controlled axes and the associated vehicle state. Often, for example, the position of an axis (such as a throttle or a steer angle) maps onto the linear or angular speed of the vehicle. 3.1 Axis Actuators Axis actuators include such things as engine throttles, motors, hydraulic jack valves, and lead screws. 3 Independent Control Level 6 3.1Axis Actuators There is usually a calibration required which maps the computed output onto quantity actuated. There can also be kinematics required to convert coordinates in minor ways. It is normally best to hide such kinematics here rather than to propagate them up into higher level control loops. 3.2 Axis Servo Control Laws A generic PID servo loop can be constructed and several instances used for each axis. The generic characteristics of the loops themselves are as shown below: x d x d x d k i k p kd u x x System Figure 3 Generic Axis Servo. This structure covers alot of real cases.

7 In the figure, x and its time derivatives denote the actual state of the system whereas x d and its derivatives denote the commanded or desired state of the system. A control law of the following PID form is most general for a system of second order open loop dynamics: ut () = x d () t + k e d () t + k p et () + k i et () dt The error terms are as follows: e () t = x d () t x () t e () t = x d () t x () t et () = x d () t xt () Suppose the system has open loop dynamics of the form: ut () x () t which is to say the input is a force applied to a unit mass. (1) (2) = (3) 3 Independent Control Level 7 3.3Integral Term Substituting the control into this permits cancelling ut () to get: e () t + k d e () t + k p et () + k i et () dt 0 With the integral term, this is a 3rd order system. Without it, it is a second order system which can be tuned to achieve critical damping. Without the integral term, the characteristic equation is: This is critically damped when: 3.3 Integral Term While it may seem that an integrated position error is meaningless, note that this term continues to grow if the system has stopped slightly away from its goal position. = (4) s 2 + k d s+ k p = 0 (5) k d 2 4k p = 0 (6)

8 Without this term, and the position error gain may be insufficient to overcome friction, since the speed and acceleration terms generate no output. The integral term will cause the system to continuously seek its goal position and oscillate around it at very low amplitude. 3.4 Proportional Term Note that the proportional gain k p is analogous to a spring constant since the output is proportional to the error deflection. Hence, it is often called servo stiffness. 3.5 Derivative Term The derivative gain generates a control signal (lets say a torque) whose amplitude is proportional to a velocity difference. Hence it is often described in terms of viscous effects. 3.6 Missing Commands and Feedback In a pinch, the equation for et () can be differentiated numerically to generate the derivative error terms but consistent command 3 Independent Control Level 8 3.4Proportional Term derivatives and real measurements of rates are better. 3.7 Profile Generation At times, it is useful to generate an entire command trajectory in the single axis case rather than asking for some distant terminal state. This is the case where a consistent set of demands can be generated easily. A common example is the generation of a trapezoidal velocity profile: Speed Short Time Duration Speed Long Time Duration Figure 4 Trapezoidal Profile Generation. Such a trajectory permits analytic computation of consistent position, rate, and acceleration demands.

9 4 Coordinated Control Level 4.1 A Generic Coordinated Control Hierarchy Coordinated control is also called MIMO (multi-input multi-output) control. Here all elements of the state vector are controlled as a unit. Here is a more detailed cut at a generic hierarchy for this level and those above it. All of these elements are based only on vehicle position and velocity feedback. Example nterpolate Between Waypoints Stay on the path Control Formation Hit recovery point on path Ramp speed to stop soon Squeeze between two trees Hold at 30 mph Move wheels at same speed Stop at waypoint Crosstrack Servos Trajectory Generation Trajectory Follower Coordinated Control Hierarchy Path Interpolation Alongtrack Servos Speed Profile Generation Cruise Control Position Hold Level Waypoint Seeking Level Path/Object Followe Level Goal Elaboration Level Goal Acquisition Level Coordinated Contro Level 4 Coordinated Control Level 9 4.1A Generic Coordinated Control Hierarchy Again, higher levels may use lower levels to do their job. The three levels in the earlier diagram are five here. Coordinating actuators requires that their responses be: consistent: so that their net effect is what is desired. synchronized: so that they have the right values at the right times. 4.2 Basic Coordinated Control This part implements at least some form of kinematics to keep actuators moving in relative lockstep. One example is driving all the wheels at potentially different rates in order to achieve some precise rigid body motion. See kinematics of wheeled mobile robots in next lecture for how to do this. Figure 5 Coordinated Control Hierarchy. All of these elements are based only on vehicle position and velocity feedback.

10 4.3 Position Hold This is a special very tight loop that is entered when near the end of a trajectory where the terminal position matters alot. It measures position error and stops the vehicle at just the right spot. 4.4 Trajectory Follower Another aspect may be synchronization. Suppose for example that the curvature profile of some intended motion is given: κ( s) = given (7) It is often the case that error along the path (alongtrack) can be ignored only the crosstrack error matters. The throttle and steering actuators can be coordinated to achieve open loop following by sacrificing speed following for curvature following. Whatever the speed is, right or wrong, compute the distance s actually travelled and use this quantity, rather than time, to compute the associated curvature command. 4 Coordinated Control Level Position Hold 4.5 Cruise Control Just like it sounds, this is a servo on vehicle speed-over-the-ground. Just maintaining motion is not so easy on rough terrain - let alone maintaining constant speed. Often used when precise path following is not important (e.g. waypoint seeking). 4.6 Trajectory Generation An elaborative control. Computes the trajectory to a desired goal state when the path to the state is unimportant or unspecified from above. See upcoming lecture on this. 4.7 Speed Profile Generation The speed equivalent of trajectory generation. Elaborates a desired distance into a way to get there. 4.8 Crosstrack Servo Our friend the path follower. Does its best to stay on a path by driving position error transverse to some desired path to zero.

11 Perhaps by using recovery trajectories generated one level down. 4.9 Alongtrack Servos Tries to drive alongtrack position error, perhaps measured with respect to some moving object, to zero. Formation control in convoys. Docking a robot with a power receptacle. Picking up a pallet with a forktruck. When path shape is controlled separately from speed, this is called the kinodynamic approach Path Interpolation An elaborative element. If waypoints are specified very sparsely and lower level algorithms require dense waypoints, this element fills in the spaces with more waypoints using some interpolation scheme. 5 Trajectory Following Alongtrack Servos 5 Trajectory Following Let a trajectory be defined as a complete and precise specification of required motion provided over some time interval. We would like in many situations to use feedback control to ensure that the robot stays on this precisely specified path. For the present purpose, let a trajectory be represented as a specified curvature function over an interval of distance: x d ( s) κ d ( s) = (8) In the plane (or even in 3D), this is a complete description of a path through space because: θ( s) = θ 0 + κds s xs ( ) = cos[ θ( s) ] ds 0s ys ( ) = sin[ θ( s) ] ds 0 s 0 (9)

12 5.1 Open Loop Execution The simplest way to execute a trajectory is to establish a correspondence between the distance travelled by the vehicle s' and the trajectory parameter s. As the vehicle moves, the curvatures associated with the curve can be computed and issued to the hardware. As shown in Figure 6, this may only be a viable option if the initial vehicle pose is sufficiently close to the initial trajectory pose. 5 Trajectory Following Open Loop Execution 5.2 Closing a Heading Loop The previous loop required that the curvature be correct at corresponding points. A more complete solution would require that the heading be correct at corresponding points. Once an error is identified, a corrective curvature can be computed and added to the present curvature. Trajectory Vehicle Path Trajectory Vehicle Path θ = θ( s) θ' ( s' ) Figure 6 Open Loop Execution of Trajectories. Trajectories provide a good mechanism for implementing coordinated control. However, initial position (and especially heading) error may lead to large terminal errors even if the curvature commands are followed perfectly. Figure 7 Heading Servo. The error between the present vehicle heading and the heading of the corresponding point on the trajectory can be used to create a corrective trajectory. Let θ( s) refer to the heading of the trajectory at some point along the trajectory.

13 Let θ' ( s' ) refer to the heading of the vehicle at the corresponding point. A proportional controller can be used to reduce this error thus: κ = θ L (10) where L is a length whose inverse serves as the proportional gain. It is important that the corrective curvature κ be added to the open loop curvature command so that additional errors are not generated as a result of ignoring the predictable curvature profile of the trajectory. The correction amounts to increase or decrease in the bending of the curve over and above the bending encoded in the open loop curvature. This controller can be expected to drive the dc component of heading error exponentially to zero. The vehicle trajectory is effectively warped in order to make this occur. A certain amount of heading error can also be expected just because of delays and rate limitations in actuation. 5 Trajectory Following Closing a Predictive Position Loop 5.3 Closing a Predictive Position Loop Crosstrack error can be reduced by explicitly steering toward a goal point on the trajectory. A simple technique is pure pursuit which generates a corrective arc designed to reaquire the trajectory at a point slightly ahead of the vehicle. However, the availability of an explicit representation of the future shape of the desired trajectory permits a computation of a corrective curvature in a more predictive fashion. The position error at some point in the future can be predicted, and a corrective addition to

14 the curvature command can be issued now to prevent it. Trajectory Vehicle Path v 2 θ Figure 8 Predictive Crosstrack Error Servo. The predicted crosstrack error in the future is used to compute a corrective curvature to be issued now. This approach can be more stable than reacting to the present crosstrack error. In this case, the corrective curvature is: κ = θ v (11) 1 v 1 5 Trajectory Following Closing a Pose Loop 5.4 Closing a Pose Loop When trajectories are very short, as is commonly the case (particularly at the end of a otherwise long one), the use of a lookahead point is not viable. In this case, it is more convenient (although less stable) to servo based on the present error. Rather than use distance travelled in order to determine corresponding points, it is useful to compute the closest point to the present vehicle pose on the goal trajectory. This mechanism can be used to correct for alongtrack error by terminating when the closest point first becomes the terminal point on the trajectory. More generally, the coordinates of this point in the vehicle frame can be used to both determine signed crosstrack error (x The control amounts to an incremental curvature impulse which, if issued now, would correct the predicted crosstrack error at the lookahead distance

15 coordinate) and issue a stop command in time to stop at the terminal point (y coordinate). Trajectory Vehicle Path v 2 θ 5 Trajectory Following Closing a Pose Loop κ = x L 2 (13) will correct for the crosstrack error by increasing heading by the angle x L over a distance of L. Closest Point Figure 9 Instantaneous Pose Error Servo. The coordinates of the closest point, expressed in vehicle coordinates, can be used to both correct for crosstrack error with a corrective curvature and predict when to stop in order to hit the terminal point. Two corrective terms can be generated and both added to the trajectory curvature. For heading error: κ is still used. For crosstrack error: = θ L (12)

16 6 Path Following This is very similiar to trajectory following with these differences: The path is often represented as just a sequence of waypoints, so the desired curvature, etc. is not available. Paths are often specified over much larger distances. Nonetheless the basic elements are the same: Determine a measure of error. It may be present error or predicted future error. It may be a single scalar or a vector of them. Doing this often requires some way to determine some corresponding point on the path. Formulate a control which reduces the measured error. Here, a steering input is required. 6 Path Following Closing a Pose Loop A simple scheme is to steer toward some goal point which is ahead of the vehicle on the path. ψ e ψ L ψ d Path Figure 10 Pure Pursuit. The heading error with respect to the line to the goal point is the error measure.

17 The error measure is the heading error between the current vehicle heading and the heading of the line to the goal point: ψ e = ψ d ψ (14) The control is a corrective arc which removes this error after travelling a distance L: κ = ψ e L (15) Clearly, the proportional gain is: 1 K p -- L = (16) In practice, tuning L is tough. When its too small, following is poor and when its too large, the system is unstable. 6.1 Path Following with Obstacle Avoidance When path following coexists with obstacle avoidance, two issues pertain: Avoidance maneuvers can cause massive following errors which may induce instability in path following. 6 Path Following Path Following with Obstacle Avoidance Only certain steering commands are being checked for obstacles and path following must use one of these in order to be following a proofed path through the environment. The first problem can be managed by gain scheduling. When the crosstrack error is large due to obstacle avoidance, increase the lookahead by the same amount. The second problem actually leads to a much better tracker. Because high fidelity simulation is used in obstacle avoidance, a model based controller can be constructed

18 which analyses the response trajectories to pick the best based on some utility functional. Note, the vehicle is in a sharp left turn and happens to have zero heading at t=0. Figure 11 Model Referenced Pure Pursuit. A simulation is used to pick the best path the hard way. good 7 Summary Path Following with Obstacle Avoidance 7 Summary There are many forms of mobile robot controls and they can be arranged in a rough hierarchy. There is a kind of generic PID loop that covers alot of cases. Coordinated control has many different variants in mobile robots. Synchronizing curvature with speed is a very good idea. It is work to get a robot to follow an intricate path. The stability/following error tradeoff is a constant concern. Life is worse when obstacle avoidance must co-exist with path following. 8 Notes Make figures 5 and 2 more consistent. Need more pictures in these noes. 9 References

19 9 References Path Following with Obstacle Avoidance

20 9 References Path Following with Obstacle Avoidance

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

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

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

UItiMotion. Paul J. Gray, Ph.D. Manager Path Planning Front-End Design R&D

UItiMotion. Paul J. Gray, Ph.D. Manager Path Planning Front-End Design R&D UItiMotion Paul J. Gray, Ph.D. Manager Path Planning Front-End Design R&D What is UltiMotion? An entirely new software-based motion control system Wholly owned by Hurco Awarded 4 patents Superior to Hurco

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

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

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

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

Lecture VI: Constraints and Controllers

Lecture VI: Constraints and Controllers Lecture VI: Constraints and Controllers Motion Constraints In practice, no rigid body is free to move around on its own. Movement is constrained: wheels on a chair human body parts trigger of a gun opening

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

DELTA TAU Data Systems, Inc.

DELTA TAU Data Systems, Inc. DELTA TAU Data Systems, Inc. Last revision: 12/5/01 Why PMAC Controllers Are Easy To Use Delta Tau s PMAC and Turbo PMAC families of controllers justly have the reputation as being the most powerful and

More information

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces

Simulation. x i. x i+1. degrees of freedom equations of motion. Newtonian laws gravity. ground contact forces Dynamic Controllers Simulation x i Newtonian laws gravity ground contact forces x i+1. x degrees of freedom equations of motion Simulation + Control x i Newtonian laws gravity ground contact forces internal

More information

Chapter 10 Motion Planning

Chapter 10 Motion Planning Chapter 10 Motion Planning 10.1 Introduction Part 1 1 10.1 Introduction Outline 10.1.1 Introducing Motion Planning 10.1.2 Formulation of Motion Planning 10.1.3 Obstacle Free Motion Planning Summary 2 Hierarchy

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

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

Exam in DD2426 Robotics and Autonomous Systems

Exam in DD2426 Robotics and Autonomous Systems Exam in DD2426 Robotics and Autonomous Systems Lecturer: Patric Jensfelt KTH, March 16, 2010, 9-12 No aids are allowed on the exam, i.e. no notes, no books, no calculators, etc. You need a minimum of 20

More information

Lecture VI: Constraints and Controllers. Parts Based on Erin Catto s Box2D Tutorial

Lecture VI: Constraints and Controllers. Parts Based on Erin Catto s Box2D Tutorial Lecture VI: Constraints and Controllers Parts Based on Erin Catto s Box2D Tutorial Motion Constraints In practice, no rigid body is free to move around on its own. Movement is constrained: wheels on a

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

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

Optimization of a two-link Robotic Manipulator

Optimization of a two-link Robotic Manipulator Optimization of a two-link Robotic Manipulator Zachary Renwick, Yalım Yıldırım April 22, 2016 Abstract Although robots are used in many processes in research and industry, they are generally not customized

More information

Automatic Control Industrial robotics

Automatic Control Industrial robotics Automatic Control Industrial robotics Prof. Luca Bascetta (luca.bascetta@polimi.it) Politecnico di Milano Dipartimento di Elettronica, Informazione e Bioingegneria Prof. Luca Bascetta Industrial robots

More information

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle

Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Waypoint Navigation with Position and Heading Control using Complex Vector Fields for an Ackermann Steering Autonomous Vehicle Tommie J. Liddy and Tien-Fu Lu School of Mechanical Engineering; The University

More information

Constrained Optimization Path Following of Wheeled Robots in Natural Terrain

Constrained Optimization Path Following of Wheeled Robots in Natural Terrain Constrained Optimization Path Following of Wheeled Robots in Natural Terrain Thomas M. Howard, Ross A. Knepper, and Alonzo Kelly The Robotics Institute, Carnegie Mellon University, 5000 Forbes Avenue,

More information

1 Trajectories. Class Notes, Trajectory Planning, COMS4733. Figure 1: Robot control system.

1 Trajectories. Class Notes, Trajectory Planning, COMS4733. Figure 1: Robot control system. Class Notes, Trajectory Planning, COMS4733 Figure 1: Robot control system. 1 Trajectories Trajectories are characterized by a path which is a space curve of the end effector. We can parameterize this curve

More information

MEM380 Applied Autonomous Robots Winter Robot Kinematics

MEM380 Applied Autonomous Robots Winter Robot Kinematics MEM38 Applied Autonomous obots Winter obot Kinematics Coordinate Transformations Motivation Ultimatel, we are interested in the motion of the robot with respect to a global or inertial navigation frame

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

Indra Works DS Tuning Procedure

Indra Works DS Tuning Procedure Indra Works DS Tuning Procedure Rexroth Indramat drives can be tuned in-house or in the field. The following procedures are written for a technician tuning a drive, in-house. Where an asterisk (*) appears,

More information

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

Torque-Position Transformer for Task Control of Position Controlled Robots

Torque-Position Transformer for Task Control of Position Controlled Robots 28 IEEE International Conference on Robotics and Automation Pasadena, CA, USA, May 19-23, 28 Torque-Position Transformer for Task Control of Position Controlled Robots Oussama Khatib, 1 Peter Thaulad,

More information

Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis

Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis Manipulator Path Control : Path Planning, Dynamic Trajectory and Control Analysis Motion planning for industrial manipulators is a challenging task when obstacles are present in the workspace so that collision-free

More information

Physics Tutorial 2: Numerical Integration Methods

Physics Tutorial 2: Numerical Integration Methods Physics Tutorial 2: Numerical Integration Methods Summary The concept of numerically solving differential equations is explained, and applied to real time gaming simulation. Some objects are moved in a

More information

INSTITUTE OF AERONAUTICAL ENGINEERING

INSTITUTE OF AERONAUTICAL ENGINEERING Name Code Class Branch Page 1 INSTITUTE OF AERONAUTICAL ENGINEERING : ROBOTICS (Autonomous) Dundigal, Hyderabad - 500 0 MECHANICAL ENGINEERING TUTORIAL QUESTION BANK : A7055 : IV B. Tech I Semester : MECHANICAL

More information

Motion Capture & Simulation

Motion Capture & Simulation Motion Capture & Simulation Motion Capture Character Reconstructions Joint Angles Need 3 points to compute a rigid body coordinate frame 1 st point gives 3D translation, 2 nd point gives 2 angles, 3 rd

More information

IVR: Open- and Closed-Loop Control. M. Herrmann

IVR: Open- and Closed-Loop Control. M. Herrmann IVR: Open- and Closed-Loop Control M. Herrmann Overview Open-loop control Feed-forward control Towards feedback control Controlling the motor over time Process model V B = k 1 s + M k 2 R ds dt Stationary

More information

TURN AROUND BEHAVIOR GENERATION AND EXECUTION FOR UNMANNED GROUND VEHICLES OPERATING IN ROUGH TERRAIN

TURN AROUND BEHAVIOR GENERATION AND EXECUTION FOR UNMANNED GROUND VEHICLES OPERATING IN ROUGH TERRAIN 1 TURN AROUND BEHAVIOR GENERATION AND EXECUTION FOR UNMANNED GROUND VEHICLES OPERATING IN ROUGH TERRAIN M. M. DABBEERU AND P. SVEC Department of Mechanical Engineering, University of Maryland, College

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

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

Robots are built to accomplish complex and difficult tasks that require highly non-linear motions.

Robots are built to accomplish complex and difficult tasks that require highly non-linear motions. Path and Trajectory specification Robots are built to accomplish complex and difficult tasks that require highly non-linear motions. Specifying the desired motion to achieve a specified goal is often a

More information

Software Architecture. Lecture 4

Software Architecture. Lecture 4 Software Architecture Lecture 4 Last time We discussed tactics to achieve architecture qualities We briefly surveyed architectural styles 23-Jan-08 http://www.users.abo.fi/lpetre/sa08/ 2 Today We check

More information

NAVIGATION AND RETRO-TRAVERSE ON A REMOTELY OPERATED VEHICLE

NAVIGATION AND RETRO-TRAVERSE ON A REMOTELY OPERATED VEHICLE NAVIGATION AND RETRO-TRAVERSE ON A REMOTELY OPERATED VEHICLE Karl Murphy Systems Integration Group Robot Systems Division National Institute of Standards and Technology Gaithersburg, MD 0899 Abstract During

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

Name Period. (b) Now measure the distances from each student to the starting point. Write those 3 distances here. (diagonal part) R measured =

Name Period. (b) Now measure the distances from each student to the starting point. Write those 3 distances here. (diagonal part) R measured = Lesson 5: Vectors and Projectile Motion Name Period 5.1 Introduction: Vectors vs. Scalars (a) Read page 69 of the supplemental Conceptual Physics text. Name at least 3 vector quantities and at least 3

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

Mass-Spring Systems. Last Time?

Mass-Spring Systems. Last Time? Mass-Spring Systems Last Time? Implicit Surfaces & Marching Cubes/Tetras Collision Detection & Conservative Bounding Regions Spatial Acceleration Data Structures Octree, k-d tree, BSF tree 1 Today Particle

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

Control 2. Keypoints: Given desired behaviour, determine control signals Inverse models:

Control 2. Keypoints: Given desired behaviour, determine control signals Inverse models: Control 2 Keypoints: Given desired behaviour, determine control signals Inverse models: Inverting the forward model for simple linear dynamic system Problems for more complex systems Open loop control:

More information

Model Library Mechanics

Model Library Mechanics Model Library Mechanics Using the libraries Mechanics 1D (Linear), Mechanics 1D (Rotary), Modal System incl. ANSYS interface, and MBS Mechanics (3D) incl. CAD import via STL and the additional options

More information

Animation. CS 4620 Lecture 33. Cornell CS4620 Fall Kavita Bala

Animation. CS 4620 Lecture 33. Cornell CS4620 Fall Kavita Bala Animation CS 4620 Lecture 33 Cornell CS4620 Fall 2015 1 Announcements Grading A5 (and A6) on Monday after TG 4621: one-on-one sessions with TA this Friday w/ prior instructor Steve Marschner 2 Quaternions

More information

Non-holonomic Planning

Non-holonomic Planning Non-holonomic Planning Jane Li Assistant Professor Mechanical Engineering & Robotics Engineering http://users.wpi.edu/~zli11 Recap We have learned about RRTs. q new q init q near q rand But the standard

More information

CANAL FOLLOWING USING AR DRONE IN SIMULATION

CANAL FOLLOWING USING AR DRONE IN SIMULATION CANAL FOLLOWING USING AR DRONE IN SIMULATION ENVIRONMENT Ali Ahmad, Ahmad Aneeque Khalid Department of Electrical Engineering SBA School of Science & Engineering, LUMS, Pakistan {14060006, 14060019}@lums.edu.pk

More information

Kinematics of Machines Prof. A. K. Mallik Department of Mechanical Engineering Indian Institute of Technology, Kanpur. Module 10 Lecture 1

Kinematics of Machines Prof. A. K. Mallik Department of Mechanical Engineering Indian Institute of Technology, Kanpur. Module 10 Lecture 1 Kinematics of Machines Prof. A. K. Mallik Department of Mechanical Engineering Indian Institute of Technology, Kanpur Module 10 Lecture 1 So far, in this course we have discussed planar linkages, which

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

Project 1 : Dead Reckoning and Tracking

Project 1 : Dead Reckoning and Tracking CS3630 Spring 2012 Project 1 : Dead Reckoning and Tracking Group : Wayward Sons Sameer Ansari, David Bernal, Tommy Kazenstein 2/8/2012 Wayward Sons CS3630 Spring 12 Project 1 Page 2 of 12 CS 3630 (Spring

More information

Elastic Bands: Connecting Path Planning and Control

Elastic Bands: Connecting Path Planning and Control Elastic Bands: Connecting Path Planning and Control Sean Quinlan and Oussama Khatib Robotics Laboratory Computer Science Department Stanford University Abstract Elastic bands are proposed as the basis

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

Autonomous Navigation for Flying Robots

Autonomous Navigation for Flying Robots Computer Vision Group Prof. Daniel Cremers Autonomous Navigation for Flying Robots Lecture 3.2: Sensors Jürgen Sturm Technische Universität München Sensors IMUs (inertial measurement units) Accelerometers

More information

Design and Development of Cartesian Robot for Machining with Error Compensation and Chatter Reduction

Design and Development of Cartesian Robot for Machining with Error Compensation and Chatter Reduction International Journal of Engineering Research and Technology. ISSN 0974-3154 Volume 6, Number 4 (2013), pp. 449-454 International Research Publication House http://www.irphouse.com Design and Development

More information

(Refer Slide Time: 00:02:02)

(Refer Slide Time: 00:02:02) Computer Graphics Prof. Sukhendu Das Dept. of Computer Science and Engineering Indian Institute of Technology, Madras Lecture - 20 Clipping: Lines and Polygons Hello and welcome everybody to the lecture

More information

1 Differential Drive Kinematics

1 Differential Drive Kinematics CS W4733 NOTES - Differential Drive Robots Note: these notes were compiled from Dudek and Jenkin, Computational Principles of Mobile Robotics. 1 Differential Drive Kinematics Many mobile robots use a drive

More information

CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM

CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM CSE 490R P1 - Localization using Particle Filters Due date: Sun, Jan 28-11:59 PM 1 Introduction In this assignment you will implement a particle filter to localize your car within a known map. This will

More information

Robotic Behaviors. Potential Field Methods

Robotic Behaviors. Potential Field Methods Robotic Behaviors Potential field techniques - trajectory generation - closed feedback-loop control Design of variety of behaviors - motivated by potential field based approach steering behaviors Closed

More information

Animation. CS 4620 Lecture 32. Cornell CS4620 Fall Kavita Bala

Animation. CS 4620 Lecture 32. Cornell CS4620 Fall Kavita Bala Animation CS 4620 Lecture 32 Cornell CS4620 Fall 2015 1 What is animation? Modeling = specifying shape using all the tools we ve seen: hierarchies, meshes, curved surfaces Animation = specifying shape

More information

MATH2071: LAB 2: Explicit ODE methods

MATH2071: LAB 2: Explicit ODE methods MATH2071: LAB 2: Explicit ODE methods 1 Introduction Introduction Exercise 1 Euler s method review Exercise 2 The Euler Halfstep (RK2) Method Exercise 3 Runge-Kutta Methods Exercise 4 The Midpoint Method

More information

A Path Tracking Method For Autonomous Mobile Robots Based On Grid Decomposition

A Path Tracking Method For Autonomous Mobile Robots Based On Grid Decomposition A Path Tracking Method For Autonomous Mobile Robots Based On Grid Decomposition A. Pozo-Ruz*, C. Urdiales, A. Bandera, E. J. Pérez and F. Sandoval Dpto. Tecnología Electrónica. E.T.S.I. Telecomunicación,

More information

Manipulator trajectory planning

Manipulator trajectory planning Manipulator trajectory planning Václav Hlaváč Czech Technical University in Prague Faculty of Electrical Engineering Department of Cybernetics Czech Republic http://cmp.felk.cvut.cz/~hlavac Courtesy to

More information

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018

Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Turning an Automated System into an Autonomous system using Model-Based Design Autonomous Tech Conference 2018 Asaf Moses Systematics Ltd., Technical Product Manager aviasafm@systematics.co.il 1 Autonomous

More information

A simple example. Assume we want to find the change in the rotation angles to get the end effector to G. Effect of changing s

A simple example. Assume we want to find the change in the rotation angles to get the end effector to G. Effect of changing s CENG 732 Computer Animation This week Inverse Kinematics (continued) Rigid Body Simulation Bodies in free fall Bodies in contact Spring 2006-2007 Week 5 Inverse Kinematics Physically Based Rigid Body Simulation

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

Animation. Computer Graphics COMP 770 (236) Spring Instructor: Brandon Lloyd 4/23/07 1

Animation. Computer Graphics COMP 770 (236) Spring Instructor: Brandon Lloyd 4/23/07 1 Animation Computer Graphics COMP 770 (236) Spring 2007 Instructor: Brandon Lloyd 4/23/07 1 Today s Topics Interpolation Forward and inverse kinematics Rigid body simulation Fluids Particle systems Behavioral

More information

Prof. Fanny Ficuciello Robotics for Bioengineering Visual Servoing

Prof. Fanny Ficuciello Robotics for Bioengineering Visual Servoing Visual servoing vision allows a robotic system to obtain geometrical and qualitative information on the surrounding environment high level control motion planning (look-and-move visual grasping) low level

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

Robotics. Lecture 5: Monte Carlo Localisation. See course website for up to date information.

Robotics. Lecture 5: Monte Carlo Localisation. See course website  for up to date information. Robotics Lecture 5: Monte Carlo Localisation See course website http://www.doc.ic.ac.uk/~ajd/robotics/ for up to date information. Andrew Davison Department of Computing Imperial College London Review:

More information

Physics 101, Lab 1: LINEAR KINEMATICS PREDICTION SHEET

Physics 101, Lab 1: LINEAR KINEMATICS PREDICTION SHEET Physics 101, Lab 1: LINEAR KINEMATICS PREDICTION SHEET After reading through the Introduction, Purpose and Principles sections of the lab manual (and skimming through the procedures), answer the following

More information

BEST2015 Autonomous Mobile Robots Lecture 2: Mobile Robot Kinematics and Control

BEST2015 Autonomous Mobile Robots Lecture 2: Mobile Robot Kinematics and Control BEST2015 Autonomous Mobile Robots Lecture 2: Mobile Robot Kinematics and Control Renaud Ronsse renaud.ronsse@uclouvain.be École polytechnique de Louvain, UCLouvain July 2015 1 Introduction Mobile robot

More information

5-Axis Flex Track Drilling Systems on Complex Contours: Solutions for Position Control

5-Axis Flex Track Drilling Systems on Complex Contours: Solutions for Position Control 5-Axis Flex Track Drilling Systems on Complex Contours: Solutions for Position Control 2013-01-2224 Published 09/17/2013 Joseph R. Malcomb Electroimpact Inc. Copyright 2013 SAE International doi:10.4271/2013-01-2224

More information

Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach

Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach IECON-Yokohama November 9-, Experimental Verification of Stability Region of Balancing a Single-wheel Robot: an Inverted Stick Model Approach S. D. Lee Department of Mechatronics Engineering Chungnam National

More information

Quick Start Training Guide

Quick Start Training Guide Quick Start Training Guide Table of Contents 1 INTRODUCTION TO MAPLESIM... 5 1.1 USER INTERFACE... 5 2 WORKING WITH A SAMPLE MODEL... 7 2.1 RUNNING A SIMULATION... 7 2.2 GRAPHICAL OUTPUT... 7 2.3 3D VISUALIZATION...

More information

State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements

State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements State Estimation for Continuous-Time Systems with Perspective Outputs from Discrete Noisy Time-Delayed Measurements António Pedro Aguiar aguiar@ece.ucsb.edu João Pedro Hespanha hespanha@ece.ucsb.edu Dept.

More information

COMPARISON OF ROBOT NAVIGATION METHODS USING PERFORMANCE METRICS

COMPARISON OF ROBOT NAVIGATION METHODS USING PERFORMANCE METRICS COMPARISON OF ROBOT NAVIGATION METHODS USING PERFORMANCE METRICS Adriano Flores Dantas, Rodrigo Porfírio da Silva Sacchi, Valguima V. V. A. Odakura Faculdade de Ciências Exatas e Tecnologia (FACET) Universidade

More information

Chapter 1: Introduction

Chapter 1: Introduction Chapter 1: Introduction This dissertation will describe the mathematical modeling and development of an innovative, three degree-of-freedom robotic manipulator. The new device, which has been named the

More information

METR 4202: Advanced Control & Robotics

METR 4202: Advanced Control & Robotics Position & Orientation & State t home with Homogenous Transformations METR 4202: dvanced Control & Robotics Drs Surya Singh, Paul Pounds, and Hanna Kurniawati Lecture # 2 July 30, 2012 metr4202@itee.uq.edu.au

More information

ACE Project Report. December 10, Reid Simmons, Sanjiv Singh Robotics Institute Carnegie Mellon University

ACE Project Report. December 10, Reid Simmons, Sanjiv Singh Robotics Institute Carnegie Mellon University ACE Project Report December 10, 2007 Reid Simmons, Sanjiv Singh Robotics Institute Carnegie Mellon University 1. Introduction This report covers the period from September 20, 2007 through December 10,

More information

Worksheet Answer Key: Scanning and Mapping Projects > Mine Mapping > Investigation 2

Worksheet Answer Key: Scanning and Mapping Projects > Mine Mapping > Investigation 2 Worksheet Answer Key: Scanning and Mapping Projects > Mine Mapping > Investigation 2 Ruler Graph: Analyze your graph 1. Examine the shape formed by the connected dots. i. Does the connected graph create

More information

Localization, Where am I?

Localization, Where am I? 5.1 Localization, Where am I?? position Position Update (Estimation?) Encoder Prediction of Position (e.g. odometry) YES matched observations Map data base predicted position Matching Odometry, Dead Reckoning

More information

Mobile Robots: An Introduction.

Mobile Robots: An Introduction. Mobile Robots: An Introduction Amirkabir University of Technology Computer Engineering & Information Technology Department http://ce.aut.ac.ir/~shiry/lecture/robotics-2004/robotics04.html Introduction

More information

Jane Li. Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute

Jane Li. Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute Jane Li Assistant Professor Mechanical Engineering Department, Robotic Engineering Program Worcester Polytechnic Institute (3 pts) How to generate Delaunay Triangulation? (3 pts) Explain the difference

More information

Constrained Optimization Path Following of Wheeled Robots in Natural Terrain

Constrained Optimization Path Following of Wheeled Robots in Natural Terrain Constrained Optimization Path Following of Wheeled Robots in Natural Terrain Thomas M. Howard, Ross A. Knepper, and Alonzo Kelly The Robotics Institute Carnegie Mellon University 5000 Forbes Avenue, Pittsburgh,

More information

Mechanical Design Challenges for Collaborative Robots

Mechanical Design Challenges for Collaborative Robots Motor Technologies Mechanical Design Challenges for Collaborative Robots TN-3301 REV 170526 THE CHALLENGE Robotics and additive manufacturing markets have entered into a new phase of growth. This growth

More information

To Do. History of Computer Animation. These Lectures. 2D and 3D Animation. Computer Animation. Foundations of Computer Graphics (Spring 2010)

To Do. History of Computer Animation. These Lectures. 2D and 3D Animation. Computer Animation. Foundations of Computer Graphics (Spring 2010) Foundations of Computer Graphics (Spring 2010) CS 184, Lecture 24: Animation http://inst.eecs.berkeley.edu/~cs184 To Do Submit HW 4 (today) Start working on HW 5 (can be simple add-on) Many slides courtesy

More information

Obstacle Avoidance Project: Final Report

Obstacle Avoidance Project: Final Report ERTS: Embedded & Real Time System Version: 0.0.1 Date: December 19, 2008 Purpose: A report on P545 project: Obstacle Avoidance. This document serves as report for P545 class project on obstacle avoidance

More information

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino

ROBOTICS 01PEEQW. Basilio Bona DAUIN Politecnico di Torino ROBOTICS 01PEEQW Basilio Bona DAUIN Politecnico di Torino Control Part 4 Other control strategies These slides are devoted to two advanced control approaches, namely Operational space control Interaction

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

Robotics and Autonomous Systems

Robotics and Autonomous Systems Robotics and Autonomous Systems Lecture 6: Perception/Odometry Terry Payne Department of Computer Science University of Liverpool 1 / 47 Today We ll talk about perception and motor control. 2 / 47 Perception

More information

Robotics and Autonomous Systems

Robotics and Autonomous Systems Robotics and Autonomous Systems Lecture 6: Perception/Odometry Simon Parsons Department of Computer Science University of Liverpool 1 / 47 Today We ll talk about perception and motor control. 2 / 47 Perception

More information

How Adaptive Systems unlock big productivity gains

How Adaptive Systems unlock big productivity gains profile Drive & Control Technical Article How Adaptive Systems unlock big productivity gains In this article, helpful insights regarding: Identifying applications where vibration control can boost throughput

More information

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary

Zürich. Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza. ETH Master Course: L Autonomous Mobile Robots Summary Roland Siegwart Margarita Chli Martin Rufli Davide Scaramuzza ETH Master Course: 151-0854-00L Autonomous Mobile Robots Summary 2 Lecture Overview Mobile Robot Control Scheme knowledge, data base mission

More information

Goals: Course Unit: Describing Moving Objects Different Ways of Representing Functions Vector-valued Functions, or Parametric Curves

Goals: Course Unit: Describing Moving Objects Different Ways of Representing Functions Vector-valued Functions, or Parametric Curves Block #1: Vector-Valued Functions Goals: Course Unit: Describing Moving Objects Different Ways of Representing Functions Vector-valued Functions, or Parametric Curves 1 The Calculus of Moving Objects Problem.

More information

[ Ω 1 ] Diagonal matrix of system 2 (updated) eigenvalues [ Φ 1 ] System 1 modal matrix [ Φ 2 ] System 2 (updated) modal matrix Φ fb

[ Ω 1 ] Diagonal matrix of system 2 (updated) eigenvalues [ Φ 1 ] System 1 modal matrix [ Φ 2 ] System 2 (updated) modal matrix Φ fb Proceedings of the IMAC-XXVIII February 1 4, 2010, Jacksonville, Florida USA 2010 Society for Experimental Mechanics Inc. Modal Test Data Adjustment For Interface Compliance Ryan E. Tuttle, Member of the

More information

The Jello Cube Assignment 1, CSCI 520. Jernej Barbic, USC

The Jello Cube Assignment 1, CSCI 520. Jernej Barbic, USC The Jello Cube Assignment 1, CSCI 520 Jernej Barbic, USC 1 The jello cube Undeformed cube Deformed cube The jello cube is elastic, Can be bent, stretched, squeezed,, Without external forces, it eventually

More information