Search results for: manipulator robot
Commenced in January 2007
Frequency: Monthly
Edition: International
Paper Count: 414

Search results for: manipulator robot

234 2-Dimensional Finger Gesture Based Mobile Robot Control Using Touch Screen

Authors: O. Ejale, N.B. Siddique, R. Seals

Abstract:

The purpose of this study was to present a reliable mean for human-computer interfacing based on finger gestures made in two dimensions, which could be interpreted and adequately used in controlling a remote robot's movement. The gestures were captured and interpreted using an algorithm based on trigonometric functions, in calculating the angular displacement from one point of touch to another as the user-s finger moved within a time interval; thereby allowing for pattern spotting of the captured gesture. In this paper the design and implementation of such a gesture based user interface was presented, utilizing the aforementioned algorithm. These techniques were then used to control a remote mobile robot's movement. A resistive touch screen was selected as the gesture sensor, then utilizing a programmed microcontroller to interpret them respectively.

Keywords: 2-Dimensional interface, finger gesture, mobile robot control, touch screen.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1882
233 Novel Rao-Blackwellized Particle Filter for Mobile Robot SLAM Using Monocular Vision

Authors: Maohai Li, Bingrong Hong, Zesu Cai, Ronghua Luo

Abstract:

This paper presents the novel Rao-Blackwellised particle filter (RBPF) for mobile robot simultaneous localization and mapping (SLAM) using monocular vision. The particle filter is combined with unscented Kalman filter (UKF) to extending the path posterior by sampling new poses that integrate the current observation which drastically reduces the uncertainty about the robot pose. The landmark position estimation and update is also implemented through UKF. Furthermore, the number of resampling steps is determined adaptively, which seriously reduces the particle depletion problem, and introducing the evolution strategies (ES) for avoiding particle impoverishment. The 3D natural point landmarks are structured with matching Scale Invariant Feature Transform (SIFT) feature pairs. The matching for multi-dimension SIFT features is implemented with a KD-Tree in the time cost of O(log2 N). Experiment results on real robot in our indoor environment show the advantages of our methods over previous approaches.

Keywords: Mobile robot, simultaneous localization and mapping, Rao-Blackwellised particle filter, evolution strategies, scale invariant feature transform.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 2092
232 Steering Velocity Bounded Mobile Robots in Environments with Partially Known Obstacles

Authors: Reza Hossseynie, Amir Jafari

Abstract:

This paper presents a method for steering velocity bounded mobile robots in environments with partially known stationary obstacles. The exact location of obstacles is unknown and only a probability distribution associated with the location of the obstacles is known. Kinematic model of a 2-wheeled differential drive robot is used as the model of mobile robot. The presented control strategy uses the Artificial Potential Field (APF) method for devising a desired direction of movement for the robot at each instant of time while the Constrained Directions Control (CDC) uses the generated direction to produce the control signals required for steering the robot. The location of each obstacle is considered to be the mean value of the 2D probability distribution and similarly, the magnitude of the electric charge in the APF is set as the trace of covariance matrix of the location probability distribution. The method not only captures the challenges of planning the path (i.e. probabilistic nature of the location of unknown obstacles), but it also addresses the output saturation which is considered to be an important issue from the control perspective. Moreover, velocity of the robot can be controlled during the steering. For example, the velocity of robot can be reduced in close vicinity of obstacles and target to ensure safety. Finally, the control strategy is simulated for different scenarios to show how the method can be put into practice.

Keywords: Steering, obstacle avoidance, mobile robots, constrained directions control, artificial potential field.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 863
231 Application of Robot Formation Scheme for Screening Solar Energy in a Greenhouse

Authors: George K. Fourlas, Konstantinos Kalovrektis, Evangelos Fountas

Abstract:

Many agricultural and especially greenhouse applications like plant inspection, data gathering, spraying and selective harvesting could be performed by robots. In this paper multiple nonholonomic robots are used in order to create a desired formation scheme for screening solar energy in a greenhouse through data gathering. The formation consists from a leader and a team member equipped with appropriate sensors. Each robot is dedicated to its mission in the greenhouse that is predefined by the requirements of the application. The feasibility of the proposed application includes experimental results with three unmanned ground vehicles (UGV).

Keywords: Greenhouses application, robot formation, solarenergy.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1591
230 Robot Vision Application based on Complex 3D Pose Computation

Authors: F. Rotaru, S. Bejinariu, C. D. Niţâ, R. Luca, I. Pâvâloi, C. Lazâr

Abstract:

The paper presents a technique suitable in robot vision applications where it is not possible to establish the object position from one view. Usually, one view pose calculation methods are based on the correspondence of image features established at a training step and exactly the same image features extracted at the execution step, for a different object pose. When such a correspondence is not feasible because of the lack of specific features a new method is proposed. In the first step the method computes from two views the 3D pose of feature points. Subsequently, using a registration algorithm, the set of 3D feature points extracted at the execution phase is aligned with the set of 3D feature points extracted at the training phase. The result is a Euclidean transform which have to be used by robot head for reorientation at execution step.

Keywords: features correspondence, registration algorithm, robot vision, triangulation method.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1419
229 Robust Adaptive Control of a Robotic Manipulator with Unknown Dead Zone and Friction Torques

Authors: Ibrahim F. Jasim, Najah F. Jasim

Abstract:

The problem of controlling a two link robotic manipulator, consisting of a rotating and a prismatic links, is addressed. The actuations of both links are assumed to have unknown dead zone nonlinearities and friction torques modeled by LuGre friction model. Because of the existence of the unknown dead zone and friction torque at the actuations, unknown parameters and unmeasured states would appear to be part of the overall system dynamics that need for estimation. Unmeasured states observer, unknown parameters estimators, and robust adaptive control laws have been derived such that closed loop global stability is achieved. Simulation results have been performed to show the efficacy of the suggested approach.

Keywords: Adaptive Robust Control, Dead Zone, Friction Torques, Robotic Manipulators.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1582
228 Robot Operating System-Based SLAM for a Gazebo-Simulated Turtlebot2 in 2d Indoor Environment with Cartographer Algorithm

Authors: Wilayat Ali, Li Sheng, Waleed Ahmed

Abstract:

The ability of the robot to make simultaneously map of the environment and localize itself with respect to that environment is the most important element of mobile robots. To solve SLAM many algorithms could be utilized to build up the SLAM process and SLAM is a developing area in Robotics research. Robot Operating System (ROS) is one of the frameworks which provide multiple algorithm nodes to work with and provide a transmission layer to robots. Manyof these algorithms extensively in use are Hector SLAM, Gmapping and Cartographer SLAM. This paper describes a ROS-based Simultaneous localization and mapping (SLAM) library Google Cartographer mapping, which is open-source algorithm. The algorithm was applied to create a map using laser and pose data from 2d Lidar that was placed on a mobile robot. The model robot uses the gazebo package and simulated in Rviz. Our research work's primary goal is to obtain mapping through Cartographer SLAM algorithm in a static indoor environment. From our research, it is shown that for indoor environments cartographer is an applicable algorithm to generate 2d maps with LIDAR placed on mobile robot because it uses both odometry and poses estimation. The algorithm has been evaluated and maps are constructed against the SLAM algorithms presented by Turtlebot2 in the static indoor environment.

Keywords: SLAM, ROS, navigation, localization and mapping, Gazebo, Rviz, Turtlebot2, SLAM algorithms, 2d Indoor environment, Cartographer.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1145
227 Adaptive Control Strategy of Robot Polishing Force Based on Position Impedance

Authors: Wang Zhan-Xi, Zhang Yi-Ming, Chen Hang, Wang Gang

Abstract:

Manual polishing has problems such as high labor intensity, low production efficiency and difficulty in guaranteeing the consistency of polishing quality. The use of robot polishing instead of manual polishing can effectively avoid these problems. Polishing force directly affects the quality of polishing, so accurate tracking and control of polishing force is one of the most important conditions for improving the accuracy of robot polishing. The traditional force control strategy is difficult to adapt to the strong coupling of force control and position control during the robot polishing process. Therefore, based on the analysis of force-based impedance control and position-based impedance control, this paper proposed a type of adaptive controller. Based on force feedback control of active compliance control, the controller can adaptively estimate the stiffness and position of the external environment and eliminate the steady-state force error produced by traditional impedance control. The simulation results of the model show that the adaptive controller has good adaptability to changing environmental positions and environmental stiffness, and can accurately track and control polishing force.

Keywords: robot polishing, force feedback, impedance control, adaptive control

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 548
226 A Real Time Collision Avoidance Algorithm for Mobile Robot based on Elastic Force

Authors: Kyung Hyun, Choi, Minh Ngoc, Nong, M. Asif Ali, Rehmani

Abstract:

This present paper proposes the modified Elastic Strip method for mobile robot to avoid obstacles with a real time system in an uncertain environment. The method deals with the problem of robot in driving from an initial position to a target position based on elastic force and potential field force. To avoid the obstacles, the robot has to modify the trajectory based on signal received from the sensor system in the sampling times. It was evident that with the combination of Modification Elastic strip and Pseudomedian filter to process the nonlinear data from sensor uncertainties in the data received from the sensor system can be reduced. The simulations and experiments of these methods were carried out.

Keywords: Collision avoidance, Avoidance obstacle, Elastic Strip, Real time collision avoidance.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1951
225 Vision Based Robotic Interception in Industrial Manipulation Tasks

Authors: Ahmet Denker, Tuğrul Adıgüzel

Abstract:

In this paper, a solution is presented for a robotic manipulation problem in industrial settings. The problem is sensing objects on a conveyor belt, identifying the target, planning and tracking an interception trajectory between end effector and the target. Such a problem could be formulated as combining object recognition, tracking and interception. For this purpose, we integrated a vision system to the manipulation system and employed tracking algorithms. The control approach is implemented on a real industrial manipulation setting, which consists of a conveyor belt, objects moving on it, a robotic manipulator, and a visual sensor above the conveyor. The trjectory for robotic interception at a rendezvous point on the conveyor belt is analytically calculated. Test results show that tracking the raget along this trajectory results in interception and grabbing of the target object.

Keywords: robotics, robot vision, rendezvous planning, self organizingmaps.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1434
224 Design of Adaptive Sliding Mode Controller for Robotic Manipulators Tracking Control

Authors: T. C. Kuo, Y. J. Huang, B. W. Hong

Abstract:

This paper proposes an adaptive sliding mode controller which combines adaptive control and sliding mode control to control a nonlinear robotic manipulator with uncertain parameters. We use an adaptive algorithm based on the concept of sliding mode control to alleviate the chattering phenomenon of control input. Adaptive laws are developed to obtain the gain of switching input and the boundary layer parameters. The stability and convergence of the robotic manipulator control system are guaranteed by applying the Lyapunov theorem. Simulation results demonstrate that the chattering of control input can be alleviated effectively. The proposed controller scheme can assure robustness against a large class of uncertainties and achieve good trajectory tracking performance.

Keywords: Robotic manipulators, sliding mode control, adaptive law, Lyapunov theorem, robustness.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 3001
223 Estimation of the External Force for a Co-Manipulation Task Using the Drive Chain Robot

Authors: Sylvain Devie, Pierre-Philippe Robet, Yannick Aoustin, Maxime Gautier

Abstract:

The aim of this paper is to show that the observation of the external effort and the sensor-less control of a system is limited by the mechanical system. First, the model of a one-joint robot with a prismatic joint is presented. Based on this model, two different procedures were performed in order to identify the mechanical parameters of the system and observe the external effort applied on it. Experiments have proven that the accuracy of the force observer, based on the DC motor current, is limited by the mechanics of the robot. The sensor-less control will be limited by the accuracy in estimation of the mechanical parameters and by the maximum static friction force, that is the minimum force which can be observed in this case. The consequence of this limitation is that industrial robots without specific design are not well adapted to perform sensor-less precision tasks. Finally, an efficient control law is presented for high effort applications.

Keywords: Control, Identification, Robot, Co-manipulation, Sensor-less.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 598
222 Receding Horizon Filtering for Mobile Robot Systems with Cross-Correlated Sensor Noises

Authors: Il Young Song, Du Yong Kim, Vladimir Shin

Abstract:

This paper reports on a receding horizon filtering for mobile robot systems with cross-correlated sensor noises and uncertainties. Also, the effect of uncertain parameters in the state of the tracking error model performance is considered. A distributed fusion receding horizon filter is proposed. The distributed fusion filtering algorithm represents the optimal linear combination of the local filters under the minimum mean square error criterion. The derivation of the error cross-covariances between the local receding horizon filters is the key of this paper. Simulation results of the tracking mobile robot-s motion demonstrate high accuracy and computational efficiency of the distributed fusion receding horizon filter.

Keywords: Distributed fusion, fusion formula, Kalman filter, multisensor, receding horizon, wheeled mobile robot

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1157
221 Evolutionary Program Based Approach for Manipulator Grasping Color Objects

Authors: Y. Harold Robinson, M. Rajaram, Honey Raju

Abstract:

Image segmentation and color identification is an important process used in various emerging fields like intelligent robotics. A method is proposed for the manipulator to grasp and place the color object into correct location. The existing methods such as PSO, has problems like accelerating the convergence speed and converging to a local minimum leading to sub optimal performance. To improve the performance, we are using watershed algorithm and for color identification, we are using EPSO. EPSO method is used to reduce the probability of being stuck in the local minimum. The proposed method offers the particles a more powerful global exploration capability. EPSO methods can determine the particles stuck in the local minimum and can also enhance learning speed as the particle movement will be faster.

Keywords: Color information, EPSO, hue, saturation, value (HSV), image segmentation, particle swarm optimization (PSO). Active Contour, GMM.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1533
220 Modular Hybrid Robots for Safe Human-Robot Interaction

Authors: J. Radojicic, D. Surdilovic, G. Schreck

Abstract:

The paper considers a novel modular and intrinsically safe redundant robotic system with biologically inspired actuators (pneumatic artificial muscles and rubber bellows actuators). Similarly to the biological systems, the stiffness of the internal parallel modules, representing 2 DOF joints in the serial robotic chains, is controlled by co-activation of opposing redundant actuator groups in the null-space of the module Jacobian, without influencing the actual robot position. The decoupled position/stiffness control allows the realization of variable joint stiffness according to different force-displacement relationships. The variable joint stiffness, as well as limited pneumatic muscle/bellows force ability, ensures internal system safety that is crucial for development of human-friendly robots intended for human-robot collaboration. The initial experiments with the system prototype demonstrate the capabilities of independently, simultaneously controlling both joint (Cartesian) motion and joint stiffness. The paper also presents the possible industrial applications of snake-like robots built using the new modules.

Keywords: bellows actuator, human-robot interaction, hyper redundant robot, pneumatic muscle.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1943
219 Development of Underactuated Robot Hand Using Cross Section Deformation Spring

Authors: Naoki Saito, Daisuke Kon, Toshiyuki Sato

Abstract:

This paper describes an underactuated robot hand operated by low-power actuators. It can grasp objects of various shapes using easy operations. This hand is suitable for use as a lightweight prosthetic hand that can grasp various objects using few input channels. To realize operations using a low-power actuator, a cross section deformation spring is proposed. The design procedure of the underactuated robot finger is proposed to realize an adaptive grasping movement. The validity of this mechanism and design procedure are confirmed through an object grasping experiment. Results demonstrate the effectiveness of across section deformation spring in reducing the actuator power. Moreover, adaptive grasping movement is realized by an easy operation.

Keywords: Robot hand, Underactuated mechanism, Cross section deformation spring, Prosthetic hand.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1617
218 Design of a Chaotic Trajectory Generator Algorithm for Mobile Robots

Authors: J. J. Cetina-Denis, R. M. López-Gutiérrez, R. Ramírez-Ramírez, C. Cruz-Hernández

Abstract:

This work addresses the problem of designing an algorithm capable of generating chaotic trajectories for mobile robots. Particularly, the chaotic behavior is induced in the linear and angular velocities of a Khepera III differential mobile robot by infusing them with the states of the H´enon chaotic map. A possible application, using the properties of chaotic systems, is patrolling a work area. In this work, numerical and experimental results are reported and analyzed. In addition, two quantitative numerical tests are applied in order to measure how chaotic the generated trajectories really are.

Keywords: Chaos, chaotic trajectories, differential mobile robot, Henons map, Khepera III robot, patrolling applications.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 670
217 Design of a 5-Joint Mechanical Arm with User-Friendly Control Program

Authors: Amon Tunwannarux, Supanunt Tunwannarux

Abstract:

This paper describes the design concepts and implementation of a 5-Joint mechanical arm for a rescue robot named CEO Mission II. The multi-joint arm is a five degree of freedom mechanical arm with a four bar linkage, which can be stretched to 125 cm. long. It is controlled by a teleoperator via the user-friendly control and monitoring GUI program. With Inverse Kinematics principle, we developed the method to control the servo angles of all arm joints to get the desired tip position. By clicking the determined tip position or dragging the tip of the mechanical arm on the computer screen to the desired target point, the robot will compute and move its multi-joint arm to the pose as seen on the GUI screen. The angles of each joint are calculated and sent to all joint servos simultaneously in order to move the mechanical arm to the desired pose at once. The operator can also use a joystick to control the movement of this mechanical arm and the locomotion of the robot. Many sensors are installed at the tip of this mechanical arm for surveillance from the high level and getting the vital signs of victims easier and faster in the urban search and rescue tasks. It works very effectively and easy to control. This mechanical arm and its software were developed as a part of the CEO Mission II Rescue Robot that won the First Runner Up award and the Best Technique award from the Thailand Rescue Robot Championship 2006. It is a low cost, simple, but functioning 5-Jiont mechanical arm which is built from scratch, and controlled via wireless LAN 802.11b/g. This 5-Jiont mechanical arm hardware concept and its software can also be used as the basic mechatronics to many real applications.

Keywords: Multi-joint, mechanical arm, inverse kinematics, rescue robot, GUI control program.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1777
216 Fuzzy Logic Control for Flexible Joint Manipulator: An Experimental Implementation

Authors: Sophia Fry, Mahir Irtiza, Alexa Hoffman, Yousef Sardahi

Abstract:

This study presents an intelligent control algorithm for a flexible robotic arm. Fuzzy control is used to control the motion of the arm to maintain the arm tip at the desired position while reducing vibration and increasing the system speed of response. The Fuzzy controller (FC) is based on adding the tip angular position to the arm deflection angle and using their sum as a feedback signal to the control algorithm. This reduces the complexity of the FC in terms of the input variables, number of membership functions, fuzzy rules, and control structure. Also, the design of the fuzzy controller is model-free and uses only our knowledge about the system. To show the efficacy of the FC, the control algorithm is implemented on the flexible joint manipulator (FJM) developed by Quanser. The results show that the proposed control method is effective in terms of response time, overshoot, and vibration amplitude.

Keywords: Fuzzy logic control, model-free control, flexible joint manipulators, nonlinear control.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 405
215 Biologically Inspired Controller for the Autonomous Navigation of a Mobile Robot in an Evasion Task

Authors: Dejanira Araiza-Illan, Tony J. Dodd

Abstract:

A novel biologically inspired controller for the autonomous navigation of a mobile robot in an evasion task is proposed. The controller takes advantage of the environment by calculating a measure of danger and subsequently choosing the parameters of a reinforcement learning based decision process. Two different reinforcement learning algorithms were used: Qlearning and Sarsa (λ). Simulations show that selecting dynamic parameters reduce the time while executing the decision making process, so the robot can obtain a policy to succeed in an escaping task in a realistic time.

Keywords: Autonomous navigation, mobile robots, reinforcement learning.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1429
214 Representations of Childcare Robots as a Controversial Issue

Authors: Raya A. Jones

Abstract:

This paper interrogates online representations of robot companions for children, including promotional material by manufacturers, media articles and technology blogs. The significance of the study lies in its contribution to understanding attitudes to robots. The prospect of childcare robots is particularly controversial ethically, and is associated with emotive arguments. The sampled material is restricted to relatively recent posts (the past three years) though the analysis identifies both continuous and changing themes across the past decade. The method extrapolates social representations theory towards examining the ways in which information about robotic products is provided for the general public. Implications for social acceptance of robot companions for the home and robot ethics are considered.

Keywords: Acceptance of robots, childcare robots, ethics, social representations.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 988
213 Attribute Based Comparison and Selection of Modular Self-Reconfigurable Robot Using Multiple Attribute Decision Making Approach

Authors: Manpreet Singh, V. P. Agrawal, Gurmanjot Singh Bhatti

Abstract:

From the last decades, there is a significant technological advancement in the field of robotics, and a number of modular self-reconfigurable robots were introduced that can help in space exploration, bucket to stuff, search, and rescue operation during earthquake, etc. As there are numbers of self-reconfigurable robots, choosing the optimum one is always a concern for robot user since there is an increase in available features, facilities, complexity, etc. The objective of this research work is to present a multiple attribute decision making based methodology for coding, evaluation, comparison ranking and selection of modular self-reconfigurable robots using a technique for order preferences by similarity to ideal solution approach. However, 86 attributes that affect the structure and performance are identified. A database for modular self-reconfigurable robot on the basis of different pertinent attribute is generated. This database is very useful for the user, for selecting a robot that suits their operational needs. Two visual methods namely linear graph and spider chart are proposed for ranking of modular self-reconfigurable robots. Using five robots (Atron, Smores, Polybot, M-Tran 3, Superbot), an example is illustrated, and raking of the robots is successfully done, which shows that Smores is the best robot for the operational need illustrated, and this methodology is found to be very effective and simple to use.

Keywords: Self-reconfigurable robots, MADM, TOPSIS, morphogenesis, scalability.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 837
212 Comparison between Minimum Direct and Indirect Jerks of Linear Dynamic Systems

Authors: Tawiwat Veeraklaew, Nathasit Phathana-im, Songkit Heama

Abstract:

Both the minimum energy consumption and smoothness, which is quantified as a function of jerk, are generally needed in many dynamic systems such as the automobile and the pick-and-place robot manipulator that handles fragile equipments. Nevertheless, many researchers come up with either solely concerning on the minimum energy consumption or minimum jerk trajectory. This research paper proposes a simple yet very interesting relationship between the minimum direct and indirect jerks approaches in designing the time-dependent system yielding an alternative optimal solution. Extremal solutions for the cost functions of direct and indirect jerks are found using the dynamic optimization methods together with the numerical approximation. This is to allow us to simulate and compare visually and statistically the time history of control inputs employed by minimum direct and indirect jerk designs. By considering minimum indirect jerk problem, the numerical solution becomes much easier and yields to the similar results as minimum direct jerk problem.

Keywords: Optimization, Dynamic, Linear Systems, Jerks.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1221
211 Combining Minimum Energy and Minimum Direct Jerk of Linear Dynamic Systems

Authors: V. Tawiwat, P. Jumnong

Abstract:

Both the minimum energy consumption and smoothness, which is quantified as a function of jerk, are generally needed in many dynamic systems such as the automobile and the pick-and-place robot manipulator that handles fragile equipments. Nevertheless, many researchers come up with either solely concerning on the minimum energy consumption or minimum jerk trajectory. This research paper proposes a simple yet very interesting when combining the minimum energy and jerk of indirect jerks approaches in designing the time-dependent system yielding an alternative optimal solution. Extremal solutions for the cost functions of the minimum energy, the minimum jerk and combining them together are found using the dynamic optimization methods together with the numerical approximation. This is to allow us to simulate and compare visually and statistically the time history of state inputs employed by combining minimum energy and jerk designs. The numerical solution of minimum direct jerk and energy problem are exactly the same solution; however, the solutions from problem of minimum energy yield the similar solution especially in term of tendency.

Keywords: Optimization, Dynamic, Linear Systems, Jerks.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1525
210 Tracking Trajectory of a Cable-Driven Robot for Lower Limb Rehabilitation

Authors: Hachmia Faqihi, Maarouf Saad, Khalid Benjelloun, Mohammed Benbrahim, M. Nabil Kabbaj

Abstract:

This paper investigates and presents a cable-driven robot to lower limb rehabilitation use in sagittal plane. The presented rehabilitation robot is used for a trajectory tracking in joint space. The paper covers kinematic and dynamic analysis, which reveals the tensionability of the used cables as being the actuating source to provide a rehabilitation exercises of the human leg. The desired trajectory is generated to be used in the control system design in joint space. The obtained simulation results is showed to be efficient in this kind of application.

Keywords: Cable-driven multibody system, computed-torque controller, lower limb rehabilitation, tracking trajectory.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1702
209 Map Matching Performance under Various Similarity Metrics for Heterogeneous Robot Teams

Authors: M. C. Akay, A. Aybakan, H. Temeltas

Abstract:

Aerial and ground robots have various advantages of usage in different missions. Aerial robots can move quickly and get a different sight of view of the area, but those vehicles cannot carry heavy payloads. On the other hand, unmanned ground vehicles (UGVs) are slow moving vehicles, since those can carry heavier payloads than unmanned aerial vehicles (UAVs). In this context, we investigate the performances of various Similarity Metrics to provide a common map for Heterogeneous Robot Team (HRT) in complex environments. Within the usage of Lidar Odometry and Octree Mapping technique, the local 3D maps of the environment are gathered.  In order to obtain a common map for HRT, informative theoretic similarity metrics are exploited. All types of these similarity metrics gave adequate as allowable simulation time and accurate results that can be used in different types of applications. For the heterogeneous multi robot team, those methods can be used to match different types of maps.

Keywords: Common maps, heterogeneous robot team, map matching, informative theoretic similarity metrics.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 840
208 Route Training in Mobile Robotics through System Identification

Authors: Roberto Iglesias, Theocharis Kyriacou, Ulrich Nehmzow, Steve Billings

Abstract:

Fundamental sensor-motor couplings form the backbone of most mobile robot control tasks, and often need to be implemented fast, efficiently and nevertheless reliably. Machine learning techniques are therefore often used to obtain the desired sensor-motor competences. In this paper we present an alternative to established machine learning methods such as artificial neural networks, that is very fast, easy to implement, and has the distinct advantage that it generates transparent, analysable sensor-motor couplings: system identification through nonlinear polynomial mapping. This work, which is part of the RobotMODIC project at the universities of Essex and Sheffield, aims to develop a theoretical understanding of the interaction between the robot and its environment. One of the purposes of this research is to enable the principled design of robot control programs. As a first step towards this aim we model the behaviour of the robot, as this emerges from its interaction with the environment, with the NARMAX modelling method (Nonlinear, Auto-Regressive, Moving Average models with eXogenous inputs). This method produces explicit polynomial functions that can be subsequently analysed using established mathematical methods. In this paper we demonstrate the fidelity of the obtained NARMAX models in the challenging task of robot route learning; we present a set of experiments in which a Magellan Pro mobile robot was taught to follow four different routes, always using the same mechanism to obtain the required control law.

Keywords: Mobile robotics, system identification, non-linear modelling, NARMAX.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1678
207 Select-Low and Select-High Methods for the Wheeled Robot Dynamic States Control

Authors: Bogusław Schreyer

Abstract:

The paper enquires on the two methods of the wheeled robot braking torque control. Those two methods are applied when the adhesion coefficient under left side wheels is different from the adhesion coefficient under the right side wheels. In case of the select-low (SL) method the braking torque on both wheels is controlled by the signals originating from the wheels on the side of the lower adhesion. In the select-high (SH) method the torque is controlled by the signals originating from the wheels on the side of the higher adhesion. The SL method is securing stable and secure robot behaviors during the braking process. However, the efficiency of this method is relatively low. The SH method is more efficient in terms of time and braking distance but in some situations may cause wheels blocking. It is important to monitor the velocity of all wheels and then take a decision about the braking torque distribution accordingly. In case of the SH method the braking torque slope may require significant decrease in order to avoid wheel blocking.

Keywords: Select-high method, select-low method, torque distribution, wheeled robot.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 432
206 Self-Tuning Robot Control Based on Subspace Identification

Authors: Mathias Marquardt, Peter Dünow, Sandra Baßler

Abstract:

The paper describes the use of subspace based identification methods for auto tuning of a state space control system. The plant is an unstable but self balancing transport robot. Because of the unstable character of the process it has to be identified from closed loop input-output data. Based on the identified model a state space controller combined with an observer is calculated. The subspace identification algorithm and the controller design procedure is combined to a auto tuning method. The capability of the approach was verified in a simulation experiments under different process conditions.

Keywords: Auto tuning, balanced robot, closed loop identification, subspace identification.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 1080
205 Dynamic Modeling of Tow Flexible Link Manipulators

Authors: E. Abedi, A. Ahmadi Nadooshan, S. Salehi

Abstract:

Modeling and vibration of a flexible link manipulator with tow flexible links and rigid joints are investigated which can include an arbitrary number of flexible links. Hamilton principle and finite element approach is proposed to model the dynamics of flexible manipulators. The links are assumed to be deflection due to bending. The association between elastic displacements of links is investigated, took into account the coupling effects of elastic motion and rigid motion. Flexible links are treated as Euler-Bernoulli beams and the shear deformation is thus abandoned. The dynamic behavior due to flexibility of links is well demonstrated through numerical simulation. The rigid-body motion and elastic deformations are separated by linearizing the equations of motion around the rigid body reference path. Simulation results are shown on for both position and force trajectory tracking tasks in the presence of varying parameters and unknown dynamics remarkably well. The proposed method can be used in both dynamic simulation and controller design.

Keywords: Flexible manipulator, flexible link, dynamicmodeling, end point.

Procedia APA BibTeX Chicago EndNote Harvard JSON MLA RIS XML ISO 690 PDF Downloads 2428