diagnostics icon indicating copy to clipboard operation
diagnostics copied to clipboard

Compilation on error on latest rolling

Open AlexKaravaev opened this issue 4 years ago • 0 comments

System info: Docker image ros:rolling

--- stderr: self_test
/overlay_ws/src/diagnostics/self_test/src/run_selftest.cpp: In member function ‘rclcpp::Client<diagnostic_msgs::srv::SelfTest>::SharedFuture ClientNode::queue_async_request()’:
/overlay_ws/src/diagnostics/self_test/src/run_selftest.cpp:94:75: error: conversion from ‘rclcpp::Client<diagnostic_msgs::srv::SelfTest>::SharedFutureAndRequestId’ to ‘rclcpp::Client<diagnostic_msgs::srv::SelfTest>::SharedFuture’ {aka ‘std::shared_future<std::shared_ptr<diagnostic_msgs::srv::SelfTest_Response_<std::allocator<void> > > >’} is ambiguous
   94 |     return client_->async_send_request(request, response_received_callback);
      |                                                                           ^
In file included from /opt/ros/rolling/include/rclcpp/callback_group.hpp:23,
                 from /opt/ros/rolling/include/rclcpp/any_executable.hpp:20,
                 from /opt/ros/rolling/include/rclcpp/memory_strategy.hpp:25,
                 from /opt/ros/rolling/include/rclcpp/memory_strategies.hpp:18,
                 from /opt/ros/rolling/include/rclcpp/executor_options.hpp:20,
                 from /opt/ros/rolling/include/rclcpp/executor.hpp:37,
                 from /opt/ros/rolling/include/rclcpp/executors/multi_threaded_executor.hpp:25,
                 from /opt/ros/rolling/include/rclcpp/executors.hpp:21,
                 from /opt/ros/rolling/include/rclcpp/rclcpp.hpp:155,
                 from /overlay_ws/src/diagnostics/self_test/src/run_selftest.cpp:41:
/opt/ros/rolling/include/rclcpp/client.hpp:64:3: note: candidate: ‘rclcpp::detail::FutureAndRequestId<FutureT>::operator FutureT&() [with FutureT = std::shared_future<std::shared_ptr<diagnostic_msgs::srv::SelfTest_Response_<std::allocator<void> > > >]’
   64 |   operator FutureT &() {return this->future;}
      |   ^~~~~~~~
/opt/ros/rolling/include/rclcpp/client.hpp:72:3: note: candidate: ‘rclcpp::detail::FutureAndRequestId<FutureT>::operator FutureT() [with FutureT = std::shared_future<std::shared_ptr<diagnostic_msgs::srv::SelfTest_Response_<std::allocator<void> > > >]’
   72 |   operator FutureT() {return this->future;}
      |   ^~~~~~~~
make[2]: *** [CMakeFiles/run_selftest.dir/build.make:63: CMakeFiles/run_selftest.dir/src/run_selftest.cpp.o] Error 1
make[1]: *** [CMakeFiles/Makefile2:80: CMakeFiles/run_selftest.dir/all] Error 2
make[1]: *** Waiting for unfinished jobs....
make: *** [Makefile:141: all] Error 2
---
Failed   <<< self_test [13.4s, exited with code 2]

AlexKaravaev avatar Sep 15 '21 18:09 AlexKaravaev