Learning the Geometric Meaning of Symbolic Abstractions for Manipulation Planning

Size: px
Start display at page:

Download "Learning the Geometric Meaning of Symbolic Abstractions for Manipulation Planning"

Transcription

1 Learning the Geometric Meaning of Symbolic Abstractions for Manipulation Planning Chris Burbridge and Richard Dearden School of Computer Science, University of Birmingham, Edgbaston, Birmingham, B15 2TT, U.K. {C.J.C.Burbridge, Abstract. We present an approach for learning a mapping between geometric states and logical predicates. This mapping is a necessary part of any robotic system that requires task-level reasoning and path planning. Consider a robot tasked with putting a number of cups on a tray. To achieve the goal the robot needs to find positions for all the objects, and if necessary may need to stack one cup inside another to get them all on the tray. This requires translating back and forth between symbolic states that the planner uses such as stacked(cup1,cup2) and geometric states representing the positions and poses of the objects. The mapping we learn in this paper achieves this translation. We learn it from labelled examples, and significantly, learn a representation that can be used in both the forward (from geometric to symbolic) and reverse directions. This enables us to build symbolic representations of scenes the robot observes, and also to translate a desired symbolic state from a plan into a geometric state that the robot can actually achieve through manipulation. We also show how the approach can be used to generate significantly different geometric solutions to support backtracking. We evaluate the work both in simulation and on a robot arm. 1 Introduction The vast majority of robots are currently controlled through hand-written programs. These programs are typically highly specialised to a single task as they include human specified geometric information about the objects and behaviours being performed. A disadvantage of this approach is that building the programs is very time-consuming, often involving a mixture of writing code and recording geometric states of the robot and the objects the robot is interacting with. To make the robot more autonomous, we would like to be able to specify high level goals such as put all the cups on the tray for the robot and use a task level planner to generate a behaviour that achieves the goals. It is clearly desirable to specify goals in this abstract language; the alternative is to specify the exact geometric location of every object, which essentially requires knowing the plan in advance since, for example, if two of the cups need to be stacked to get them all on the tray, this must be specified in the goal. Task level planners [1, 2] work largely in symbolic spaces [3]. World states are expressed using predicates such as on(x,y) and holding(x) and actions are specified in term of the predicates that must be true for the action to be executed the action preconditions and the changes to the predicates that result the action effects. Recent

2 planners (e.g. [2]) may also support numerical or temporal quantities, but for computational reasons they do not support planning in continuous multi-dimensional spaces in the way that path planners (e.g. [4, 5]) do. Robot programs, in contrast, typically involve specifying sequences of geometric positions of the robot and the objects it manipulates, with the results of the manipulations expressed only in the names of functions, or in comments in the code, or not at all. The approach we describe in this paper is to learn a bi-directional mapping between geometric and symbolic states. This means that for any geometric state we can generate an equivalent symbolic state, for example to generate the initial state for the planner. In addition, we can generate a geometric state consistent with a symbolic state. This allows us to generate the sequence of symbolic states that the world would pass through when a task level plan is executed and produce a geometric state for each of them. These geometric states can then be passed to a path planner to generate the actual motion of the robot. Thus the mapping, along with the high-level actions and the planner itself, provide all we need to generate path plans for the robot that achieve task level goals specified by the user. In this work we assume that object recognition is reliable, so we don t need to worry about unrecognised or mis-recognised objects in the world, only about the relationships between them. An alternative to learning a mapping would be to hand-build one. However, this is quite complex in practice due to the dimensionality of the state space required to represent the relationship between two objects (in our representation this comes to 17 dimensions). Furthermore, the learned mapping naturally captures the typical solutions found, so that for example if an object placed on a tray is typically placed close to the centre, then the learned mapping will capture this fact. We use a supervised learning approach to finding the mapping between symbolic and geometric states. We assume that the actual predicates are pre-defined as part of the planning domain, and we leverage the hand-built robot behaviours to generate labelled training data for each predicate. We assume that the labels are either provided by comments or function names in the code for the hand-built programs, or configurations that result from the execution of the programs are hand-labelled to provide training data. We then learn a kernel density estimate [6, 7] for each label (predicate) from the training data. This allows us not only to label unseen geometric states (the forward direction for the mapping), but also, via hill-climbing search, to find geometric states that match a symbolic predicates with high probability (the backwards direction). We extend this to find geometric states for conjunctions of symbolic predicates and also for back-tracking to find multiple, significantly different geometric states for a predicate. As well as evaluating the mapping itself, we also use it in a relatively simple planning system that uses a standard classical planner [2] to generate symbolic plans and our learned mapping to translate them into geometric goals for a path planner (since the emphasis in this paper is on the learned mapping we do not describe the planner in detail). The result is a plan which we show running on a Kuka robot arm. In the next section we examine related work on mapping from symbolic predicates to geometric states and vice versa; in Section 3 we present our approach to learning the mapping; we present experiments to demonstrate the effectiveness of the approach in Section 4, and present our conclusions and future work in Section 5.

3 2 Related Work A number of planning systems have been developed that operate in a mixture of geometric and symbolic states and therefore need to map between them. Probably the best known is asymov [8], which solves tasks very similar to ours using a planner that combines a symbolic planner with a probabilistic roadmap [5] for geometric planning. In common with most of these approaches, they assume they are given a mapping from geometric to symbolic state. In addition, they restrict the objects to certain fixed world positions, so the translation from symbolic to geometric states is trivial. Another recent example is [9], in which the mapping from symbolic to geometric states is handled by geometric suggesters which are hand-built functions for generating geometric states. Our learned mappings should be able to replace the hand-built mappings in either of these approaches. The idea of learning the mapping from geometric to symbolic state has been considered before in the literature. However, what sets our approach apart from others is the idea of using the learned mapping in reverse, generating geometry from symbolic description to enable symbolic planning operators to be utilised to produce geometric effects. Jäkel et al. [10] present an approach to action learning and geometric constraint learning in the context of Programming by Demonstration. After segmenting logs of human demonstrated actions, constraints on the possible motion of the robot arm are learned. However, constraints on object positions are not directly considered. Unlike our approach, they never need to use the mapping in the reverse direction because there is no task-level planning in their system: the task is only for the robot to execute the learned actions in different geometric configurations. The recent work of Sjöö et al. [11, 12] has also addressed spatial relationships. In [11] they consider the geometric meaning of on, and use hand built rules to map from geometric to symbolic state. Although they go on to use the rules to construct a probability function of the on predicate, which gives them similar representational capabilities to the approach we take, the representation chosen does not generalise to other predicates and requires hand construction. In [12], the same authors address the issue of hand building rules, presenting a system than learns to classify object relationships by generating samples in simulation. While classification of several relations is successful, they are only interested in learning the mapping from geometric to symbolic states; using the mapping in reverse is not considered. Furthermore, the geometric state is described by a 93 dimensional feature vector comprising of contact points, surface normals and object poses, and the symbolic object relationships are learned from this feature vector. The high dimensionality means that far more training data is required to learn a good mapping and makes adapting their approach to compute the reverse mapping impractical. An approach similar to that in [12] is presented in [13]. Again, contact points are used, this time between segmented point clouds. However, the use of K-Nearest neighbours for classification again prevents using the classifier in reverse.

4 3 Symbolic to Geometric Mapping Our approach is to learn a model of the probability density function p(c G) where C is a symbolic state clause, G is geometric state, and a probability of 1.0 indicates that C holds in the given G. Given an entire symbolic state S = C 1 C 2... C n, assuming that the probability of each clause is independent, the probability of it holding in a given geometric state can then be calculated as p(s G) = n p(c i G). (1) i=1 Our aim is to learn a classifier capable of producing class probability estimates from a number of labelled positive and negative examples of (G, C) pairs as discussed in the introduction. Most importantly however, we choose both a p.d.f model and a geometric state representation that allow optimising the probability and turning a given symbolic state representation back into an actual geometric state. 3.1 Geometric state representation For a symbolic predicate of two objects A and B, we define the geometric state representation as: G = [ S A S B TB A R ] A R B (2) where S o, R o are the size and rotation of object o respectively, and TB A is the relative translation between objects A and B. Using the difference in position between the objects rather than absolute positions provides better generalisation from the examples. However, the same can not be done with the rotation as many predicates require specific orientations (pouring for example). We represent the rotations using quaternions, taking the geometric state vector to 17 dimensions. The size of the each object is expressed as the dimensions of its bounding box. Including this in the state allows us to learn just a single general distribution per predicate rather than, for example, needing to learn distributions for both above(cup,tray) and above(cup,cup). 3.2 Probability model It is important to have a smooth continuous representation of p(c G). This allows points of high probability in the multi-dimensional space to be located using numerical methods, which in turn allows finding geometric representations for a given symbolic state. Modelling the probability using Gaussian Kernel Density Estimation (KDE) provides such a smooth function. Given a set of p example geometric states G P that a predicate holds in, and a set of n geometric states G N in which the same predicate does not hold, we model the probability as: p(c G) = P C (G) P C (G) + N C (G), (3)

5 P(G) / (P(G)+N(G)) Positive examples Probability function Negative examples Positive examples G Fig. 1: 1D example of a probability distribution modelled using equation 3. where P C (G) and N C (G) are the multivariate KDEs of the positive and negative datasets for C respectively, evaluated at G: P C (x) = 1 p e GP i x 2 /h 2 (4) p i=1 N C (x) = 1 n e GN i x 2 /h 2, (5) n i=1 where h is the kernel bandwidth. We use the FigTree Fast Gaussian Transform library [7] for efficient KDE implementation. Figure 1 shows an example of the probability model for a one dimensional case. It is clear that in areas of negative examples, the function yields near zero and in areas of positive examples the function yields values of near 1. Importantly, in the boundary between positive and negative examples the function varies smoothly with a smoothness dependent upon the width of the Gaussian example points either side. This allows numerical hill-climbing techniques as described in the following section. 3.3 Using the learned mapping The learned probability distribution can now be used both to classify given geometric states into symbolic states, and to generate geometric states that comply with desired symbolic states. Classification can be achieved by thresholding the class probability at some sensible value, depending upon how certain the classification needs to be. The more interesting case of using the learned distribution to generate geometric states matching desired symbolic configurations is more demanding. For a single predicate goal we achieve this by maximising the 17D probability function, keeping the 6 elements corresponding to object size constant. The smooth and continuous nature of the function allows maximisation to be carried out numerically using hill climbing from an initial estimate selected from G P. We found the Broyden-Fletcher-Goldfarb-Shanno optimisation method to perform suitably well for this purpose.

6 When considering more than one predicate clause using (1), the dimensionality of the space increases and dependencies between objects have to be taken into account. When an object appears in multiple clauses, the size and orientation of the object only appear once in the geometric state. In addition to this, the translations between objects are never allowed to form a cycle. For example, if the state contains the translation between A and B, and between B and C, then there must be no translation between A and C. We avoid these problems by optimising over the direct pose of all non-fixed objects in one shot, evaluating the poses using the relative translations between objects as described in Section 3.1. As an example consider using the approach to find a geometric state for the 5 clause symbolic state (and (above cup1 tray) (touching cup1 tray) (above cup2 tray) (touching cup2 tray) (not (touching cup1 cup2))). If each predicate was treated independently then the search space would contain 85 dimensions. Removing the repeated dimensions for the orientations of objects appearing in the state multiple times, and setting the sizes of all the objects that the state concerns constant leaves a search space of 27D. However, optimising directly in this space could lead to an impossible geometric state as the space contains a loop of transformations: if a transformation between cup1 and the tray is found, and a transformation between cup2 and the tray is found, then the transformation between cup1 and cup2 has to be fixed and can not be found independently. To avoid inconsistencies we optimise in the space of absolute object poses not relative poses. In this example, the optimisation vector comprises of a quaternion and a position for each object considered in the state (3 objects, 21D). When calculating the probability of a state in this form, each relative translation between object is calculated on the fly. 3.4 Generating multiple candidate geometric states Our approach for generating geometric states for given symbolic states outlined in the previous section will provide only a single geometric state with a high probability of complying with the requested symbolic description. However, the reverse mapping is of a one-to-many nature, and in some cases multiple candidate geometric states might be required. A key example of this is when performing hybrid planning, in which the robot may need to decide where to place a cup. If the first chosen place is not possible, because it is blocked by an obstacle for example, alternative candidate locations that are significantly different from the first may need to be selected and tested during a back-tracking stage. The nature of our selected model lends itself well to a straight forward solution to this: for each generated geometric state, we mask the probability distribution (Equation 1) temporarily decreasing the probability of geometric states already created thereby forcing the maximisation to select an alternative point. For the mask we again select a Kernel Density estimate for smoothness: [ Q n+1 = arg max p(s G) G n e t(qi) t(g) 2 /h 2] (6) i=1

7 (a) (b) (c) (d) Fig. 2: Probability distributions superimposed on a geometric state. (a) Tray and two cups. (b) Probability of a cup above the table. (c) Probability of a cup above the table and not touching other cups. (d) Probability of a cup above and touching other cup. where Q n is the n th generated geometric state corresponding to the desired symbolic state S and t(g) is a function providing a vector of positions of objects in state G. Initially no masks are present and n = 0. 4 Experiments and Results To test our system, example geometric states of two cups and a tray were created as discussed in the introduction. Each state was labelled to indicate whether one cup was above and/or touching the tray or the other cup. The data set for the above predicate comprised of 328 positive and 1672 negative examples, and the data set for the touching predicate comprised of 384 positive and 1872 negative examples. These samples were then used to create the 17 dimensional probability distribution detailed in Section 3.2. Examples of the x and y dimensions of the distribution with z 3cm above the tray are shown in Figure 2. Each point on the plane is coloured according to the probability that a cup placed at that (X,Y,Z) position meets the specific symbolic state: sub image (b) shows the probability that the position is above the tray; (c) above the tray and not touching either other cup; (c) above and touching the cup on the right. The bandwidth parameter (variance of the Gaussians) to the Kernel density estimation was selected manually. Larger values make the boundary transitions slower, while low values lead to abrupt transitions that are more difficult for the optimisation. 4.1 The forward mapping To evaluate the classifier in the forward direction we carried out leave-one-out crossvalidation for each predicate. Carrying out the cross-validation for several classification thresholds suggested an optimum value of about 0.8. We found that with significantly less training samples than the already small number that we demonstrate with here, the classification results in large numbers of false negatives. The resulting confusion matrices when using a threshold of 0.8 were as follows: Predicted above not above Actual above not above Actual Predicted touching not touching touching not touching

8 Table 1: Classification probabilities for the states shown in Figure 3 State (a) (b) (c) (d) (above cup tray) (touching cup tray) (above cup2 tray) (touching cup2 tray) (touching cup cup2) (above cup cup2) (a) (b) (c) (d) Fig. 3: The geometric states tested in Table 1 Figure 3 illustrates the forward mapping by showing four simulated geometric configurations. For each of them, we compute the probability of a number of symbolic predicates, with the results in Table 1. From the table it can be seen that even with a higher threshold in the region of 0.9 these states are classified correctly. Although the geometric configurations differ from the examples that the system was trained with, the choice of representation for the probability distribution means that states falling between two positive examples are awarded near 1 probability. The smooth nature of the probability estimate can be further seen in example (d) (one cup stacked inside another) when deciding if the upper cup is touching the tray or not. A probability of indicates that it is close to the tray, but not as close as the cup below which is touching with probability greater than The reverse mapping Figure 4 shows four geometric configurations automatically generated to match the compound states listed in Table 2. States (b) and (c) demonstrate the result of combining the individual predicate distributions. Trying to find a geometric state that has multiple cups on the tray, but not touching each other results in a process somewhat like a spring-and-mass system during hill climbing where the cups are pushing each other apart while the tray is pulling them towards it. The end configuration is the cups on the tray and as far apart from each other as possible. To demonstrate generating multiple different geometric solutions, Figure 5 shows a two dimensional slice through the masked PDFs on a single X,Y plane 3 cm above the tray resulting from generating 6 positions for a cup on a tray using the masking approach detailed in Section 3.4. The effect of the Gaussian shape of the masks where the cups are placed can be seen in the distribution; a wider kernel width will mask

9 Table 2: Classification probabilities for the states shown in Figure 4 Goal state supplied Probability (a) (and (above cup tray) (touching cup tray)) (and (above cup tray) (touching cup tray) (above cup2 tray) (touching (b) cup2 tray) (not (touching cup cup2))) (and (above cup tray) (touching cup tray) (above cup2 tray) (touching (c) cup2 tray) (above cup3 tray) (touching cup3 tray) (not (touching cup cup2)) (not (touching cup cup3)) (not (touching cup2 cup3))) (and (above cup tray) (touching cup tray) (above cup2 tray) (touching (d) cup2 tray) (above cup3 cup2) (touching cup3 cup2) (not (touching cup cup2))) (a) (b) (c) (d) Fig. 4: Geometric states generated for the symbolic states give in Table 2. more of the distribution leading to the generated positions being further apart, while a narrower kernel width would have the opposite effect. 4.3 Robotic Manipulation Planning To demonstrate the applicability and usefulness of our approach in a real world robotics context we used the learned predicates in a symbolic planning system to generate plans for execution by a robot manipulator. We constructed a planning domain description in PDDL [3] comprising actions to pick objects and place them on other objects. For each symbolic action we created a chunk of robot code to perform the action, with additional parameters for the geometric positions. The actions make calls to an RRT path-planner to move the 6 DOF arm between poses. We tested the approach using the Fast Downward[2] symbolic planner with the goal of three cups being above and touching the tray and the fourth above and touching another. The planner generated the sequence of actions necessary to arrange the cups, but only provides the symbolic effect of actions. In order to turn the symbolic plan into a full geometric plan ready for executing on the robot, we then simulated the plan symbolically to generate the sequence of states the robot will visit when executing the plan. Each of these states consists of a set of predicates that is true at that point in the plan. For each state, we then used the geometric to symbolic mapping in reverse to generate a geometric state in which the symbolic state predicates would be true with high probability. We do this state-by-state translation in reverse order and when we search for a corresponding geometric state we only allow objects that have been touched by the robot up to that point in the plan to be moved.

10 Cup position masked Tray Mask after 1 st cup Mask after 2 nd cup Mask after 3 rd cup Mask after 4 th cup Mask after 5 th cup Mask after 6 th cup Fig. 5: Generating multiple candidate geometries for the symbolic state (and (above cup tray) (touching cup tray)) by masking the probability distribution after each candidate is generated. After generating the geometric information for each action in the plan it was directly executed on the real robot as shown in Fig The robot used was an industrial arm (Kuka KR5-Sixx R850) with a two finger gripper (RoadNarrows Graboid). Cup localisation was performed using a Kinect RGBD camera. The point cloud was segmented into clusters above the table plane, with each cluster centroid giving the location of an object. The transformation from Kinect frame to robot frame was calculated using a calibration board at a known location in the robot frame. 5 Discussion and Future Work As we argued above, the mapping between geometric and symbolic states is a necessary part of any robotic system that needs high-level reasoning to achieve tasks. We have shown that such a mapping can be learned from examples and that the mapping can successfully be used in both directions. In addition, we have demonstrated the usefulness of the mapping in a real planning task with a simple planner. At present we have only learned two predicates (the most useful ones for the task), but the approach generalises to more predicates, and as we show in the experiments, the reverse mapping can cope with conjunctions of predicates, although performance does depend on the number of predicates in the conjunction. At present, the parameters of the learned Gaussians are set by hand. There has been significant work in the learning literature on learning the parameters of the models, and 1 Video of execution available at:

11 (a) (b) (c) (d) Fig. 6: The test planning scenario on the Kuka arm. (a) The initial configuration. (b) Ready to grasp a cup. (c) Cup above table. (d) Cup above another cup. we plan to incorporate this work in future. This is particularly important because at present we assume the Gaussians have the same variance in every direction, which is clearly not true in the case, for example, of the touching predicate, which has a very tight variance in the vertical direction. One interesting observation from the experimental task was that there is a third predicate needed to perform well in cup stacking. This new predicate captures the idea that it is safe to release a held cup to form a stack. At present, our planner assumes that above and touching are sufficient, but in fact the held cup should be inside the other to minimise the distance it falls when released. While we could simply add this predicate to the planning domain and learn it as before, one area we are investigating is whether we can use an unsupervised approach to recognise from the examples that there is a consistent relationship between the objects whenever a cup is stacked in another. Similarly, unsupervised learning from arm trajectories might yield constraints such as that cups should be kept open-end-up when moving them.

12 Finally, the experiments shown here perform planning hierarchically: first the symbolic plan is found, then the mapping is used to generate corresponding geometric goals, and then a path planner is used. As the task gets more complex, this approach will fail as the path planner will fail to solve the geometric problem. In these cases, what is needed is a fully hybrid planner as in, for example [8]. We are currently working on integrating this approach with a hybrid planner, and also with execution monitoring and repair to make it more robust to unpredictability in the world. Acknowledgements This work was supported by the European Community s Seventh Framework Programme as part of the GeRT project, grant agreement number ICT References 1. Blum, A., Furst, M.: Fast planning through planning graph analysis. Artificial Intelligence (90) (1997) Helmert, M.: The Fast Downward planning system. Journal of Artificial Intelligence Research 26 (2006) McDermott, D., Ghallab, M., Howe, A., Knoblock, C.A., Ram, A., Veloso, M., Weld, D.S., Wilkins, D.E.: PDDL The planning domain definition language. Technical Report DCS TR-1165, Yale University, New Haven, Connecticut (1998) 4. James J. Kuffner, J., LaValle, S.M.: RRT-connect: An efficient approach to single-query path planning. Proceedings of the IEEE International Conference on Robotics and Automation (ICRA-00) (2000) Siméon, T., Laumond, J., Nissoux, C.: Visibility based probabilistic roadmaps for motion planning. Advanced Robotics Journal (2000) 6. Scott, D.W.: Multivariate Density Estimation: Theory, Practice, and Visualization. John Wiley and Sons, Inc., Hoboken, NJ, USA (2008) 7. Morariu, V.I., Srinivasan, B.V., Raykar, V.C., Duraiswami, R., Davis, L.S.: Automatic online tuning for fast Gaussian summation. In: Advances in Neural Information Processing Systems (NIPS). (2008) 8. Gravot, F., Cambon, S., Alami, R.: asymov: A planner that deals with intricate symbolic and geometric problems. In: ISRR. Volume 15 of Springer Tracts in Advanced Robotics., Springer (2003) Kaelbling, L.P., Lozano-Pérez, T.: Hierarchical task and motion planning in the now. In: Proceedings of Robotics and Automation (ICRA). (2011) Jäkel, R., Schmidt-Rohr, S., Lösch, M., Kasper, A., Dillmann, R.: Learning of generalized manipulation strategies in the context of programming by demonstration. In: Humanoid Robots (Humanoids), th IEEE-RAS International Conference on, IEEE (2010) Sjöö, K., Aydemir, A., Morwald, T., Zhou, K., Jensfelt, P.: Mechanical support as a spatial abstraction for mobile robots. In: Intelligent Robots and Systems (IROS), 2010 IEEE/RSJ International Conference on, IEEE (2010) Sjöö, K., Jensfelt, P.: Learning spatial relations from functional simulation. In: Intelligent Robots and Systems (IROS), 2011 IEEE/RSJ International Conference on, IEEE (2011) Rosman, B., Ramamoorthy, S.: Learning spatial relationships between objects. The International Journal of Robotics Research 30(11) (2011)

arxiv: v1 [cs.ro] 23 May 2018

arxiv: v1 [cs.ro] 23 May 2018 Tool Exchangeable Grasp/Assembly Planner Kensuke Harada 1,2, Kento Nakayama 1, Weiwei Wan 1,2, Kazuyuki Nagata 2 Natsuki Yamanobe 2, and Ixchel G. Ramirez-Alpizar 1 arxiv:1805.08962v1 [cs.ro] 23 May 2018

More information

COMBINING TASK AND MOTION PLANNING FOR COMPLEX MANIPULATION

COMBINING TASK AND MOTION PLANNING FOR COMPLEX MANIPULATION COMBINING TASK AND MOTION PLANNING FOR COMPLEX MANIPULATION 16-662: ROBOT AUTONOMY PROJECT Team: Gauri Gandhi Keerthana Manivannan Lekha Mohan Rohit Dashrathi Richa Varma ABSTRACT Robots performing household

More information

A Modular Software Framework for Eye-Hand Coordination in Humanoid Robots

A Modular Software Framework for Eye-Hand Coordination in Humanoid Robots A Modular Software Framework for Eye-Hand Coordination in Humanoid Robots Jurgen Leitner, Simon Harding, Alexander Forster and Peter Corke Presentation: Hana Fusman Introduction/ Overview The goal of their

More information

Robot Learning. There are generally three types of robot learning: Learning from data. Learning by demonstration. Reinforcement learning

Robot Learning. There are generally three types of robot learning: Learning from data. Learning by demonstration. Reinforcement learning Robot Learning 1 General Pipeline 1. Data acquisition (e.g., from 3D sensors) 2. Feature extraction and representation construction 3. Robot learning: e.g., classification (recognition) or clustering (knowledge

More information

Simultaneous surface texture classification and illumination tilt angle prediction

Simultaneous surface texture classification and illumination tilt angle prediction Simultaneous surface texture classification and illumination tilt angle prediction X. Lladó, A. Oliver, M. Petrou, J. Freixenet, and J. Martí Computer Vision and Robotics Group - IIiA. University of Girona

More information

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz Humanoid Robotics Inverse Kinematics and Whole-Body Motion Planning Maren Bennewitz 1 Motivation Plan a sequence of configurations (vector of joint angle values) that let the robot move from its current

More information

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz

Humanoid Robotics. Inverse Kinematics and Whole-Body Motion Planning. Maren Bennewitz Humanoid Robotics Inverse Kinematics and Whole-Body Motion Planning Maren Bennewitz 1 Motivation Planning for object manipulation Whole-body motion to reach a desired goal configuration Generate a sequence

More information

Algorithmic Robotics and Motion Planning

Algorithmic Robotics and Motion Planning Algorithmic Robotics and Motion Planning Spring 2018 Introduction Dan Halperin School of Computer Science Tel Aviv University Dolce & Gabbana 2018 handbag collection Today s lesson basic terminology fundamental

More information

Geometric Path Planning McGill COMP 765 Oct 12 th, 2017

Geometric Path Planning McGill COMP 765 Oct 12 th, 2017 Geometric Path Planning McGill COMP 765 Oct 12 th, 2017 The Motion Planning Problem Intuition: Find a safe path/trajectory from start to goal More precisely: A path is a series of robot configurations

More information

A New Online Clustering Approach for Data in Arbitrary Shaped Clusters

A New Online Clustering Approach for Data in Arbitrary Shaped Clusters A New Online Clustering Approach for Data in Arbitrary Shaped Clusters Richard Hyde, Plamen Angelov Data Science Group, School of Computing and Communications Lancaster University Lancaster, LA1 4WA, UK

More information

Multiple-Choice Questionnaire Group C

Multiple-Choice Questionnaire Group C Family name: Vision and Machine-Learning Given name: 1/28/2011 Multiple-Choice naire Group C No documents authorized. There can be several right answers to a question. Marking-scheme: 2 points if all right

More information

Classification. Vladimir Curic. Centre for Image Analysis Swedish University of Agricultural Sciences Uppsala University

Classification. Vladimir Curic. Centre for Image Analysis Swedish University of Agricultural Sciences Uppsala University Classification Vladimir Curic Centre for Image Analysis Swedish University of Agricultural Sciences Uppsala University Outline An overview on classification Basics of classification How to choose appropriate

More information

Sampling-based Planning 2

Sampling-based Planning 2 RBE MOTION PLANNING Sampling-based Planning 2 Jane Li Assistant Professor Mechanical Engineering & Robotics Engineering http://users.wpi.edu/~zli11 Problem with KD-tree RBE MOTION PLANNING Curse of dimension

More information

Learning a Manifold as an Atlas Supplementary Material

Learning a Manifold as an Atlas Supplementary Material Learning a Manifold as an Atlas Supplementary Material Nikolaos Pitelis Chris Russell School of EECS, Queen Mary, University of London [nikolaos.pitelis,chrisr,lourdes]@eecs.qmul.ac.uk Lourdes Agapito

More information

Model-based segmentation and recognition from range data

Model-based segmentation and recognition from range data Model-based segmentation and recognition from range data Jan Boehm Institute for Photogrammetry Universität Stuttgart Germany Keywords: range image, segmentation, object recognition, CAD ABSTRACT This

More information

Combining Motion Planning and Task Assignment for a Dual-arm System

Combining Motion Planning and Task Assignment for a Dual-arm System Combining Motion Planning and Task Assignment for a Dual-arm System Carlos Rodríguez and Raúl Suárez Abstract This paper deals with the problem of combining motion and task assignment for a dual-arm robotic

More information

Vision-Motion Planning with Uncertainty

Vision-Motion Planning with Uncertainty Vision-Motion Planning with Uncertainty Jun MIURA Yoshiaki SHIRAI Dept. of Mech. Eng. for Computer-Controlled Machinery, Osaka University, Suita, Osaka 565, Japan jun@ccm.osaka-u.ac.jp Abstract This paper

More information

AMR 2011/2012: Final Projects

AMR 2011/2012: Final Projects AMR 2011/2012: Final Projects 0. General Information A final project includes: studying some literature (typically, 1-2 papers) on a specific subject performing some simulations or numerical tests on an

More information

Leave-One-Out Support Vector Machines

Leave-One-Out Support Vector Machines Leave-One-Out Support Vector Machines Jason Weston Department of Computer Science Royal Holloway, University of London, Egham Hill, Egham, Surrey, TW20 OEX, UK. Abstract We present a new learning algorithm

More information

Configuration Space of a Robot

Configuration Space of a Robot Robot Path Planning Overview: 1. Visibility Graphs 2. Voronoi Graphs 3. Potential Fields 4. Sampling-Based Planners PRM: Probabilistic Roadmap Methods RRTs: Rapidly-exploring Random Trees Configuration

More information

A Robust Two Feature Points Based Depth Estimation Method 1)

A Robust Two Feature Points Based Depth Estimation Method 1) Vol.31, No.5 ACTA AUTOMATICA SINICA September, 2005 A Robust Two Feature Points Based Depth Estimation Method 1) ZHONG Zhi-Guang YI Jian-Qiang ZHAO Dong-Bin (Laboratory of Complex Systems and Intelligence

More information

II. RELATED WORK. A. Probabilistic roadmap path planner

II. RELATED WORK. A. Probabilistic roadmap path planner Gaussian PRM Samplers for Dynamic Configuration Spaces Yu-Te Lin and Shih-Chia Cheng Computer Science Department Stanford University Stanford, CA 94305, USA {yutelin, sccheng}@cs.stanford.edu SUID: 05371954,

More information

Ground Plane Motion Parameter Estimation For Non Circular Paths

Ground Plane Motion Parameter Estimation For Non Circular Paths Ground Plane Motion Parameter Estimation For Non Circular Paths G.J.Ellwood Y.Zheng S.A.Billings Department of Automatic Control and Systems Engineering University of Sheffield, Sheffield, UK J.E.W.Mayhew

More information

Learning Semantic Environment Perception for Cognitive Robots

Learning Semantic Environment Perception for Cognitive Robots Learning Semantic Environment Perception for Cognitive Robots Sven Behnke University of Bonn, Germany Computer Science Institute VI Autonomous Intelligent Systems Some of Our Cognitive Robots Equipped

More information

then assume that we are given the image of one of these textures captured by a camera at a different (longer) distance and with unknown direction of i

then assume that we are given the image of one of these textures captured by a camera at a different (longer) distance and with unknown direction of i Image Texture Prediction using Colour Photometric Stereo Xavier Lladó 1, Joan Mart 1, and Maria Petrou 2 1 Institute of Informatics and Applications, University of Girona, 1771, Girona, Spain fllado,joanmg@eia.udg.es

More information

Machine Learning in the Wild. Dealing with Messy Data. Rajmonda S. Caceres. SDS 293 Smith College October 30, 2017

Machine Learning in the Wild. Dealing with Messy Data. Rajmonda S. Caceres. SDS 293 Smith College October 30, 2017 Machine Learning in the Wild Dealing with Messy Data Rajmonda S. Caceres SDS 293 Smith College October 30, 2017 Analytical Chain: From Data to Actions Data Collection Data Cleaning/ Preparation Analysis

More information

Machine Learning and Pervasive Computing

Machine Learning and Pervasive Computing Stephan Sigg Georg-August-University Goettingen, Computer Networks 17.12.2014 Overview and Structure 22.10.2014 Organisation 22.10.3014 Introduction (Def.: Machine learning, Supervised/Unsupervised, Examples)

More information

The Application of Automated Planning to Machine Tool Calibration

The Application of Automated Planning to Machine Tool Calibration The Application of Automated Planning to Machine Tool Calibration S. Parkinson 1 A. P. Longstaff 1 A. Crampton 2 P. Gregory 2 1 Centre for Precision Technologies 2 Department of Informatics School of Computing

More information

Fast 3D Mean Shift Filter for CT Images

Fast 3D Mean Shift Filter for CT Images Fast 3D Mean Shift Filter for CT Images Gustavo Fernández Domínguez, Horst Bischof, and Reinhard Beichel Institute for Computer Graphics and Vision, Graz University of Technology Inffeldgasse 16/2, A-8010,

More information

arxiv: v1 [cs.ro] 8 Sep 2015

arxiv: v1 [cs.ro] 8 Sep 2015 Developing and Comparing Single-arm and Dual-arm Regrasp Weiwei Wan and Kensuke Harada arxiv:1509.02302v1 [cs.ro] 8 Sep 2015 Abstract The goal of this paper is to develop efficient regrasp algorithms for

More information

Lighting- and Occlusion-robust View-based Teaching/Playback for Model-free Robot Programming

Lighting- and Occlusion-robust View-based Teaching/Playback for Model-free Robot Programming Lighting- and Occlusion-robust View-based Teaching/Playback for Model-free Robot Programming *Yusuke MAEDA (Yokohama National University) Yoshito SAITO (Ricoh Corp) Background Conventional Teaching/Playback

More information

Semantic Object Recognition in Digital Images

Semantic Object Recognition in Digital Images Semantic Object Recognition in Digital Images Semantic Object Recognition in Digital Images Falk Schmidsberger and Frieder Stolzenburg Hochschule Harz, Friedrichstr. 57 59 38855 Wernigerode, GERMANY {fschmidsberger,fstolzenburg}@hs-harz.de

More information

Sampling-Based Robot Motion Planning. Lydia Kavraki Department of Computer Science Rice University Houston, TX USA

Sampling-Based Robot Motion Planning. Lydia Kavraki Department of Computer Science Rice University Houston, TX USA Sampling-Based Robot Motion Planning Lydia Kavraki Department of Computer Science Rice University Houston, TX USA Motion planning: classical setting Go from Start to Goal without collisions and while respecting

More information

Pedestrian Detection Using Correlated Lidar and Image Data EECS442 Final Project Fall 2016

Pedestrian Detection Using Correlated Lidar and Image Data EECS442 Final Project Fall 2016 edestrian Detection Using Correlated Lidar and Image Data EECS442 Final roject Fall 2016 Samuel Rohrer University of Michigan rohrer@umich.edu Ian Lin University of Michigan tiannis@umich.edu Abstract

More information

Using the generalized Radon transform for detection of curves in noisy images

Using the generalized Radon transform for detection of curves in noisy images Downloaded from orbit.dtu.dk on: Jan 13, 2018 Using the generalized Radon transform for detection of curves in noisy images Toft, eter Aundal ublished in: Conference roceedings. 1996 IEEE International

More information

Human Motion Detection and Tracking for Video Surveillance

Human Motion Detection and Tracking for Video Surveillance Human Motion Detection and Tracking for Video Surveillance Prithviraj Banerjee and Somnath Sengupta Department of Electronics and Electrical Communication Engineering Indian Institute of Technology, Kharagpur,

More information

CIRCULAR MOIRÉ PATTERNS IN 3D COMPUTER VISION APPLICATIONS

CIRCULAR MOIRÉ PATTERNS IN 3D COMPUTER VISION APPLICATIONS CIRCULAR MOIRÉ PATTERNS IN 3D COMPUTER VISION APPLICATIONS Setiawan Hadi Mathematics Department, Universitas Padjadjaran e-mail : shadi@unpad.ac.id Abstract Geometric patterns generated by superimposing

More information

Tracking of Human Body using Multiple Predictors

Tracking of Human Body using Multiple Predictors Tracking of Human Body using Multiple Predictors Rui M Jesus 1, Arnaldo J Abrantes 1, and Jorge S Marques 2 1 Instituto Superior de Engenharia de Lisboa, Postfach 351-218317001, Rua Conselheiro Emído Navarro,

More information

6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning

6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning 6.141: Robotics systems and science Lecture 9: Configuration Space and Motion Planning Lecture Notes Prepared by Daniela Rus EECS/MIT Spring 2012 Figures by Nancy Amato, Rodney Brooks, Vijay Kumar Reading:

More information

Random projection for non-gaussian mixture models

Random projection for non-gaussian mixture models Random projection for non-gaussian mixture models Győző Gidófalvi Department of Computer Science and Engineering University of California, San Diego La Jolla, CA 92037 gyozo@cs.ucsd.edu Abstract Recently,

More information

Active Recognition and Manipulation of Simple Parts Exploiting 3D Information

Active Recognition and Manipulation of Simple Parts Exploiting 3D Information experiment ActReMa Active Recognition and Manipulation of Simple Parts Exploiting 3D Information Experiment Partners: Rheinische Friedrich-Wilhelms-Universität Bonn Metronom Automation GmbH Experiment

More information

Improving Latent Fingerprint Matching Performance by Orientation Field Estimation using Localized Dictionaries

Improving Latent Fingerprint Matching Performance by Orientation Field Estimation using Localized Dictionaries Available Online at www.ijcsmc.com International Journal of Computer Science and Mobile Computing A Monthly Journal of Computer Science and Information Technology IJCSMC, Vol. 3, Issue. 11, November 2014,

More information

Task analysis based on observing hands and objects by vision

Task analysis based on observing hands and objects by vision Task analysis based on observing hands and objects by vision Yoshihiro SATO Keni Bernardin Hiroshi KIMURA Katsushi IKEUCHI Univ. of Electro-Communications Univ. of Karlsruhe Univ. of Tokyo Abstract In

More information

COMP 551 Applied Machine Learning Lecture 13: Unsupervised learning

COMP 551 Applied Machine Learning Lecture 13: Unsupervised learning COMP 551 Applied Machine Learning Lecture 13: Unsupervised learning Associate Instructor: Herke van Hoof (herke.vanhoof@mail.mcgill.ca) Slides mostly by: (jpineau@cs.mcgill.ca) Class web page: www.cs.mcgill.ca/~jpineau/comp551

More information

Elastic Bands: Connecting Path Planning and Control

Elastic Bands: Connecting Path Planning and Control Elastic Bands: Connecting Path Planning and Control Sean Quinlan and Oussama Khatib Robotics Laboratory Computer Science Department Stanford University Abstract Elastic bands are proposed as the basis

More information

Robotics in Agriculture

Robotics in Agriculture Robotics in Agriculture The Australian Centre for Field Robotics is currently pursuing exciting research and development projects in agricultural robotics, which will have a large and long-term impact

More information

Object Segmentation and Tracking in 3D Video With Sparse Depth Information Using a Fully Connected CRF Model

Object Segmentation and Tracking in 3D Video With Sparse Depth Information Using a Fully Connected CRF Model Object Segmentation and Tracking in 3D Video With Sparse Depth Information Using a Fully Connected CRF Model Ido Ofir Computer Science Department Stanford University December 17, 2011 Abstract This project

More information

A Neural Classifier for Anomaly Detection in Magnetic Motion Capture

A Neural Classifier for Anomaly Detection in Magnetic Motion Capture A Neural Classifier for Anomaly Detection in Magnetic Motion Capture Iain Miller 1 and Stephen McGlinchey 2 1 University of Paisley, Paisley. PA1 2BE, UK iain.miller@paisley.ac.uk, 2 stephen.mcglinchey@paisley.ac.uk

More information

Small Object Manipulation in 3D Perception Robotic Systems Using Visual Servoing

Small Object Manipulation in 3D Perception Robotic Systems Using Visual Servoing Small Object Manipulation in 3D Perception Robotic Systems Using Visual Servoing Camilo Perez Quintero, Oscar Ramirez, Mona Gridseth and Martin Jägersand* Abstract Robot manipulation has benefited from

More information

Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization

Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization Mobile Robot Path Planning in Static Environments using Particle Swarm Optimization M. Shahab Alam, M. Usman Rafique, and M. Umer Khan Abstract Motion planning is a key element of robotics since it empowers

More information

Locally Weighted Learning for Control. Alexander Skoglund Machine Learning Course AASS, June 2005

Locally Weighted Learning for Control. Alexander Skoglund Machine Learning Course AASS, June 2005 Locally Weighted Learning for Control Alexander Skoglund Machine Learning Course AASS, June 2005 Outline Locally Weighted Learning, Christopher G. Atkeson et. al. in Artificial Intelligence Review, 11:11-73,1997

More information

An Interactive Technique for Robot Control by Using Image Processing Method

An Interactive Technique for Robot Control by Using Image Processing Method An Interactive Technique for Robot Control by Using Image Processing Method Mr. Raskar D. S 1., Prof. Mrs. Belagali P. P 2 1, E&TC Dept. Dr. JJMCOE., Jaysingpur. Maharashtra., India. 2 Associate Prof.

More information

BACKWARD-FORWARD SEARCH FOR MANIPULATION PLANNING

BACKWARD-FORWARD SEARCH FOR MANIPULATION PLANNING BACKWARD-FORWARD SEARCH FOR MANIPULATION PLANNING Caelan Garrett, Tomás Lozano-Pérez, and Leslie Kaelbling MIT CSAIL - IROS 2015 Hybrid Planning Mixed discrete/continuous state & actions Hybrid Planning

More information

Programs for MDE Modeling and Conditional Distribution Calculation

Programs for MDE Modeling and Conditional Distribution Calculation Programs for MDE Modeling and Conditional Distribution Calculation Sahyun Hong and Clayton V. Deutsch Improved numerical reservoir models are constructed when all available diverse data sources are accounted

More information

Robot localization method based on visual features and their geometric relationship

Robot localization method based on visual features and their geometric relationship , pp.46-50 http://dx.doi.org/10.14257/astl.2015.85.11 Robot localization method based on visual features and their geometric relationship Sangyun Lee 1, Changkyung Eem 2, and Hyunki Hong 3 1 Department

More information

Techniques. IDSIA, Istituto Dalle Molle di Studi sull'intelligenza Articiale. Phone: Fax:

Techniques. IDSIA, Istituto Dalle Molle di Studi sull'intelligenza Articiale. Phone: Fax: Incorporating Learning in Motion Planning Techniques Luca Maria Gambardella and Marc Haex IDSIA, Istituto Dalle Molle di Studi sull'intelligenza Articiale Corso Elvezia 36 - CH - 6900 Lugano Phone: +41

More information

Nearest Clustering Algorithm for Satellite Image Classification in Remote Sensing Applications

Nearest Clustering Algorithm for Satellite Image Classification in Remote Sensing Applications Nearest Clustering Algorithm for Satellite Image Classification in Remote Sensing Applications Anil K Goswami 1, Swati Sharma 2, Praveen Kumar 3 1 DRDO, New Delhi, India 2 PDM College of Engineering for

More information

University of Cambridge Engineering Part IIB Paper 4F10: Statistical Pattern Processing Handout 10: Decision Trees

University of Cambridge Engineering Part IIB Paper 4F10: Statistical Pattern Processing Handout 10: Decision Trees University of Cambridge Engineering Part IIB Paper 4F10: Statistical Pattern Processing Handout 10: Decision Trees colour=green? size>20cm? colour=red? watermelon size>5cm? size>5cm? colour=yellow? apple

More information

SPATIAL GUIDANCE TO RRT PLANNER USING CELL-DECOMPOSITION ALGORITHM

SPATIAL GUIDANCE TO RRT PLANNER USING CELL-DECOMPOSITION ALGORITHM SPATIAL GUIDANCE TO RRT PLANNER USING CELL-DECOMPOSITION ALGORITHM Ahmad Abbadi, Radomil Matousek, Pavel Osmera, Lukas Knispel Brno University of Technology Institute of Automation and Computer Science

More information

Abstract. 1 Introduction

Abstract. 1 Introduction Robotic Path Planning using Rapidly exploring Random Trees Zoltan Deak Jnr. zoltanj@zoltanj.com Professor Ray Jarvis Intelligent Robotics Research Centre Monash University Ray.Jarvis@eng.monash.edu.au

More information

A Task-Oriented Approach for Retrieving an Object from a Pile

A Task-Oriented Approach for Retrieving an Object from a Pile A Task-Oriented Approach for Retrieving an Object from a Pile Vinay Pilania, Dale M c Conachie, Brent Griffin, Jason J. Corso, and Dmitry Berenson Abstract We present a framework for object retrieval tasks

More information

Probabilistic Methods for Kinodynamic Path Planning

Probabilistic Methods for Kinodynamic Path Planning 16.412/6.834J Cognitive Robotics February 7 th, 2005 Probabilistic Methods for Kinodynamic Path Planning Based on Past Student Lectures by: Paul Elliott, Aisha Walcott, Nathan Ickes and Stanislav Funiak

More information

Grasping Known Objects with Aldebaran Nao

Grasping Known Objects with Aldebaran Nao CS365 Project Report Grasping Known Objects with Aldebaran Nao By: Ashu Gupta( ashug@iitk.ac.in) Mohd. Dawood( mdawood@iitk.ac.in) Department of Computer Science and Engineering IIT Kanpur Mentor: Prof.

More information

Fundamentals of Digital Image Processing

Fundamentals of Digital Image Processing \L\.6 Gw.i Fundamentals of Digital Image Processing A Practical Approach with Examples in Matlab Chris Solomon School of Physical Sciences, University of Kent, Canterbury, UK Toby Breckon School of Engineering,

More information

arxiv: v1 [cs.cv] 28 Sep 2018

arxiv: v1 [cs.cv] 28 Sep 2018 Camera Pose Estimation from Sequence of Calibrated Images arxiv:1809.11066v1 [cs.cv] 28 Sep 2018 Jacek Komorowski 1 and Przemyslaw Rokita 2 1 Maria Curie-Sklodowska University, Institute of Computer Science,

More information

Robotics Tasks. CS 188: Artificial Intelligence Spring Manipulator Robots. Mobile Robots. Degrees of Freedom. Sensors and Effectors

Robotics Tasks. CS 188: Artificial Intelligence Spring Manipulator Robots. Mobile Robots. Degrees of Freedom. Sensors and Effectors CS 188: Artificial Intelligence Spring 2006 Lecture 5: Robot Motion Planning 1/31/2006 Dan Klein UC Berkeley Many slides from either Stuart Russell or Andrew Moore Motion planning (today) How to move from

More information

Image Coding with Active Appearance Models

Image Coding with Active Appearance Models Image Coding with Active Appearance Models Simon Baker, Iain Matthews, and Jeff Schneider CMU-RI-TR-03-13 The Robotics Institute Carnegie Mellon University Abstract Image coding is the task of representing

More information

Performance Evaluation Metrics and Statistics for Positional Tracker Evaluation

Performance Evaluation Metrics and Statistics for Positional Tracker Evaluation Performance Evaluation Metrics and Statistics for Positional Tracker Evaluation Chris J. Needham and Roger D. Boyle School of Computing, The University of Leeds, Leeds, LS2 9JT, UK {chrisn,roger}@comp.leeds.ac.uk

More information

PATTERN CLASSIFICATION AND SCENE ANALYSIS

PATTERN CLASSIFICATION AND SCENE ANALYSIS PATTERN CLASSIFICATION AND SCENE ANALYSIS RICHARD O. DUDA PETER E. HART Stanford Research Institute, Menlo Park, California A WILEY-INTERSCIENCE PUBLICATION JOHN WILEY & SONS New York Chichester Brisbane

More information

Motion in 2D image sequences

Motion in 2D image sequences Motion in 2D image sequences Definitely used in human vision Object detection and tracking Navigation and obstacle avoidance Analysis of actions or activities Segmentation and understanding of video sequences

More information

Texture Segmentation by Windowed Projection

Texture Segmentation by Windowed Projection Texture Segmentation by Windowed Projection 1, 2 Fan-Chen Tseng, 2 Ching-Chi Hsu, 2 Chiou-Shann Fuh 1 Department of Electronic Engineering National I-Lan Institute of Technology e-mail : fctseng@ccmail.ilantech.edu.tw

More information

Developing Algorithms for Robotics and Autonomous Systems

Developing Algorithms for Robotics and Autonomous Systems Developing Algorithms for Robotics and Autonomous Systems Jorik Caljouw 2015 The MathWorks, Inc. 1 Key Takeaway of this Talk Success in developing an autonomous robotics system requires: 1. Multi-domain

More information

Optimizing Schedules for Prioritized Path Planning of Multi-Robot Systems

Optimizing Schedules for Prioritized Path Planning of Multi-Robot Systems Proceedings of the 20 IEEE International Conference on Robotics & Automation Seoul, Korea May 21-26, 20 Optimizing Schedules for Prioritized Path Planning of Multi-Robot Systems Maren Bennewitz y Wolfram

More information

View Planning for 3D Object Reconstruction with a Mobile Manipulator Robot

View Planning for 3D Object Reconstruction with a Mobile Manipulator Robot View Planning for 3D Object Reconstruction with a Mobile Manipulator Robot J. Irving Vasquez-Gomez, L. Enrique Sucar, Rafael Murrieta-Cid National Institute for Astrophysics, Optics and Electronics (INAOE),

More information

Hand-Eye Calibration from Image Derivatives

Hand-Eye Calibration from Image Derivatives Hand-Eye Calibration from Image Derivatives Abstract In this paper it is shown how to perform hand-eye calibration using only the normal flow field and knowledge about the motion of the hand. The proposed

More information

An intelligent task programming system for modular manufacturing machines

An intelligent task programming system for modular manufacturing machines Loughborough University Institutional Repository An intelligent task programming system for modular manufacturing machines This item was submitted to Loughborough University's Institutional Repository

More information

Towards the completion of assignment 1

Towards the completion of assignment 1 Towards the completion of assignment 1 What to do for calibration What to do for point matching What to do for tracking What to do for GUI COMPSCI 773 Feature Point Detection Why study feature point detection?

More information

University of Cambridge Engineering Part IIB Paper 4F10: Statistical Pattern Processing Handout 10: Decision Trees

University of Cambridge Engineering Part IIB Paper 4F10: Statistical Pattern Processing Handout 10: Decision Trees University of Cambridge Engineering Part IIB Paper 4F10: Statistical Pattern Processing Handout 10: Decision Trees colour=green? size>20cm? colour=red? watermelon size>5cm? size>5cm? colour=yellow? apple

More information

15-494/694: Cognitive Robotics

15-494/694: Cognitive Robotics 15-494/694: Cognitive Robotics Dave Touretzky Lecture 9: Path Planning with Rapidly-exploring Random Trees Navigating with the Pilot Image from http://www.futuristgerd.com/2015/09/10 Outline How is path

More information

Advanced Robotics Path Planning & Navigation

Advanced Robotics Path Planning & Navigation Advanced Robotics Path Planning & Navigation 1 Agenda Motivation Basic Definitions Configuration Space Global Planning Local Planning Obstacle Avoidance ROS Navigation Stack 2 Literature Choset, Lynch,

More information

An Introduction to PDF Estimation and Clustering

An Introduction to PDF Estimation and Clustering Sigmedia, Electronic Engineering Dept., Trinity College, Dublin. 1 An Introduction to PDF Estimation and Clustering David Corrigan corrigad@tcd.ie Electrical and Electronic Engineering Dept., University

More information

Navigation and Metric Path Planning

Navigation and Metric Path Planning Navigation and Metric Path Planning October 4, 2011 Minerva tour guide robot (CMU): Gave tours in Smithsonian s National Museum of History Example of Minerva s occupancy map used for navigation Objectives

More information

Srikumar Ramalingam. Review. 3D Reconstruction. Pose Estimation Revisited. School of Computing University of Utah

Srikumar Ramalingam. Review. 3D Reconstruction. Pose Estimation Revisited. School of Computing University of Utah School of Computing University of Utah Presentation Outline 1 2 3 Forward Projection (Reminder) u v 1 KR ( I t ) X m Y m Z m 1 Backward Projection (Reminder) Q K 1 q Presentation Outline 1 2 3 Sample Problem

More information

In this assignment, we investigated the use of neural networks for supervised classification

In this assignment, we investigated the use of neural networks for supervised classification Paul Couchman Fabien Imbault Ronan Tigreat Gorka Urchegui Tellechea Classification assignment (group 6) Image processing MSc Embedded Systems March 2003 Classification includes a broad range of decision-theoric

More information

Introduction to Robotics

Introduction to Robotics Jianwei Zhang zhang@informatik.uni-hamburg.de Universität Hamburg Fakultät für Mathematik, Informatik und Naturwissenschaften Technische Aspekte Multimodaler Systeme 05. July 2013 J. Zhang 1 Task-level

More information

A Low Power, High Throughput, Fully Event-Based Stereo System: Supplementary Documentation

A Low Power, High Throughput, Fully Event-Based Stereo System: Supplementary Documentation A Low Power, High Throughput, Fully Event-Based Stereo System: Supplementary Documentation Alexander Andreopoulos, Hirak J. Kashyap, Tapan K. Nayak, Arnon Amir, Myron D. Flickner IBM Research March 25,

More information

Locally Weighted Learning

Locally Weighted Learning Locally Weighted Learning Peter Englert Department of Computer Science TU Darmstadt englert.peter@gmx.de Abstract Locally Weighted Learning is a class of function approximation techniques, where a prediction

More information

Field-of-view dependent registration of point clouds and incremental segmentation of table-tops using time-offlight

Field-of-view dependent registration of point clouds and incremental segmentation of table-tops using time-offlight Field-of-view dependent registration of point clouds and incremental segmentation of table-tops using time-offlight cameras Dipl.-Ing. Georg Arbeiter Fraunhofer Institute for Manufacturing Engineering

More information

A Novelty Detection Approach for Foreground Region Detection in Videos with Quasi-stationary Backgrounds

A Novelty Detection Approach for Foreground Region Detection in Videos with Quasi-stationary Backgrounds A Novelty Detection Approach for Foreground Region Detection in Videos with Quasi-stationary Backgrounds Alireza Tavakkoli 1, Mircea Nicolescu 1, and George Bebis 1 Computer Vision Lab. Department of Computer

More information

Exploiting Depth Camera for 3D Spatial Relationship Interpretation

Exploiting Depth Camera for 3D Spatial Relationship Interpretation Exploiting Depth Camera for 3D Spatial Relationship Interpretation Jun Ye Kien A. Hua Data Systems Group, University of Central Florida Mar 1, 2013 Jun Ye and Kien A. Hua (UCF) 3D directional spatial relationships

More information

arxiv: v1 [cs.ro] 11 Jul 2016

arxiv: v1 [cs.ro] 11 Jul 2016 Initial Experiments on Learning-Based Randomized Bin-Picking Allowing Finger Contact with Neighboring Objects Kensuke Harada, Weiwei Wan, Tokuo Tsuji, Kohei Kikuchi, Kazuyuki Nagata, and Hiromu Onda arxiv:1607.02867v1

More information

DEVELOPMENT OF LEG WHEEL HYBRID HEXAPOD BOT

DEVELOPMENT OF LEG WHEEL HYBRID HEXAPOD BOT DEVELOPMENT OF LEG WHEEL HYBRID HEXAPOD BOT Sai Srinivas Nallamothu, Sai Preetham Sata, P. Sateesh Kumar Reddy, B. Jaswanth Babu ABSTRACT The conventional mobile robotic platforms which either uses wheels

More information

Data mining with Support Vector Machine

Data mining with Support Vector Machine Data mining with Support Vector Machine Ms. Arti Patle IES, IPS Academy Indore (M.P.) artipatle@gmail.com Mr. Deepak Singh Chouhan IES, IPS Academy Indore (M.P.) deepak.schouhan@yahoo.com Abstract: Machine

More information

Robust and Accurate Detection of Object Orientation and ID without Color Segmentation

Robust and Accurate Detection of Object Orientation and ID without Color Segmentation 0 Robust and Accurate Detection of Object Orientation and ID without Color Segmentation Hironobu Fujiyoshi, Tomoyuki Nagahashi and Shoichi Shimizu Chubu University Japan Open Access Database www.i-techonline.com

More information

Srikumar Ramalingam. Review. 3D Reconstruction. Pose Estimation Revisited. School of Computing University of Utah

Srikumar Ramalingam. Review. 3D Reconstruction. Pose Estimation Revisited. School of Computing University of Utah School of Computing University of Utah Presentation Outline 1 2 3 Forward Projection (Reminder) u v 1 KR ( I t ) X m Y m Z m 1 Backward Projection (Reminder) Q K 1 q Q K 1 u v 1 What is pose estimation?

More information

3D Simultaneous Localization and Mapping and Navigation Planning for Mobile Robots in Complex Environments

3D Simultaneous Localization and Mapping and Navigation Planning for Mobile Robots in Complex Environments 3D Simultaneous Localization and Mapping and Navigation Planning for Mobile Robots in Complex Environments Sven Behnke University of Bonn, Germany Computer Science Institute VI Autonomous Intelligent Systems

More information

Collision-Aware Assembly Planning

Collision-Aware Assembly Planning Collision-Aware Assembly Planning Tesca Fitzgerald Andrew Price Laura Strickland Zhefan Ye Abstract We present a collision-aware approach to assembly planning using a robotic manipulator arm equipped with

More information

Enabling a Robot to Open Doors Andrei Iancu, Ellen Klingbeil, Justin Pearson Stanford University - CS Fall 2007

Enabling a Robot to Open Doors Andrei Iancu, Ellen Klingbeil, Justin Pearson Stanford University - CS Fall 2007 Enabling a Robot to Open Doors Andrei Iancu, Ellen Klingbeil, Justin Pearson Stanford University - CS 229 - Fall 2007 I. Introduction The area of robotic exploration is a field of growing interest and

More information

A Comparative Study of Conventional and Neural Network Classification of Multispectral Data

A Comparative Study of Conventional and Neural Network Classification of Multispectral Data A Comparative Study of Conventional and Neural Network Classification of Multispectral Data B.Solaiman & M.C.Mouchot Ecole Nationale Supérieure des Télécommunications de Bretagne B.P. 832, 29285 BREST

More information

Articulated Pose Estimation with Flexible Mixtures-of-Parts

Articulated Pose Estimation with Flexible Mixtures-of-Parts Articulated Pose Estimation with Flexible Mixtures-of-Parts PRESENTATION: JESSE DAVIS CS 3710 VISUAL RECOGNITION Outline Modeling Special Cases Inferences Learning Experiments Problem and Relevance Problem:

More information