• Refine Query
  • Source
  • Publication year
  • to
  • Language
  • 106
  • 23
  • 12
  • 10
  • 5
  • 5
  • 5
  • 3
  • 1
  • Tagged with
  • 206
  • 206
  • 59
  • 58
  • 49
  • 38
  • 32
  • 30
  • 29
  • 29
  • 26
  • 23
  • 22
  • 20
  • 17
  • About
  • The Global ETD Search service is a free service for researchers to find electronic theses and dissertations. This service is provided by the Networked Digital Library of Theses and Dissertations.
    Our metadata is collected from universities around the world. If you manage a university/consortium/country archive and want to be added, details can be found on the NDLTD website.
11

A robotic approach to the analysis of obstacle avoidance in crane lift path planning

Lei, Zhen Unknown Date
No description available.
12

Efficient Planning of Humanoid Motions by Modifying Constraints

Uno, Yoji, Kagawa, Takahiro, Sung, ChangHyun 09 1900 (has links)
No description available.
13

A robotic approach to the analysis of obstacle avoidance in crane lift path planning

Lei, Zhen 06 1900 (has links)
Crane lift path planning is time-consuming, prone to errors, and requires the practitioners to have exceptional visualization abilities, in particular, as the construction site is congested and dynamically changing. This research presents a methodology based on robotics motion planning to numerically solve the crane path planning problem. The proposed methodology integrates a database in order to automatically conduct 2D path planning for a crane lift operation, and accounts for the rotation of the lifted object during its movements. The proposed methodology has been implemented into a computer module, which provides a user-friendly interface to aid the practitioners to perform a collision-free path planning, and check the feasibility of the path at different stages of the project. Three examples are described in order to demonstrate the effectiveness of the proposed methodology and illustrate the essential features of the developed module. / Construction Engineering and Management
14

Locomotion of bipedal humanoid robots: planning and learning to walk

Yik, Tak Fai, Computer Science & Engineering, Faculty of Engineering, UNSW January 2007 (has links)
Pure reinforcement learning does not scale well to domains with many degrees of freedom and particularly to continuous domains. In this thesis, we introduce a hybrid method in which a symbolic planner constructs all approximate solution to a control problem.. Subsequently, a numerical optimisation algorithm is used to refine the qualitative plan into an operational policy. The method is demonstrated on the problem of learning a stable walking gait for a bipedal robot. The contributions of this thesis are as follows. Firstly, the thesis proposes a novel way to generate gait patterns by using a genetic algorithm to generate walking gaits for a humanoid robot using zero moment point as the stability criterion. This is validated on physical robot. Second, we propose an innovative generic learning method that utilises the trainer's domain knowledge about the task to accelerate learning and extend the capabilities of the learning algorithm. The proposed method, which takes advantage of domain knowledge and combines symbolic planning and learning to accelerate and reduce the search space of the learning problem, is tested on a bipedal humanoid robot learning to walk. Finally, it is shown that the extended capability of the learning algorithm handles high complexity learning tasks in the physical world with experimental verification on a physical robot.
15

Kinodynamic motion planning for quadrotor-like aerial robots

Boeuf, Alexandre 05 July 2017 (has links) (PDF)
Motion planning is the field of computer science that aims at developing algorithmic techniques allowing the automatic computation of trajecto- ries for a mechanical system. The nature of such a system vary according to the fields of application. In computer animation it could be a humanoid avatar. In molecular biology it could be a protein. The field of application of this work being aerial robotics, the system is here a four-rotor UAV (Unmanned Aerial Vehicle) called quadrotor. The motion planning problem consists in computing a series of motions that brings the system from a given initial configuration to a desired final configuration without generating collisions with its environment, most of the time known in advance. Usual methods explore the system’s configuration space regardless of its dynamics. By construction the thrust force that allows a quadrotor to fly is tangential to its attitude which implies that not every motion can be performed. Furthermore, the magnitude of this thrust force and hence the linear acceleration of the center of mass are limited by the physical capabilities of the robot. For all these reasons, not only position and orientation must be planned, higher derivatives must be planned also if the motion is to be executed. When this is the case we talk of kinodynamic motion planning. A distinction is made between the local planner and the global planner. The former is in charge of producing a valid trajectory between two states of the system without necessarily taking collisions into account. The later is the overall algorithmic process that is in charge of solving the motion planning problem by exploring the state space of the system. It relies on multiple calls to the local planner. We present a local planner that interpolates two states consisting of an arbitrary number of degrees of freedom (dof) and their first and second derivatives. Given a set of bounds on the dof derivatives up to the fourth order (snap), it quickly produces a near-optimal minimum time trajectory that respects those bounds. In most of modern global motion planning algorithms, the exploration is guided by a distance function (or metric). The best choice is the cost-to-go, i.e. the cost associated to the local method. In the context of kinodynamic motion planning, it is the duration of the minimal-time trajectory. The problem in this case is that computing the cost-to-go is as hard (and thus as costly) as computing the optimal trajectory itself. We present a metric that is a good approximation of the cost-to-go but which computation is far less time consuming. The dominant paradigm nowadays is sampling-based motion planning. This class of algorithms relies on random sampling of the state space in order to quickly explore it. A common strategy is uniform sampling. It however appears that, in our context, it is a rather poor choice. Indeed, a great majority of uniformly sampled states cannot be interpolated. We present an incremental sampling strategy that significantly decreases the probability of this happening.
16

Imitation learning with dynamic movement primitives

Zhou, Haoying 17 May 2020 (has links)
Scientists have been working on making robots act like human beings for decades. Therefore, how to imitate human motion has became a popular academic topic in recent years. Nevertheless, there are infinite trajectories between two points in three-dimensional space. As a result, imitation learning, which is an algorithm of teaching from demonstrations, is utilized for learning human motion. Dynamic Movement Primitives (DMPs) is a framework for learning trajectories from demonstrations. Likewise, DMPs can also learn orientations given rotational movement's data. Also, the simulation is implemented on Robot Baxter which has seven degrees of freedom (DOF) and the Inverse Kinematic (IK) solver has been pre-programmed in the robot, which means that it is able to control a robot system as long as both translational and rotational data are provided. Taking advantage of DMPs, complex motor movements can achieve task-oriented regeneration without parametric adjustment and consideration of instability. In this work, discrete DMPs is utilized as the framework of the whole system. The sample task is to move the objects into the target area using Robot Baxter which is a robotic arm-hand system. For more effective learning, a weighted learning algorithm called Local Weighted Regression (LWR) is implemented. To achieve the goal, the weights of basis functions are firstly trained from the demonstration using DMPs framework as well as LWR. Then, regard the weights as learning parameters and substitute the weights, desired initial state, desired goal state as well as time-correlated parameters into a DMPs framework. Ultimately, the translational and rotational data for a new task-specific trajectory is generated. The visualized results are simulated and shown in Virtual Robot Experimentation Platform (VREP). For accomplishing the tasks better, independent DMP is used for each translation or rotation axis. With relatively low computational cost, motions with relatively high complexity can also be achieved. Moreover, the task-oriented movements can always be successfully stabilized even though there are some spatial scaling and transformation as well as time scaling. Twelve videos are included in supplementary materials of this thesis. The videos mainly describe the simulation results of Robot Baxter shown on Virtual Robot Experimentation Platform (VREP). The specific information can be found in the appendix.
17

Sampling-based Motion Planning Algorithms: Analysis and Development

Wedge, Nathan Alexander 15 April 2011 (has links)
No description available.
18

Development of Real Time Self Driving Software for Wheeled Robot with UI based Navigation

Keshavamurthi, Karthik Balaji 26 August 2020 (has links)
Autonomous Vehicles are complex modular systems with various inter-dependent safety critical modules, the failure of which leads to failure of the overall system. The Localization system, which estimates the pose of the vehicle in the global coordinate frame with respect to a map, has a drift in error, when operated only based on data from proprioceptive sensors. Current solutions to the problem are computationally heavy SLAM algorithms. An alternate system is proposed in the thesis which eliminates the drift by resetting the global coordinate frame to the local frame at every motion planning update. The system replaces the mission planner with a user interface(UI) onto which the User provides local navigation inputs, thus eliminating the need for maintenance of a Global frame. The User Input is considered in the decision framework of the behavioral planner, which selects a safe and legal maneuver for the vehicle to follow. The path and trajectory planners generate a trajectory to accomplish the maneuver and the controller follows the trajectory until the next motion planning update. A prototype of the system has been built on a wheeled robot and tested for the feasibility of continuous operation in Autonomous Vehicles. / Master of Science / Autonomous Vehicles are complex modular systems with various inter-dependent safety critical modules, the failure of which leads to failure of the overall system. One such module is the Localization system, that is responsible for estimating the pose of the vehicle in the global coordinate frame, with respect to a map. Based on the pose, the vehicle navigates to the goal waypoints, which are points in the global coordinate frame specified in the map by the route or mission planner of the planning module. The Localization system, however, consists of a drift in position error, due to poor GPS signals and high noise in the inertial sensors. This has been tackled by applying computationally heavy Simultaneous Localization and Mapping based methods, which identify landmarks in the environment at every time step and correct the vehicle position, based on the relative change in position of landmarks. An alternate solution is proposed in this thesis, which delegates navigation to the passenger. This system replaces the mission planner from the planning module with a User Interface onto which the passenger provides local Navigation input, which is followed by the vehicle. The system resets the global coordinate frame to the vehicle frame at every motion planning update, thus eliminating the error accumulated between the two updates. The system is also designed to perform default actions in the absence of user Navigation commands, to reduce the number of commands to be provided by the passenger in the journey towards the goal. A prototype of the system is built and tested for feasibility.
19

A Greedy Search Algorithm for Maneuver-Based Motion Planning of Agile Vehicles

Neas, Charles Bennett 29 December 2010 (has links)
This thesis presents a greedy search algorithm for maneuver-based motion planning of agile vehicles. In maneuver-based motion planning, vehicle maneuvers are solved offline and saved in a library to be used during motion planning. From this library, a tree of possible vehicle states can be generated through the search space. A depth-first, library-based algorithm called AD-Lib is developed and used to quickly provide feasible trajectories along the tree. AD-Lib combines greedy search techniques with hill climbing and effective backtracking to guide the search process rapidly towards the goal. Using simulations of a four-thruster hovercraft, AD-Lib is compared to existing suboptimal search algorithms in both known and unknown environments with static obstacles. AD-Lib is shown to be faster than existing techniques, at the expense of increased path cost. The motion planning strategy of AD-Lib along with a switching controller is also tested in an environment with dynamic obstacles. / Master of Science
20

Predictive Path Planning For Vehicles at Non-signalized Intersections

Wu, Xihui 23 September 2020 (has links)
In the context of path planning, the non-signalized intersections are always a challenging scenario due to the mixture of traffic flow. Most path planning algorithms use the information at the current time instance to generate an optimal path. Because of the dynamics of the non-signalized intersections, iteratively generating a path in a high frequency is necessary, resulting in an enormous waste of computational resources. Rapidly-exploring Random Tree (RRT) as an effective local path planning methodology can determine a feasible path in the static environment. Few improvements are proposed to adopt the RRT to the non-signalized intersections. Gaussian Processes Regression (GPR) is used to predict the other vehicles' future location. The location information in the current and future time instance is used to generate a probability position map. The map not only avoids useless sampling procedures but also increases the speed of generating a path. The optimal steering strategy is deployed to guarantee the trajectory is collision-free in both current and future time frames. Overall, the proposed probabilistic RRT algorithm can select a collision-free path in the non-signalized intersections by combining the GPR, probability position map, and optimal-steering. / Master of Science / Path planning problem is a challenge in the non-signalized intersections. Many path planning algorithms can generate an optimal path in the space domain but not in the time domain. Thus, the algorithms need to run iteratively at a high frequency to ensure the path's optimality in the time domain. By combining prediction and the standard RRT path planning algorithm, the resulting path ensures to be optimal in the space and time domain.

Page generated in 0.0282 seconds