Questions tagged [moveit2]
The moveit2 tag has no summary.
93 questions
0 votes
0 answers
13 views
Problems with moveit2 and cartesian path with pymoveit2
I made a Moveit config package with the setup assistant (ROS2 Humble). To control the robot, I'm programming a script with pymoveit2, and I can give successful commands to the arm. The problem I have ...
0 votes
0 answers
17 views
move_group.moveit.moveit.ros.occupancy_map_monitor: No 3D sensor plugin(s) defined for octomap updates
When launching MoveIt2 with Gazebo and RViz2, the move_group node throws a rclcpp::ParameterTypeException and terminates. The entity spawn also fails, and RViz2 ...
1 vote
1 answer
65 views
MoveIt2 Path Constraints unable to find valid plan
I am trying to move my robot from one side of the Quadrant to the opposite side(180° yaw). While doing this I want to maintain the orientation of the end effector, such that when the robot holds ...
0 votes
0 answers
19 views
Moveit2-Isaac Sim Docker Example GPG Error
I'm keep having ...
0 votes
0 answers
20 views
Change robot state in Simulation without planning in Moveit2
I am new to Moveit2. I need to set my robot's joints to some certain values so that robot first moves to that location and then from there plans for the goal target pose. At the start, when I set the ...
1 vote
0 answers
21 views
How to exclude the robotic arm from being treated as a collision object?
I integrated Octomap into issac_ros_cumotion ur_isaac_sim.launch.py using sensors_kinect_depthmap.yaml, but the surface of my robotic(ur10e) arm is also considered an obstacle. I would like to ask how ...
1 vote
0 answers
42 views
Trouble interpreting joint velocity profiles
i have trouble interpreting the joint speed profiles my robot produces. Setup: ROS2 Humble Robot: Yaskawa HC10 + YRC1000 Motion Planner: Moveit2 + Pilz Industrial Motion Planner Image Descriptions: ...
0 votes
0 answers
76 views
How to enable approximate IK solutions for MoveIt2
I'm trying to get my MoveIt2 setup to work and I ran into this issue: Unable to move MoveIt2 interactive markers. As I said in my answer, the solution ended up being allowing approximate IK solutions ...