planning with multiple target points
Hello! I'm working on a KUKA industrial robot with moveit. is it possible to plan multiple target points with one command? I want my robot to go from his starting position to point A and then to point...
View ArticlerobotStateToRobotStateMsg
Hello! I keep getting the error: ‘robotStateToRobotStateMsg’ is not a member of ‘moveit::core’ In the CMakeList I have moveit_core, moveit_ros_planning, moveit_ros_planning_interface, roscpp, rospy and...
View Articlemoveit setup assistant problem
Hello, I have a problem I installed moveit (apt-get install ros-indigo-full) in indigo ros. When I try to start moveit_setup_assistant I have an error> ERROR: cannot launch node of type...
View Articlecannot import moveit_commander
hi, i tried to run this code import sys import copy import rospy import moveit_commander import moveit_msgs.msg import geometry_msgs.msg and got this error message: Traceback (most recent call last):...
View Article[MoveIt!] How to Use the Python Move Group Interface
Hi, I want to use MoveIt! for pathfinding for a simple manipulator arm. The [MoveIt! Setup Assistant](http://docs.ros.org/indigo/api/moveit_setup_assistant/html/doc/tutorial.html) and [Rviz...
View ArticleMoveit Setup Assistant Package Missing
I installed the Moveit! package following [this](http://moveit.ros.org/install/) link. Then I moved to the Setup Assistant but I encountered the following problem : :~$ roslaunch moveit_setup_assistant...
View ArticleComplete n00b: Getting Started via ROS or MoveIt!?
I'm an amateur/hobby roboticist who loves robots but has only built a couple of simple, fairly dumb Arduino- and AVR-based robots that can avoid obstacles (most of the time), wander around aimlessly,...
View Articleerror when catkin_make package
I write a node to subscribe /move_group/display_planned_path to get the path,and publish to /mavros/setpoint_position/local. But when i catkin_make the package,there is an error....
View ArticleMove Group Interface C++
Hi, I am trying the first lot of tutorials from the moveit website and I am having trouble with the move group interface. Here is my cpp file: #include #include #include #include "std_msgs/String.h"...
View ArticleUR5 velocity control and trajectory recording/replaying
Hello everyone, I have the following two issues to solve: #1 I would like to control the velocity of the path execution of the UR5 robot. At the moment, I'm using the UR5 ROS-Industrial driver and...
View Articleplanning plugin load error
I was running rviz plugin turoial in moveit, but as i press plan inside rviz, i get error: [ERROR] [1471947311.840651367]: No planning plugin loaded. Cannot plan. [ WARN] [1471947311.907169887]: Fail:...
View ArticleImproving MoveIt, RViz, and using trac_ik
Hello all, I am currently attempting to use MoveIt and trac_ik to coordinate x4 UR arms for a project in ROS. I had a few questions that maybe someone could help me with/point me in the right direction...
View Article[MoveIt!] Can't plan to a pose goal
Hi, I'm using a simple 4 DoF arm and want to use MoveIt! to calculate and execute trajectories for it. I followed the [setup...
View ArticleURDF from joint_states
Hi everybody! I am wondering if there is a way to generate the URDF model of my robot starting from the joint_states or tf messages. The fact is that I have the single parts of my robot in STL format,...
View ArticleMoveit Setup Assistant Package Missing
I installed the Moveit! package following [this](http://moveit.ros.org/install/) link. Then I moved to the Setup Assistant but I encountered the following problem : :~$ roslaunch moveit_setup_assistant...
View ArticleProblems integrating external packages
I am trying to use [vigir](https://github.com/team-vigir/vigir_manipulation_planning)'s `ContinuousReplanningCapability` in my existing code. For that I downloaded and compiled only the packages...
View ArticleSegmentation fault at MoveIt python tutorial
I am trying to follow the python tutorial, but this simple file already crashes: #!/usr/bin/python import sys import copy import rospy import moveit_commander import moveit_msgs.msg import...
View ArticleMoveIt: How to write a joint_names.yaml for robots with multiple arms.
Hello all, I currently have a robotic system that has x4 UR robots. 1 UR10 and 3 UR5s. In the controllers.yaml file, each robot has it's own controller of the format one right after another as such:...
View Article[MoveIt!] Certain .stl files can't be used
Hi, I'm trying to implement a robot model into MoveIt!. URDF-file and meshes have been build by my colleagues. The robot can be viewed using RViz. However, when I'm loading the URDF into the MoveIt...
View ArticleMoveIt demo.launch error
Hi, I have used the setup assistant of MoveIt to create the config package and it worked fine. But when I launched the demo.launch file, I got the following error : ... auto-starting new master...
View Article