ros2 / tutorials

Apache License 2.0
31 stars 11 forks source link

error when Building rclcpp_tutorials #22

Closed itfanr closed 5 years ago

itfanr commented 5 years ago

OS envrionment: ubuntu 16.04 ros2 version: bouncy

I cannt find the get_rclcpp_information command.

+++ Building 'rclcpp_tutorials'
Running cmake because arguments have changed.
==> '. /home/itfanr/ros2_ws/build/rclcpp_tutorials/cmake__build.sh && /usr/bin/cmake -DBUILD_TESTING=0 -DCMAKE_INSTALL_PREFIX=/home/itfanr/ros2_ws/install /home/itfanr/ros2_ws/src/tutorials/rclcpp_tutorials' in '/home/itfanr/ros2_ws/build/rclcpp_tutorials'
-- The C compiler identification is GNU 5.4.0
-- The CXX compiler identification is GNU 5.4.0
-- Check for working C compiler: /usr/bin/cc
-- Check for working C compiler: /usr/bin/cc -- works
-- Detecting C compiler ABI info
-- Detecting C compiler ABI info - done
-- Detecting C compile features
-- Detecting C compile features - done
-- Check for working CXX compiler: /usr/bin/c++
-- Check for working CXX compiler: /usr/bin/c++ -- works
-- Detecting CXX compiler ABI info
-- Detecting CXX compiler ABI info - done
-- Detecting CXX compile features
-- Detecting CXX compile features - done
-- Found ament_cmake: 0.5.1 (/opt/ros/bouncy/share/ament_cmake/cmake)
-- Found PythonInterp: /usr/bin/python3 (found suitable version "3.5.2", minimum required is "3") 
-- Using PYTHON_EXECUTABLE: /usr/bin/python3
-- Found example_interfaces: 0.5.0 (/opt/ros/bouncy/share/example_interfaces/cmake)
-- Found rclcpp: 0.5.1 (/opt/ros/bouncy/share/rclcpp/cmake)
-- Found rmw_implementation_cmake: 0.5.0 (/opt/ros/bouncy/share/rmw_implementation_cmake/cmake)
-- Found sensor_msgs: 0.5.1 (/opt/ros/bouncy/share/sensor_msgs/cmake)
-- Found rmw_fastrtps_cpp: 0.5.1 (/opt/ros/bouncy/share/rmw_fastrtps_cpp/cmake)
-- Found fastrtps_cmake_module: 0.5.1 (/opt/ros/bouncy/share/fastrtps_cmake_module/cmake)
-- Found FastRTPS: /opt/ros/bouncy/include  
CMake Error at CMakeLists.txt:29 (get_rclcpp_information):
  Unknown CMake command "get_rclcpp_information".
Call Stack (most recent call first):
  /home/itfanr/ros2_ws/build/rclcpp_tutorials/call_for_each_rmw_implementation.cmake:1 (targets)
  /opt/ros/bouncy/share/rmw_implementation_cmake/cmake/call_for_each_rmw_implementation.cmake:57 (include)
  CMakeLists.txt:56 (call_for_each_rmw_implementation)

-- Configuring incomplete, errors occurred!
See also "/home/itfanr/ros2_ws/build/rclcpp_tutorials/CMakeFiles/CMakeOutput.log".

<== Command '. /home/itfanr/ros2_ws/build/rclcpp_tutorials/cmake__build.sh && /usr/bin/cmake -DBUILD_TESTING=0 -DCMAKE_INSTALL_PREFIX=/home/itfanr/ros2_ws/install /home/itfanr/ros2_ws/src/tutorials/rclcpp_tutorials' failed in '/home/itfanr/ros2_ws/build/rclcpp_tutorials' with exit code '1'
<== Command '. /home/itfanr/ros2_ws/build/rclcpp_tutorials/cmake__build.sh && /usr/bin/cmake -DBUILD_TESTING=0 -DCMAKE_INSTALL_PREFIX=/home/itfanr/ros2_ws/install /home/itfanr/ros2_ws/src/tutorials/rclcpp_tutorials' failed in '/home/itfanr/ros2_ws/build/rclcpp_tutorials' with exit code '1'
dirk-thomas commented 5 years ago

As the readme indicates:

These tutorials are still under construction, please refer to our demos or examples in the meantime.

So the packages in this repository are not supported at the moment and might not work.

itfanr commented 5 years ago

@dirk-thomas OK, thank you