scispace - formally typeset
Search or ask a question

Showing papers in "IEEE Transactions on Automation Science and Engineering in 2015"


Journal ArticleDOI
TL;DR: This survey considers robots and automation systems that rely on data or code from a network to support their operation, i.e., where not all sensing, computation, and memory is integrated into a standalone system.
Abstract: The Cloud infrastructure and its extensive set of Internet-accessible resources has potential to provide significant benefits to robots and automation systems. We consider robots and automation systems that rely on data or code from a network to support their operation, i.e., where not all sensing, computation, and memory is integrated into a standalone system. This survey is organized around four potential benefits of the Cloud: 1) Big Data: access to libraries of images, maps, trajectories, and descriptive data; 2) Cloud Computing: access to parallel grid computing on demand for statistical analysis, learning, and motion planning; 3) Collective Robot Learning: robots sharing trajectories, control policies, and outcomes; and 4) Human Computation: use of crowdsourcing to tap human skills for analyzing images and video, classification, learning, and error recovery. The Cloud can also improve robots and automation systems by providing access to: a) datasets, publications, models, benchmarks, and simulation tools; b) open competitions for designs and systems; and c) open-source software. This survey includes over 150 references on results and open challenges. A website with new developments and updates is available at: http://goldberg.berkeley.edu/cloud-robotics/

761 citations


Journal ArticleDOI
TL;DR: Rapyuta as mentioned in this paper is an open-source cloud robotics platform that helps robots to offload heavy computation by providing secured customizable computing environments in the cloud and allows robots to easily access the RoboEarth knowledge repository.
Abstract: In this paper, we present the design and implementation of Rapyuta, an open-source cloud robotics platform. Rapyuta helps robots to offload heavy computation by providing secured customizable computing environments in the cloud. The computing environments also allow the robots to easily access the RoboEarth knowledge repository. Furthermore, these computing environments are tightly interconnected, paving the way for deployment of robotic teams. We also describe three typical use cases, some benchmarking and performance results, and two proof-of-concept demonstrations.

237 citations


Journal ArticleDOI
TL;DR: This paper addresses the task scheduling and path planning problem for a team of cooperating vehicles performing autonomous deliveries in urban environments and proposes two additional algorithms, based on enumeration and a reduction to the traveling salesman problem, for this special case.
Abstract: This paper addresses the task scheduling and path planning problem for a team of cooperating vehicles performing autonomous deliveries in urban environments. The cooperating team comprises two vehicles with complementary capabilities, a truck restricted to travel along a street network, and a quadrotor micro-aerial vehicle of capacity one that can be deployed from the truck to perform deliveries. The problem is formulated as an optimal path planning problem on a graph and the goal is to find the shortest cooperative route enabling the quadrotor to deliver items at all requested locations. The problem is shown to be NP-hard. A solution is then proposed using a novel reduction to the Generalized Traveling Salesman Problem, for which well-established heuristic solvers exist. The heterogeneous delivery problem contains as a special case the problem of scheduling deliveries from multiple static warehouses. We propose two additional algorithms, based on enumeration and a reduction to the traveling salesman problem, for this special case. Simulation results compare the performance of the presented algorithms and demonstrate examples of delivery route computations over real urban street maps.

218 citations


Journal ArticleDOI
Yuan Yuan1, Hua Xu1
TL;DR: New memetic algorithms (MAs) for the multiobjective flexible job shop scheduling problem (MO-FJSP) with the objectives to minimize the makespan, total workload, and critical workload are proposed.
Abstract: In this paper, we propose new memetic algorithms (MAs) for the multiobjective flexible job shop scheduling problem (MO-FJSP) with the objectives to minimize the makespan, total workload, and critical workload. The problem is addressed in a Pareto manner, which aims to search for a set of Pareto optimal solutions. First, by using well-designed chromosome encoding/decoding scheme and genetic operators, the nondominated sorting genetic algorithm II (NSGA-II) is adapted for the MO-FJSP. Then, our MAs are developed by incorporating a novel local search algorithm into the adapted NSGA-II, where some good individuals are chosen from the offspring population for local search using a selection mechanism. Furthermore, in the proposed local search, a hierarchical strategy is adopted to handle the three objectives, which mainly considers the minimization of makespan, while the concern of the other two objectives is reflected in the order of trying all the possible actions that could generate the acceptable neighbor. In the experimental studies, the influence of two alternative acceptance rules on the performance of the proposed MAs is first examined. Afterwards, the effectiveness of key components in our MAs is verified, including genetic search, local search, and the hierarchical strategy in local search. Finally, extensive comparisons are carried out with the state-of-the-art methods specially presented for the MO-FJSP on well-known benchmark instances. The results show that the proposed MAs perform much better than all the other algorithms.

187 citations


Journal ArticleDOI
TL;DR: An adaptive cooperative control scheme is proposed for uncertain high-order nonlinear multi-agent systems, whose node' controlling effects are state-dependent, and the effectiveness of the control strategies is illustrated via simulation study.
Abstract: This paper investigates the cooperative control problem of uncertain high-order nonlinear multi-agent systems on directed graph with a fixed topology. Each follower is assumed to have an unknown controlling effect which depends on its own state. By the Nussbaum-type gain technique and the function approximation capability of neural networks, a distributed adaptive neural networks-based controller is designed for each follower in the graph such that all followers can asymptotically synchronize the leader with tracking errors being semi-globally uniform ultimate bounded. Analysis of stability and parameter convergence of the proposed algorithm are conducted based on algebraic graph theory and Lyapunov theory. Finally, a example is provided to validate the theoretical results.

180 citations


Journal ArticleDOI
TL;DR: An intention-guided control strategy is proposed and applied to an upper-limb power-assist exoskeleton and a new concept called the “intentional reaching direction (IRD)” is proposed to quantitatively describe this intention.
Abstract: Recognition of the wearer’s motion intention plays an important role in the study of power-assist robots In this paper, an intention-guided control strategy is proposed and applied to an upper-limb power-assist exoskeleton Meanwhile, a human-robot interface comprised of force-sensing resistors (FSRs) is designed to estimate the motion intention of the wearer's upper limb in real time Moreover, a new concept called the “intentional reaching direction (IRD)” is proposed to quantitatively describe this intention Both the state model and the observation model of IRD are obtained by studying the upper limb behavior modes and analyzing the relationship between the measured force signals and the motion intention Based on these two models, the IRD can be inferred online using an adapted filtering technique Guided by the inferred IRD, an admittance control strategy is deployed to control the motions of three DC motors placed at the corresponding joints of the robotic arm The effectiveness of the proposed approaches is finally confirmed by experiments on a 3 degree-of-freedom (DOF) upper-limb robotic exoskeleton

156 citations


Journal ArticleDOI
TL;DR: This paper presents an architecture, protocol, and parallel algorithms for collaborative 3D mapping in the cloud with low-cost robots, as well as quantitative evaluation of localization accuracy, bandwidth usage, processing speeds, and map storage.
Abstract: This paper presents an architecture, protocol, and parallel algorithms for collaborative 3D mapping in the cloud with low-cost robots. The robots run a dense visual odometry algorithm on a smartphone-class processor. Key-frames from the visual odometry are sent to the cloud for parallel optimization and merging with maps produced by other robots. After optimization the cloud pushes the updated poses of the local key-frames back to the robots. All processes are managed by Rapyuta, a cloud robotics framework that runs in a commercial data center. This paper includes qualitative visualization of collaboratively built maps, as well as quantitative evaluation of localization accuracy, bandwidth usage, processing speeds, and map storage.

133 citations


Journal ArticleDOI
TL;DR: This paper presents the software and hardware frameworks established to facilitate cloud-hosted robot simulation, and addresses the challenges associated with conducting a task-oriented robot competition designed to mimic reality.
Abstract: This paper presents the software framework established to facilitate cloud-hosted robot simulation. The framework addresses the challenges associated with conducting a task-oriented and real-time robot competition, the Defense Advanced Research Projects Agency (DARPA) Virtual Robotics Challenge (VRC), designed to mimic reality. The core of the framework is the Gazebo simulator, a platform to simulate robots, objects, and environments, as well as the enhancements made for the VRC to maintain a high fidelity simulation using a high degree of freedom and multisensor robot. The other major component used is the CloudSim tool, designed to enhance the automation of robotics simulation using existing cloud technologies. The results from the VRC and a discussion are also detailed in this work.

132 citations


Journal ArticleDOI
TL;DR: In this paper, the authors proposed a method for finding coordinated trajectories from start to destination for all the robots and then letting the robots follow the preplanned coordinated trajectory, where robots plan sequentially one after another.
Abstract: In autonomous multirobot systems one of the concerns is how to prevent collisions between the individual robots. One approach to this problem involves finding coordinated trajectories from start to destination for all the robots and then letting the robots follow the preplanned coordinated trajectories. A widely used practical method for finding such coordinated trajectories is “classical” prioritized planning, where robots plan sequentially one after another. This method has been shown to be effective in practice, but it is incomplete (i.e., there are solvable problem instances that the algorithm fails to solve) and it has not yet been formally analyzed under what circumstances is the method guaranteed to succeed. Further, prioritized planning is a centralized algorithm, which makes the method unsuitable for decentralized multirobot systems.

131 citations


Journal ArticleDOI
TL;DR: An automatic-segmentation-based screening approach with the single channel of Electrocardiogram (ECG) signal for OSA subject diagnosis and the main work of the proposed approach lies in three aspects: an automatic signal segmentation algorithm is adopted for signal segmentations instead of the equal-length segmentation rule.
Abstract: Traditional approaches for obstructive sleep apnea (OSA) diagnosis are apt to using multiple channels of physiological signals to detect apnea events by dividing the signals into equal-length segments, which may lead to incorrect apnea event detection and weaken the performance of OSA diagnosis. This paper proposes an automatic-segmentation-based screening approach with the single channel of Electrocardiogram (ECG) signal for OSA subject diagnosis, and the main work of the proposed approach lies in three aspects: (i) an automatic signal segmentation algorithm is adopted for signal segmentation instead of the equal-length segmentation rule; (ii) a local median filter is improved for reduction of the unexpected RR intervals before signal segmentation; (iii) the designed OSA severity index and additional admission information of OSA suspects are plugged into support vector machine (SVM) for OSA subject diagnosis. A real clinical example from PhysioNet database is provided to validate the proposed approach and an average accuracy of 97.41% for subject diagnosis is obtained which demonstrates the effectiveness for OSA diagnosis.

116 citations


Journal ArticleDOI
TL;DR: This paper proposes a new image-based process monitoring approach that is capable of handling both grayscale and color images and employs low-rank tensor decomposition techniques to extract important monitoring features monitored using multivariate control charts.
Abstract: Image and video sensors are increasingly being deployed in complex systems due to the rich process information that these sensors can capture. As a result, image data play an important role in process monitoring and control in different application domains such as manufacturing processes, food industries, medical decision-making, and structural health monitoring. Existing process monitoring techniques fail to fully utilize the information of color images due to their complex data characteristics including the high-dimensionality and correlation structure (i.e., temporal, spatial and spectral correlation). This paper proposes a new image-based process monitoring approach that is capable of handling both grayscale and color images. The proposed approach models the high-dimensional structure of the image data with tensors and employs low-rank tensor decomposition techniques to extract important monitoring features monitored using multivariate control charts. In addition, this paper shows the analytical relationships between different low-rank tensor decomposition methods. The performance of the proposed method in quick detection of process changes is evaluated and compared with existing methods through extensive simulations and a case study in a steel tube manufacturing process.

Journal ArticleDOI
TL;DR: Novel Gaussian process (GP) decentralized data fusion and active sensing algorithms for real-time, fine-grained traffic modeling and prediction with a fleet of MoD vehicles with theoretical performance guarantees are presented.
Abstract: Mobility-on-demand (MoD) systems have recently emerged as a promising paradigm of one-way vehicle sharing for sustainable personal urban mobility in densely populated cities. We assume the capability of a MoD system to be enhanced by deploying robotic shared vehicles that can autonomously cruise the streets to be hailed by users. A key challenge of the MoD system is that of real-time, fine-grained mobility demand and traffic flow sensing and prediction. This paper presents novel Gaussian process (GP) decentralized data fusion and active sensing algorithms for real-time, fine-grained traffic modeling and prediction with a fleet of MoD vehicles. The predictive performance of our decentralized data fusion algorithms are theoretically guaranteed to be equivalent to that of sophisticated centralized sparse GP approximations. We derive consensus filtering variants requiring only local communication between neighboring vehicles. We theoretically guarantee the performance of our decentralized active sensing algorithms. When they are used to gather informative data for mobility demand prediction, they can achieve a dual effect of fleet rebalancing to service mobility demands. Empirical evaluation on real-world datasets shows that our algorithms are significantly more time-efficient and scalable in the size of data and fleet while achieving predictive performance comparable to that of state-of-the-art algorithms.

Journal ArticleDOI
TL;DR: The problems of state estimation are investigated for switched linear systems with average dwell time (ADT) switching in both continuous-time and discrete-time contexts and sufficient conditions for the existence of the Luenberger-type observers are formulated in terms of a set of linear matrix inequalities.
Abstract: In this paper, the problems of state estimation are investigated for switched linear systems with average dwell time (ADT) switching in both continuous-time and discrete-time contexts. First, a set of mode-dependent Luenberger-type observers is designed subject to the ADT switching that is synchronous with the switching of the estimated systems. Then, a more practical case of the delayed observers is also considered, which implies that the switching of the multiple-mode observer to be designed has a lag to the switching of the estimated systems. In this case, the asynchronous switching signals are combined as a preliminary attempt, upon which sufficient conditions for the existence of the Luenberger-type observers and the corresponding ADT switching are formulated in terms of a set of linear matrix inequalities. Finally, the proposed approaches are applied to the state estimation of electronic circuits to demonstrate the effectiveness and applicability.

Journal ArticleDOI
TL;DR: An intelligent agent is developed, which provides four solutions to reconfigure the system at runtime and modifies their temporal parameters dynamically, in order to feasibly serve the probabilistic tasks and reduce the system's power consumption.
Abstract: This paper deals with the dynamic low-power reconfiguration of a real-time system. It processes periodic and probabilistic tasks that have hard/soft deadlines corresponding to internal/external events. A runtime event-based reconfiguration scenario is a dynamic operation allowing the addition/removal of the assumed periodic/probabilistic tasks. Thereafter, some tasks may miss their hard deadlines and the power consumption may increase. In order to reconfigure the system to be feasible, i.e., satisfying its real-time constraints with low-power consumption, this research presents a software-agent-based architecture. An intelligent agent is developed, which provides four solutions to reconfigure the system at runtime. For these solutions, in order to reconfigure the probabilistic tasks to be feasible, the agent modifies their temporal parameters dynamically; moreover, in order to feasibly serve the probabilistic tasks and reduce the system's power consumption, the agent provides three virtual processors by dynamically extending the periods of the periodic tasks. A simulation study verifies the effectiveness of the agent.

Journal ArticleDOI
TL;DR: This work proposes an analytical model-based approach for quality evaluation of Infrastructure-as-a-Service cloud by considering expected request completion time, rejection probability, and system overhead rate as key quality metrics.
Abstract: Cloud computing is a recently developed new technology for complex systems with massive service sharing, which is different from the resource sharing of the grid computing systems. In a cloud environment, service requests from users go through numerous provider-specific steps from the instant it is submitted to when the requested service is fully delivered. Quality modeling and analysis of clouds are not easy tasks because of the complexity of the automated provisioning mechanism and dynamically changing cloud environment. This work proposes an analytical model-based approach for quality evaluation of Infrastructure-as-a-Service cloud by considering expected request completion time, rejection probability, and system overhead rate as key quality metrics. It also features with the modeling of different warm-up and cool-down strategies of machines and the ability to identify the optimal balance between system overhead and performance. To validate the correctness of the proposed model, we obtain simulative quality-of-service (QoS) data and conduct a confidence interval analysis. The result can be used to help design and optimize industrial cloud computing systems.

Journal ArticleDOI
TL;DR: This work describes the RoboEarth semantic mapping system and shows the synergetic relation of the SLAM map of objects that grounds the terminological knowledge coded in the ontology.
Abstract: The vision of the RoboEarth project is to design a knowledge-based system to provide web and cloud services that can transform a simple robot into an intelligent one. In this work, we describe the RoboEarth semantic mapping system. The semantic map is composed of: 1) an ontology to code the concepts and relations in maps and objects and 2) a SLAM map providing the scene geometry and the object locations with respect to the robot. We propose to ground the terminological knowledge in the robot perceptions by means of the SLAM map of objects. RoboEarth boosts mapping by providing: 1) a subdatabase of object models relevant for the task at hand, obtained by semantic reasoning, which improves recognition by reducing computation and the false positive rate; 2) the sharing of semantic maps between robots; and 3) software as a service to externalize in the cloud the more intensive mapping computations, while meeting the mandatory hard real time constraints of the robot. To demonstrate the RoboEarth cloud mapping system, we investigate two action recipes that embody semantic map building in a simple mobile robot. The first recipe enables semantic map building for a novel environment while exploiting available prior information about the environment. The second recipe searches for a novel object, with the efficiency boosted thanks to the reasoning on a semantically annotated map. Our experimental results demonstrate that, by using RoboEarth cloud services, a simple robot can reliably and efficiently build the semantic maps needed to perform its quotidian tasks. In addition, we show the synergetic relation of the SLAM map of objects that grounds the terminological knowledge coded in the ontology.

Journal ArticleDOI
TL;DR: An ensemble approach based on a two layer control architecture and on an automatic algorithm for the definition of the roadmap to coordinate a fleet of automated guided vehicles (AGVs) in an industrial environment is proposed.
Abstract: This paper deals with a holistic approach to coordinate a fleet of automated guided vehicles (AGVs) in an industrial environment. We propose an ensemble approach based on a two layer control architecture and on an automatic algorithm for the definition of the roadmap. The roadmap is built by considering the path planning algorithm implemented on the hierarchical architecture and vice versa. In this way, we want to manage the coordination of the whole system in order to increase the flexibility and the global efficiency. Furthermore, the roadmap is computed in order to maximize the redundancy, the coverage and the connectivity. The architecture is composed of two layers. The low-level represents the roadmap itself. The high-level describes the topological relationship among different areas of the environment. The path planning algorithm works on both these levels and the subsequent coordination among AGVs is obtained exploiting shared resource (i.e., centralized information) and local negotiation (i.e., decentralized coordination). The proposed approach is validated by means of simulations and comparison using real plants.

Journal ArticleDOI
TL;DR: This paper presents an automatic Web service composition method that deals with both input/output compatibility and behavioral constraint compatibility of fuzzy semantic services.
Abstract: Web service composition is a challenging research issue. This paper presents an automatic Web service composition method that deals with both input/output compatibility and behavioral constraint compatibility of fuzzy semantic services. First, user input and output requirements are modeled as a set of facts and a goal statement in the Horn clauses, respectively. A service composition problem is transformed into a Horn clause logic reasoning problem. Next, a Fuzzy Predicate Petri Net (FPPN) is applied to model the Horn clause set, and T-invariant technique is used to determine the existence of composite services fulfilling the user input/output requirements. Then, two algorithms are presented to obtain the composite service satisfying behavioral constraints, as well as to construct an FPPN model that shows the calling order of the selected services.

Journal ArticleDOI
TL;DR: An efficient branch and bound procedure for noncyclic scheduling of a cluster tool with the makespan measurement is developed based on a timed Petri net (TPN) and verified the efficiency of the B&B procedure with various cluster tool scheduling problems.
Abstract: Cluster tools, each of which consists of multiple processing modules, one material handling robot, and loadlocks, are widely used for wafer fabrication processes, such as lithography, etching, and deposition. There have been many approaches and algorithms for cyclic scheduling of cluster tools in which the robot repeats a specified sequence for processing identical wafers. However, the lot order size has recently been decreasing due to the larger wafer size and circuit width reductions. In modern fabs, each wafer lot can have different flow patterns and process times for the same process step, and heterogeneous lots are processed consecutively in a tool. Even some tools in a fab have idle time waiting for wafer lots depending on the work-in-process fluctuations. Such different wafer lots and frequent tool state changes cannot be handled with cyclic scheduling methods, and accordingly noncyclic scheduling methods for such cases are required. Therefore, we develop an efficient branch and bound (B&B) procedure for noncyclic scheduling problems of cluster tools to minimize the makespan. Since a timed Petri net (TPN) is known for its powerful modeling ability and analysis capability, the algorithm is developed based on a TPN. We verify the efficiency of the B&B procedure with various cluster tool scheduling problems.

Journal ArticleDOI
TL;DR: A wireless sensor network using predicted mean vote (PMV) as a thermal comfort index around occupants in buildings is presented using feedforward-feedback control and digital self-tuning control, respectively, to satisfy thermal comfort.
Abstract: For human-centered automation, this study presents a wireless sensor network using predicted mean vote (PMV) as a thermal comfort index around occupants in buildings. The network automatically controls air conditioning by means of changing temperature settings in air conditioners. Interior devices of air conditioners thus do not have to be replaced. An adaptive neurofuzzy inference system and a particle swarm algorithm are adopted for solving a nonlinear multivariable inverse PMV model so as to determine thermal comfort temperatures. In solving inverse PMV models, the particle swarm algorithm is more accurate than ANFIS according to computational results. Based on the comfort temperature, this study utilizes feedforward–feedback control and digital self-tuning control, respectively, to satisfy thermal comfort. The control methods are validated by experimental results. Compared with conventional fixed temperature settings, the present control methods effectively maintain the PMV value within the range of ${\pm} 0.5$ and energy is saved more than 30% in this study.

Journal ArticleDOI
TL;DR: A coherent anomaly detection framework to effectively detect different behavioral anomalies in human daily life using a probabilistic theoretical framework based on complex activity recognition using dynamic Bayesian network modeling is presented.
Abstract: Detecting behavioral anomalies in human daily life is important to developing smart assisted-living systems for elderly care. Based on data collected from wearable motion sensors and the associated locational context, this paper presents a coherent anomaly detection framework to effectively detect different behavioral anomalies in human daily life. Four types of anomalies, including spatial anomaly, timing anomaly, duration anomaly, and sequence anomaly, are detected using a probabilistic theoretical framework. This framework is based on complex activity recognition using dynamic Bayesian network modeling. The maximum-likelihood estimation algorithm and Laplace smoothing are used in learning the parameters in the anomaly detection model. We conducted experimental evaluation in a mock apartment environment, and the results verified the effectiveness of the proposed framework. We expect that this behavioral anomaly detection system can be integrated into future smart homes for elderly care.

Journal ArticleDOI
TL;DR: Two existing simulation systems at application level for Cloud computing are studied, a novel lightweight simulation system is proposed for real-time VM scheduling in Cloud data centers, and results by applying the proposed simulation system are analyzed and discussed.
Abstract: Resource scheduling in infrastructure as a service (IaaS) is one of the keys for large-scale Cloud applications. Extensive research on all issues in real environment is extremely difficult because it requires developers to consider network infrastructure and the environment, which may be beyond the control. In addition, the network conditions cannot be predicted or controlled. Therefore, performance evaluation of workload models and Cloud provisioning algorithms in a repeatable manner under different configurations and requirements is difficult. There is still lack of tools that enable developers to compare different resource scheduling algorithms in IaaS regarding both computing servers and user workloads. To fill this gap in tools for evaluation and modeling of Cloud environments and applications, we propose CloudSched. CloudSched can help developers identify and explore appropriate solutions considering different resource scheduling algorithms. Unlike traditional scheduling algorithms considering only one factor such as CPU, which can cause hotspots or bottlenecks in many cases, CloudSched treats multidimensional resource such as CPU, memory and network bandwidth integrated for both physical machines and virtual machines (VMs) for different scheduling objectives (algorithms). In this paper, two existing simulation systems at application level for Cloud computing are studied, a novel lightweight simulation system is proposed for real-time VM scheduling in Cloud data centers, and results by applying the proposed simulation system are analyzed and discussed.

Journal ArticleDOI
TL;DR: This work proposes a model predictive control strategy to optimally schedule the campus central plant based on plant system dynamics and predicted campus cooling load and proposes a heuristic algorithm to obtain suboptimal solutions for the MPC problem.
Abstract: This work considers the optimal scheduling problem for a campus central plant equipped with a bank of multiple electrical chillers and a thermal energy storage (TES). Typically, the chillers are operated in ON/OFF modes to charge TES and supply chilled water to satisfy the campus cooling demands. A bilinear model is established to describe the system dynamics of the central plant. A model predictive control (MPC) problem is formulated to obtain optimal set-points to satisfy the campus cooling demands and minimize daily electricity cost. At each time step, the MPC problem is represented as a large-scale mixed-integer nonlinear programming problem. We propose a heuristic algorithm to obtain suboptimal solutions for it via dynamic programming (DP) and mixed integer linear programming (MILP). The system dynamics is linearized along the simulated trajectories of the system. The optimal TES operation profile is obtained by solving a DP problem at every horizon, and the optimal chiller operations are obtained by solving an MILP problem at every time step with a fixed TES operation profile. Simulation results show desired performance and computational tractability of the proposed algorithm.

Journal ArticleDOI
TL;DR: A neuro-fuzzy-based human intelligence model is constructed and implemented as an intelligent controller in automated GTAW process to maintain a consistent desired full penetration.
Abstract: Human welder's experiences and skills are critical for producing quality welds in manual gas tungsten arc welding (GTAW) process. In this paper, a neuro-fuzzy-based human intelligence model is constructed and implemented as an intelligent controller in automated GTAW process to maintain a consistent desired full penetration. An innovative vision system is utilized to real-time measure the specular 3D weld pool surface under strong arc light interference. Experiments are designed to produce random changes in the welding speed and voltage resulting in fluctuations in the weld pool surface. Adaptive neuro-fuzzy inference system (ANFIS) is proposed to correlate the human welder's response to the 3D weld pool surface as characterized by its width, length and convexity. Closed-loop control experiments are conducted to verify the robustness of the proposed controller. It is found that the human intelligence model can adjust the current to robustly control the process to a desired penetration state despite different initial conditions and various disturbances. A foundation is thus established to explore the mechanism and transformation of human welder's intelligence into robotic welding systems.

Journal ArticleDOI
TL;DR: This paper presents provably good multirobot task assignment algorithms, while considering practical constraints like task deadlines and limited battery life of robots.
Abstract: We present distributed algorithms for multirobot task assignment where the tasks have to be completed within given deadlines. Each robot has a limited battery life and thus there is an upper limit on the amount of time that it has to perform tasks. Performing each task requires certain amount of time (called the task duration) and each robot can have different payoffs for the tasks. Our problem is to assign the tasks to the robots such that the total payoff is maximized while respecting the task deadline constraints and the robot’s battery life constraints. Our problem is NP-hard since a special case of our problem is the classical generalized assignment problem (which is NP-hard). There are no known algorithms (distributed or centralized) for this problem with provably good guarantees of performance. We present a distributed algorithm for solving this problem and prove that our algorithm has an approximation ratio of 2. For the special case of constant task duration we present a distributed algorithm that is provably almost optimal. Our distributed algorithms are polynomial in the number of robots and the number of tasks. We also present simulation results to depict the performance of our algorithms.

Journal ArticleDOI
TL;DR: A novel sensor fusion algorithm is presented that incorporates locally processed tightly coupled GPS/INS-based absolute navigation solutions from each UAV in a relative navigation filter that estimates the baseline separation using integer-fixed relative CP-DGPS and a set of peer-to-peer ranging radios.
Abstract: This paper considers the fusion of carrier-phase differential GPS (CP-DGPS), peer-to-peer ranging radios, and low-cost inertial navigation systems (INS) for the application of relative navigation of small unmanned aerial vehicles (UAVs) in close formation-flight. A novel sensor fusion algorithm is presented that incorporates locally processed tightly coupled GPS/INS-based absolute navigation solutions from each UAV in a relative navigation filter that estimates the baseline separation using integer-fixed relative CP-DGPS and a set of peer-to-peer ranging radios. The robustness of the dynamic baseline estimation performance under conditions that are typically challenging for CP-DGPS alone, such as a high occurrence of phase breaks, poor satellite visibility/geometry due to extreme UAV attitude, and heightened multipath intensity, amongst others, is evaluated using Monte Carlo simulation trials. The simulation environment developed for this work combines a UAV formation flight control simulator with a GPS constellation simulator, stochastic models of the inertial measurement unit (IMU) sensor errors, and measurement noise of the ranging radios. The sensor fusion is shown to offer improved robustness for 3-D relative positioning in terms of 3-D residual sum of squares (RSS) accuracy and increased percentage of correctly fixed phase ambiguities. Moreover, baseline estimation performance is significantly improved during periods in which differential carrier phase ambiguities are unsuccessfully fixed.

Journal ArticleDOI
TL;DR: A novel system to achieve coordinated task-based control on a dual-arm industrial robot for the general tasks of visual servoing and bimanual hybrid motion/force control is presented.
Abstract: We present a novel system to achieve coordinated task-based control on a dual-arm industrial robot for the general tasks of visual servoing and bimanual hybrid motion/force control. The industrial robot, consisting of a rotating torso and two seven degree-of-freedom arms, performs autonomous vision-based target alignment of both arms with the aid of fiducial markers, two-handed grasping and force control, and robust object manipulation in a tele-robotic framework. The operator uses hand motions to command the desired position for the object via Microsoft Kinect while the autonomous force controller maintains a stable grasp. Gestures detected by the Kinect are also used to dictate different operation modes. We demonstrate the effectiveness of our approach using a variety of common objects with different sizes, shapes, weights, and surface compliances.

Journal ArticleDOI
TL;DR: Hardware and software techniques to facilitate reliable docking of elements in the presence of estimation and actuation errors are described, and how these local variable stiffness connections may be used to control the structural properties of the larger assembly are considered.
Abstract: We present the methodology, algorithms, system design, and experiments addressing the self-assembly of large teams of autonomous robotic boats into floating platforms. Identical self-propelled robotic boats autonomously dock together and form connected structures with controllable variable stiffness. These structures can self-reconfigure into arbitrary shapes limited only by the number of rectangular elements assembled in brick-like patterns. An $O(m^{2})$ complexity algorithm automatically generates assembly plans which maximize opportunities for parallelism while constructing operator-specified target configurations with $m$ components. The system further features an $O(n^{3})$ complexity algorithm for the concurrent assignment and planning of trajectories from $n$ free robots to the growing structure. Such peer-to-peer assembly among modular robots compares favorably to a single active element assembling passive components in terms of both construction rate and potential robustness through redundancy. We describe hardware and software techniques to facilitate reliable docking of elements in the presence of estimation and actuation errors, and we consider how these local variable stiffness connections may be used to control the structural properties of the larger assembly. Assembly experiments validate these ideas in a fleet of 0.5 m long modular robotic boats with onboard thrusters, active connectors, and embedded computers.

Journal ArticleDOI
TL;DR: An algorithm for robotic kinematic calibration based on a minimal product of exponentials (POE)-based model for the applications where only position measurements are required is proposed, which outperforms in terms of convenience, efficiency, and accuracy.
Abstract: This paper proposes an algorithm for robotic kinematic calibration based on a minimal product of exponentials (POE)-based model for the applications where only position measurements are required. Both joint zero-offset errors and initial frame twist error can be involved in this model. Analysis of the identifiability of these errors shows that at most six elements of these parameters can be identified. It also suggests that at least three noncollinear points on the end-effector should be measured to maximize the identifiability. Compared with the traditional POE-based model with full pose (position and orientation) measurements, the minimal model with only position measurements outperforms in terms of convenience, efficiency, and accuracy.

Journal ArticleDOI
TL;DR: A predictive control approach is proposed to accurately track the human motion by controlling the speed of the robot arm movement and it is found that the proposed predictive controller is able to track human hand movement with satisfactory accuracy.
Abstract: This paper presents a remotely controlled welding scheme that enables transformation of human welder knowledge into a welding robot. In particular, a 6-DOF UR-5 industrial robot arm is equipped with sensors to observe the welding process, including a compact 3D weld pool surface sensing system and an additional camera to provide direct view of the work-piece. Human welder operates a virtual welding torch, whose motion is tracked by a Leap sensor. To remotely operate the robot based on the motion information from the Leap sensor, a predictive control approach is proposed to accurately track the human motion by controlling the speed of the robot arm movement. Tracking experiments are conducted to track both simulated movement with varying speed and actual human hand movement. It is found that the proposed predictive controller is able to track human hand movement with satisfactory accuracy. A welding experiment has also been conducted to verify the effectiveness of the proposed remotely-controlled welding system. A foundation is thus established to realize teleoperation and help transfer human knowledge to the welding robot.