ros-industrial / ros2_canopen

CANopen driver framework for ROS2
https://ros-industrial.github.io/ros2_canopen/manual/rolling/
127 stars 52 forks source link

ros2_canopen testing #216

Closed sandropp closed 7 months ago

sandropp commented 8 months ago

Describe the bug git clone https://github.com/ros-industrial/ros2_canopen.git cd .. rosdep install --from-paths src/ros2_canopen --ignore-src -r -y colcon build

when execute the "colcon build", the following errors coming: --- stderr: canopen_core
/home/sandro/can_ws/src/ros2_canopen/canopen_core/src/node_interfaces/node_canopen_driver.cpp: In member function ‘void ros2_canopen::node_interfaces::NodeCanopenDriver::demand_set_master() [with NODETYPE = rclcpp::Node]’: /home/sandro/can_ws/src/ros2_canopen/canopen_core/src/node_interfaces/node_canopen_driver.cpp:30:32: error: cannot convert ‘rclcpp::QoS’ to ‘const rmw_qos_profile_t&’ {aka ‘const rmw_qos_profile_s&’} 30
init_service_name, rclcpp::QoS(10), clientcbg); ^~~
rclcpp::QoS

In file included from /opt/ros/humble/include/rclcpp/rclcpp/node.hpp:1321, from /opt/ros/humble/include/rclcpp/rclcpp/executors/single_threaded_executor.hpp:28, from /opt/ros/humble/include/rclcpp/rclcpp/executors.hpp:22, from /opt/ros/humble/include/rclcpp/rclcpp/rclcpp.hpp:155, from /home/sandro/can_ws/src/ros2_canopen/canopen_core/include/canopen_core/node_interfaces/node_canopen_driver.hpp:33, from /home/sandro/can_ws/src/ros2_canopen/canopen_core/src/node_interfaces/node_canopen_driver.cpp:14: /opt/ros/humble/include/rclcpp/rclcpp/node_impl.hpp:127:29: note: initializing argument 2 of ‘typename rclcpp::Client::SharedPtr rclcpp::Node::create_client(const string&, const rmw_qos_profile_t&, rclcpp::CallbackGroup::SharedPtr) [with ServiceT = canopen_interfaces::srv::CONode; typename rclcpp::Client::SharedPtr = std::shared_ptr<rclcpp::Client >; std::string = std::__cxx11::basic_string; rmw_qos_profile_t = rmw_qos_profile_s; rclcpp::CallbackGroup::SharedPtr = std::shared_ptr]’ 127 | const rmw_qos_profile_t & qos_profile, | ~~~~~~^~~

could you support this issue? Logs Add build or execution log for context.

Setup:

Additional context Add any other context about the problem here.

ipa-vsp commented 8 months ago

Hi @sandropp,

Please use the humble branch with the ROS Humble version.

217