Control Architecture Design For Autonomous Vehicles

1y ago
13 Views
2 Downloads
2.14 MB
10 Pages
Last View : 4m ago
Last Download : 3m ago
Upload by : Laura Ramon
Transcription

MITSUBISHI ELECTRIC RESEARCH LABORATORIEShttp://www.merl.comControl Architecture Design for Autonomous VehiclesBerntorp, K.; Hoang, T.; Quirynen, R.; Di Cairano, S.TR2018-125August 25, 2018AbstractThe system design of an autonomous vehicle encompasses numerous different interconnectedsensing and control algorithms that can be devised in several ways, and the system has to beextensively tested and verified before employed on roads. Full-scale testing of such a systemis complex due to the involved time effort, cost aspects, and safety considerations. In thistutorial paper, we give an overview of the design, implementation, and testing of the controlstack in autonomous vehicles, based on our research on motion planning and control. We usescaled vehicles as part of the testing and verification of the system design. Scaled vehiclesprovide possibilities to test some of the relevant interplay in the control stack and robustnessto time delays and sensor errors. We illustrate how scaled vehicles can help reduce the amountof full-scale testing, by finding shortcomings of the system design before deploying it on afull-scale test setup.Conference on Control Technology and Applications (CCTA)This work may not be copied or reproduced in whole or in part for any commercial purpose. Permission to copy inwhole or in part without payment of fee is granted for nonprofit educational and research purposes provided that allsuch whole or partial copies include the following: a notice that such copying is by permission of Mitsubishi ElectricResearch Laboratories, Inc.; an acknowledgment of the authors and individual contributions to the work; and allapplicable portions of the copyright notice. Copying, reproduction, or republishing for any other purpose shall requirea license with payment of fee to Mitsubishi Electric Research Laboratories, Inc. All rights reserved.Copyright c Mitsubishi Electric Research Laboratories, Inc., 2018201 Broadway, Cambridge, Massachusetts 02139

Control Architecture Design for Autonomous VehiclesKarl Berntorp1 , Tru Hoang1 , Rien Quirynen1 , and Stefano Di Cairano1Abstract— The system design of an autonomous vehicleencompasses numerous different interconnected sensing andcontrol algorithms that can be devised in several ways, and thesystem has to be extensively tested and verified before employedon roads. Full-scale testing of such a system is complex due tothe involved time effort, cost aspects, and safety considerations.In this tutorial paper, we give an overview of the design,implementation, and testing of the control stack in autonomousvehicles, based on our research on motion planning and control.We use scaled vehicles as part of the testing and verificationof the system design. Scaled vehicles provide possibilities totest some of the relevant interplay in the control stack androbustness to time delays and sensor errors. We illustrate howscaled vehicles can help reduce the amount of full-scale testing,by finding shortcomings of the system design before deployingit on a full-scale test setup.I. I NTRODUCTIONSelf-driving cars are decision-making systems whose complexity scales with the level of autonomy. In the highestlevel of autonomy, Level 5, the self-driving car should beable to provide full-time operation of all aspects of drivingunder different roadway and environmental conditions. Thecontrol architecture and its components can be designedand interconnected in different ways, but, at high level,the system structure of a vehicle with at least partial selfdriving capabilities resembles that of Fig. 1 [1]. Each blockin Fig. 1 typically consists of several subcomponents, withvarious communication and sensor interfaces connectingeach block [2], [3]. The sensing and mapping module usesvarious sensor information, such as radar, Lidar, camera,and global positioning system (GPS), together with priormap information, to estimate the parts of the surroundingenvironment relevant to the driving scenario. The motionplanning block can be abstracted to include a route plannerthat finds a route on the road network, a discrete decisionlayer that determines the local driving behavior in terms of,for example, whether to stop at an intersection or to changelane, and a trajectory planner that determines a referencetrajectory the vehicle should follow. The vehicle-controlblock computes adjusted control commands and tracks thereference trajectories from the motion planner. The controlcommands are subsequently realized by the actuator controlthat is responsible for the low-level steering and accelerationtorque commands. While autonomous vehicles increasinglybegin testing on public roads, production vehicles are morecommonly being equipped with advanced driver-assistance1 ories (MERL), 02139 Cambridge, MA, USA, Email:karl.o.berntorp@ieee.orgMotion planningSensing & mappingVehicle controlEnvironmentActuator controlVehicleFig. 1. A high-level view of the system architecture of an autonomousvehicle from a control perspective, with the control and guidance stack inblue color. The different blocks can be interconnected in various ways butthe main building blocks remain the same.systems (ADAS) such as adaptive cruise control and lanechange assist. This is driven by both safety and economic aspects such as the high number of traffic accidents associatedwith overtaking and lane-change maneuvers and potentialfuel savings [4].There are a number of key issues to solve before selfdriving cars become fully operational on public roads. Forinstance, designing a control stack that is inherently safe,and with redundancy to handle cases when one or severalcomponents fail, is a challenge by itself, as illustrated inthe DARPA Grand and Urban Challenges [2], [3], [5]–[7].However, also verifying in practice that the control systemis indeed safe further complicates the task. A bottle-neckin designing algorithms for enabling self-driving capabilitiesis the amount of testing and verification of the differentcomponents contained in Fig. 1 [8]. For full-scale tests,the cost of maintaining testing infrastructure and personnel,implementing safety precautions, as well as the time for deploying the algorithms on the vehicle, may have a significantimpact on the time for developing the autonomous vehicle.Computer simulations help in designing the algorithms,but cannot entirely capture unmodeled failure modes andcircumstances [9]. Another way to complement full-scaletesting is to use scaled vehicles that resemble regular vehiclesin terms of kinematics, computation, and sensing capabilities, but without enforcing the strict safety regulationsand costs associated with full-scale testing. While scaledvehicles lack the ability to test the self-driving system underevery potential environment, they can help in reducing theamount of time needed to be spent on full-scale testing while

still capturing the relevant interplay between the differentcontrollers and the connections to other building blocks ofan autonomous vehicle. For instance, the interaction betweenthe motion planner and vehicle controller, the driving behavior, and the robustness to timing delays and sensing errorscan be evaluated using scaled vehicles.Scaled vehicles have been used to verify parts of thecontrol stack in previous works, see, for example, [10]–[12].Our recent research on vehicles with self-driving capabilitieshas been on estimation [13], [14], motion planning [15]–[17], and vehicle control algorithms [18], [19], which areall important components for self-driving cars. In this paper,we give an example design of the control architecture of anautonomous vehicle. Based on some of our recent researchon control and estimation algorithms for enabling selfdriving cars [15], [18], [20], we show how a scaled vehicleplatform can be used to test and verify the operation of thecontrol stack. Based on the structure in Fig. 1, we describe asystematic way of designing the different control blocks, andestimators are designed to increase robustness of the systemto sensing errors and inherent timing delays. Specifically, weleverage a recently developed sampling-based motion planner[15] for generating desired trajectories and model predictivecontrol (MPC) [21], [22] for tracking the desired trajectories.We point out important implementation details for achievinggood performance in practice and evaluate different aspectsof the control performance.The rest of the paper starts with a description of ourvehicle test setup in Sec. II, and Sec. III discusses themodeling and estimation aspects involved when designingthe control stack. Sec. IV provides the design of the planningand control layer. The section focuses on the motion planningand real-time vehicle control aspects of the system design.The paper continues with an experimental evaluation inSec. V and is concluded in Sec. VI.II. S CALED V EHICLE E XPERIMENTAL P LATFORMWe use the Hamster platform [23] for testing and verifyingour control stack before deploying on a full-scale vehicle,see Fig. 2. The Hamster is a 25 20 cm mobile robotfor research and prototype development. It is equipped withscaled versions of sensors commonly available on full-scaleresearch vehicles, such as a 6 m range mechanically rotating360 deg Lidar, an inertial measurement unit, GPS receiver,HD camera, and motor encoders. It uses two RaspberryPI3 computing platforms, each with an ARM Cortex-A53processor running Linux Ubuntu for processing. The robothas Ackermann steering and is therefore kinematically equivalent to a full-scale vehicle, and its dynamics, such as thesuspension system, resembles that of a regular vehicle. Oursetup consists of multiple Hamster robots. The Hamster hasa low-level controller with dedicated hardware for powerdistribution and monitoring. By default, the Hamster iscontrolled by setting the desired wheel-steering angle andlongitudinal velocity. In addition, the Hamster has built-inmapping and localization capabilities, and object detectionand tracking can be done with the onboard Lidar and/orFig. 2.The Ackermann-steered Hamster mobile robot used in theexperiments. The markers (five visible in the figure) are used to track therobot via an Optitrack motion-capture system (Fig. 3).Fig. 3. A camera from the Optitrack motion-capture system used forverifying our control and estimation algorithms.camera. Hence, the platform is a good proxy for verifyingdynamic feasibility and for testing the performance of thesystem in a realistic setting, with a sensor setup similar to theone expected in full-scale autonomous vehicles. The Hamstercommunicates and connects to external algorithms using therobot operating system (ROS).To be able to evaluate the control and estimation algorithms in terms of tracking errors and resulting trajectoriesin a controlled environment, we use an Optitrack motioncapture system [24]. The Optitrack system is a flexiblecamera-based (see Fig. 3) six degrees-of-freedom trackingsystem that can be used for tracking drones, ground, andindustrial robots. Depending on the environment and qualityof the calibration, the system can track the position of theHamster within 0.9 mm and with a rotational error of lessthan 3 deg. The OptiTrack can be connected to the ROSnetwork using the common VRPN protocol.III. M ODELING AND E STIMATIONWe refer to the autonomous vehicle as the ego vehicle(EV). Other moving entities in the region of interest (ROI) ofthe EV are designated as other vehicles (OV). The OVs canbe either in autonomous or manual mode. The modeling ofthe EV can be done either with respect to the global inertialframe, or in local vehicle frame coordinates with respect to aroad-aligned noninertial frame. In a practical implementationthe alternatives have different limitations depending on theparticular driving scenario. In the following, we model thevehicle with respect to the global inertial frame.The planning and control schemes typically employ receding horizon implementations, in that they rely on models ofthe environment and the EV itself to predict its evolution inrelation to the environment, depending on the control inputs.There is a tradeoff between the complexity and the accuracyof the models, which has to be taken into consideration whenchoosing the models. In this section we describe a specific

lflrvfψαfβδFig. 4.αrxFx,fFy,fvrFx,rvyFy,rA schematic of the single-track model and related notation.choice of EV and OV motion models, but the algorithms aregeneral and hence applicable to any EV and OV model.A. Vehicle ModelFor the vehicle, there are three categories of models;point-mass models that represent the vehicle as a particle;kinematic models that only consider the geometry of thevehicle; and dynamic models that account for the forcemass balances and tire models to more accurately capture thevehicle motion under (highly) dynamic maneuvers. Althougha model based on force-mass balances is generally moreaccurate than a kinematic model, the differences are small forregular driving [25], and model errors are corrected for by thefeedback control functions (Fig. 1). Furthermore, a dynamicmodel depends on more parameters, such as the wheel radii,tire stiffness, and vehicle mass and inertia, which typicallyare unknown/uncertain and may be difficult, or at leasttedious, to estimate. Under the assumption of normal drivingconditions (i.e., not at-the-limit maneuvers) the modeling canbe based on a single-track model, see Fig. 4, where the twowheels on each wheel axle are lumped together. Hence, inthis paper we use the kinematic single-track model vx cos(ψ β)/ cos(β)ṗX ṗY vx sin(ψ β)/ cos(β) , (1)ẋ vx tan(δ)/L ψ̇ v̇x u1δ̇u2where pX , pY is the longitudinal and lateral position inthe world frame, respectively, ψ̇ is the heading rate of thevehicle, vx is the longitudinal velocity of the vehicle, δ is thesteering angle of the front wheel, L : lf lr is the wheelbase, and β is β : arctan (lr tan(δ)/L) is the body-slipangle. The inputs u1 , u2 are the acceleration and steeringrate, respectively. This choice of control inputs allows toprovide smooth velocity and steering profiles and to constrainthe allowed rate of changes of the velocity and steering angle.In short, we write (1) asẋ f (x) g(x)u.(2)We impose various state and input constraints on thevehicle motion. For instance, the steering angle δ is subjectto the linear constraintδmin δ δmax .(3)This constraint is determined by the physical limitations ofthe vehicle (i.e., maximum steering angle) or induced byensuring that the assumptions made for deriving (1) hold.For instance, the linear single-track model is valid for lateralaccelerations up to approximately 0.4g on dry asphalt, whereg is the gravitational acceleration. Hence, limitations on δ canbe set by the relation to ψ̇ for steady-state cornering [26].The input constraints on the steering rate δ̇ and acceleration v̇x are formulated as linear constraints similar to (3),δ̇min δ̇ δ̇max ,(4a)v̇x,min v̇x v̇x,max ,(4b)where the bounds in (4) are determined as a tradeoff betweenthe allowed level of aggressiveness and driving comfort.B. Environment ModelFor a trajectory-generation system it is necessary to determine the time-varying obstacle spaceXobs (t),(5)which essentially boils down to predicting the motion of themoving obstacles, as well as expressing the time-varyingand nonconvex road boundary constraint. Without motionprediction, the motion planner and vehicle control have toassume a static environment, which is unrealistic becausethe environment is typically dynamic and highly uncertain.Motion prediction (potentially including driver-intentionrecognition) can be approached in several ways. For example,deterministic methods predict a single future trajectory, whilestochastic methods represent the future trajectories withprobability density functions (PDFs), which are estimatedusing statistical methods such as Monte-Carlo sampling [27].Another common approach is to base the prediction onMarkov chains [25], [28] for reachable set computations [29].The road boundaries and OVs in the ROI impose constraintson the position of the EV. The road-boundary constraint canbe written asΓ(pX , pY ) 0,(6)where the function Γ is typically constructed from point-wisedata of the road and lane boundaries, for instance, obtainedfrom map data or cameras. In general the constraints due tothe OVs can take any shape. For instance, if the motion ofthe OVs is estimated by means of Kalman filters, a naturalchoice is to model the OVs as ellipsoids. Alternatively, theOVs can be modeled as having rectangular shape [30], or berepresented by particles [27], [31].The constraints resulting from (5), (6) are in generalnonconvex, and sometimes it may be too computationallydemanding to enforce such constraints in real-time in thevehicle control. In that case, it is possible to enforce (5),(6) with an additional margin in the motion-planning block,which has more computation time available, and then makesure that the vehicle stays within the same margin from thereference trajectory generated by the motion planner [18],thus enforcing the constraints.

In this paper, we model the OVs by assuming that they donot change lane in the planning horizon of the motion planner, and that the velocity change within one planning phaseis approximately constant. The predicted trajectories of theOVs are generated by designing lane-keeping controllers foreach OV, and uncertainty is incorporated by increasing thesize of the box surrounding the vehicle [30]. The predictedtrajectories are then used to create the obstacle region (5),which is used to constrain the trajectories generated by themotion planner. This approach is suitable if the update rateof the motion planner is sufficiently fast. Another benefitwith such an approach is that the motion planner we employcan straightforwardly find solutions to nonlinear/nonconvexproblems. As long as the vehicle control stays within thetolerance levels of the path, safety is therefore guaranteedfor the whole system.C. Sensor-Offset CompensationSeveral of the sensors found in the current generation ofproduction vehicles are typically of low cost and as a consequence prone to time-varying offset and scale errors, andmay have relatively low signal-to-noise ratio. For instance,the lateral acceleration and heading-rate measurements areknown to have drift and large noise in the sensor measurements, leading to measurements that are only reliable forprediction over a very limited time interval. Similarly, thesensor implicitly measuring the steering angle of the wheelshas an offset error that, when used for dead reckoning ina vehicle model, leads to prediction errors that accumulateover time.Knowing the steering angle is crucial for ADAS and autonomous vehicles, because the vehicle will operate withouthuman intervention for long periods of time. Without steering offset compensation, the vehicle control may becomeunstable, or at least perform poorly, as errors accumulate.Our method for steering offset compensation is based onthe vehicle model (1) with added Gaussian process noise toaccount for modeling errors. We model the steering angleoffset bδ with a random walk model,ḃδ wδ ,(7)where wδ is assumed Gaussian distributed process noise. Theresulting six-dimensional nonlinear model consisting of (1),(3), and (7) is estimated with an extended Kalman filter,which at each time step k produces a state estimate x̂k k thatis used in the vehicle control to compensate for the sensoroffset.IV. P LANNING AND C ONTROLIn this section we briefly discuss the control architecture,and specifically the motion planning and vehicle controlaspects. Referring to Fig. 1, the actuator control is handled inthe low-level controllers in the scaled vehicle and is not partof this evaluation. Similarly, the route planning, sometimesinside the motion-planning block, is not treated in this paper.A. Motion PlanningThe objective of the motion planner is to determine acollision-free trajectory the vehicle should follow based onthe outputs from the sensing and mapping module, whileobeying the vehicle dynamics and reaching the goal regionXgoal determined by the decision-making module. The goalregion Xgoal can be a specific location on the road or a targetset, such as a desired lane.Sampling-based methods, such as RRT and its variants[32], have been subject to much research over the last twodecades, and have been used successfully in autonomousvehicles [33]. Sampling-based methods are focused towardincrementally building a feasible path, or a sequence offeasible paths that converge to an optimal path, given enoughcomputation time. RRT is an important instance of samplingbased methods, which has found various applications [32].RRT-type algorithms incrementally build a tree by selecting arandom sample and expanding the tree towards that sample.Checking if the sample and the corresponding edge is inXobs amounts to pointwise comparison. Therefore, RRT doesnaturally integrate with some of the methods for determiningthe drivable space, since it does not require a geometric expression for Xobs , as opposed to some graph-search methods,during the construction phase.In [15], we have developed a variant of the RRT basedon particle filtering (PF) for generating complex trajectories,which optionally includes decision making embedded in theplanner. Particle filtering is a sampling-based technique forsolving the nonlinear filtering problem. The particle filter(PF) numerically approximates the PDF of the variables ofinterest given the measurement history, by generating Nrandom trajectories and assigning a weight q i to each oneaccording to how well they predict the observations. Theplanner relies on the fact that driving requirements, such asstaying on the road, right-hand traffic, and avoid obstacles,are known ahead of planning. The driving requirements aremodeled as measurements generated by an ideal system.An interpretation is then that the PF determines trajectoriesand scores them according to how likely they are to obeythe driving requirements. In each planning phase, the PFapproximates the joint probability density function of thestate trajectory conditioned on the decision and drivingrequirements.Specifically, our method formulates the vehicle model (1)and driving requirements in discrete time asxk 1 f (xk ) ḡ(xk )wx,k ,(8a)zk h(xk , m) wz,k ,(8b)where f and ḡ are discretized versions of (2) and k isthe discrete time index. The function h models the drivingrequirements and is dependent on the chosen decision m bythe decision maker. The terms wx,k and wz,k are disturbanceson the vehicle model and driving requirements, respectively. They are important to include for several reasons,for example, due to sensor noise from estimation algorithmsresponsible for estimating the vehicle state and road map

and to avoid infeasibility in trying to fulfill all drivingrequirements exactly. The control inputs are in our approachcontained in the disturbance term wx,k .Using a Bayesian framework, (8a) and (8b) can be reformulated asxk 1 p(xk 1 xk ),(9a)zk p(zk xk , m),(9b)where xk 1 and zk are regarded as samples from therespective distributions. Given the vehicle dynamics (1), thegoal of the motion planner is to generate an input trajectoryuk , k [0, Tf ] over the planning horizon Tf satisfying theinput constraints (3), (4), such that when applied to (1) leadsto a trajectory ydes , k [0, Tf ] that obeys (6), ends upin Xgoal , and avoids the obstacle set (5). The PF estimatesthe PDF p(x0:k z0:k ) in each tree expansion toward the goalregion. In this paper we generate the desired trajectory byextracting the minimum mean-square estimate,ydes NXqki xi0:k ,(10)general and for vehicle-dynamics control in particular. MPCsolves at each time step a finite-horizon, possibly nonlinearand nonconvex, optimal-control problem (OCP) and appliesthe resulting control inputs to the system until the nextsampling time step. The MPC formulation depends on thenature of the model, constraints, computational resources,and performance guarantees. Most of the standard nonlinearoptimization tools are impractical in such a safety criticalembedded application as autonomous vehicle control. Thenonlinear and nonconvex OCP needs to be solved at eachsampling time instant under stringent timing requirements.For this purpose, tailored continuation-based online algorithms have been developed for solving these nonlinear OCPsin real-time [36].A common OCP formulation isZ TkF (x(t), u(t)) ydes (t)k2W dt(11a)minx(·), u(·)0s.t. 0 x(0) x̂0 ,0 f (ẋ(t), x(t), u(t)), t [0, T ],(11c)0 h(x(t), u(t)), t [0, T ],(11d)i 1in each tree expansion. This procedure is repeated untila solution is found. For more details, see [15]. For ourpurposes, we have implemented a high-level target-pointgenerator to create the goal region Xgoal .1) Implementation Aspects: Because of sensing errors andunpredicted changes in the environment, for instance, dueto new obstacles (5) entering the ROI, we implement themotion planner using a receding-horizon strategy. That is,the computed trajectory is Tf long but is only applied forthe time period t Tf , and the allocated computationtime for finding the motion plan is δt. We keep a committedtree-branch, where the leaf coincides with the root node ofthe next planning phase. The part of the tree that does notoriginate from the end node is deleted. Similar to [18], wepropagate tracking-error information from the vehicle controlto the motion planner. This helps in determining when todiscard the current motion plan and restart the planner.For instance, when the vehicle controller cannot maintainthe vehicle closer than some predefined threshold from thedesired trajectory ydes , the current motion plan is discardedand a new plan is computed, starting with an empty tree.Another aspect is the node to which we associate thecurrent position within the tree. At the start of the planningphase the motion planner acquires the EV state. The allocatedcomputation time of the motion planner is δt s. Hence, toassociate the node in the tree with the position the vehiclewill be in when starting to apply the generated motion plan,we predict the current estimated EV state for δt s using thevehicle model (1) and the last control value, and associate thepredicted EV state with the closest node in the tree, whichbecomes the root node of the next planning phase and allowsreusing at least part of the previously-computed tree.B. Vehicle Control by Model Predictive ControlMPC [21], [34], [35] has recently evolved as an importantapproach in the research literature for automotive control in(11b)0 r(x(T )),(11e)whose objective is tracking the desired trajectory ydes fromthe motion planner. The objective in (11a) consists of anonlinear least-squares type Lagrange term. For simplicity ofnotation, T defines both the control and prediction horizonlength and we do not consider a terminal (i.e., Mayer) costterm. Note that the NMPC problem depends on the currentstate estimate x̂0 through the initial condition (11b). Thevehicle dynamics in (11c) are described by an implicit systemof ordinary differential equations (ODE), which allows theformulation of kinematic, as well as single- and double-trackvehicle dynamics as described in [37]. However, in this paperwe for simplicity use the vehicle model (2), which is anexplicit ODE. Eqs. (11d) and (11e) denote respectively thepath and terminal inequality constraints.The constraints (11d) in the NMPC problem formulationconsist of geometric and physical limitations of the system. Depending on the particular maneuver and on whichconstraints are handled by the motion planner, one caninclude constraints on the longitudinal and lateral positionof the vehicle. However, in practice, it is important toreformulate these requirements as soft constraints because ofunknown disturbances and model approximations and errors.For simplicity, we define a quadratic penalization of the slackvariable to ensure a feasible solution whenever possible. Thesteering angle, steering rate, and acceleration constraints (3),(4) are included in (11d).The cost function in (11a) allows for formulating any standard tracking-type objective. In the presented experimentalresults, the NMPC scheme is based on a direct tracking ofa reference trajectory for the state and control variableskx(t) ydes (t)k2Q ku(t) udes (t)k2R γ e2y (t),(12)

where Q and R are the corresponding weighting matrices ofsuitable dimensions and γ is a scalar weight. The termey (·) cos (ψref )(pY pY,ref ) sin (ψref )(pX pX,ref )(13)is the projected distance from the reference trajectory, whichideally should be zero.1) Online Tracking of the Desired Trajectory: Similar tothe work in [18] and based on [26], we model the referencetrajectory ydes from the motion planner as a piecewiseclothoidal trajectory, such that the desired yaw angle ψdesand yaw rate ψ̇des of the vehicle can be described asψ̈des vdes (t)κ̇(t),(14)where vdes (t) denotes the reference velocity, and κ̇(t) denotes the curvature of the reference trajectory.2) Implementation Aspects: The nonlinear, nonconvexproblem (11) renders analytical solutions intractable. Instead,we transform the infinite dimensional OCP (11) into a nonlinear program (NLP) by a control and state parameterization.A popular approach is based on the direct multiple shootingmethod from [38]. We formulate an equidistant grid over thecontrol horizon consisting of the collection of time points ti ,T : Ts for i 0, . . . , N 1. Additionwhere ti 1 ti Nally, we consider a piecewise constant control parametrization u(τ ) ui for τ [ti , ti 1 ). The time discretization forthe state variables can then be obtained by simulating thesystem dynamics using a numerical integration scheme. Thiscorresponds to solving the fo

of the system design. Scaled vehicles provide possibilities to test some of the relevant interplay in the control stack and robustness to time delays and sensor errors. We illustrate how scaled vehicles can help reduce the amount of full-scale testing, by finding shortcomings of the system design before deploying it on a full-scale test setup. I.

Related Documents:

Bruksanvisning för bilstereo . Bruksanvisning for bilstereo . Instrukcja obsługi samochodowego odtwarzacza stereo . Operating Instructions for Car Stereo . 610-104 . SV . Bruksanvisning i original

10 tips och tricks för att lyckas med ert sap-projekt 20 SAPSANYTT 2/2015 De flesta projektledare känner säkert till Cobb’s paradox. Martin Cobb verkade som CIO för sekretariatet för Treasury Board of Canada 1995 då han ställde frågan

service i Norge och Finland drivs inom ramen för ett enskilt företag (NRK. 1 och Yleisradio), fin ns det i Sverige tre: Ett för tv (Sveriges Television , SVT ), ett för radio (Sveriges Radio , SR ) och ett för utbildnings program (Sveriges Utbildningsradio, UR, vilket till följd av sin begränsade storlek inte återfinns bland de 25 största

Hotell För hotell anges de tre klasserna A/B, C och D. Det betyder att den "normala" standarden C är acceptabel men att motiven för en högre standard är starka. Ljudklass C motsvarar de tidigare normkraven för hotell, ljudklass A/B motsvarar kraven för moderna hotell med hög standard och ljudklass D kan användas vid

LÄS NOGGRANT FÖLJANDE VILLKOR FÖR APPLE DEVELOPER PROGRAM LICENCE . Apple Developer Program License Agreement Syfte Du vill använda Apple-mjukvara (enligt definitionen nedan) för att utveckla en eller flera Applikationer (enligt definitionen nedan) för Apple-märkta produkter. . Applikationer som utvecklas för iOS-produkter, Apple .

Page 2 Autonomous Systems Working Group Charter n Autonomous systems are here today.How do we envision autonomous systems of the future? n Our purpose is to explore the 'what ifs' of future autonomous systems'. - 10 years from now what are the emerging applications / autonomous platform of interest? - What are common needs/requirements across different autonomous

systems to autonomous systems. Firstly, the autonomy and autonomous systems in different fields are summarized. The article classifies and summarizes the architecture of typical automated systems and infer three suggestions for building an autonomous system architecture: extensibility, evolvability, and collaborability.

och krav. Maskinerna skriver ut upp till fyra tum breda etiketter med direkt termoteknik och termotransferteknik och är lämpliga för en lång rad användningsområden på vertikala marknader. TD-seriens professionella etikettskrivare för . skrivbordet. Brothers nya avancerade 4-tums etikettskrivare för skrivbordet är effektiva och enkla att

Den kanadensiska språkvetaren Jim Cummins har visat i sin forskning från år 1979 att det kan ta 1 till 3 år för att lära sig ett vardagsspråk och mellan 5 till 7 år för att behärska ett akademiskt språk.4 Han införde två begrepp för att beskriva elevernas språkliga kompetens: BI

**Godkänd av MAN för upp till 120 000 km och Mercedes Benz, Volvo och Renault för upp till 100 000 km i enlighet med deras specifikationer. Faktiskt oljebyte beror på motortyp, körförhållanden, servicehistorik, OBD och bränslekvalitet. Se alltid tillverkarens instruktionsbok. Art.Nr. 159CAC Art.Nr. 159CAA Art.Nr. 159CAB Art.Nr. 217B1B

produktionen sker på ett reproducerbart sätt. Alla geler som produceras testas därför för att kontrollera att de upprätthåller den kvalité som krävs för produktion av läkemedel. De biologiska läkemedlen kan sorteras på olika egenskaper och för geler som separerar med

An Asahi Kasei Group Company Inledning Den här manualen innehåller handhavandeinstruktioner för webbportalen Senseair Dashboard med dess användare som tänkta läsare. Inledningsvis beskrivs några begrepp som lägger grunden för behörigheter i systemet. Därefter följer steg för steg instruktioner av alla funktioner i systemet.

Att läsa och förstå Läsförståelse av vad och för vad? Att läsa och förstå. Skolverket. KUNSKAPSÖVERSIKT KUNSKAPSÖVERSIKT. Forskning visar att läsförståelsen påverkar möjlig heterna att tillägna sig kunskaper i alla skolämnen. Men vad kan skolan göra för att stödja elevers läs förståelse genom hela grundskolan?

This presentation and SAP's strategy and possible future developments are subject to change and may be changed by SAP at any time for any reason without notice. This document is 7 provided without a warranty of any kind, either express or implied, including but not limited to, the implied warranties of merchantability, fitness for a .

Autonomous Differential Equations 1. A differential equation of the form y0 F(y) is autonomous. 2. That is, if the right side does not depend on x, the equation is autonomous. 3. Autonomous equations are separable, but ugly integrals and expressions that cannot be solved for y make qualitative analysis sensible. 4.

Florida Statutes - Autonomous Vehicles (2016) HB 7027, signed April 4. th. 2016 - updates: F.S. 316.85 -Autonomous Vehicles; Operation (1) "A person who possesses a valid driver license may operate an autonomous vehicle in autonomous mode on roads in this state if the vehicle is equipped with autonomous technology, as defined in s. 316. .

The overall design of the autonomous pesticide spraying robot is illustrated in Fig. 1. The design is done using Solidwork software and the development of the autonomous pesticide spraying system based on the design. The specification of the autonomous pesticide spraying robot is shown in Table I.

What is Computer Architecture? “Computer Architecture is the science and art of selecting and interconnecting hardware components to create computers that meet functional, performance and cost goals.” - WWW Computer Architecture Page An analogy to architecture of File Size: 1MBPage Count: 12Explore further(PDF) Lecture Notes on Computer Architecturewww.researchgate.netComputer Architecture - an overview ScienceDirect Topicswww.sciencedirect.comWhat is Computer Architecture? - Definition from Techopediawww.techopedia.com1. An Introduction to Computer Architecture - Designing .www.oreilly.comWhat is Computer Architecture? - University of Washingtoncourses.cs.washington.eduRecommended to you b

12 Architecture, Interior Design & Landscape Architecture Enroll at uclaextension.edu or call (800) 825-9971 Architecture & Interior Design Architecture Prerequisite Foundation Level These courses provide fundamental knowledge and skills in the field of interior design. For more information on the Master of Interior Architecture

of control architecture and the transition among them for a Long Range Autonomous Space Rover. We used a graphical programming for the design of the control architecture as a common and intuitive languague for a design team composed of managers, architecture designers, engineers, programmers, and maintenance personnel.