ros2 / ros1_bridge

ROS 2 package that provides bidirectional communication between ROS 1 and ROS 2
Apache License 2.0
448 stars 286 forks source link

ros1_bridge build error in Windows #435

Open Dr2546 opened 4 months ago

Dr2546 commented 4 months ago

Bug report

Required Info:

Steps to reproduce issue

I follow README.md build from source step 1.c:\opt\ros\noetic\x64\setup.bat 2.c:\opt\ros\foxy\x64\setup.bat 3.colcon build --symlink-install --packages-select ros1_bridge --cmake-force-configure

Expected behavior

Build successfully

Actual behavior

My stderr log is very large (around 76k lines) but there are patterns of errors

CMake Error at CMakeLists.txt:157 (add_executable):
  Target "parameter_bridge" links to target
  "geometry_msgs::geometry_msgs__rosidl_generator_c" but the target was not
  found.  Perhaps a find_package() call is missing for an IMPORTED target, or
  an ALIAS target is missing?
Call Stack (most recent call first):
  CMakeLists.txt:211 (custom_executable)

CMake Error at CMakeLists.txt:157 (add_executable):
  Target "parameter_bridge" links to target
  "geometry_msgs::geometry_msgs__rosidl_typesupport_introspection_c" but the
  target was not found.  Perhaps a find_package() call is missing for an
  IMPORTED target, or an ALIAS target is missing?
Call Stack (most recent call first):
  CMakeLists.txt:211 (custom_executable)

CMake Error at CMakeLists.txt:157 (add_executable):
  Target "parameter_bridge" links to target
  "geometry_msgs::geometry_msgs__rosidl_typesupport_c" but the target was not
  found.  Perhaps a find_package() call is missing for an IMPORTED target, or
  an ALIAS target is missing?
Call Stack (most recent call first):
  CMakeLists.txt:211 (custom_executable)

CMake Error at CMakeLists.txt:157 (add_executable):
  Target "parameter_bridge" links to target
  "geometry_msgs::geometry_msgs__rosidl_generator_cpp" but the target was not
  found.  Perhaps a find_package() call is missing for an IMPORTED target, or
  an ALIAS target is missing?
Call Stack (most recent call first):
  CMakeLists.txt:211 (custom_executable)

CMake Error at CMakeLists.txt:157 (add_executable):
  Target "parameter_bridge" links to target
  "geometry_msgs::geometry_msgs__rosidl_typesupport_introspection_cpp" but
  the target was not found.  Perhaps a find_package() call is missing for an
  IMPORTED target, or an ALIAS target is missing?
Call Stack (most recent call first):
  CMakeLists.txt:211 (custom_executable)

CMake Error at CMakeLists.txt:157 (add_executable):
  Target "parameter_bridge" links to target
  "geometry_msgs::geometry_msgs__rosidl_typesupport_cpp" but the target was
  not found.  Perhaps a find_package() call is missing for an IMPORTED
  target, or an ALIAS target is missing?
Call Stack (most recent call first):
  CMakeLists.txt:211 (custom_executable)

and same goes for static_bridge, dynamic_bridge and also nav_msgs, diagonostic_msgs format.

there are also

CMake Error at C:/opt/ros/noetic/x64/share/catkin/cmake/platform/windows.cmake:47 (_add_library):
  Target "ros1_bridge" links to target
  "nav_msgs::nav_msgs__rosidl_generator_cpp" but the target was not found.
  Perhaps a find_package() call is missing for an IMPORTED target, or an
  ALIAS target is missing?
Call Stack (most recent call first):
  CMakeLists.txt:186 (add_library)

and same pattern with above.

I'm download foxy branch and didn't edit any code. they found those msgs as in this stdout log

-- Selecting Windows SDK version 10.0.19041.0 to target Windows 10.0.19045.
-- Found rmw: 1.0.3 (C:/opt/ros/foxy/x64/share/rmw/cmake)
-- Using PYTHON_EXECUTABLE: C:/opt/ros/foxy/x64/python.exe
-- Override CMake install command with custom implementation using symlinks instead of copying resources
-- Found rclcpp: 2.4.0 (C:/opt/ros/foxy/x64/share/rclcpp/cmake)
-- Using all available rosidl_typesupport_c: rosidl_typesupport_fastrtps_c;rosidl_typesupport_introspection_c
-- Found rosidl_adapter: 1.2.1 (C:/opt/ros/foxy/x64/share/rosidl_adapter/cmake)
-- Using all available rosidl_typesupport_cpp: rosidl_typesupport_fastrtps_cpp;rosidl_typesupport_introspection_cpp
-- Found rmw_implementation_cmake: 1.0.3 (C:/opt/ros/foxy/x64/share/rmw_implementation_cmake/cmake)
-- Using RMW implementation 'rmw_fastrtps_cpp' as default
-- Found std_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/std_msgs/cmake)
-- Found ament_lint_auto: 0.9.6 (C:/opt/ros/foxy/x64/share/ament_lint_auto/cmake)
-- Found python_cmake_module: 0.8.1 (C:/opt/ros/foxy/x64/share/python_cmake_module/cmake)
-- Found PythonInterp: C:/opt/ros/foxy/x64/python.exe (found suitable version "3.8.3", minimum required is "3.5") 
-- Using PYTHON_EXECUTABLE: C:/opt/ros/foxy/x64/python.exe
-- Using PYTHON_INCLUDE_DIRS: C:/opt/ros/noetic/x64/include/python3.8
-- Using PYTHON_LIBRARIES: C:/opt/ros/noetic/x64/Lib/python38.lib
-- Found ament_cmake_gtest: 0.9.9 (C:/opt/ros/foxy/x64/share/ament_cmake_gtest/cmake)
-- Added test 'copyright' to check source files copyright and LICENSE
-- Added test 'cppcheck' to perform static code analysis on C / C++ code
-- Configured cppcheck include dirs: 
-- Configured cppcheck exclude dirs and/or files: 
-- Added test 'cpplint' to check C / C++ code against the Google style
-- Configured cpplint exclude dirs and/or files: 
-- Added test 'flake8' to check Python code syntax and style conventions
-- Added test 'lint_cmake' to check CMake code style
-- Added test 'pep257' to check Python code against some of the style conventions in PEP 257
-- Added test 'uncrustify' to check C / C++ code style
-- Configured uncrustify additional arguments: 
-- Added test 'xmllint' to check XML markup files
-- Found carla_ackermann_msgs: 1.0.0 (C:/foxy_ws/install/carla_ackermann_msgs/share/carla_ackermann_msgs/cmake)
-- Using CATKIN_DEVEL_PREFIX: C:/foxy_ws/build/ros1_bridge/devel
-- Using CMAKE_PREFIX_PATH: c:\foxy_ws\install\carla_ackermann_msgs;c:\foxy_ws\install\carla_waypoint_types;c:\foxy_ws\install\carla_ros_scenario_runner_types;c:\foxy_ws\install\carla_msgs;c:\foxy_ws\install\ackermann_msgs;C:\opt\ros\foxy\x64\tools\vcpkg\installed\x64-windows;c:\opt\ros\foxy\x64;C:\opt\ros\noetic\x64\tools\vcpkg\installed\x64-windows;c:\opt\ros\noetic\x64
-- This workspace overlays: c:/opt/ros/noetic/x64
-- Found PythonInterp: C:/opt/ros/foxy/x64/python.exe (found suitable version "3.8.3", minimum required is "3") 
-- Using PYTHON_EXECUTABLE: C:/opt/ros/foxy/x64/python.exe
-- Using default Python package layout
-- Using empy: C:/opt/ros/foxy/x64/lib/site-packages/em.py
-- Using CATKIN_ENABLE_TESTING: ON
-- Call enable_testing()
-- Using CATKIN_TEST_RESULTS_DIR: C:/foxy_ws/build/ros1_bridge/test_results
-- Found gtest: gtests will be built
-- Using Python nosetests: C:/opt/ros/noetic/x64/Scripts/nosetests.exe
-- catkin 0.8.9
-- BUILD_SHARED_LIBS is on
-- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy
-- Found carla_waypoint_types: 0.1.0 (C:/foxy_ws/install/carla_waypoint_types/share/carla_waypoint_types/cmake)
-- Found carla_ros_scenario_runner_types: 0.1.0 (C:/foxy_ws/install/carla_ros_scenario_runner_types/share/carla_ros_scenario_runner_types/cmake)
-- Found carla_msgs: 1.3.0 (C:/foxy_ws/install/carla_msgs/share/carla_msgs/cmake)
-- Found ackermann_msgs: 2.0.2 (C:/foxy_ws/install/ackermann_msgs/share/ackermann_msgs/cmake)
-- Found action_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/action_msgs/cmake)
-- Found action_tutorials_interfaces: 0.9.3 (C:/opt/ros/foxy/x64/share/action_tutorials_interfaces/cmake)
-- Found actionlib_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/actionlib_msgs/cmake)
-- Found builtin_interfaces: 1.0.0 (C:/opt/ros/foxy/x64/share/builtin_interfaces/cmake)
-- Found cartographer_ros_msgs: 1.0.0 (C:/opt/ros/noetic/x64/share/cartographer_ros_msgs/cmake)
-- Found composition_interfaces: 1.0.0 (C:/opt/ros/foxy/x64/share/composition_interfaces/cmake)
-- Found control_msgs: 1.5.2 (C:/opt/ros/noetic/x64/share/control_msgs/cmake)
-- Found controller_manager_msgs: 0.19.4 (C:/opt/ros/noetic/x64/share/controller_manager_msgs/cmake)
-- Found diagnostic_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/diagnostic_msgs/cmake)
-- Found dwb_msgs: 0.4.7 (C:/opt/ros/foxy/x64/share/dwb_msgs/cmake)
-- Found example_interfaces: 0.9.1 (C:/opt/ros/foxy/x64/share/example_interfaces/cmake)
-- Found gazebo_msgs: 2.9.1 (C:/opt/ros/noetic/x64/share/gazebo_msgs/cmake)
-- Found geometry_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/geometry_msgs/cmake)
-- Found lifecycle_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/lifecycle_msgs/cmake)
-- Found logging_demo: 0.9.3 (C:/opt/ros/foxy/x64/share/logging_demo/cmake)
-- Found map_msgs: 1.14.1 (C:/opt/ros/noetic/x64/share/map_msgs/cmake)
-- Found move_base_msgs: 1.14.1 (C:/opt/ros/noetic/x64/share/move_base_msgs/cmake)
-- Found moveit_msgs: 0.11.1 (C:/opt/ros/noetic/x64/share/moveit_msgs/cmake)
-- Found nav2_msgs: 0.4.7 (C:/opt/ros/foxy/x64/share/nav2_msgs/cmake)
-- Found nav_2d_msgs: 0.4.7 (C:/opt/ros/foxy/x64/share/nav_2d_msgs/cmake)
-- Found nav_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/nav_msgs/cmake)
-- Found object_recognition_msgs: 0.4.2 (C:/opt/ros/noetic/x64/share/object_recognition_msgs/cmake)
-- Found octomap_msgs: 0.3.5 (C:/opt/ros/noetic/x64/share/octomap_msgs/cmake)
-- Found pcl_msgs: 0.3.0 (C:/opt/ros/noetic/x64/share/pcl_msgs/cmake)
-- Found pendulum_msgs: 0.9.3 (C:/opt/ros/foxy/x64/share/pendulum_msgs/cmake)
-- Found rcl_interfaces: 1.0.0 (C:/opt/ros/foxy/x64/share/rcl_interfaces/cmake)
-- Found rmw_dds_common: 1.0.3 (C:/opt/ros/foxy/x64/share/rmw_dds_common/cmake)
-- Found rosgraph_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/rosgraph_msgs/cmake)
-- Found sensor_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/sensor_msgs/cmake)
-- Found shape_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/shape_msgs/cmake)
-- Found statistics_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/statistics_msgs/cmake)
-- Found std_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/std_msgs/cmake)
-- Found std_srvs: 1.11.3 (C:/opt/ros/noetic/x64/share/std_srvs/cmake)
-- Found stereo_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/stereo_msgs/cmake)
-- Found test_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/test_msgs/cmake)
-- Found tf2_msgs: 0.7.5 (C:/opt/ros/noetic/x64/share/tf2_msgs/cmake)
-- Found theora_image_transport: 2.3.1 (C:/opt/ros/foxy/x64/share/theora_image_transport/cmake)
-- Found trajectory_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/trajectory_msgs/cmake)
-- Found turtlebot3_msgs: 2.2.1 (C:/opt/ros/foxy/x64/share/turtlebot3_msgs/cmake)
-- Found turtlesim: 0.10.2 (C:/opt/ros/noetic/x64/share/turtlesim/cmake)
-- Found unique_identifier_msgs: 2.1.3 (C:/opt/ros/foxy/x64/share/unique_identifier_msgs/cmake)
-- Found visualization_msgs: 1.13.0 (C:/opt/ros/noetic/x64/share/visualization_msgs/cmake)
-- Configuring done
-- Generating done
Dr2546 commented 4 months ago

So I decided to create new workspace and rebuild because I think my previous build workspace is very messy.

The step is same

  1. I download ros1_bridge from foxy branches and extract in src of ros1_bridge_ws and do colcon build --package-skip ros1_bridge
  2. c:\opt\ros\noetic\x64\setup.bat
  3. c:\opt\ros\foxy\x64\setup.bat
  4. colcon build --executor sequential --symlink-install --packages-select ros1_bridge --cmake-force-configure

I also change some code interface_factories.cpp.em

(ros2_msg.@(ros2_field_selection).size()) >= (ros1_msg.@(ros1_field_selection).size()),

to

(std::tuple_size<decltype(ros2_msg.@(ros2_field_selection))>::value >= (ros1_msg.@(ros1_field_selection).static_size),)

and

(ros1_msg.@(ros1_field_selection).size()) >= (ros2_msg.@(ros2_field_selection).size()),

to

(ros1_msg.@(ros1_field_selection).static_size) >= std::tuple_size<decltype(ros2_msg.@(ros2_field_selection))>::value,

at line 160,247

factory.hpp

#ifndef  ROS1_BRIDGE__FACTORY_HPP_
#define  ROS1_BRIDGE__FACTORY_HPP_

#include <functional>

to

#ifndef  ROS1_BRIDGE__FACTORY_HPP_
#define  ROS1_BRIDGE__FACTORY_HPP_

#ifndef ROS_BUILD_SHARED_LIBS
#define ROS_BUILD_SHARED_LIBS
#endif // !ROS_BUILD_SHARED_LIBS

#include <functional>

because I get similar error like this

This is my stdout_stderr log

-- Selecting Windows SDK version 10.0.22000.0 to target Windows 10.0.22621.
-- Found rmw: 1.0.3 (C:/opt/ros/foxy/x64/share/rmw/cmake)
-- Found PythonInterp: C:/opt/ros/foxy/x64/python.exe (found suitable version "3.8.3", minimum required is "3") 
-- Using PYTHON_EXECUTABLE: C:/opt/ros/foxy/x64/python.exe
-- Override CMake install command with custom implementation using symlinks instead of copying resources
-- Found rclcpp: 2.4.0 (C:/opt/ros/foxy/x64/share/rclcpp/cmake)
-- Using all available rosidl_typesupport_c: rosidl_typesupport_fastrtps_c;rosidl_typesupport_introspection_c
-- Found rosidl_adapter: 1.2.1 (C:/opt/ros/foxy/x64/share/rosidl_adapter/cmake)
-- Using all available rosidl_typesupport_cpp: rosidl_typesupport_fastrtps_cpp;rosidl_typesupport_introspection_cpp
-- Found rmw_implementation_cmake: 1.0.3 (C:/opt/ros/foxy/x64/share/rmw_implementation_cmake/cmake)
-- Using RMW implementation 'rmw_fastrtps_cpp' as default
-- Found std_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/std_msgs/cmake)
CMake Warning (dev) at cmake/find_ros1_interface_packages.cmake:53 (set):
  Only the first value argument is used when setting an environment variable.
  Argument 'c:\opt\ros\noetic\x64\lib/site-packages' and later are unused.
Call Stack (most recent call first):
  CMakeLists.txt:60 (find_ros1_interface_packages)
This warning is for project developers.  Use -Wno-dev to suppress it.

-- Found ament_lint_auto: 0.9.6 (C:/opt/ros/foxy/x64/share/ament_lint_auto/cmake)
-- Found diagnostic_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/diagnostic_msgs/cmake)
-- Found python_cmake_module: 0.8.1 (C:/opt/ros/foxy/x64/share/python_cmake_module/cmake)
-- Found PythonInterp: C:/opt/ros/foxy/x64/python.exe (found suitable version "3.8.3", minimum required is "3.5") 
-- Using PYTHON_EXECUTABLE: C:/opt/ros/foxy/x64/python.exe
-- Using PYTHON_INCLUDE_DIRS: C:/opt/ros/foxy/x64/include/python3.8
-- Using PYTHON_LIBRARIES: C:/opt/ros/foxy/x64/Lib/python38.lib
-- Added test 'copyright' to check source files copyright and LICENSE
-- Added test 'cppcheck' to perform static code analysis on C / C++ code
-- Configured cppcheck include dirs: 
-- Configured cppcheck exclude dirs and/or files: 
-- Added test 'cpplint' to check C / C++ code against the Google style
-- Configured cpplint exclude dirs and/or files: 
-- Added test 'flake8' to check Python code syntax and style conventions
-- Added test 'lint_cmake' to check CMake code style
-- Added test 'pep257' to check Python code against some of the style conventions in PEP 257
-- Added test 'uncrustify' to check C / C++ code style
-- Configured uncrustify additional arguments: 
-- Added test 'xmllint' to check XML markup files
-- Found action_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/action_msgs/cmake)
-- Found action_tutorials_interfaces: 0.9.3 (C:/opt/ros/foxy/x64/share/action_tutorials_interfaces/cmake)
-- Found actionlib_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/actionlib_msgs/cmake)
-- Found builtin_interfaces: 1.0.0 (C:/opt/ros/foxy/x64/share/builtin_interfaces/cmake)
-- Found cartographer_ros_msgs: 1.0.9001 (C:/opt/ros/foxy/x64/share/cartographer_ros_msgs/cmake)
-- Found composition_interfaces: 1.0.0 (C:/opt/ros/foxy/x64/share/composition_interfaces/cmake)
-- Found control_msgs: 2.5.1 (C:/opt/ros/foxy/x64/share/control_msgs/cmake)
-- Found controller_manager_msgs: 0.8.1 (C:/opt/ros/foxy/x64/share/controller_manager_msgs/cmake)
-- Found diagnostic_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/diagnostic_msgs/cmake)
-- Found dwb_msgs: 0.4.7 (C:/opt/ros/foxy/x64/share/dwb_msgs/cmake)
-- Found example_interfaces: 0.9.1 (C:/opt/ros/foxy/x64/share/example_interfaces/cmake)
-- Found gazebo_msgs: 3.5.3 (C:/opt/ros/foxy/x64/share/gazebo_msgs/cmake)
-- Found geometry_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/geometry_msgs/cmake)
-- Found lifecycle_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/lifecycle_msgs/cmake)
-- Found logging_demo: 0.9.3 (C:/opt/ros/foxy/x64/share/logging_demo/cmake)
-- Found map_msgs: 2.0.2 (C:/opt/ros/foxy/x64/share/map_msgs/cmake)
-- Found move_base_msgs: 2.0.2 (C:/opt/ros/foxy/x64/share/move_base_msgs/cmake)
-- Found moveit_msgs: 2.1.0 (C:/opt/ros/foxy/x64/share/moveit_msgs/cmake)
-- Found nav2_msgs: 0.4.7 (C:/opt/ros/foxy/x64/share/nav2_msgs/cmake)
-- Found nav_2d_msgs: 0.4.7 (C:/opt/ros/foxy/x64/share/nav_2d_msgs/cmake)
-- Found nav_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/nav_msgs/cmake)
-- Found object_recognition_msgs: 2.0.0 (C:/opt/ros/foxy/x64/share/object_recognition_msgs/cmake)
-- Found octomap_msgs: 2.0.0 (C:/opt/ros/foxy/x64/share/octomap_msgs/cmake)
-- Found pcl_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/pcl_msgs/cmake)
-- Found pendulum_msgs: 0.9.3 (C:/opt/ros/foxy/x64/share/pendulum_msgs/cmake)
-- Found rcl_interfaces: 1.0.0 (C:/opt/ros/foxy/x64/share/rcl_interfaces/cmake)
-- Found rmw_dds_common: 1.0.3 (C:/opt/ros/foxy/x64/share/rmw_dds_common/cmake)
-- Found rosgraph_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/rosgraph_msgs/cmake)
-- Found sensor_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/sensor_msgs/cmake)
-- Found shape_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/shape_msgs/cmake)
-- Found statistics_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/statistics_msgs/cmake)
-- Found std_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/std_msgs/cmake)
-- Found std_srvs: 2.0.4 (C:/opt/ros/foxy/x64/share/std_srvs/cmake)
-- Found stereo_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/stereo_msgs/cmake)
-- Found test_msgs: 1.0.0 (C:/opt/ros/foxy/x64/share/test_msgs/cmake)
-- Found tf2_msgs: 0.13.12 (C:/opt/ros/foxy/x64/share/tf2_msgs/cmake)
-- Found theora_image_transport: 2.3.1 (C:/opt/ros/foxy/x64/share/theora_image_transport/cmake)
-- Found trajectory_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/trajectory_msgs/cmake)
-- Found turtlebot3_msgs: 2.2.1 (C:/opt/ros/foxy/x64/share/turtlebot3_msgs/cmake)
-- Found turtlesim: 1.2.5 (C:/opt/ros/foxy/x64/share/turtlesim/cmake)
-- Found unique_identifier_msgs: 2.1.3 (C:/opt/ros/foxy/x64/share/unique_identifier_msgs/cmake)
-- Found visualization_msgs: 2.0.4 (C:/opt/ros/foxy/x64/share/visualization_msgs/cmake)
-- Configuring done
-- Generating done
-- Build files have been written to: C:/ros1_bridge_ws/build/ros1_bridge
Microsoft (R) Build Engine version 16.11.2+f32259642 for .NET Framework
Copyright (C) Microsoft Corporation. All rights reserved.

roscpp_serialization.lib(roscpp_serialization.dll) : error LNK2005: "public: __cdecl ros::SerializedMessage::~SerializedMessage(void)" (??1SerializedMessage@ros@@QEAA@XZ) already defined in builtin_interfaces_factories.obj [C:\ros1_bridge_ws\build\ros1_bridge\ros1_bridge.vcxproj]
controller_manager_msgs__srv__ListControllers__factories.obj : error LNK2019: unresolved external symbol "public: static void __cdecl ros1_bridge::Factory<struct controller_manager_msgs::ControllerState_<class std::allocator<void> >,struct controller_manager_msgs::msg::ControllerState_<class std::allocator<void> > >::convert_1_to_2(struct controller_manager_msgs::ControllerState_<class std::allocator<void> > const &,struct controller_manager_msgs::msg::ControllerState_<class std::allocator<void> > &)" (?convert_1_to_2@?$Factory@U?$ControllerState_@V?$allocator@X@std@@@controller_manager_msgs@@U1msg@2@@ros1_bridge@@SAXAEBU?$ControllerState_@V?$allocator@X@std@@@controller_manager_msgs@@AEAU3msg@4@@Z) referenced in function "public: void __cdecl ros1_bridge::ServiceFactory<struct controller_manager_msgs::ListControllers,struct controller_manager_msgs::srv::ListControllers>::forward_2_to_1(class ros::ServiceClient,class rclcpp::Logger,class std::shared_ptr<struct rmw_request_id_t>,class std::shared_ptr<struct controller_manager_msgs::srv::ListControllers_Request_<class std::allocator<void> > >,class std::shared_ptr<struct controller_manager_msgs::srv::ListControllers_Response_<class std::allocator<void> > >)" (?forward_2_to_1@?$ServiceFactory@UListControllers@controller_manager_msgs@@U1srv@2@@ros1_bridge@@QEAAXVServiceClient@ros@@VLogger@rclcpp@@V?$shared_ptr@Urmw_request_id_t@@@std@@V?$shared_ptr@U?$ListControllers_Request_@V?$allocator@X@std@@@srv@controller_manager_msgs@@@8@V?$shared_ptr@U?$ListControllers_Response_@V?$allocator@X@std@@@srv@controller_manager_msgs@@@8@@Z) [C:\ros1_bridge_ws\build\ros1_bridge\ros1_bridge.vcxproj]
controller_manager_msgs__srv__ListControllers__factories.obj : error LNK2019: unresolved external symbol "public: static void __cdecl ros1_bridge::Factory<struct controller_manager_msgs::ControllerState_<class std::allocator<void> >,struct controller_manager_msgs::msg::ControllerState_<class std::allocator<void> > >::convert_2_to_1(struct controller_manager_msgs::msg::ControllerState_<class std::allocator<void> > const &,struct controller_manager_msgs::ControllerState_<class std::allocator<void> > &)" (?convert_2_to_1@?$Factory@U?$ControllerState_@V?$allocator@X@std@@@controller_manager_msgs@@U1msg@2@@ros1_bridge@@SAXAEBU?$ControllerState_@V?$allocator@X@std@@@msg@controller_manager_msgs@@AEAU35@@Z) referenced in function "public: bool __cdecl ros1_bridge::ServiceFactory<struct controller_manager_msgs::ListControllers,struct controller_manager_msgs::srv::ListControllers>::forward_1_to_2(class std::shared_ptr<class rclcpp::ClientBase>,class rclcpp::Logger,struct controller_manager_msgs::ListControllersRequest_<class std::allocator<void> > const &,struct controller_manager_msgs::ListControllersResponse_<class std::allocator<void> > &)" (?forward_1_to_2@?$ServiceFactory@UListControllers@controller_manager_msgs@@U1srv@2@@ros1_bridge@@QEAA_NV?$shared_ptr@VClientBase@rclcpp@@@std@@VLogger@rclcpp@@AEBU?$ListControllersRequest_@V?$allocator@X@std@@@controller_manager_msgs@@AEAU?$ListControllersResponse_@V?$allocator@X@std@@@8@@Z) [C:\ros1_bridge_ws\build\ros1_bridge\ros1_bridge.vcxproj]
C:\ros1_bridge_ws\build\ros1_bridge\Release\ros1_bridge.dll : fatal error LNK1120: 2 unresolved externals [C:\ros1_bridge_ws\build\ros1_bridge\ros1_bridge.vcxproj]
simple_bridge.obj : error LNK2019: unresolved external symbol "bool ros::console::g_initialized" (?g_initialized@console@ros@@3_NA) referenced in function "public: virtual class boost::shared_ptr<void const > __cdecl ros::SubscriptionCallbackHelperT<class ros::MessageEvent<struct std_msgs::String_<class std::allocator<void> > const > const &,void>::deserialize(struct ros::SubscriptionCallbackHelperDeserializeParams const &)" (?deserialize@?$SubscriptionCallbackHelperT@AEBV?$MessageEvent@$$CBU?$String_@V?$allocator@X@std@@@std_msgs@@@ros@@X@ros@@UEAA?AV?$shared_ptr@$$CBX@boost@@AEBUSubscriptionCallbackHelperDeserializeParams@2@@Z) [C:\ros1_bridge_ws\build\ros1_bridge\simple_bridge.vcxproj]
C:\ros1_bridge_ws\build\ros1_bridge\Release\simple_bridge.exe : fatal error LNK1120: 1 unresolved externals [C:\ros1_bridge_ws\build\ros1_bridge\simple_bridge.vcxproj]
simple_bridge_1_to_2.obj : error LNK2019: unresolved external symbol "bool ros::console::g_initialized" (?g_initialized@console@ros@@3_NA) referenced in function "public: virtual class boost::shared_ptr<void const > __cdecl ros::SubscriptionCallbackHelperT<class boost::shared_ptr<struct std_msgs::String_<class std::allocator<void> > const > const &,void>::deserialize(struct ros::SubscriptionCallbackHelperDeserializeParams const &)" (?deserialize@?$SubscriptionCallbackHelperT@AEBV?$shared_ptr@$$CBU?$String_@V?$allocator@X@std@@@std_msgs@@@boost@@X@ros@@UEAA?AV?$shared_ptr@$$CBX@boost@@AEBUSubscriptionCallbackHelperDeserializeParams@2@@Z) [C:\ros1_bridge_ws\build\ros1_bridge\simple_bridge_1_to_2.vcxproj]
C:\ros1_bridge_ws\build\ros1_bridge\Release\simple_bridge_1_to_2.exe : fatal error LNK1120: 1 unresolved externals [C:\ros1_bridge_ws\build\ros1_bridge\simple_bridge_1_to_2.vcxproj]
  simple_bridge_2_to_1.vcxproj -> C:\ros1_bridge_ws\build\ros1_bridge\Release\simple_bridge_2_to_1.exe
test_ros1_client.obj : error LNK2019: unresolved external symbol "bool ros::console::g_initialized" (?g_initialized@console@ros@@3_NA) referenced in function "private: void __cdecl ros::ServiceClient::deserializeFailed(class std::exception const &)" (?deserializeFailed@ServiceClient@ros@@AEAAXAEBVexception@std@@@Z) [C:\ros1_bridge_ws\build\ros1_bridge\test_ros1_client.vcxproj]
C:\ros1_bridge_ws\build\ros1_bridge\Release\test_ros1_client.exe : fatal error LNK1120: 1 unresolved externals [C:\ros1_bridge_ws\build\ros1_bridge\test_ros1_client.vcxproj]
  test_ros1_server.vcxproj -> C:\ros1_bridge_ws\build\ros1_bridge\Release\test_ros1_server.exe
  test_ros2_client_cpp.vcxproj -> C:\ros1_bridge_ws\build\ros1_bridge\Release\test_ros2_client_cpp.exe
  test_ros2_server_cpp.vcxproj -> C:\ros1_bridge_ws\build\ros1_bridge\Release\test_ros2_server_cpp.exe

Additional Info

I use Windows 10 Home 22H2 with lenovo ideapad gaming 3 15ach6 16Gb Rams and 8 Core cpu

When colcon build I see that memory usage is almost at 100% (I close every app possible only terminal colcon and task manager) and sometime memory usage is drop and cpu usage is 100% instead,and building time is around 50 minutes.

Please help me.