pal-robotics / tiago_moveit_config

http://wiki.ros.org/Robots/TIAGo
Apache License 2.0
6 stars 15 forks source link

Differential-Drive Mobile Base and an Arm Planning ROS2 Humble #15

Closed kavikode closed 2 months ago

kavikode commented 2 months ago

Our goal is to follow the tutorial of Differential-Drive Mobile Base and an Arm Planning, link: https://moveit.picknik.ai/humble/doc/examples/mobile_base_arm/mobile_base_arm_tutorial.html

How do we setup the kinematics plugin to have a joint model group that consist of two joint model groups: one for the manipulator and the other one for the mobile base which has only one joint with planar type in the.srdf file in ROS2 Humble?

I am trying to edit the existing Moveit Configuration Package with the command:

ros2 launch moveit_setup_assistant setup_assistant.launch.py

Using the contents of tiago.srdf.xacro, I created the file tiago.srdf with the parameters base_type:=pmb2 arm_type:=tiago-arm ft_sensor:=schunk-ft end_effector:=pal-gripper:

<?xml version="1.0" ?>

Thank you

saikishor commented 2 months ago

@kavikode I believe this ticket should go to MoveIt as you are having problems reproducing their tutorials.

I hope this helps.

Best regards, Sai

kavikode commented 2 months ago

thank you. Actually, the question is how to add motion planning for the mobile base of Tiago with the arm.

saikishor commented 2 months ago

thank you. Actually, the question is how to add motion planning for the mobile base of Tiago with the arm.

What we do internally is using Nav2 navigation. We are not expertise in using MoveIt for doing the same.

kavikode commented 2 months ago

An particular for the Stretch robot, they had created a stretch_kinematics_plugin/StretchKinematicsPlugin as a kinematics solver with the source code at [](https://github.com/PickNikRobotics/stretch_moveit_plugins/blob/main/stretch_kinematics_plugin/src/stretch_kinematics_plugin.cpp).

Likewise, I had thought there could be something similar for Tiago.

I wonder if the same code could work. Any suggestions, please?

Thank you

saikishor commented 2 months ago

Hello @kavikode!

I don't think we have something similar to this. You can give it a try to see if it works. This is something that we cannot help you as I said earlier, we use Nav2 but not with this approach.

Best Regards, PAL Robotics Team