Closed newcanopies closed 3 years ago
CMake Error at /opt/ros/foxy/share/rosidl_typesupport_c/cmake/get_used_typesupports.cmake:35 (message): No 'rosidl_typesupport_c' found
path to package being built: ~/ws_ROS2/src/moveit2/moveit_msgs
export COLCON_WS=~/ws_ROS2 ~/ws_ROS2$ colcon build --symlink-install --packages-select moveit_msgs
Starting >>> moveit_msgs --- stderr: moveit_msgs CMake Error at /opt/ros/foxy/share/rosidl_typesupport_c/cmake/get_used_typesupports.cmake:35 (message): No 'rosidl_typesupport_c' found Call Stack (most recent call first): /opt/ros/foxy/share/rosidl_typesupport_c/cmake/rosidl_typesupport_c-extras.cmake:8 (get_used_typesupports) /opt/ros/foxy/share/rosidl_typesupport_c/cmake/rosidl_typesupport_cConfig.cmake:41 (include) /opt/ros/foxy/share/rosidl_default_generators/cmake/rosidl_default_generators-extras.cmake:21 (find_package) /opt/ros/foxy/share/rosidl_default_generators/cmake/rosidl_default_generatorsConfig.cmake:41 (include) CMakeLists.txt:17 (find_package) --- Failed <<< moveit_msgs [0.23s, exited with code 1] Summary: 0 packages finished [0.44s] 1 package failed: moveit_msgs 1 package had stderr output: moveit_msgs
Successfull build, no errors.
echo $COLCON_PREFIX_PATH=/home/user/ws_ROS2/install echo $AMENT_PREFIX_PATH= echo $CMAKE_PREFIX_PATH=/opt/ros/foxy/
Closing this miss-post by leaving the Issue at ros2/rosidl https://github.com/ros2/rosidl/issues/585
ros2/rosidl
Bug report
CMake Error at /opt/ros/foxy/share/rosidl_typesupport_c/cmake/get_used_typesupports.cmake:35 (message): No 'rosidl_typesupport_c' found
Steps to reproduce issue
path to package being built: ~/ws_ROS2/src/moveit2/moveit_msgs
export COLCON_WS=~/ws_ROS2 ~/ws_ROS2$ colcon build --symlink-install --packages-select moveit_msgs
Expected behavior
Additional information
echo $COLCON_PREFIX_PATH=/home/user/ws_ROS2/install echo $AMENT_PREFIX_PATH= echo $CMAKE_PREFIX_PATH=/opt/ros/foxy/