Closed shivaldube closed 3 months ago
This worked for me: git clone https://github.com/ros-planning/moveit2_tutorials --branch humble
The issue I have now is the python bindings aren't in the humble branch...sigh
Same as you
Starting >>> robotiq_driver --- stderr: robotiq_driver /home/jin/ws_moveit/src/ros2_robotiq_gripper/robotiq_driver/tests/test_robotiq_gripper_hardware_interface.cpp: In member function ‘virtual void robotiq_driver::test::TestRobotiqGripperHardwareInterface_load_urdf_Test::TestBody()’: /home/jin/ws_moveit/src/ros2_robotiq_gripper/robotiq_driver/tests/test_robotiq_gripper_hardware_interface.cpp:79:114: error: no matching function for call to ‘hardware_interface::ResourceManager::ResourceManager(std::string&, rclcpp::node_interfaces::NodeClockInterface::SharedPtr, rclcpp::node_interfaces::NodeLoggingInterface::SharedPtr)’ 79 | hardware_interface::ResourceManager rm(urdf, node.get_node_clock_interface(), node.get_node_logging_interface()); | ^ In file included from /home/jin/ws_moveit/src/ros2_robotiq_gripper/robotiq_driver/tests/test_robotiq_gripper_hardware_interface.cpp:31: /opt/ros/iron/include/hardware_interface/hardware_interface/resource_manager.hpp:71:12: note: candidate: ‘hardware_interface::ResourceManager::ResourceManager(const string&, bool, bool, unsigned int, rclcpp::node_interfaces::NodeClockInterface::SharedPtr)’ 71 | explicit ResourceManager( | ^~~~~~~~~~~~~~~ /opt/ros/iron/include/hardware_interface/hardware_interface/resource_manager.hpp:72:36: note: no known conversion for argument 2 from ‘rclcpp::node_interfaces::NodeClockInterface::SharedPtr’ {aka ‘std::shared_ptr<rclcpp::node_interfaces::NodeClockInterface>’} to ‘bool’ 72 | const std::string & urdf, bool validate_interfaces = true, bool activate_all = false, | ~~~~~^~~~~~~~~~~~~~~~~~~~~~~~~~ /opt/ros/iron/include/hardware_interface/hardware_interface/resource_manager.hpp:52:3: note: candidate: ‘hardware_interface::ResourceManager::ResourceManager(unsigned int, rclcpp::node_interfaces::NodeClockInterface::SharedPtr)’ 52 | ResourceManager( | ^~~~~~~~~~~~~~~ /opt/ros/iron/include/hardware_interface/hardware_interface/resource_manager.hpp:52:3: note: candidate expects 2 arguments, 3 provided gmake[2]: *** [tests/CMakeFiles/test_robotiq_gripper_hardware_interface.dir/build.make:76:tests/CMakeFiles/test_robotiq_gripper_hardware_interface.dir/test_robotiq_gripper_hardware_interface.cpp.o] 错误 1
4 days ago,i colcon build --mixin release ,succeeded.Today,i tried it again in a new virtual machine,failed.Now,i meet the same quesition with you...
identical issue with humble under ubuntu22.04
-
now,i think the code on official website(https://moveit.picknik.ai/main/doc/tutorials/getting_started/getting_started.html) can't use,because'If you are just getting started, we recommend you use the latest stable version of ROS (Iron) on Ubuntu 22.04 for the most seamless experience.'However,when i used Iron version and downloaded the code,'colcon build' still had problems.In a result,i think the official codes have problems.My solution is following this website(https://moveit.picknik.ai/humble/doc/tutorials/getting_started/getting_started.html),with Ubuntu 22.04 and ROS2 humble,the code'git clone --branch humble https://github.com/ros-planning/moveit2_tutorials' just clone the humble branch,after 'colcon build',we can follow the tutorials completely:),just the website no longer updated:(.
If you're running main, what is your ros2_control version? You can check with:
apt list --installed | grep ros-rolling-ros2-control
This looks you may have the most recent robotiq_driver package (which you would get if you used vcs import
as per the tutorial documentation recently, but not the compatible version of ros2_control.
I found that the package robotiq_driver always fail to build. Here is my solution.
Remove the original ros_2robotiq_gripper from src and pull it again from the Humble branch.
git clone https://github.com/PickNikRobotics/ros2_robotiq_gripper.git --branch humble
It works for me.
Description
Not able to build the Colcon workspace, following the tutorial at Getting started tutorial
Your environment
Steps to reproduce
Follow the tutorial Getting started tutorial
Expected behaviour
Build colcon workspace without error.
Console output