Giter VIP home page Giter VIP logo

Comments (3)

GarmischWg avatar GarmischWg commented on July 30, 2024

I am having the exact same problem.
I tested the that without using cartesian path, the planning can be done properly, but fails once the use cartesian path option is checked.

Tested with Ubuntu, ROS2 Humble, moveit2 with a custom robot arm.

[move_group-3] [INFO] [1705745748.146743477] [move_group.moveit.MoveGroupMoveAction]: Solution was found and executed.
[rviz2-4] [INFO] [1705745748.147269596] [moveit_1380153168.move_group_interface]: Plan and Execute request complete!
[rviz2-4] [WARN] [1705745749.148093912] [moveit_1380153168.planning_scene_monitor]: Maybe failed to update robot state, time diff: 0.022s
[move_group-3] [INFO] [1705745881.816698724] [move_group.moveit.cartesian_path_service_capability]: Received request to compute Cartesian path
[move_group-3] [INFO] [1705745881.816842509] [move_group.moveit.cartesian_path_service_capability]: Attempting to follow 1 waypoints for link 'link05' using a step of 0.010000 m and jump threshold 0.000000 (in global reference frame)
[move_group-3] terminate called after throwing an instance of 'std::invalid_argument'
[move_group-3]   what():  invalid argument passed
[move_group-3] Stack trace (most recent call last) in thread 143384:
[move_group-3] #18   Object "", at 0xffffffffffffffff, in 
[move_group-3] #17   Object "/usr/lib/x86_64-linux-gnu/libc.so.6", at 0x7f51f8a3c84f, in 
[move_group-3] #16   Object "/usr/lib/x86_64-linux-gnu/libc.so.6", at 0x7f51f89aaac2, in 
[move_group-3] #15   Object "/usr/lib/x86_64-linux-gnu/libstdc++.so.6.0.30", at 0x7f51f8c3d252, in 
[move_group-3] #14   Object "/opt/ros/humble/lib/librclcpp.so", at 0x7f51f8ead279, in rclcpp::executors::MultiThreadedExecutor::run(unsigned long)
[move_group-3] #13   Object "/opt/ros/humble/lib/librclcpp.so", at 0x7f51f8ea5ff5, in rclcpp::Executor::execute_any_executable(rclcpp::AnyExecutable&)
[move_group-3] #12   Object "/opt/ros/humble/lib/librclcpp.so", at 0x7f51f8ea5c89, in rclcpp::Executor::execute_service(std::shared_ptr<rclcpp::ServiceBase>)
[move_group-3] #11   Object "/opt/ros/humble/lib/librclcpp.so", at 0x7f51f8ea82a5, in 
[move_group-3] #10   Object "/home/garmisch/RobotArmProject-MoveIt/install/moveit_ros_move_group/lib/libmoveit_move_group_default_capabilities.so.2.9.0", at 0x7f51c4650471, in rclcpp::Service<moveit_msgs::srv::GetCartesianPath>::handle_request(std::shared_ptr<rmw_request_id_s>, std::shared_ptr<void>)
[move_group-3] #9    Object "/home/garmisch/RobotArmProject-MoveIt/install/moveit_ros_move_group/lib/libmoveit_move_group_default_capabilities.so.2.9.0", at 0x7f51c464fdf5, in rclcpp::AnyServiceCallback<moveit_msgs::srv::GetCartesianPath>::dispatch(std::shared_ptr<rclcpp::Service<moveit_msgs::srv::GetCartesianPath> > const&, std::shared_ptr<rmw_request_id_s> const&, std::shared_ptr<moveit_msgs::srv::GetCartesianPath_Request_<std::allocator<void> > >)
[move_group-3] #8    Object "/home/garmisch/RobotArmProject-MoveIt/install/moveit_ros_move_group/lib/libmoveit_move_group_default_capabilities.so.2.9.0", at 0x7f51c46367c3, in move_group::MoveGroupCartesianPathService::computeService(std::shared_ptr<rmw_request_id_s> const&, std::shared_ptr<moveit_msgs::srv::GetCartesianPath_Request_<std::allocator<void> > > const&, std::shared_ptr<moveit_msgs::srv::GetCartesianPath_Response_<std::allocator<void> > > const&)
[move_group-3] #7    Object "/home/garmisch/RobotArmProject-MoveIt/install/moveit_core/lib/libmoveit_robot_state.so.2.9.0", at 0x7f51f880c82d, in moveit::core::JumpThreshold::relative(double) [clone .cold]
[move_group-3] #6    Object "/usr/lib/x86_64-linux-gnu/libstdc++.so.6.0.30", at 0x7f51f8c0f4d7, in __cxa_throw
[move_group-3] #5    Object "/usr/lib/x86_64-linux-gnu/libstdc++.so.6.0.30", at 0x7f51f8c0f276, in std::terminate()
[move_group-3] #4    Object "/usr/lib/x86_64-linux-gnu/libstdc++.so.6.0.30", at 0x7f51f8c0f20b, in 
[move_group-3] #3    Object "/usr/lib/x86_64-linux-gnu/libstdc++.so.6.0.30", at 0x7f51f8c03b9d, in 
[move_group-3] #2    Object "/usr/lib/x86_64-linux-gnu/libc.so.6", at 0x7f51f893e7f2, in abort
[move_group-3] #1    Object "/usr/lib/x86_64-linux-gnu/libc.so.6", at 0x7f51f8958475, in raise
[move_group-3] #0    Object "/usr/lib/x86_64-linux-gnu/libc.so.6", at 0x7f51f89ac9fc, in pthread_kill
[move_group-3] Aborted (Signal sent by tkill() 143180 1000)

from moveit2_tutorials.

GarmischWg avatar GarmischWg commented on July 30, 2024

I found a temporary solution, in Rviz, go to the context tab,
and configure the planner like below.
image
LIN stands for linear path, i think it is the same as cartesian path.
PTP stands for point to point trajectory planning.

from moveit2_tutorials.

marioprats avatar marioprats commented on July 30, 2024

This is an issue introduced after a change to the JumpThreshold API. Working on a fix.

from moveit2_tutorials.

Related Issues (20)

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    🖖 Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. 📊📈🎉

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google ❤️ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.