471 research outputs found

    Optimization and Mathematical Modelling for Path Planning of Co-operative Intra-logistics Automated Vehicles

    Get PDF
    Small indoor Autonomous Vehicles have revolutionized the operation of pick-pack-and-ship warehouses. The challenges for path planning and co-operation in this domain stem from uncontrolled environments including workspaces shared with humans and human-operated vehicles. Solutions are needed which scale up to the largest existing sites with thousands of vehicles and beyond. These challenges might be familiar to anyone modelling road traffic control with the introduction of Autonomous Vehicles, but key differences in the level of decision autonomy lead to different approaches to conflict-resolution. This thesis proposes a decomposition of site-wide conflict-free motion planning into individual shortest paths though a roadmap representing the free space across the site, zone-based speed optimization to resolve conflicts in the vicinity of one intersection and individual path optimization for local obstacles. In numerical tests the individual path optimization based on clothoid basis functions created paths traversable by different vehicle configurations (steering rate limit, lateral acceleration limit and wheelbase) only by choosing an appropriate maximum longitudinal speed. Using two clothoid segments per convex region was sufficient to reach any goal, and the problem could be solved reliably and quickly with sequential quadratic programming due to the approximate graph method used to determine a good sequence of obstacle-free regions to the local goal. A design for zone-based intersection management, obtained by minimizing a linear objective subject to quadratic constraints was refined by the addition of a messaging interface compatible with the path adaptations based on clothoids. A new approximation of the differential constraints was evaluated in a multi-agent simulation of an elementary intersection layout. The proposed FIFO ordering heuristic converted the problem into a linear program. Interior point methods either found a solution quickly or showed that the problem was infeasible, unlike a quadratic constraint formulation with ordering flexibility. Subsequent tests on more complex multi-lane intersection geometries showed the quadratic constraint formulation converged to significantly better solutions than FIFO at the cost of longer and unpredictable search time. Both effects were magnified as the number of vehicles increased. To properly address site-wide conflict-free motion planning, it is essential that the local solutions are compatible with each other at the zone boundaries. The intersection management design was refined with new boundary constraints to ensure compatibility and smooth transitions without the need for a backup system. In numerical tests it was found that the additional boundary constraints were sufficient to ensure smooth transitions on an idealized map including two intersections

    Actuators for Intelligent Electric Vehicles

    Get PDF
    This book details the advanced actuators for IEVs and the control algorithm design. In the actuator design, the configuration four-wheel independent drive/steering electric vehicles is reviewed. An in-wheel two-speed AMT with selectable one-way clutch is designed for IEV. Considering uncertainties, the optimization design for the planetary gear train of IEV is conducted. An electric power steering system is designed for IEV. In addition, advanced control algorithms are proposed in favour of active safety improvement. A supervision mechanism is applied to the segment drift control of autonomous driving. Double super-resolution network is used to design the intelligent driving algorithm. Torque distribution control technology and four-wheel steering technology are utilized for path tracking and adaptive cruise control. To advance the control accuracy, advanced estimation algorithms are studied in this book. The tyre-road peak friction coefficient under full slip rate range is identified based on the normalized tyre model. The pressure of the electro-hydraulic brake system is estimated based on signal fusion. Besides, a multi-semantic driver behaviour recognition model of autonomous vehicles is designed using confidence fusion mechanism. Moreover, a mono-vision based lateral localization system of low-cost autonomous vehicles is proposed with deep learning curb detection. To sum up, the discussed advanced actuators, control and estimation algorithms are beneficial to the active safety improvement of IEVs

    Brachiating power line inspection robot: controller design and implementation

    Get PDF
    The prevalence of electrical transmission networks has led to an increase in productivity and prosperity. In 2014, estimates showed that the global electric power transmission network consisted of 5.5 million circuit kilometres (Ckm) of high-voltage transmission lines with a combined capacity of 17 million mega-volt ampere. The vastness of the global transmission grid presents a significant problem for infrastructure maintenance. The high maintenance costs, coupled with challenging terrain, provide an opportunity for autonomous inspection robots. The Brachiating Power Line Inspection Robot (BPLIR) with wheels [73] is a transmission line inspection robot. The BPLIR is the focus of this research and this dissertation tackles the problem of state estimation, adaptive trajectory generation and robust control for the BPLIR. A kinematics-based Kalman Filter state estimator was designed and implemented to determine the full system state. Instrumentation used for measurement consisted of 2 Inertial Measurement Units (IMUs). The advantages of utilising IMUs is that they are less susceptible to drift, have no moving parts and are not prone to misalignment errors. The use of IMU's in the design meant that absolute angles (link angles measured with respect to earth) could be estimated, enabling the BPLIR to navigate inclined slopes. Quantitative Feedback Control theory was employed to address the issue of parameter uncertainty during operation. The operating environment of the BPLIR requires it to be robust to environmental factors such as wind disturbance and uncertainty in joint friction over time. The resulting robust control system was able to compensate for uncertain system parameters and reject disturbances in simulation. An online trajectory generator (OTG), inspired by Raibert-style reverse-time symmetry[10], fed into the control system to drive the end effector to the power line by employing brachiation. The OTG produced two trajectories; one of which was reverse time symmetrical and; another which minimised the perpendicular distance between the end gripper and the power line. Linear interpolation between the two trajectories ensured a smooth bump-less trajectory for the BPLIR to follow

    Proceedings of the 3rd Annual Conference on Aerospace Computational Control, volume 1

    Get PDF
    Conference topics included definition of tool requirements, advanced multibody component representation descriptions, model reduction, parallel computation, real time simulation, control design and analysis software, user interface issues, testing and verification, and applications to spacecraft, robotics, and aircraft

    Fast and Safe Trajectory Optimization for Autonomous Mobile Robots using Reachability Analysis

    Full text link
    Autonomous mobile robots (AMRs) can transform a wide variety of industries including transportation, shipping and goods delivery, and defense. AMRs must match or exceed human performance in metrics for task completion and safety. Motion plans for AMRs are generated by solving an optimization program where collision avoidance and the trajectory obeying a dynamic model of the robot are enforced as constraints. This dissertation focuses on three main challenges associated with trajectory planning. First, collision checks are typically performed at discrete time steps. Second, there can be a nontrivial gap between the planning model used and the actual system. Finally, there is inherent uncertainty in the motion of other agents or robots. This dissertation first proposes a receding-horizon planning methodology called Reachability-based Trajectory Design (RTD) to address the first and second challenges, where uncertainty is dealt with robustly. Sums-of-Squares (SOS) programming is used to represent the forward reachable set for a dynamic system plus uncertainty, over an interval of time, as a polynomial level set. The trajectory optimization is a polynomial optimization program over a space of trajectory parameters. Hardware demonstrations are implemented on a Segway, rover, and electric vehicle. In a simulation of 1,000 trials with static obstacles, RTD is compared to Rapidly-exploring Random Tree (RRT) and Nonlinear Model Predictive Control (NMPC) planners. RTD has success rates of 95.4% and 96.3% for the Segway and rover respectively, compared to 97.6% and 78.2% for RRT and 0% for NMPC planners. RTD is the only successful planner with no collisions. In 10 simulations with a CarSim model, RTD navigates a test track on all trials. In 1,000 simulations with random dynamic obstacles RTD has success rates of 96.8% and 100% respectively for the electric vehicle and Segway, compared to 77.3% and 92.4% for a State Lattice planner. In 100 simulations performing left turns, RTD has a success rate of 99% compared to 80% for an MPC controller tracking the lane centerline. The latter half of the dissertation treats uncertainty with the second and/or third challenges probabilistically. The Chance-constrained Parallel Bernstein Algorithm (CCPBA) allows one to solve the trajectory optimization program from RTD when obstacle states are given as probability functions. A comparison for an autonomous vehicle planning a lane change with one obstacle shows an MPC algorithm using Cantelli's inequality is unable to find a solution when the obstacle's predictions are generated with process noise three orders of magnitude less than CCPBA. In environments with 1-6 obstacles, CCPBA finds solutions in 1e-3 to 1.2 s compared to 1 to 16 s for an NMPC algorithm using the Chernoff bound. A hardware demonstration is implemented on the Segway. The final portion of the dissertation presents a chance-constrained NMPC method where uncertain components of the robot model are estimated online. The application is an autonomous vehicle with varying road surfaces. In the first study, the controller uses a linear tire force model. Over 200 trials of lane changes at 17 m/s, the chance-constrained controller has a cost 86% less than a controller using fixed coefficients for snow, and only 29% more than an oracle controller using the simulation model. The chance-constrained controller also has 0 lateral position constraint violations, while an adaptive-only controller has minor violations. The second study uses nonlinear tire models on a more aggressive maneuver and provides similar results.PHDMechanical EngineeringUniversity of Michigan, Horace H. Rackham School of Graduate Studieshttp://deepblue.lib.umich.edu/bitstream/2027.42/169729/1/skvaskov_1.pd

    Exploiting structures of trajectory optimization for efficient optimal motion planning

    Get PDF
    Trajectory optimization is an important tool for optimal motion planning due to its flexibility in cost design, capability to handle complex constraints, and optimality certification. It has been widely used in robotic applications such as autonomous vehicles, unmanned aerial vehicles, humanoid robots, and highly agile robots. However, practical robotic applications often possess nonlinear dynamics and non-convex constraints and cost functions, which makes the trajectory optimization problem usually difficult to be efficiently solved to global optimum. The long computation time, possibility of non-convergence, and existence of local optima impose significant challenges to applying trajectory optimization in reactive tasks with requirements of real-time replanning. In this thesis, two structures of optimization problems are exploited to significantly improve the efficiency, i.e. computation time, reliability, i.e. success rate, and optimality, i.e. quality of the solution. The first structure is the existence of a convex sub-problem, i.e. the problem becomes convex if a subset of optimization variables is fixed and removed from the optimization. This structure exists in a wide variety of problems, especially where decomposition of spatial and temporal variables may result in convex sub-problem. A bilevel optimization framework is proposed that optimizes the subset and its complement hierarchically where the upper level optimizes the subset with convex constraints and the lower level uses convex optimization to solve its complement. The key is to use the solution of the lower level problem to compute analytic gradients for the upper-level problem. The bilevel framework is reliable due to its convex lower problem, efficient due to its simple upper problem, and yields better solutions than alternatives, although the existing requirement of convex sub-problem is generally too strict for many applications. The second structure is the local continuity of the argmin function for parametric optimization problems which map from problem parameters to the corresponding optimal solutions. The argmin function can be approximated from data which is collected offline by sampling the problem parameters and solving them to optima. Three approaches are proposed to learn the argmin from data each suited best for distinct applications. The nearest-neighbor optimal control searches problems with similar parameters and uses their solution to initialize nonlinear optimization. For problems with globally continuous argmin, neural networks can be used to learn from data and a few steps of convex optimization can further improve their predictions. As for problems with discontinuous argmin, mixture of experts (MoE) models are used. The MoE contains several experts and a classifier and is trained by splitting the data first according to discontinuity of argmin and then training each expert independently. Both empirical kk-Means and theoretical topological data analysis approaches are explored for discontinuity identification and finding suitable data splits. Both methods result in data splits that help train MoE models that outperform the discontinuity-agnostic learning pipeline using standard neural networks. The trajectory learning approach is efficient since it only requires model evaluation to compute a trajectory, reliable since the MoE model is accurate after correctly handling discontinuity, and optimal since the data are collected offline and solved to optimal. Moreover, this local continuity structure is less restrictive and exists for a wide range of non-degenerate problems. The exploitation of these two structures helps build an efficient optimal motion planner with high reliability

    Combining Sensors and Multibody Models for Applications in Vehicles, Machines, Robots and Humans

    Get PDF
    The combination of physical sensors and computational models to provide additional information about system states, inputs and/or parameters, in what is known as virtual sensing, is becoming increasingly popular in many sectors, such as the automotive, aeronautics, aerospatial, railway, machinery, robotics and human biomechanics sectors. While, in many cases, control-oriented models, which are generally simple, are the best choice, multibody models, which can be much more detailed, may be better suited to some applications, such as during the design stage of a new product
    • …
    corecore