活动介绍

planner@ubuntu:~/catkin_google_ws$ catkin_make_isolated --install --use-ninja Base path: /home/planner/catkin_google_ws Source space: /home/planner/catkin_google_ws/src Build space: /home/planner/catkin_google_ws/build_isolated Devel space: /home/planner/catkin_google_ws/devel_isolated Install space: /home/planner/catkin_google_ws/install_isolated ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ ~~ traversing 4 packages in topological order: ~~ - cartographer (plain cmake) ~~ - cartographer_ros_msgs ~~ - cartographer_ros ~~ - cartographer_rviz ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ 我只想使用ros_msgs这个包怎么做

时间: 2025-07-01 19:12:44 浏览: 20
### 单独编译和使用 `cartographer_ros_msgs` 包的方法 为了单独编译和使用 `cartographer_ros_msgs` 包,可以按照以下方式操作: #### 1. 创建 ROS 工作空间 创建一个新的 ROS 工作空间来存储 `cartographer_ros_msgs` 包及其依赖项。 ```bash mkdir -p ~/cartographer_ws/src cd ~/cartographer_ws/src ``` #### 2. 获取 `cartographer_ros_msgs` 包 通过 Git 克隆官方仓库中的消息定义文件夹到工作空间中。 ```bash git clone https://github.com/cartographer-project/cartographer_ros.git -b ros2-foxy --depth 1 ln -s cartographer_ros/cartographer_ros_msgs . ``` 这里需要注意的是 `-b ros2-foxy` 参数指定了分支版本。如果使用的 ROS 版本不同,则需调整为对应的分支名称[^1]。 #### 3. 安装依赖项 确保安装了必要的工具链以及构建环境支持。 ```bash sudo apt update && sudo apt install python3-colcon-common-extensions rosdep init rosdep update rosdep install --from-paths src --ignore-src -r -y ``` #### 4. 编译消息包 利用 Colcon 构建系统针对单一目标进行优化处理。 ```bash colcon build --packages-select cartographer_ros_msgs source install/setup.bash ``` 以上命令会只对指定的消息包执行编译流程而跳过其余部分[^2]。 #### 5. 验证安装情况 确认生成的目标产物是否存在,并测试基本功能是否正常运作。 ```python import rclpy from cartographer_ros_msgs.msg import SubmapEntry def main(args=None): rclpy.init(args=args) node = rclpy.create_node('test_submap_entry') msg = SubmapEntry() msg.submap_id.id = "test" print(f"Created message with ID: {msg.submap_id.id}") if __name__ == '__main__': main() ``` 运行脚本验证能否成功导入模块并实例化对象[^3]。 --- ### 注意事项 尽管能够独立于整个项目之外完成该子集的部署过程,但在实际应用过程中仍可能面临某些隐含关联性带来的挑战。因此建议始终遵循官方文档指导下的标准配置步骤来进行开发活动。
阅读全文

相关推荐

catkin_make Base path: /home/hhb/catkin_ws Source space: /home/hhb/catkin_ws/src Build space: /home/hhb/catkin_ws/build Devel space: /home/hhb/catkin_ws/devel Install space: /home/hhb/catkin_ws/install #### #### Running command: "make cmake_check_build_system" in "/home/hhb/catkin_ws/build" #### -- Using CATKIN_DEVEL_PREFIX: /home/hhb/catkin_ws/devel -- Using CMAKE_PREFIX_PATH: /home/hhb/catkin_ws/devel;/opt/ros/noetic -- This workspace overlays: /home/hhb/catkin_ws/devel;/opt/ros/noetic -- Found PythonInterp: /usr/bin/python3 (found suitable version "3.8.10", minimum required is "3") -- Using PYTHON_EXECUTABLE: /usr/bin/python3 -- Using Debian Python package layout -- Using empy: /usr/lib/python3/dist-packages/em.py -- Using CATKIN_ENABLE_TESTING: ON -- Call enable_testing() -- Using CATKIN_TEST_RESULTS_DIR: /home/hhb/catkin_ws/build/test_results -- Forcing gtest/gmock from source, though one was otherwise available. -- Found gtest sources under '/usr/src/googletest': gtests will be built -- Found gmock sources under '/usr/src/googletest': gmock will be built -- Found PythonInterp: /usr/bin/python3 (found version "3.8.10") -- Using Python nosetests: /usr/bin/nosetests3 -- catkin 0.8.10 -- BUILD_SHARED_LIBS is on -- BUILD_SHARED_LIBS is on WARNING: package "turtlebot3_gazebo" should not depend on metapackage "gazebo_ros_pkgs" but on its packages instead -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- ~~ traversing 22 packages in topological order: -- ~~ - turtlebot3_simulations (plain cmake) -- ~~ - wpb_home_bringup -- ~~ - wpb_home_remote -- ~~ - abc_swarm -- ~~ - map_pkg -- ~~ - slam_pkg -- ~~ - tianbot_mini -- ~~ - nav_pkg -- ~~ - lidar_pkg -- ~~ - multi_robot_slam -- ~~ - multirobot_map_merge -- ~~ - turtlebot3_fake_node (plain cmake) -- ~~ - tianbot_mini_description -- ~~ - turtlebot3_gazebo (plain cmake) -- ~~ - explore_lite -- ~~ - rrt_star_global_planner -- ~~ - wpb_home_behaviors -- ~~ - wpb_home_python -- ~~ - wpb_home_python3

运行roslaunch primitive_planner swarm.launch输出[ERROR] [1752714797.310398330]: Illegal pathID=-1,然后验证地图和起点参数 Bash # 检查地图尺寸参数(应为正值) rosparam get /random_forest/map/x_size rosparam get /random_forest/map/y_size # 检查无人机起点(示例值) rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_x rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_y输出vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam get /random_forest/map/x_size 7.590095790206243 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam get /random_forest/map/y_size 7.590095790206243 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_x -6.366197723675814 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_y -0.0 然后运行# 设置起点在有效范围内 (x ≥ 0, y ≥ 0) rosparam set /drone_0_primitive_planner_node/fsm/waypoint0_x 1.0 rosparam set /drone_0_primitive_planner_node/fsm/waypoint0_y 1.0 # 验证参数 rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_x rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_y地图未正确初始化: Bash rostopic echo /map 确保地图已发布且包含有效数据 坐标系不一致: Bash rosrun tf view_frames 检查所有坐标系是否统一(通常是 map 或 odom) 规划算法参数错误: Bash rosparam get /drone_0_primitive_planner_node/planner 验证规划器参数是否合理 障碍物配置问题: Bash rosservice call /get_obstacles 输出vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam set /drone_0_primitive_planner_node/fsm/waypoint0_x 1.0 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam set /drone_0_primitive_planner_node/fsm/waypoint0_y 1.0 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_x 1.0 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam get /drone_0_primitive_planner_node/fsm/waypoint0_y 1.0 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rostopic echo /map WARNING: topic [/map] does not appear to be published yet ^Z [2]+ 已停止 rostopic echo /map vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosrun tf view_frames WARNING: tf view_frames is deprecated. Use tf2_tools view_frames.py instead. Listening to /tf for 5.0 seconds Done Listening frames.pdf generated vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosparam get /drone_0_primitive_planner_node/planner ERROR: Parameter [/drone_0_primitive_planner_node/planner] is not set vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src$ rosservice call /get_obstacles ERROR: Service [/get_obstacles] is not available.

vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src/Primitive-Planner/src/planner/plan_manage$ sudo rm /etc/apt/sources.list.d/ros2.list # 若存在 rm: 无法删除 '/etc/apt/sources.list.d/ros2.list': 没有那个文件或目录 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src/Primitive-Planner/src/planner/plan_manage$ sudo rm /etc/apt/sources.list.d/ros-fuerte* # 若存在 (引用[3]) rm: 无法删除 '/etc/apt/sources.list.d/ros-fuerte*': 没有那个文件或目录 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src/Primitive-Planner/src/planner/plan_manage$ sudo sh -c 'echo "deb http://packages.ros.org/ros/ubuntu focal main" > /etc/apt/sources.list.d/ros-latest.list' vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src/Primitive-Planner/src/planner/plan_manage$ sudo apt-key adv --keyserver 'hkp://keyserver.ubuntu.com:80' --recv-key C1CF6E31E6BADE8868B172B4F42ED6FBAB17C654 Executing: /tmp/apt-key-gpghome.wHCpRjn1jw/gpg.1.sh --keyserver hkp://keyserver.ubuntu.com:80 --recv-key C1CF6E31E6BADE8868B172B4F42ED6FBAB17C654 gpg: 密钥 F42ED6FBAB17C654:“Open Robotics <[email protected]>” 1 个新的签名 gpg: 处理的总数:1 gpg: 新的签名:1 vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src/Primitive-Planner/src/planner/plan_manage$ dpkg -l | grep pcl-ros ii ros-noetic-pcl-ros 1.7.4-1focal.20250521.004323 amd64 PCL (Point Cloud Library) ROS interface stack. vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws/src/Primitive-Planner/src/planner/plan_manage$ rosrun pcl_ros pointcloud_to_pcd input:=/points2 [INFO] [1752722398.222521893]: Saving as ASCII PCD [INFO] [1752722398.223133113]: Listening for incoming data on topic /points2

EPRobot@EPRobot:~/robot_ws$ cd ~/robot_ws # 在每次打开新终端时运行 EPRobot@EPRobot:~/robot_ws$ catkin_make Base path: /home/EPRobot/robot_ws Source space: /home/EPRobot/robot_ws/src Build space: /home/EPRobot/robot_ws/build Devel space: /home/EPRobot/robot_ws/devel Install space: /home/EPRobot/robot_ws/install #### #### Running command: "make cmake_check_build_system" in "/home/EPRobot/robot_ws/build" #### -- Using CATKIN_DEVEL_PREFIX: /home/EPRobot/robot_ws/devel -- Using CMAKE_PREFIX_PATH: /home/EPRobot/robot_ws/devel;/opt/ros/melodic -- This workspace overlays: /home/EPRobot/robot_ws/devel;/opt/ros/melodic -- Found PythonInterp: /usr/bin/python2 (found suitable version "2.7.17", minimum required is "2") -- Using PYTHON_EXECUTABLE: /usr/bin/python2 -- Using Debian Python package layout -- Using empy: /usr/bin/empy -- Using CATKIN_ENABLE_TESTING: ON -- Call enable_testing() -- Using CATKIN_TEST_RESULTS_DIR: /home/EPRobot/robot_ws/build/test_results -- Found gtest sources under '/usr/src/googletest': gtests will be built -- Found gmock sources under '/usr/src/googletest': gmock will be built -- Found PythonInterp: /usr/bin/python2 (found version "2.7.17") -- Using Python nosetests: /usr/bin/nosetests-2.7 -- catkin 0.7.29 -- BUILD_SHARED_LIBS is on -- BUILD_SHARED_LIBS is on -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- ~~ traversing 62 packages in topological order: -- ~~ - astra_launch -- ~~ - base_control -- ~~ - hibot_follower -- ~~ - lslidar (metapackage) -- ~~ - navigation (metapackage) -- ~~ - robot_navigation -- ~~ - robot_upstart -- ~~ - simple_navigation_goals -- ~~ - lslidar_msgs -- ~~ - rospy_message_converter -- ~~ - eprobot_auto_home -- ~~ - eprobot_start -- ~~ - ls01d -- ~~ - map_server -- ~~ - hls_lfcd_lds_driver -- ~~ - iiiroboticslidar2 -- ~~ - astra_camera -- ~~ - rplidar_ros -- ~~ - eprobot_joy -- ~~ - lslidar_driver -- ~~ - robot_pose_ekf -- ~~ - sc_mini -- ~~ - amcl -- ~~ - fake_localization -- ~~ - laser_filters -- ~~ - robot_localization -- ~~ - track_detection -- ~~ - voxel_grid -- ~~ - costmap_2d -- ~~ - nav_core -- ~~ - base_local_planner -- ~~ - carrot_planner -- ~~ - clear_costmap_recovery -- ~~ - dwa_local_planner -- ~~ - move_slow_and_clear -- ~~ - navfn -- ~~ - global_planner -- ~~ - rotate_recovery -- ~~ - move_base -- ~~ - teb_local_planner -- ~~ - eprobot_description -- ~~ - xf_mic_asr_offline -- ~~ - ydlidar -- ~~ - yocs_ar_pair_approach -- ~~ - yocs_cmd_vel_mux -- ~~ - yocs_controllers -- ~~ - yocs_keyop -- ~~ - yocs_localization_manager -- ~~ - yocs_math_toolkit -- ~~ - yocs_ar_marker_tracking -- ~~ - yocs_diff_drive_pose_controller -- ~~ - yocs_ar_pair_tracking -- ~~ - yocs_joyop -- ~~ - yocs_navi_toolkit -- ~~ - yocs_navigator -- ~~ - yocs_rapps -- ~~ - yocs_safety_controller -- ~~ - yocs_velocity_smoother -- ~~ - yocs_virtual_sensor -- ~~ - yocs_waypoint_provider -- ~~ - yocs_waypoints_navi -- ~~ - yujin_ocs (metapackage) -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- +++ processing catkin package: 'astra_launch' -- ==> add_subdirectory(ros_astra_launch) -- +++ processing catkin package: 'base_control' -- ==> add_subdirectory(base_control) -- +++ processing catkin package: 'hibot_follower' -- ==> add_subdirectory(hibot_follower) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy CMake Warning at /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'system_lib' but neither 'system_lib_INCLUDE_DIRS' nor 'system_lib_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) hibot_follower/CMakeLists.txt:24 (catkin_package) -- +++ processing catkin metapackage: 'lslidar' -- ==> add_subdirectory(lslidar) -- +++ processing catkin metapackage: 'navigation' -- ==> add_subdirectory(navigation-melodic/navigation) -- +++ processing catkin package: 'robot_navigation' -- ==> add_subdirectory(robot_navigation) -- +++ processing catkin package: 'robot_upstart' -- ==> add_subdirectory(robot_upstart) -- +++ processing catkin package: 'simple_navigation_goals' -- ==> add_subdirectory(simple_navigation_goals) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'lslidar_msgs' -- ==> add_subdirectory(lslidar_msgs) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- lslidar_msgs: 5 messages, 0 services -- +++ processing catkin package: 'rospy_message_converter' -- ==> add_subdirectory(rospy_message_converter) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- rospy_message_converter: 4 messages, 1 services -- +++ processing catkin package: 'eprobot_auto_home' -- ==> add_subdirectory(eprobot_auto_home) -- +++ processing catkin package: 'eprobot_start' -- ==> add_subdirectory(eprobot_start) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy CMake Warning at /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'system_lib' but neither 'system_lib_INCLUDE_DIRS' nor 'system_lib_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) eprobot_start/CMakeLists.txt:24 (catkin_package) -- +++ processing catkin package: 'ls01d' -- ==> add_subdirectory(lidar/ls01d) -- +++ processing catkin package: 'map_server' -- ==> add_subdirectory(navigation-melodic/map_server) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- Found the following Boost libraries: -- filesystem -- system -- +++ processing catkin package: 'hls_lfcd_lds_driver' -- ==> add_subdirectory(lidar/hls_lfcd_lds_driver) -- Boost version: 1.65.1 -- +++ processing catkin package: 'iiiroboticslidar2' -- ==> add_subdirectory(lidar/iiiroboticslidar2_ros) -- +++ processing catkin package: 'astra_camera' -- ==> add_subdirectory(ros_astra_camera) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- Found the following Boost libraries: -- system -- thread -- chrono -- date_time -- atomic -- ORRBEC Machine : aarch64 -- ORRBEC Machine Bits : 64 -- ORRBEC : arm64 -- libuvc 0.0.6 -- astra_camera: 0 messages, 19 services -- +++ processing catkin package: 'rplidar_ros' -- ==> add_subdirectory(lidar/rplidar_ros) -- +++ processing catkin package: 'eprobot_joy' -- ==> add_subdirectory(eprobot_joy) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy CMake Warning at /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'system_lib' but neither 'system_lib_INCLUDE_DIRS' nor 'system_lib_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) eprobot_joy/CMakeLists.txt:39 (catkin_package) -- +++ processing catkin package: 'lslidar_driver' -- ==> add_subdirectory(lslidar_driver) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 CMake Warning at /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'boost' but neither 'boost_INCLUDE_DIRS' nor 'boost_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) lslidar_driver/CMakeLists.txt:22 (catkin_package) -- +++ processing catkin package: 'robot_pose_ekf' -- ==> add_subdirectory(robot_pose_ekf) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- Found the following Boost libraries: -- thread -- chrono -- system -- date_time -- atomic -- robot_pose_ekf: 0 messages, 1 services -- +++ processing catkin package: 'sc_mini' -- ==> add_subdirectory(lidar/sc_mini) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- +++ processing catkin package: 'amcl' -- ==> add_subdirectory(navigation-melodic/amcl) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- +++ processing catkin package: 'fake_localization' -- ==> add_subdirectory(navigation-melodic/fake_localization) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- +++ processing catkin package: 'laser_filters' -- ==> add_subdirectory(laser_filters) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- Found the following Boost libraries: -- system -- +++ processing catkin package: 'robot_localization' -- ==> add_subdirectory(robot_localization) robot_localization: You did not request a specific build type: selecting 'RelWithDebInfo'. -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- robot_localization: 0 messages, 7 services -- +++ processing catkin package: 'track_detection' -- ==> add_subdirectory(track_detection) -- +++ processing catkin package: 'voxel_grid' -- ==> add_subdirectory(navigation-melodic/voxel_grid) -- +++ processing catkin package: 'costmap_2d' -- ==> add_subdirectory(navigation-melodic/costmap_2d) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- Found the following Boost libraries: -- system -- thread -- chrono -- date_time -- atomic -- costmap_2d: 1 messages, 0 services -- +++ processing catkin package: 'nav_core' -- ==> add_subdirectory(navigation-melodic/nav_core) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'base_local_planner' -- ==> add_subdirectory(navigation-melodic/base_local_planner) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- Found the following Boost libraries: -- thread -- chrono -- system -- date_time -- atomic -- base_local_planner: 1 messages, 0 services -- +++ processing catkin package: 'carrot_planner' -- ==> add_subdirectory(navigation-melodic/carrot_planner) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'clear_costmap_recovery' -- ==> add_subdirectory(navigation-melodic/clear_costmap_recovery) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'dwa_local_planner' -- ==> add_subdirectory(navigation-melodic/dwa_local_planner) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'move_slow_and_clear' -- ==> add_subdirectory(navigation-melodic/move_slow_and_clear) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Boost version: 1.65.1 -- Found the following Boost libraries: -- thread -- chrono -- system -- date_time -- atomic -- +++ processing catkin package: 'navfn' -- ==> add_subdirectory(navigation-melodic/navfn) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- navfn: 0 messages, 2 services -- NAVFN_HAVE_FLTK: , NETPBM: 1 -- FLTK orf NETPBM not found: cannot build navtest -- +++ processing catkin package: 'global_planner' -- ==> add_subdirectory(navigation-melodic/global_planner) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'rotate_recovery' -- ==> add_subdirectory(navigation-melodic/rotate_recovery) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'move_base' -- ==> add_subdirectory(navigation-melodic/move_base) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'teb_local_planner' -- ==> add_subdirectory(teb_local_planner-melodic) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- System: Linux-5.3.0-1030-raspi2 -- /opt/ros/melodic/share/cmake_modules/cmake/../../../share/cmake_modules/cmake/Modules;/home/EPRobot/robot_ws/src/teb_local_planner-melodic/cmake_modules -- Boost version: 1.65.1 -- Found the following Boost libraries: -- system -- thread -- graph -- chrono -- date_time -- atomic -- Found SuiteSparse -- Searching for g2o ... -- Found g2o headers in: /opt/ros/melodic/include/g2o -- Found libg2o: /opt/ros/melodic/lib/libg2o_csparse_extension.so;/opt/ros/melodic/lib/libg2o_core.so;/opt/ros/melodic/lib/libg2o_stuff.so;/opt/ros/melodic/lib/libg2o_types_slam2d.so;/opt/ros/melodic/lib/libg2o_types_slam3d.so;/opt/ros/melodic/lib/libg2o_solver_cholmod.so;/opt/ros/melodic/lib/libg2o_solver_pcg.so;/opt/ros/melodic/lib/libg2o_solver_csparse.so;/opt/ros/melodic/lib/libg2o_incremental.so -- teb_local_planner: 3 messages, 0 services -- +++ processing catkin package: 'eprobot_description' -- ==> add_subdirectory(eprobot_description) -- +++ processing catkin package: 'xf_mic_asr_offline' -- ==> add_subdirectory(xf_mic_asr_offline) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- xf_mic_asr_offline: 2 messages, 7 services -- +++ processing catkin package: 'ydlidar' -- ==> add_subdirectory(ydlidar) -- +++ processing catkin package: 'yocs_ar_pair_approach' -- ==> add_subdirectory(yujin_ocs/yocs_ar_pair_approach) -- +++ processing catkin package: 'yocs_cmd_vel_mux' -- ==> add_subdirectory(yujin_ocs/yocs_cmd_vel_mux) -- +++ processing catkin package: 'yocs_controllers' -- ==> add_subdirectory(yujin_ocs/yocs_controllers) -- +++ processing catkin package: 'yocs_keyop' -- ==> add_subdirectory(yujin_ocs/yocs_keyop) -- Could NOT find ecl_threads (missing: ecl_threads_DIR) -- Could not find the required component 'ecl_threads'. The following CMake error indicates that you either need to install the package with the same name or change your environment so that it can be found. CMake Error at /opt/ros/melodic/share/catkin/cmake/catkinConfig.cmake:83 (find_package): Could not find a package configuration file provided by "ecl_threads" with any of the following names: ecl_threadsConfig.cmake ecl_threads-config.cmake Add the installation prefix of "ecl_threads" to CMAKE_PREFIX_PATH or set "ecl_threads_DIR" to a directory containing one of the above files. If "ecl_threads" provides a separate development package or SDK, be sure it has been installed. Call Stack (most recent call first): yujin_ocs/yocs_keyop/CMakeLists.txt:3 (find_package) -- Configuring incomplete, errors occurred! See also "/home/EPRobot/robot_ws/build/CMakeFiles/CMakeOutput.log". See also "/home/EPRobot/robot_ws/build/CMakeFiles/CMakeError.log". Makefile:9560: recipe for target 'cmake_check_build_system' failed make: *** [cmake_check_build_system] Error 1 Invoking "make cmake_check_build_system" failed EPRobot@EPRobot:~/robot_ws$ source devel/setup.bash # 在每次打开新终端时运行

EPRobot@EPRobot:~/robot_ws/src/eprobot_start/script/one_car_pkg$ roslaunch eprobot_start one_car_start.launch RLException: [one_car_start.launch] is neither a launch file in package [eprobot_start] nor is [eprobot_start] a launch file name The traceback for the exception was written to the log file EPRobot@EPRobot:~/robot_ws/src/eprobot_start/script/one_car_pkg$ roscd usd_cam roscd: No such package/stack 'usd_cam' EPRobot@EPRobot:~/robot_ws/src/eprobot_start/script/one_car_pkg$ source /opt/ros/melodic/setup.bash EPRobot@EPRobot:~/robot_ws/src/eprobot_start/script/one_car_pkg$ cd ~/robot_ws EPRobot@EPRobot:~/robot_ws$ source devel/setup.bash EPRobot@EPRobot:~/robot_ws$ roslaunch eprobot_start one_car_start.launch ... logging to /home/EPRobot/.ros/log/98e3a152-624a-11f0-a474-e45f0131f240/roslaunch-EPRobot-28515.log Checking log directory for disk usage. This may take a while. Press Ctrl-C to interrupt Done checking log file disk usage. Usage is <1GB. started roslaunch server http://EPRobot:33123/ SUMMARY ======== CLEAR PARAMETERS * /ekf_se/ PARAMETERS * /amcl/base_frame_id: base_footprint * /amcl/global_frame_id: map * /amcl/gui_publish_rate: 10.0 * /amcl/initial_pose_a: 0.0 * /amcl/initial_pose_x: 0.0 * /amcl/initial_pose_y: 0.0 * /amcl/kld_err: 0.05 * /amcl/kld_z: 0.99 * /amcl/laser_lambda_short: 0.1 * /amcl/laser_likelihood_max_dist: 5.0 * /amcl/laser_max_beams: 60 * /amcl/laser_max_range: 12.0 * /amcl/laser_model_type: likelihood_field * /amcl/laser_sigma_hit: 0.2 * /amcl/laser_z_hit: 0.7 * /amcl/laser_z_max: 0.1 * /amcl/laser_z_rand: 0.3 * /amcl/laser_z_short: 0.1 * /amcl/max_particles: 2000 * /amcl/min_particles: 600 * /amcl/odom_alpha1: 0.2 * /amcl/odom_alpha2: 0.2 * /amcl/odom_alpha3: 0.2 * /amcl/odom_alpha4: 0.2 * /amcl/odom_alpha5: 0.1 * /amcl/odom_frame_id: odom * /amcl/odom_model_type: diff * /amcl/recovery_alpha_fast: 0.2 * /amcl/recovery_alpha_slow: 0.005 * /amcl/resample_interval: 0.4 * /amcl/transform_tolerance: 0.5 * /amcl/update_min_a: 0.05 * /amcl/update_min_d: 0.05 * /amcl/use_map_topic: True * /base_control/base_kd: 0.0 * /base_control/base_ki: 100.0 * /base_control/base_kp: 1000.0 * /base_control/base_kv: 1.0 * /base_control/is_send_anger: false * /camera_uri: http://192.168.3.... * /ekf_se/base_link_frame: /base_footprint * /ekf_se/debug: False * /ekf_se/debug_out_file: /path/to/debug/fi... * /ekf_se/frequency: 30 * /ekf_se/imu0: /imu_data * /ekf_se/imu0_config: [False, False, Fa... * /ekf_se/imu0_differential: False * /ekf_se/imu0_nodelay: True * /ekf_se/imu0_pose_rejection_threshold: 0.8 * /ekf_se/imu0_queue_size: 8 * /ekf_se/imu0_relative: True * /ekf_se/imu0_remove_gravitational_acceleration: True * /ekf_se/initial_estimate_covariance: ['1e-9', 0, 0, 0,... * /ekf_se/map_frame: /map * /ekf_se/odom0: /odom * /ekf_se/odom0_config: [False, False, Fa... * /ekf_se/odom0_differential: False * /ekf_se/odom0_nodelay: True * /ekf_se/odom0_queue_size: 5 * /ekf_se/odom0_relative: True * /ekf_se/odom_frame: /odom * /ekf_se/print_diagnostics: True * /ekf_se/process_noise_covariance: [0.01, 0, 0, 0, 0... * /ekf_se/publish_acceleration: True * /ekf_se/publish_tf: True * /ekf_se/sensor_timeout: 0.025 * /ekf_se/transform_time_offset: 0.0001 * /ekf_se/transform_timeout: 0.025 * /ekf_se/two_d_mode: True * /ekf_se/world_frame: /odom * /image_view/autosize: True * /laser_filter/scan_filter_chain: [{'type': 'laser_... * /lslidar_driver_node/angle_disable_max: 0 * /lslidar_driver_node/angle_disable_min: 0 * /lslidar_driver_node/compensation: False * /lslidar_driver_node/frame_id: base_laser_link * /lslidar_driver_node/high_reflection: False * /lslidar_driver_node/interface_selection: serial * /lslidar_driver_node/lidar_name: M10 * /lslidar_driver_node/max_range: 100.0 * /lslidar_driver_node/min_range: 0.1 * /lslidar_driver_node/pubPointCloud2: False * /lslidar_driver_node/pubScan: True * /lslidar_driver_node/scan_topic: scan * /lslidar_driver_node/serial_port: /dev/EPRobot_laser * /lslidar_driver_node/use_gps_ts: False * /map_server/frame_id: map * /move_base/TebLocalPlannerROS/acc_lim_theta: 0.3 * /move_base/TebLocalPlannerROS/acc_lim_x: 0.2 * /move_base/TebLocalPlannerROS/allow_init_with_backwards_motion: True * /move_base/TebLocalPlannerROS/cmd_angle_instead_rotvel: False * /move_base/TebLocalPlannerROS/costmap_converter_plugin: * /move_base/TebLocalPlannerROS/costmap_converter_rate: 5 * /move_base/TebLocalPlannerROS/costmap_converter_spin_thread: True * /move_base/TebLocalPlannerROS/costmap_obstacles_behind_robot_dist: 1.0 * /move_base/TebLocalPlannerROS/dt_hysteresis: 0.1 * /move_base/TebLocalPlannerROS/dt_ref: 0.3 * /move_base/TebLocalPlannerROS/dynamic_obstacle_inflation_dist: 0.2 * /move_base/TebLocalPlannerROS/enable_homotopy_class_planning: False * /move_base/TebLocalPlannerROS/enable_multithreading: True * /move_base/TebLocalPlannerROS/exact_arc_length: False * /move_base/TebLocalPlannerROS/feasibility_check_no_poses: 3 * /move_base/TebLocalPlannerROS/footprint_model/line_end: [0.1, 0.0] * /move_base/TebLocalPlannerROS/footprint_model/line_start: [-0.1, 0.0] * /move_base/TebLocalPlannerROS/footprint_model/type: line * /move_base/TebLocalPlannerROS/force_reinit_new_goal_dist: 0.5 * /move_base/TebLocalPlannerROS/free_goal_vel: False * /move_base/TebLocalPlannerROS/global_plan_overwrite_orientation: True * /move_base/TebLocalPlannerROS/global_plan_viapoint_sep: 3.0 * /move_base/TebLocalPlannerROS/h_signature_prescaler: 0.5 * /move_base/TebLocalPlannerROS/h_signature_threshold: 0.1 * /move_base/TebLocalPlannerROS/include_costmap_obstacles: True * /move_base/TebLocalPlannerROS/include_dynamic_obstacles: True * /move_base/TebLocalPlannerROS/inflation_dist: 0.35 * /move_base/TebLocalPlannerROS/is_footprint_dynamic: False * /move_base/TebLocalPlannerROS/legacy_obstacle_association: False * /move_base/TebLocalPlannerROS/max_global_plan_lookahead_dist: 10.0 * /move_base/TebLocalPlannerROS/max_number_classes: 2 * /move_base/TebLocalPlannerROS/max_vel_theta: 1.0 * /move_base/TebLocalPlannerROS/max_vel_x: 0.6 * /move_base/TebLocalPlannerROS/max_vel_x_backwards: 0.3 * /move_base/TebLocalPlannerROS/max_vel_y: 0.0 * /move_base/TebLocalPlannerROS/min_obstacle_dist: 0.55 * /move_base/TebLocalPlannerROS/min_turning_radius: 0.6 * /move_base/TebLocalPlannerROS/no_inner_iterations: 5 * /move_base/TebLocalPlannerROS/no_outer_iterations: 4 * /move_base/TebLocalPlannerROS/obstacle_association_cutoff_factor: 5.0 * /move_base/TebLocalPlannerROS/obstacle_association_force_inclusion_factor: 1.5 * /move_base/TebLocalPlannerROS/obstacle_cost_exponent: 5.5 * /move_base/TebLocalPlannerROS/obstacle_heading_threshold: 0.45 * /move_base/TebLocalPlannerROS/obstacle_keypoint_offset: 0.1 * /move_base/TebLocalPlannerROS/obstacle_poses_affected: 15 * /move_base/TebLocalPlannerROS/odom_topic: odom * /move_base/TebLocalPlannerROS/optimization_activate: True * /move_base/TebLocalPlannerROS/optimization_verbose: False * /move_base/TebLocalPlannerROS/oscillation_recovery: True * /move_base/TebLocalPlannerROS/penalty_epsilon: 0.08 * /move_base/TebLocalPlannerROS/roadmap_graph_area_length_scale: 1.0 * /move_base/TebLocalPlannerROS/roadmap_graph_area_width: 5 * /move_base/TebLocalPlannerROS/roadmap_graph_no_samples: 15 * /move_base/TebLocalPlannerROS/selection_alternative_time_cost: False * /move_base/TebLocalPlannerROS/selection_cost_hysteresis: 1.0 * /move_base/TebLocalPlannerROS/selection_obst_cost_scale: 1.0 * /move_base/TebLocalPlannerROS/selection_viapoint_cost_scale: 1.0 * /move_base/TebLocalPlannerROS/shrink_horizon_backup: True * /move_base/TebLocalPlannerROS/simple_exploration: False * /move_base/TebLocalPlannerROS/teb_autosize: True * /move_base/TebLocalPlannerROS/via_points_ordered: False * /move_base/TebLocalPlannerROS/visualize_hc_graph: False * /move_base/TebLocalPlannerROS/weight_acc_lim_theta: 1 * /move_base/TebLocalPlannerROS/weight_acc_lim_x: 1 * /move_base/TebLocalPlannerROS/weight_adapt_factor: 1.0 * /move_base/TebLocalPlannerROS/weight_dynamic_obstacle: 100 * /move_base/TebLocalPlannerROS/weight_dynamic_obstacle_inflation: 0.6 * /move_base/TebLocalPlannerROS/weight_inflation: 1.0 * /move_base/TebLocalPlannerROS/weight_kinematics_forward_drive: 800 * /move_base/TebLocalPlannerROS/weight_kinematics_nh: 1000 * /move_base/TebLocalPlannerROS/weight_kinematics_turning_radius: 6.0 * /move_base/TebLocalPlannerROS/weight_max_vel_theta: 1 * /move_base/TebLocalPlannerROS/weight_max_vel_x: 2 * /move_base/TebLocalPlannerROS/weight_obstacle: 190 * /move_base/TebLocalPlannerROS/weight_optimaltime: 15 * /move_base/TebLocalPlannerROS/weight_shortest_path: 5.0 * /move_base/TebLocalPlannerROS/weight_viapoint: 10.0 * /move_base/TebLocalPlannerROS/wheelbase: 0.3 * /move_base/TebLocalPlannerROS/xy_goal_tolerance: 0.1 * /move_base/TebLocalPlannerROS/yaw_goal_tolerance: 0.1 * /move_base/base_local_planner: teb_local_planner... * /move_base/clearing_rotation_allowed: False * /move_base/conservative_reset_dist: 0.2 * /move_base/controller_frequency: 5.0 * /move_base/controller_patience: 15.0 * /move_base/global_costmap/footprint: [[-0.18, -0.18], ... * /move_base/global_costmap/global_frame: map * /move_base/global_costmap/inflation_layer/cost_scaling_factor: 10.0 * /move_base/global_costmap/inflation_layer/enabled: True * /move_base/global_costmap/inflation_layer/inflation_radius: 0.3 * /move_base/global_costmap/inflation_radius: 0.4 * /move_base/global_costmap/laser_scan_sensor/clearing: True * /move_base/global_costmap/laser_scan_sensor/data_type: LaserScan * /move_base/global_costmap/laser_scan_sensor/marking: True * /move_base/global_costmap/laser_scan_sensor/topic: scan * /move_base/global_costmap/map_type: costmap * /move_base/global_costmap/observation_sources: laser_scan_sensor * /move_base/global_costmap/obstacle_layer/combination_method: 1 * /move_base/global_costmap/obstacle_layer/enabled: True * /move_base/global_costmap/obstacle_layer/inflation_radius: 0.2 * /move_base/global_costmap/obstacle_layer/obstacle_range: 6.5 * /move_base/global_costmap/obstacle_layer/raytrace_range: 6.0 * /move_base/global_costmap/obstacle_layer/track_unknown_space: False * /move_base/global_costmap/plugins: [{'type': 'costma... * /move_base/global_costmap/publish_frequency: 5.0 * /move_base/global_costmap/robot_base_frame: base_footprint * /move_base/global_costmap/static_layer/enabled: True * /move_base/global_costmap/static_layer/map_topic: /map * /move_base/global_costmap/static_map: True * /move_base/global_costmap/transform_tolerance: 0.5 * /move_base/global_costmap/update_frequency: 5.0 * /move_base/local_costmap/cost_scaling_factor: 10 * /move_base/local_costmap/footprint: [[-0.18, -0.18], ... * /move_base/local_costmap/global_frame: map * /move_base/local_costmap/height: 3 * /move_base/local_costmap/inflation_layer/cost_scaling_factor: 10.0 * /move_base/local_costmap/inflation_layer/enabled: True * /move_base/local_costmap/inflation_layer/inflation_radius: 0.3 * /move_base/local_costmap/inflation_radius: 0.16 * /move_base/local_costmap/laser_scan_sensor/clearing: True * /move_base/local_costmap/laser_scan_sensor/data_type: LaserScan * /move_base/local_costmap/laser_scan_sensor/marking: True * /move_base/local_costmap/laser_scan_sensor/topic: scan * /move_base/local_costmap/map_type: costmap * /move_base/local_costmap/observation_sources: laser_scan_sensor * /move_base/local_costmap/obstacle_layer/combination_method: 1 * /move_base/local_costmap/obstacle_layer/enabled: True * /move_base/local_costmap/obstacle_layer/inflation_radius: 0.2 * /move_base/local_costmap/obstacle_layer/obstacle_range: 6.5 * /move_base/local_costmap/obstacle_layer/raytrace_range: 6.0 * /move_base/local_costmap/obstacle_layer/track_unknown_space: False * /move_base/local_costmap/plugins: [{'type': 'costma... * /move_base/local_costmap/publish_frequency: 5.0 * /move_base/local_costmap/resolution: 0.05 * /move_base/local_costmap/robot_base_frame: base_footprint * /move_base/local_costmap/rolling_window: True * /move_base/local_costmap/static_layer/enabled: True * /move_base/local_costmap/static_layer/map_topic: /map * /move_base/local_costmap/static_map: False * /move_base/local_costmap/transform_tolerance: 0.5 * /move_base/local_costmap/update_frequency: 5.0 * /move_base/local_costmap/width: 3 * /move_base/oscillation_distance: 0.2 * /move_base/oscillation_timeout: 10.0 * /move_base/planner_frequency: 1.0 * /move_base/planner_patience: 5.0 * /robot_description: <?xml version="1.... * /rosdistro: melodic * /rosversion: 1.14.13 * /time0: 5.0 * /time1: 15.0 * /time2: 2.0 * /time3: 10.0 * /time4: 2.0 * /time5: 5.0 * /usb_cam/camera_frame_id: usb_cam * /usb_cam/color_format: yuv422p * /usb_cam/image_height: 960 * /usb_cam/image_width: 1280 * /usb_cam/io_method: mmap * /usb_cam/pixel_format: yuyv * /usb_cam/video_device: /dev/video0 NODES / amcl (amcl/amcl) base_control (eprobot_start/art_racecar.py) base_to_camera (tf/static_transform_publisher) base_to_gyro (tf/static_transform_publisher) base_to_laser (tf/static_transform_publisher) base_to_link (tf/static_transform_publisher) ekf_se (robot_localization/ekf_localization_node) image_view (image_view/image_view) joint_state_publisher (joint_state_publisher/joint_state_publisher) laser_filter (laser_filters/scan_to_scan_filter_chain) lslidar_driver_node (lslidar_driver/lslidar_driver_node) map_server (map_server/map_server) move_base (move_base/move_base) one_car_start (eprobot_start/one_car_start.py) robot_state_publisher (robot_state_publisher/robot_state_publisher) usb_cam (usb_cam/usb_cam_node) auto-starting new master process[master]: started with pid [28540] ROS_MASTER_URI=http://EPRobot:11311 setting /run_id to 98e3a152-624a-11f0-a474-e45f0131f240 process[rosout-1]: started with pid [28569] started core service [/rosout] process[usb_cam-2]: started with pid [28577] [ INFO] [1752673306.541706342]: using default calibration URL [ INFO] [1752673306.544599750]: camera calibration URL: file:///home/EPRobot/.ros/camera_info/head_camera.yaml [ INFO] [1752673306.548678571]: Starting 'head_camera' (/dev/video0) at 1280x960 via mmap (yuyv) at 30 FPS [ WARN] [1752673306.947265581]: unknown control 'focus_auto' process[image_view-3]: started with pid [28591] [ INFO] [1752673307.509032663]: Initializing nodelet with 4 worker threads. [ INFO] [1752673307.861474363]: Using transport "raw" Unable to init server: Could not connect: Connection refused (image_raw:28591): Gtk-WARNING **: 21:41:47.890: cannot open display: process[base_to_link-4]: started with pid [28612] [image_view-3] process has died [pid 28591, exit code -7, cmd /opt/ros/melodic/lib/image_view/image_view image:=/usb_cam/image_raw __name:=image_view __log:=/home/EPRobot/.ros/log/98e3a152-624a-11f0-a474-e45f0131f240/image_view-3.log]. log file: /home/EPRobot/.ros/log/98e3a152-624a-11f0-a474-e45f0131f240/image_view-3*.log process[base_to_gyro-5]: started with pid [28629] process[base_to_laser-6]: started with pid [28635] process[base_to_camera-7]: started with pid [28657] process[joint_state_publisher-8]: started with pid [28680] process[robot_state_publisher-9]: started with pid [28686] /opt/ros/melodic/lib/python2.7/dist-packages/roslib/packages.py:470: UnicodeWarning: Unicode equal comparison failed to convert both arguments to Unicode - interpreting them as being unequal if resource_name in files: process[base_control-10]: started with pid [28694] ERROR: cannot launch node of type [lslidar_driver/lslidar_driver_node]: Cannot locate node of type [lslidar_driver_node] in package [lslidar_driver]. Make sure file exists in package path and permission is set to executable (chmod +x) ERROR: cannot launch node of type [laser_filters/scan_to_scan_filter_chain]: Cannot locate node of type [scan_to_scan_filter_chain] in package [laser_filters]. Make sure file exists in package path and permission is set to executable (chmod +x) ERROR: cannot launch node of type [map_server/map_server]: Cannot locate node of type [map_server] in package [map_server]. Make sure file exists in package path and permission is set to executable (chmod +x) ERROR: cannot launch node of type [amcl/amcl]: Cannot locate node of type [amcl] in package [amcl]. Make sure file exists in package path and permission is set to executable (chmod +x) ERROR: cannot launch node of type [move_base/move_base]: Cannot locate node of type [move_base] in package [move_base]. Make sure file exists in package path and permission is set to executable (chmod +x) ERROR: cannot launch node of type [robot_localization/ekf_localization_node]: Cannot locate node of type [ekf_localization_node] in package [robot_localization]. Make sure file exists in package path and permission is set to executable (chmod +x) ERROR: cannot launch node of type [eprobot_start/one_car_start.py]: Cannot locate node of type [one_car_start.py] in package [eprobot_start]. Make sure file exists in package path and permission is set to executable (chmod +x) [INFO] [1752673319.775691]: base control start... [INFO] [1752673319.816039]: LaserMode : Express [INFO] [1752673319.819294]: is_pub_odom_tf : false [INFO] [1752673319.822670]: is_send_anger : false [INFO] [1752673319.827339]: Opening Serial [INFO] [1752673319.831187]: Serial Open Succeed

Starting >>> mav_planning_msgs Finished <<< mav_planning_msgs [ 22.5 seconds ] Starting >>> rotors_control _______________________________________________________________________________ Warnings << rotors_control:cmake /home/ishtar/mbplanner_ws/logs/rotors_control/build.cmake.000.log CMake Warning at /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'Eigen3' but neither 'Eigen3_INCLUDE_DIRS' nor 'Eigen3_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/melodic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) CMakeLists.txt:17 (catkin_package) cd /home/ishtar/mbplanner_ws/build/rotors_control; catkin build --get-env rotors_control | catkin env -si /usr/bin/cmake /home/ishtar/mbplanner_ws/src/sim/rotors_simulator/rotors_control --no-warn-unused-cli -DCATKIN_DEVEL_PREFIX=/home/ishtar/mbplanner_ws/devel/.private/rotors_control -DCMAKE_INSTALL_PREFIX=/home/ishtar/mbplanner_ws/install -DCMAKE_BUILD_TYPE=Release; cd - ............................................................................... Finished <<< rotors_control [ 1 minute and 8.0 seconds ] Starting >>> rotors_joy_interface Finished <<< rotors_joy_interface [ 11.4 seconds ] Starting >>> mbplanner_ui Finished <<< mbplanner_ui [ 0.5 seconds ] Starting >>> planner_control_interface Finished <<< planner_control_interface [ 19.2 seconds ] Starting >>> glog_catkin Finished <<< glog_catkin [ 0.3 seconds ] Starting >>> rotors_gazebo_plugins _______________________________________________________________________________ Errors << rotors_gazebo_plugins:cmake /home/ishtar/mbplanner_ws/logs/rotors_gazebo_plugins/build.cmake.000.log CMake Error at /opt/ros/melodic/share/catkin/cmake/catkinConfig.cmake:83 (find_package): Could not find a package configuration file provided by "octomap_ros" with any of the following names: octomap_rosConfig.cmake octomap_ros-config.cmake Add the installation prefix of "octomap_ros" to CMAKE_PREFIX_PATH or set "octomap_ros_DIR" to a directory containing one of the above files. If "octomap_ros" provides a separate development package or SDK, be sure it has been installed. Call Stack (most recent call first): CMakeLists.txt:98 (find_package) cd /home/ishtar/mbplanner_ws/build/rotors_gazebo_plugins; catkin build --get-env rotors_gazebo_plugins | catkin env -si /usr/bin/cmake /home/ishtar/mbplanner_ws/src/sim/rotors_simulator/rotors_gazebo_plugins --no-warn-unused-cli -DCATKIN_DEVEL_PREFIX=/home/ishtar/mbplanner_ws/devel/.private/rotors_gazebo_plugins -DCMAKE_INSTALL_PREFIX=/home/ishtar/mbplanner_ws/install -DCMAKE_BUILD_TYPE=Release; cd - ............................................................................... Failed << rotors_gazebo_plugins:cmake [ Exited with code 1 ] Failed <<< rotors_gazebo_plugins [ 4.9 seconds ] Abandoned <<< pci_mav [ Unrelated job failed ] Abandoned <<< eigen_checks [ Unrelated job failed ] Abandoned <<< minkindr [ Unrelated job failed ] Abandoned <<< minkindr_conversions [ Unrelated job failed ] Abandoned <<< rotors_gazebo [ Unrelated job failed ] Abandoned <<< volumetric_map_base [ Unrelated job failed ] Abandoned <<< octomap_world [ Unrelated job failed ] Abandoned <<< voxblox [ Unrelated job failed ] Abandoned <<< voxblox_rviz_plugin [ Unrelated job failed ] Abandoned <<< voxblox_ros [ Unrelated job failed ] Abandoned <<< planner_common [ Unrelated job failed ] Abandoned <<< global_planner [ Unrelated job failed ] Abandoned <<< mbplanner [ Unrelated job failed ] [build - 03:35.9] [24/38 complete] [2/2 jobs] [0 queued] [1 failed] [yaml_cpp_catkin:make (48%) - 03:25.1] [build - 03:36.0] [24/38 complete] [2/2 jobs] [0 queued] [1 failed] [yaml_cpp_catkin:make (48%) - 03:25.2] [build - 03:36.1] [24/38 complete] [2/2 jobs] [0 queued] [1 failed] [yaml_cpp_catkin:make (48%) - 03:25.3] [build - 03:47.4] [build - 03:47.5] [24/38 complete] [[build[build - 03:47.7] [build[build - 03:47.9] [24/38 compl[build - 03:48.0] [24/38 complete] [2/2 jobs] [0[build - 03:48.2] [build[build[build - 03:[build[build[build[build[build[build[build[build - 03:[build - 04:16.9] [24/38 complete] [2/2 jobs] [0 queued] [1 failed] [yaml_cpp_[build - 04:20.1] [24/38 complete] [2/2 jobs]__________________________________________________________________________________________________________________________ Warnings << yaml_cpp_catkin:make /home/ishtar/mbplanner_ws/logs/yaml_cpp_catkin/build.make.001.log 正克隆到 'yaml_cpp_src'... 注意:正在检出 '11607eb5bf1258641d80f7051e7cf09e317b4746'。 您正处于分离头指针状态。您可以查看、做试验性的修改及提交,并且您可以通过另外 的检出分支操作丢弃在这个状态下所做的任何提交。 如果您想要通过创建分支来保留在此状态下所做的提交,您可以通过在检出命令添加 参数 -b 来实现(现在或稍后)。例如: git checkout -b <新分支名> HEAD 目前位于 11607eb fix some warnings in public headers (#486) CMake Deprecation Warning at CMakeLists.txt:9 (cmake_policy): The OLD behavior for policy CMP0012 will be removed from a future version of CMake. The cmake-policies(7) manual explains that the OLD behaviors of all policies are deprecated and that a policy should be set to OLD only under specific short-term circumstances. Projects should be ported to the NEW behavior and not rely on setting a policy to OLD. CMake Deprecation Warning at CMakeLists.txt:13 (cmake_policy): The OLD behavior for policy CMP0015 will be removed from a future version of CMake. The cmake-policies(7) manual explains that the OLD behaviors of all policies are deprecated and that a policy should be set to OLD only under specific short-term circumstances. Projects should be ported to the NEW behavior and not rely on setting a policy to OLD. In file included from /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/integration/handler_test.cpp:2:0: /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:839:13: warning: ‘{anonymous}::ex8_22’ defined but not used [-Wunused-variable] const char *ex8_22 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:831:13: warning: ‘{anonymous}::ex8_21’ defined but not used [-Wunused-variable] const char *ex8_21 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:823:13: warning: ‘{anonymous}::ex8_20’ defined but not used [-Wunused-variable] const char *ex8_20 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:818:13: warning: ‘{anonymous}::ex8_19’ defined but not used [-Wunused-variable] const char *ex8_19 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:812:13: warning: ‘{anonymous}::ex8_18’ defined but not used [-Wunused-variable] const char *ex8_18 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:805:13: warning: ‘{anonymous}::ex8_17’ defined but not used [-Wunused-variable] const char *ex8_17 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:801:13: warning: ‘{anonymous}::ex8_16’ defined but not used [-Wunused-variable] const char *ex8_16 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:793:13: warning: ‘{anonymous}::ex8_15’ defined but not used [-Wunused-variable] const char *ex8_15 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:788:13: warning: ‘{anonymous}::ex8_14’ defined but not used [-Wunused-variable] const char *ex8_14 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:760:13: warning: ‘{anonymous}::ex8_9’ defined but not used [-Wunused-variable] const char *ex8_9 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:749:13: warning: ‘{anonymous}::ex8_8’ defined but not used [-Wunused-variable] const char *ex8_8 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:743:13: warning: ‘{anonymous}::ex8_7’ defined but not used [-Wunused-variable] const char *ex8_7 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:735:13: warning: ‘{anonymous}::ex8_6’ defined but not used [-Wunused-variable] const char *ex8_6 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:714:13: warning: ‘{anonymous}::ex8_5’ defined but not used [-Wunused-variable] const char *ex8_5 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:706:13: warning: ‘{anonymous}::ex8_4’ defined but not used [-Wunused-variable] const char *ex8_4 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:702:13: warning: ‘{anonymous}::ex8_3c’ defined but not used [-Wunused-variable] const char *ex8_3c = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:697:13: warning: ‘{anonymous}::ex8_3b’ defined but not used [-Wunused-variable] const char *ex8_3b = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:692:13: warning: ‘{anonymous}::ex8_3a’ defined but not used [-Wunused-variable] const char *ex8_3a = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:679:13: warning: ‘{anonymous}::ex8_2’ defined but not used [-Wunused-variable] const char *ex8_2 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:668:13: warning: ‘{anonymous}::ex8_1’ defined but not used [-Wunused-variable] const char *ex8_1 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:661:13: warning: ‘{anonymous}::ex7_24’ defined but not used [-Wunused-variable] const char *ex7_24 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:654:13: warning: ‘{anonymous}::ex7_23’ defined but not used [-Wunused-variable] const char *ex7_23 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:649:13: warning: ‘{anonymous}::ex7_22’ defined but not used [-Wunused-variable] const char *ex7_22 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:644:13: warning: ‘{anonymous}::ex7_21’ defined but not used [-Wunused-variable] const char *ex7_21 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:638:13: warning: ‘{anonymous}::ex7_20’ defined but not used [-Wunused-variable] const char *ex7_20 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:633:13: warning: ‘{anonymous}::ex7_19’ defined but not used [-Wunused-variable] const char *ex7_19 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:626:13: warning: ‘{anonymous}::ex7_18’ defined but not used [-Wunused-variable] const char *ex7_18 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:618:13: warning: ‘{anonymous}::ex7_17’ defined but not used [-Wunused-variable] const char *ex7_17 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:611:13: warning: ‘{anonymous}::ex7_16’ defined but not used [-Wunused-variable] const char *ex7_16 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:607:13: warning: ‘{anonymous}::ex7_15’ defined but not used [-Wunused-variable] const char *ex7_15 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:597:13: warning: ‘{anonymous}::ex7_14’ defined but not used [-Wunused-variable] const char *ex7_14 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:593:13: warning: ‘{anonymous}::ex7_13’ defined but not used [-Wunused-variable] const char *ex7_13 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:587:13: warning: ‘{anonymous}::ex7_12’ defined but not used [-Wunused-variable] const char *ex7_12 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:582:13: warning: ‘{anonymous}::ex7_11’ defined but not used [-Wunused-variable] const char *ex7_11 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:568:13: warning: ‘{anonymous}::ex7_10’ defined but not used [-Wunused-variable] const char *ex7_10 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:562:13: warning: ‘{anonymous}::ex7_9’ defined but not used [-Wunused-variable] const char *ex7_9 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:557:13: warning: ‘{anonymous}::ex7_8’ defined but not used [-Wunused-variable] const char *ex7_8 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:555:13: warning: ‘{anonymous}::ex7_7’ defined but not used [-Wunused-variable] const char *ex7_7 = " 'here''s to \"quotes\"'"; ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:549:13: warning: ‘{anonymous}::ex7_6’ defined but not used [-Wunused-variable] const char *ex7_6 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:542:13: warning: ‘{anonymous}::ex7_5’ defined but not used [-Wunused-variable] const char *ex7_5 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:537:13: warning: ‘{anonymous}::ex7_4’ defined but not used [-Wunused-variable] const char *ex7_4 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:531:13: warning: ‘{anonymous}::ex7_3’ defined but not used [-Wunused-variable] const char *ex7_3 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:525:13: warning: ‘{anonymous}::ex7_2’ defined but not used [-Wunused-variable] const char *ex7_2 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:519:13: warning: ‘{anonymous}::ex7_1’ defined but not used [-Wunused-variable] const char *ex7_1 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:515:13: warning: ‘{anonymous}::ex6_29’ defined but not used [-Wunused-variable] const char *ex6_29 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:509:13: warning: ‘{anonymous}::ex6_28’ defined but not used [-Wunused-variable] const char *ex6_28 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:504:13: warning: ‘{anonymous}::ex6_27b’ defined but not used [-Wunused-variable] const char *ex6_27b = ^~~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:499:13: warning: ‘{anonymous}::ex6_27a’ defined but not used [-Wunused-variable] const char *ex6_27a = ^~~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:492:13: warning: ‘{anonymous}::ex6_26’ defined but not used [-Wunused-variable] const char *ex6_26 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:488:13: warning: ‘{anonymous}::ex6_25’ defined but not used [-Wunused-variable] const char *ex6_25 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:484:13: warning: ‘{anonymous}::ex6_24’ defined but not used [-Wunused-variable] const char *ex6_24 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:479:13: warning: ‘{anonymous}::ex6_23’ defined but not used [-Wunused-variable] const char *ex6_23 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:474:13: warning: ‘{anonymous}::ex6_22’ defined but not used [-Wunused-variable] const char *ex6_22 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:465:13: warning: ‘{anonymous}::ex6_21’ defined but not used [-Wunused-variable] const char *ex6_21 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:460:13: warning: ‘{anonymous}::ex6_20’ defined but not used [-Wunused-variable] const char *ex6_20 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:455:13: warning: ‘{anonymous}::ex6_19’ defined but not used [-Wunused-variable] const char *ex6_19 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:446:13: warning: ‘{anonymous}::ex6_18’ defined but not used [-Wunused-variable] const char *ex6_18 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:441:13: warning: ‘{anonymous}::ex6_17’ defined but not used [-Wunused-variable] const char *ex6_17 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:436:13: warning: ‘{anonymous}::ex6_16’ defined but not used [-Wunused-variable] const char *ex6_16 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:431:13: warning: ‘{anonymous}::ex6_15’ defined but not used [-Wunused-variable] const char *ex6_15 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:425:13: warning: ‘{anonymous}::ex6_14’ defined but not used [-Wunused-variable] const char *ex6_14 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:420:13: warning: ‘{anonymous}::ex6_13’ defined but not used [-Wunused-variable] const char *ex6_13 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:412:13: warning: ‘{anonymous}::ex6_12’ defined but not used [-Wunused-variable] const char *ex6_12 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:406:13: warning: ‘{anonymous}::ex6_11’ defined but not used [-Wunused-variable] const char *ex6_11 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:401:13: warning: ‘{anonymous}::ex6_10’ defined but not used [-Wunused-variable] const char *ex6_10 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:397:13: warning: ‘{anonymous}::ex6_9’ defined but not used [-Wunused-variable] const char *ex6_9 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:388:13: warning: ‘{anonymous}::ex6_8’ defined but not used [-Wunused-variable] const char *ex6_8 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:380:13: warning: ‘{anonymous}::ex6_7’ defined but not used [-Wunused-variable] const char *ex6_7 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:371:13: warning: ‘{anonymous}::ex6_6’ defined but not used [-Wunused-variable] const char *ex6_6 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:362:13: warning: ‘{anonymous}::ex6_5’ defined but not used [-Wunused-variable] const char *ex6_5 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:353:13: warning: ‘{anonymous}::ex6_4’ defined but not used [-Wunused-variable] const char *ex6_4 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:348:13: warning: ‘{anonymous}::ex6_3’ defined but not used [-Wunused-variable] const char *ex6_3 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:342:13: warning: ‘{anonymous}::ex6_2’ defined but not used [-Wunused-variable] const char *ex6_2 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:328:13: warning: ‘{anonymous}::ex6_1’ defined but not used [-Wunused-variable] const char *ex6_1 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:323:13: warning: ‘{anonymous}::ex5_14’ defined but not used [-Wunused-variable] const char *ex5_14 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:316:13: warning: ‘{anonymous}::ex5_13’ defined but not used [-Wunused-variable] const char *ex5_13 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:308:13: warning: ‘{anonymous}::ex5_12’ defined but not used [-Wunused-variable] const char *ex5_12 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:303:13: warning: ‘{anonymous}::ex5_11’ defined but not used [-Wunused-variable] const char *ex5_11 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:296:13: warning: ‘{anonymous}::ex5_8’ defined but not used [-Wunused-variable] const char *ex5_8 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:288:13: warning: ‘{anonymous}::ex5_7’ defined but not used [-Wunused-variable] const char *ex5_7 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:284:13: warning: ‘{anonymous}::ex5_6’ defined but not used [-Wunused-variable] const char *ex5_6 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:282:13: warning: ‘{anonymous}::ex5_5’ defined but not used [-Wunused-variable] const char *ex5_5 = "# Comment only."; ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:278:13: warning: ‘{anonymous}::ex5_4’ defined but not used [-Wunused-variable] const char *ex5_4 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:269:13: warning: ‘{anonymous}::ex5_3’ defined but not used [-Wunused-variable] const char *ex5_3 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:239:13: warning: ‘{anonymous}::ex2_28’ defined but not used [-Wunused-variable] const char *ex2_28 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:208:13: warning: ‘{anonymous}::ex2_27’ defined but not used [-Wunused-variable] const char *ex2_27 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:199:13: warning: ‘{anonymous}::ex2_26’ defined but not used [-Wunused-variable] const char *ex2_26 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:190:13: warning: ‘{anonymous}::ex2_25’ defined but not used [-Wunused-variable] const char *ex2_25 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:174:13: warning: ‘{anonymous}::ex2_24’ defined but not used [-Wunused-variable] const char *ex2_24 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:159:13: warning: ‘{anonymous}::ex2_23’ defined but not used [-Wunused-variable] const char *ex2_23 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:149:13: warning: ‘{anonymous}::ex2_18’ defined but not used [-Wunused-variable] const char *ex2_18 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:140:13: warning: ‘{anonymous}::ex2_17’ defined but not used [-Wunused-variable] const char *ex2_17 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:131:13: warning: ‘{anonymous}::ex2_16’ defined but not used [-Wunused-variable] const char *ex2_16 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:121:13: warning: ‘{anonymous}::ex2_15’ defined but not used [-Wunused-variable] const char *ex2_15 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:115:13: warning: ‘{anonymous}::ex2_14’ defined but not used [-Wunused-variable] const char *ex2_14 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:109:13: warning: ‘{anonymous}::ex2_13’ defined but not used [-Wunused-variable] const char *ex2_13 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:99:13: warning: ‘{anonymous}::ex2_12’ defined but not used [-Wunused-variable] const char *ex2_12 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:88:13: warning: ‘{anonymous}::ex2_11’ defined but not used [-Wunused-variable] const char *ex2_11 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:78:13: warning: ‘{anonymous}::ex2_10’ defined but not used [-Wunused-variable] const char *ex2_10 = ^~~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:68:13: warning: ‘{anonymous}::ex2_9’ defined but not used [-Wunused-variable] const char *ex2_9 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:56:13: warning: ‘{anonymous}::ex2_8’ defined but not used [-Wunused-variable] const char *ex2_8 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:44:13: warning: ‘{anonymous}::ex2_7’ defined but not used [-Wunused-variable] const char *ex2_7 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:37:13: warning: ‘{anonymous}::ex2_6’ defined but not used [-Wunused-variable] const char *ex2_6 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:32:13: warning: ‘{anonymous}::ex2_5’ defined but not used [-Wunused-variable] const char *ex2_5 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:22:13: warning: ‘{anonymous}::ex2_4’ defined but not used [-Wunused-variable] const char *ex2_4 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:12:13: warning: ‘{anonymous}::ex2_3’ defined but not used [-Wunused-variable] const char *ex2_3 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:7:13: warning: ‘{anonymous}::ex2_2’ defined but not used [-Wunused-variable] const char *ex2_2 = ^~~~~ /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin/yaml_cpp_src-prefix/src/yaml_cpp_src/test/specexamples.h:2:13: warning: ‘{anonymous}::ex2_1’ defined but not used [-Wunused-variable] const char *ex2_1 = ^~~~~ cc1plus: warning: unrecognized command line option ‘-Wno-c99-extensions’ cd /home/ishtar/mbplanner_ws/build/yaml_cpp_catkin; catkin build --get-env yaml_cpp_catkin | catkin env -si /usr/bin/make --jobserver-fds=6,7 -j; cd - .......................................................................................................................... Finished <<< yaml_cpp_catkin [ 4 minutes and 48.2 seconds ] [build] Summary: 24 of 38 packages succeeded. [build] Ignored: 4 packages were skipped or are blacklisted. [build] Warnings: 2 packages succeeded with warnings. [build] Abandoned: 13 packages were abandoned. [build] Failed: 1 packages failed. [build] Runtime: 4 minutes and 59.0 seconds total. [build] Note: Workspace packages have changed, please re-source setup files to use them. ishtar@ubuntu:~/mbplanner_ws$ 分析原因

我希望在ununtu22.04上安装ros1,但是失败了,以下是我的尝试过程,请给我在此基础上能成功安装ros1的一步步教程(base) casbot@casbot:~$ sudo sed -i 's|https://raw.githubusercontent.com/ros/rosdistro/master|https://mirrors.tuna.tsinghua.edu.cn/rosdistro|g' /etc/ros/rosdep/sources.list.d/20-default.list sed: can't read /etc/ros/rosdep/sources.list.d/20-default.list: No such file or directory (base) casbot@casbot:~$ sudo rosdep init Wrote /etc/ros/rosdep/sources.list.d/20-default.list Recommended: please run rosdep update (base) casbot@casbot:~$ ^C (base) casbot@casbot:~$ rosdep update reading in sources list data from /etc/ros/rosdep/sources.list.d Hit https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/osx-homebrew.yaml Hit https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/base.yaml Hit https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/python.yaml Hit https://raw.githubusercontent.com/ros/rosdistro/master/rosdep/ruby.yaml Hit https://raw.githubusercontent.com/ros/rosdistro/master/releases/fuerte.yaml Query rosdistro index https://raw.githubusercontent.com/ros/rosdistro/master/index-v4.yaml Skip end-of-life distro "ardent" Skip end-of-life distro "bouncy" Skip end-of-life distro "crystal" Skip end-of-life distro "dashing" Skip end-of-life distro "eloquent" Skip end-of-life distro "foxy" Skip end-of-life distro "galactic" Skip end-of-life distro "groovy" Add distro "humble" Skip end-of-life distro "hydro" Skip end-of-life distro "indigo" Skip end-of-life distro "iron" Skip end-of-life distro "jade" Add distro "jazzy" Add distro "kilted" Skip end-of-life distro "kinetic" Skip end-of-life distro "lunar" Skip end-of-life distro "melodic" Skip end-of-life distro "noetic" Add distro "rolling" updated cache in /home/casbot/.ros/rosdep/sources.cache (base) casbot@casbot:~$ cd ~/ros_catkin_ws (base) casbot@casbot:~/ros_catkin_ws$ rosinstall_generator desktop_full --rosdistro noetic --deps \ --exclude roslisp \ --local index-v4.yaml \ > noetic-desktop.rosinstall usage: rosinstall_generator [-h] [--debug] [--verbose] --rosdistro ROSDISTRO [--from-path [FROM_PATH ...]] [--repos [reponame ...]] [--upstream | --upstream-development] [--deps | --deps-up-to [DEPS_UP_TO ...]] [--deps-depth N] [--deps-only] [--wet-only | --dry-only | --catkin-only | --non-catkin-only] [--exclude [EXCLUDE ...]] [--exclude-path [EXCLUDE_PATH ...]] [--flat] [--tar] [--format {rosinstall,repos}] [pkgname ...] rosinstall_generator: error: unrecognized arguments: --local index-v4.yaml (base) casbot@casbot:~/ros_catkin_ws$ rosinstall_generator desktop_full --rosdistro noetic --deps > noetic-desktop.rosinstall Traceback (most recent call last): File "/usr/lib/python3/dist-packages/rosdistro/loader.py", line 43, in load_url fh = urlopen(url, timeout=timeout) File "/usr/lib/python3.10/urllib/request.py", line 216, in urlopen return opener.open(url, data, timeout) File "/usr/lib/python3.10/urllib/request.py", line 519, in open response = self._open(req, data) File "/usr/lib/python3.10/urllib/request.py", line 536, in _open result = self._call_chain(self.handle_open, protocol, protocol + File "/usr/lib/python3.10/urllib/request.py", line 496, in _call_chain result = func(*args) File "/usr/lib/python3.10/urllib/request.py", line 1391, in https_open return self.do_open(http.client.HTTPSConnection, req, File "/usr/lib/python3.10/urllib/request.py", line 1352, in do_open r = h.getresponse() File "/usr/lib/python3.10/http/client.py", line 1375, in getresponse response.begin() File "/usr/lib/python3.10/http/client.py", line 318, in begin version, status, reason = self._read_status() File "/usr/lib/python3.10/http/client.py", line 279, in _read_status line = str(self.fp.readline(_MAXLINE + 1), "iso-8859-1") File "/usr/lib/python3.10/socket.py", line 705, in readinto return self._sock.recv_into(b) File "/usr/lib/python3.10/ssl.py", line 1303, in recv_into return self.read(nbytes, buffer) File "/usr/lib/python3.10/ssl.py", line 1159, in read return self._sslobj.read(len, buffer) TimeoutError: The read operation timed out During handling of the above exception, another exception occurred: Traceback (most recent call last): File "/usr/bin/rosinstall_generator", line 33, in <module> sys.exit(load_entry_point('rosinstall-generator==0.1.23', 'console_scripts', 'rosinstall_generator')()) File "/usr/lib/python3/dist-packages/rosinstall_generator/cli.py", line 155, in main rosinstall_data = generate_rosinstall(args.rosdistro, args.package_names, File "/usr/lib/python3/dist-packages/rosinstall_generator/generator.py", line 267, in generate_rosinstall wet_package_names, unreleased_repo_names = _get_packages_for_repos(distro_name, repo_names, source=upstream_source_version) File "/usr/lib/python3/dist-packages/rosinstall_generator/generator.py", line 93, in _get_packages_for_repos wet_distro = get_wet_distro(distro_name) File "/usr/lib/python3/dist-packages/rosinstall_generator/generator.py", line 224, in get_wet_distro _wet_distro = _get_wet_distro(distro_name) File "/usr/lib/python3/dist-packages/rosinstall_generator/distro.py", line 45, in get_distro index = get_index(get_index_url()) File "/usr/lib/python3/dist-packages/rosdistro/__init__.py", line 102, in get_index yaml_str = load_url(url) File "/usr/lib/python3/dist-packages/rosdistro/loader.py", line 56, in load_url raise socket.timeout(str(e) + ' (%s)' % url) TimeoutError: The read operation timed out (https://raw.githubusercontent.com/ros/rosdistro/master/index-v4.yaml) (base) casbot@casbot:~/ros_catkin_ws$ wget https://ghproxy.com/https://raw.githubusercontent.com/ros/rosdistro/master/index-v4.yaml --2025-07-22 15:09:11-- https://ghproxy.com/https://raw.githubusercontent.com/ros/rosdistro/master/index-v4.yaml Resolving ghproxy.com (ghproxy.com)... 144.24.81.189 Connecting to ghproxy.com (ghproxy.com)|144.24.81.189|:443... connected. Unable to establish SSL connection. (base) casbot@casbot:~/ros_catkin_ws$ rosinstall_generator desktop_full --rosdistro noetic --deps \ --exclude roslisp \ --local index-v4.yaml \ > noetic-desktop.rosinstall usage: rosinstall_generator [-h] [--debug] [--verbose] --rosdistro ROSDISTRO [--from-path [FROM_PATH ...]] [--repos [reponame ...]] [--upstream | --upstream-development] [--deps | --deps-up-to [DEPS_UP_TO ...]] [--deps-depth N] [--deps-only] [--wet-only | --dry-only | --catkin-only | --non-catkin-only] [--exclude [EXCLUDE ...]] [--exclude-path [EXCLUDE_PATH ...]] [--flat] [--tar] [--format {rosinstall,repos}] [pkgname ...] rosinstall_generator: error: unrecognized arguments: --local index-v4.yaml (base) casbot@casbot:~/ros_catkin_ws$ ^C (base) casbot@casbot:~/ros_catkin_ws$

/home/ubuntu/work_space/catkin_navigation/src/planner/plan_manage/src/display.cpp: In function ‘void NextGoalCallback(const String&)’: /home/ubuntu/work_space/catkin_navigation/src/planner/plan_manage/src/display.cpp:16:9: error: ‘IsNearby’ was not declared in this scope 16 | if (IsNearby(curr_pose, init_pose)) { | ^~~~~~~~ /home/ubuntu/work_space/catkin_navigation/src/planner/plan_manage/src/display.cpp: In function ‘bool IsNearby(geometry_msgs::PoseStamped, geometry_msgs::PoseStamped)’: /home/ubuntu/work_space/catkin_navigation/src/planner/plan_manage/src/display.cpp:40:113: error: no matching function for call to ‘sqrt(geometry_msgs::Point_<std::allocator<void> >::_x_type, geometry_msgs::Point_<std::allocator<void> >::_y_type)’ 40 | return sqrt(pose_a.pose.position.x - pose_b.pose.position.x, pose_a.pose.position.y - pose_b.pose.position.y) < 1 ? : true : false; | ^ In file included from /usr/include/features.h:461, from /usr/include/x86_64-linux-gnu/c++/9/bits/os_defines.h:39, from /usr/include/x86_64-linux-gnu/c++/9/bits/c++config.h:528, from /usr/include/c++/9/iostream:38, from /home/ubuntu/work_space/catkin_navigation/src/planner/plan_manage/src/display.cpp:1: /usr/include/x86_64-linux-gnu/bits/mathcalls.h:143:1: note: candidate: ‘double sqrt(double)’ 143 | __MATHCALL (sqrt,, (_Mdouble_ __x)); | ^~~~~~~~~~ /usr/include/x86_64-linux-gnu/bits/mathcalls.h:143:1: note: candidate expects 1 argument, 2 provided In file included from /opt/ros/noetic/include/ros/time.h:55, from /opt/ros/noetic/include/ros/ros.h:38, from /home/ubuntu/work_space/catkin_navigation/src/planner/plan_manage/src/display.cpp:2: /usr/include/c++/9/cmath:475:5: note: candidate: ‘template<class _Tp> constexpr typename __gnu_cxx::__enable_if<

配置工作空间环境 Bash # 初始化工作空间(如果未完成) cd ~/primitive_ws catkin_init_workspace # 生成顶层CMakeLists.txt # 编译工作空间 catkin_make 运行catkin_make输出vae@vae-ASUS-TUF-Gaming-A15-FA507UU-FA507UU:~/primitive_ws$ catkin_make Base path: /home/vae/primitive_ws Source space: /home/vae/primitive_ws/src Build space: /home/vae/primitive_ws/build Devel space: /home/vae/primitive_ws/devel Install space: /home/vae/primitive_ws/install #### #### Running command: "cmake /home/vae/primitive_ws/src -DCATKIN_DEVEL_PREFIX=/home/vae/primitive_ws/devel -DCMAKE_INSTALL_PREFIX=/home/vae/primitive_ws/install -G Unix Makefiles" in "/home/vae/primitive_ws/build" #### -- Using CATKIN_DEVEL_PREFIX: /home/vae/primitive_ws/devel -- Using CMAKE_PREFIX_PATH: /opt/ros/noetic -- This workspace overlays: /opt/ros/noetic -- Found PythonInterp: /usr/bin/python3 (found suitable version "3.8.10", minimum required is "3") -- Using PYTHON_EXECUTABLE: /usr/bin/python3 -- Using Debian Python package layout -- Using empy: /usr/lib/python3/dist-packages/em.py -- Using CATKIN_ENABLE_TESTING: ON -- Call enable_testing() -- Using CATKIN_TEST_RESULTS_DIR: /home/vae/primitive_ws/build/test_results -- Forcing gtest/gmock from source, though one was otherwise available. -- Found gtest sources under '/usr/src/googletest': gtests will be built -- Found gmock sources under '/usr/src/googletest': gmock will be built -- Found PythonInterp: /usr/bin/python3 (found version "3.8.10") -- Using Python nosetests: /usr/bin/nosetests3 -- catkin 0.8.12 -- BUILD_SHARED_LIBS is on -- BUILD_SHARED_LIBS is on -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- ~~ traversing 19 packages in topological order: -- ~~ - quadrotor_msgs -- ~~ - map_generator -- ~~ - poscmd_2_odom -- ~~ - pose_utils -- ~~ - map_server -- ~~ - manual_take_over -- ~~ - odom_visualization -- ~~ - local_sensing_node -- ~~ - mockamap -- ~~ - so3_control -- ~~ - traj_utils -- ~~ - primitive_planner -- ~~ - swarm_bridge -- ~~ - uav_utils -- ~~ - assign_goals -- ~~ - random_goals -- ~~ - so3_quadrotor_simulator -- ~~ - rviz_plugins -- ~~ - selected_points_publisher -- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ -- +++ processing catkin package: 'quadrotor_msgs' -- ==> add_subdirectory(Primitive-Planner/src/Utils/quadrotor_msgs) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- quadrotor_msgs: 14 messages, 0 services -- +++ processing catkin package: 'map_generator' -- ==> add_subdirectory(Primitive-Planner/src/uav_simulator/map_generator) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- Found PCL: pcl_common;pcl_kdtree;pcl_octree;pcl_search;pcl_sample_consensus;pcl_filters;pcl_io;pcl_features;pcl_ml;pcl_segmentation;pcl_visualization;pcl_surface;pcl_registration;pcl_keypoints;pcl_tracking;pcl_recognition;pcl_stereo;pcl_apps;pcl_outofcore;pcl_people;/usr/lib/x86_64-linux-gnu/libboost_system.so;/usr/lib/x86_64-linux-gnu/libboost_filesystem.so;/usr/lib/x86_64-linux-gnu/libboost_date_time.so;/usr/lib/x86_64-linux-gnu/libboost_iostreams.so;/usr/lib/x86_64-linux-gnu/libboost_regex.so;optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so;/usr/lib/libOpenNI.so;/usr/lib/libOpenNI2.so;vtkChartsCore;vtkCommonColor;vtkCommonCore;vtksys;vtkCommonDataModel;vtkCommonMath;vtkCommonMisc;vtkCommonSystem;vtkCommonTransforms;vtkCommonExecutionModel;vtkFiltersGeneral;vtkCommonComputationalGeometry;vtkFiltersCore;vtkInfovisCore;vtkFiltersExtraction;vtkFiltersStatistics;vtkImagingFourier;vtkImagingCore;vtkalglib;vtkRenderingContext2D;vtkRenderingCore;vtkFiltersGeometry;vtkFiltersSources;vtkRenderingFreeType;/usr/lib/x86_64-linux-gnu/libfreetype.so;/usr/lib/x86_64-linux-gnu/libz.so;vtkFiltersModeling;vtkImagingSources;vtkInteractionStyle;vtkInteractionWidgets;vtkFiltersHybrid;vtkImagingColor;vtkImagingGeneral;vtkImagingHybrid;vtkIOImage;vtkDICOMParser;vtkmetaio;/usr/lib/x86_64-linux-gnu/libjpeg.so;/usr/lib/x86_64-linux-gnu/libpng.so;/usr/lib/x86_64-linux-gnu/libtiff.so;vtkRenderingAnnotation;vtkRenderingVolume;vtkIOXML;vtkIOCore;vtkIOXMLParser;/usr/lib/x86_64-linux-gnu/libexpat.so;vtkIOGeometry;vtkIOLegacy;vtkIOPLY;vtkRenderingLOD;vtkViewsContext2D;vtkViewsCore;vtkRenderingContextOpenGL2;vtkRenderingOpenGL2;FLANN::FLANN -- +++ processing catkin package: 'poscmd_2_odom' -- ==> add_subdirectory(Primitive-Planner/src/uav_simulator/fake_drone) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'pose_utils' -- ==> add_subdirectory(Primitive-Planner/src/Utils/pose_utils) -- +++ processing catkin package: 'map_server' -- ==> add_subdirectory(map_server) CMake Error at /opt/ros/noetic/share/catkin/cmake/catkin_workspace.cmake:121 (add_subdirectory): The source directory /home/vae/primitive_ws/src/map_server does not contain a CMakeLists.txt file. Call Stack (most recent call first): CMakeLists.txt:69 (catkin_workspace) -- +++ processing catkin package: 'manual_take_over' -- ==> add_subdirectory(Primitive-Planner/src/Utils/manual_take_over) -- +++ processing catkin package: 'odom_visualization' -- ==> add_subdirectory(Primitive-Planner/src/Utils/odom_visualization) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'local_sensing_node' -- ==> add_subdirectory(Primitive-Planner/src/uav_simulator/local_sensing) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'Eigen' but neither 'Eigen_INCLUDE_DIRS' nor 'Eigen_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Primitive-Planner/src/uav_simulator/local_sensing/CMakeLists.txt:72 (catkin_package) -- +++ processing catkin package: 'mockamap' -- ==> add_subdirectory(Primitive-Planner/src/uav_simulator/mockamap) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'so3_control' -- ==> add_subdirectory(Primitive-Planner/src/uav_simulator/so3_control) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'traj_utils' -- ==> add_subdirectory(Primitive-Planner/src/planner/traj_utils) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- traj_utils: 2 messages, 0 services -- +++ processing catkin package: 'primitive_planner' -- ==> add_subdirectory(Primitive-Planner/src/planner/plan_manage) -- Eigen found (include: /usr/include/eigen3, version: 3.3.7) -- The imported target "vtkParseOGLExt" references the file "/usr/bin/vtkParseOGLExt-7.1" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtkRenderingPythonTkWidgets" references the file "/usr/lib/x86_64-linux-gnu/libvtkRenderingPythonTkWidgets.so" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "vtk" references the file "/usr/bin/vtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- The imported target "pvtk" references the file "/usr/bin/pvtk" but this file does not exist. Possible reasons include: * The file was deleted, renamed, or moved to another location. * An install or uninstall procedure did not complete successfully. * The installation package was faulty and contained "/usr/lib/cmake/vtk-7.1/VTKTargets.cmake" but not all the files it references. -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) ** WARNING ** io features related to pcap will be disabled ** WARNING ** io features related to png will be disabled ** WARNING ** io features related to libusb-1.0 will be disabled -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- OpenNI2 found (include: /usr/include/openni2, lib: /usr/lib/libOpenNI2.so) -- QHULL found (include: /usr/include, lib: optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so) -- OpenNI found (include: /usr/include/ni, lib: /usr/lib/libOpenNI.so) -- looking for PCL_COMMON -- looking for PCL_KDTREE -- looking for PCL_OCTREE -- looking for PCL_SEARCH -- looking for PCL_SAMPLE_CONSENSUS -- looking for PCL_FILTERS -- looking for PCL_2D -- looking for PCL_GEOMETRY -- looking for PCL_IO -- looking for PCL_FEATURES -- looking for PCL_ML -- looking for PCL_SEGMENTATION -- looking for PCL_VISUALIZATION -- looking for PCL_SURFACE -- looking for PCL_REGISTRATION -- looking for PCL_KEYPOINTS -- looking for PCL_TRACKING -- looking for PCL_RECOGNITION -- looking for PCL_STEREO -- looking for PCL_APPS -- looking for PCL_IN_HAND_SCANNER -- looking for PCL_POINT_CLOUD_EDITOR -- looking for PCL_OUTOFCORE -- looking for PCL_PEOPLE -- Found PCL: pcl_common;pcl_kdtree;pcl_octree;pcl_search;pcl_sample_consensus;pcl_filters;pcl_io;pcl_features;pcl_ml;pcl_segmentation;pcl_visualization;pcl_surface;pcl_registration;pcl_keypoints;pcl_tracking;pcl_recognition;pcl_stereo;pcl_apps;pcl_outofcore;pcl_people;/usr/lib/x86_64-linux-gnu/libboost_system.so;/usr/lib/x86_64-linux-gnu/libboost_filesystem.so;/usr/lib/x86_64-linux-gnu/libboost_date_time.so;/usr/lib/x86_64-linux-gnu/libboost_iostreams.so;/usr/lib/x86_64-linux-gnu/libboost_regex.so;optimized;/usr/lib/x86_64-linux-gnu/libqhull.so;debug;/usr/lib/x86_64-linux-gnu/libqhull.so;/usr/lib/libOpenNI.so;/usr/lib/libOpenNI2.so;vtkChartsCore;vtkCommonColor;vtkCommonCore;vtksys;vtkCommonDataModel;vtkCommonMath;vtkCommonMisc;vtkCommonSystem;vtkCommonTransforms;vtkCommonExecutionModel;vtkFiltersGeneral;vtkCommonComputationalGeometry;vtkFiltersCore;vtkInfovisCore;vtkFiltersExtraction;vtkFiltersStatistics;vtkImagingFourier;vtkImagingCore;vtkalglib;vtkRenderingContext2D;vtkRenderingCore;vtkFiltersGeometry;vtkFiltersSources;vtkRenderingFreeType;/usr/lib/x86_64-linux-gnu/libfreetype.so;/usr/lib/x86_64-linux-gnu/libz.so;vtkFiltersModeling;vtkImagingSources;vtkInteractionStyle;vtkInteractionWidgets;vtkFiltersHybrid;vtkImagingColor;vtkImagingGeneral;vtkImagingHybrid;vtkIOImage;vtkDICOMParser;vtkmetaio;/usr/lib/x86_64-linux-gnu/libjpeg.so;/usr/lib/x86_64-linux-gnu/libpng.so;/usr/lib/x86_64-linux-gnu/libtiff.so;vtkRenderingAnnotation;vtkRenderingVolume;vtkIOXML;vtkIOCore;vtkIOXMLParser;/usr/lib/x86_64-linux-gnu/libexpat.so;vtkIOGeometry;vtkIOLegacy;vtkIOPLY;vtkRenderingLOD;vtkViewsContext2D;vtkViewsCore;vtkRenderingContextOpenGL2;vtkRenderingOpenGL2;FLANN::FLANN (Required is at least version "1.7") -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- +++ processing catkin package: 'swarm_bridge' -- ==> add_subdirectory(Primitive-Planner/src/planner/swarm_bridge) -- +++ processing catkin package: 'uav_utils' -- ==> add_subdirectory(Primitive-Planner/src/Utils/uav_utils) -- +++ processing catkin package: 'assign_goals' -- ==> add_subdirectory(Primitive-Planner/src/Utils/assign_goals) -- +++ processing catkin package: 'random_goals' -- ==> add_subdirectory(Primitive-Planner/src/Utils/random_goals) -- +++ processing catkin package: 'so3_quadrotor_simulator' -- ==> add_subdirectory(Primitive-Planner/src/uav_simulator/so3_quadrotor_simulator) CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'Eigen3' but neither 'Eigen3_INCLUDE_DIRS' nor 'Eigen3_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Primitive-Planner/src/uav_simulator/so3_quadrotor_simulator/CMakeLists.txt:29 (catkin_package) CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'system_lib' but neither 'system_lib_INCLUDE_DIRS' nor 'system_lib_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Primitive-Planner/src/uav_simulator/so3_quadrotor_simulator/CMakeLists.txt:29 (catkin_package) -- +++ processing catkin package: 'rviz_plugins' -- ==> add_subdirectory(Primitive-Planner/src/Utils/rviz_plugins) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy CMake Warning at /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:166 (message): catkin_package() DEPENDS on 'system_lib' but neither 'system_lib_INCLUDE_DIRS' nor 'system_lib_LIBRARIES' is defined. Call Stack (most recent call first): /opt/ros/noetic/share/catkin/cmake/catkin_package.cmake:102 (_catkin_package) Primitive-Planner/src/Utils/rviz_plugins/CMakeLists.txt:12 (catkin_package) -- Using Qt5 based on the rviz_QT_VERSION: 5.12.8 -- +++ processing catkin package: 'selected_points_publisher' -- ==> add_subdirectory(Primitive-Planner/src/Utils/selected_points_publisher) -- Using these message generators: gencpp;geneus;genlisp;gennodejs;genpy -- Configuring incomplete, errors occurred! See also "/home/vae/primitive_ws/build/CMakeFiles/CMakeOutput.log". See also "/home/vae/primitive_ws/build/CMakeFiles/CMakeError.log". Invoking "cmake" failed

最新推荐

recommend-type

langchain4j-anthropic-spring-boot-starter-0.31.0.jar中文文档.zip

1、压缩文件中包含: 中文文档、jar包下载地址、Maven依赖、Gradle依赖、源代码下载地址。 2、使用方法: 解压最外层zip,再解压其中的zip包,双击 【index.html】 文件,即可用浏览器打开、进行查看。 3、特殊说明: (1)本文档为人性化翻译,精心制作,请放心使用; (2)只翻译了该翻译的内容,如:注释、说明、描述、用法讲解 等; (3)不该翻译的内容保持原样,如:类名、方法名、包名、类型、关键字、代码 等。 4、温馨提示: (1)为了防止解压后路径太长导致浏览器无法打开,推荐在解压时选择“解压到当前文件夹”(放心,自带文件夹,文件不会散落一地); (2)有时,一套Java组件会有多个jar,所以在下载前,请仔细阅读本篇描述,以确保这就是你需要的文件。 5、本文件关键字: jar中文文档.zip,java,jar包,Maven,第三方jar包,组件,开源组件,第三方组件,Gradle,中文API文档,手册,开发手册,使用手册,参考手册。
recommend-type

TMS320F28335电机控制程序详解:BLDC、PMSM无感有感及异步VF源代码与开发资料

TMS320F28335这款高性能数字信号处理器(DSP)在电机控制领域的应用,涵盖了BLDC(无刷直流电机)、PMSM(永磁同步电机)的无感有感控制以及异步VF(变频调速)程序。文章不仅解释了各类型的电机控制原理,还提供了完整的开发资料,包括源代码、原理图和说明文档,帮助读者深入了解其工作原理和编程技巧。 适合人群:从事电机控制系统开发的技术人员,尤其是对TMS320F28335感兴趣的工程师。 使用场景及目标:适用于需要掌握TMS320F28335在不同电机控制应用场景下具体实现方法的专业人士,旨在提高他们对该微控制器的理解和实际操作能力。 其他说明:文中提供的开发资料为读者提供了从硬件到软件的全面支持,有助于加速项目开发进程并提升系统性能。
recommend-type

基于爬山搜索法的风力发电MPPT控制Simulink仿真:定步长与变步长算法性能对比 - 爬山搜索法 最新版

基于爬山搜索法的风力发电最大功率点追踪(MPPT)控制的Simulink仿真模型,重点比较了定步长和变步长算法在不同风速条件下的表现。文中展示了两种算法的具体实现方法及其优缺点。定步长算法虽然结构简单、计算量小,但在风速突变时响应较慢,存在明显的稳态振荡。相比之下,变步长算法能够根据功率变化动态调整步长,表现出更快的响应速度和更高的精度,尤其在风速突变时优势明显。实验数据显示,变步长算法在风速从8m/s突增至10m/s的情况下,仅用0.3秒即可稳定,功率波动范围仅为±15W,而定步长算法则需要0.8秒,功率波动达到±35W。 适合人群:从事风力发电研究的技术人员、对MPPT控制感兴趣的工程技术人员以及相关专业的高校师生。 使用场景及目标:适用于风力发电系统的设计与优化,特别是需要提高系统响应速度和精度的场合。目标是在不同风速条件下,选择合适的MPPT算法以最大化风能利用率。 其他说明:文章还讨论了定步长算法在风速平稳情况下的优势,提出了根据不同应用场景灵活选择或组合使用这两种算法的建议。
recommend-type

Visual C++.NET编程技术实战指南

根据提供的文件信息,可以生成以下知识点: ### Visual C++.NET编程技术体验 #### 第2章 定制窗口 - **设置窗口风格**:介绍了如何通过编程自定义窗口的外观和行为。包括改变窗口的标题栏、边框样式、大小和位置等。这通常涉及到Windows API中的`SetWindowLong`和`SetClassLong`函数。 - **创建六边形窗口**:展示了如何创建一个具有特殊形状边界的窗口,这类窗口不遵循标准的矩形形状。它需要使用`SetWindowRgn`函数设置窗口的区域。 - **创建异形窗口**:扩展了定制窗口的内容,提供了创建非标准形状窗口的方法。这可能需要创建一个不规则的窗口区域,并将其应用到窗口上。 #### 第3章 菜单和控制条高级应用 - **菜单编程**:讲解了如何创建和修改菜单项,处理用户与菜单的交互事件,以及动态地添加或删除菜单项。 - **工具栏编程**:阐述了如何使用工具栏,包括如何创建工具栏按钮、分配事件处理函数,并实现工具栏按钮的响应逻辑。 - **状态栏编程**:介绍了状态栏的创建、添加不同类型的指示器(如文本、进度条等)以及状态信息的显示更新。 - **为工具栏添加皮肤**:展示了如何为工具栏提供更加丰富的视觉效果,通常涉及到第三方的控件库或是自定义的绘图代码。 #### 第5章 系统编程 - **操作注册表**:解释了Windows注册表的结构和如何通过程序对其进行读写操作,这对于配置软件和管理软件设置非常关键。 - **系统托盘编程**:讲解了如何在系统托盘区域创建图标,并实现最小化到托盘、从托盘恢复窗口的功能。 - **鼠标钩子程序**:介绍了钩子(Hook)技术,特别是鼠标钩子,如何拦截和处理系统中的鼠标事件。 - **文件分割器**:提供了如何将文件分割成多个部分,并且能够重新组合文件的技术示例。 #### 第6章 多文档/多视图编程 - **单文档多视**:展示了如何在同一个文档中创建多个视图,这在文档编辑软件中非常常见。 #### 第7章 对话框高级应用 - **实现无模式对话框**:介绍了无模式对话框的概念及其应用场景,以及如何实现和管理无模式对话框。 - **使用模式属性表及向导属性表**:讲解了属性表的创建和使用方法,以及如何通过向导性质的对话框引导用户完成多步骤的任务。 - **鼠标敏感文字**:提供了如何实现点击文字触发特定事件的功能,这在阅读器和编辑器应用中很有用。 #### 第8章 GDI+图形编程 - **图像浏览器**:通过图像浏览器示例,展示了GDI+在图像处理和展示中的应用,包括图像的加载、显示以及基本的图像操作。 #### 第9章 多线程编程 - **使用全局变量通信**:介绍了在多线程环境下使用全局变量进行线程间通信的方法和注意事项。 - **使用Windows消息通信**:讲解了通过消息队列在不同线程间传递信息的技术,包括发送消息和处理消息。 - **使用CriticalSection对象**:阐述了如何使用临界区(CriticalSection)对象防止多个线程同时访问同一资源。 - **使用Mutex对象**:介绍了互斥锁(Mutex)的使用,用以同步线程对共享资源的访问,保证资源的安全。 - **使用Semaphore对象**:解释了信号量(Semaphore)对象的使用,它允许一个资源由指定数量的线程同时访问。 #### 第10章 DLL编程 - **创建和使用Win32 DLL**:介绍了如何创建和链接Win32动态链接库(DLL),以及如何在其他程序中使用这些DLL。 - **创建和使用MFC DLL**:详细说明了如何创建和使用基于MFC的动态链接库,适用于需要使用MFC类库的场景。 #### 第11章 ATL编程 - **简单的非属性化ATL项目**:讲解了ATL(Active Template Library)的基础使用方法,创建一个不使用属性化组件的简单项目。 - **使用ATL开发COM组件**:详细阐述了使用ATL开发COM组件的步骤,包括创建接口、实现类以及注册组件。 #### 第12章 STL编程 - **list编程**:介绍了STL(标准模板库)中的list容器的使用,讲解了如何使用list实现复杂数据结构的管理。 #### 第13章 网络编程 - **网上聊天应用程序**:提供了实现基本聊天功能的示例代码,包括客户端和服务器的通信逻辑。 - **简单的网页浏览器**:演示了如何创建一个简单的Web浏览器程序,涉及到网络通信和HTML解析。 - **ISAPI服务器扩展编程**:介绍了如何开发ISAPI(Internet Server API)服务器扩展来扩展IIS(Internet Information Services)的功能。 #### 第14章 数据库编程 - **ODBC数据库编程**:解释了ODBC(开放数据库互联)的概念,并提供了使用ODBC API进行数据库访问的示例。 - **ADO编程**:介绍了ADO(ActiveX Data Objects)技术,讲解了如何使用ADO进行数据库的增删改查等操作。 #### 第15章 HTML帮助系统编程 - **创建HTML帮助文件**:讲解了如何创建HTML帮助文件(.chm),这是微软帮助系统的一种形式。 - **区分上下文帮助**:提供了在应用程序中实现上下文敏感帮助的技术示例。 #### 第16章 安装和部署项目 - **用安装程序向导创建安装项目**:介绍了如何使用Visual Studio中的安装和部署项目向导,快速创建安装程序。 - **部署应用程序**:阐述了部署应用程序到目标系统的过程,以及如何确保应用程序的正确安装和运行。 以上内容涵盖了Visual C++.NET编程技术体验一书中涉及的各个技术点,并对每个章节中的示例做了详细的说明。这些知识点对于理解和掌握Visual C++.NET编程非常重要,并能够帮助读者在实际项目开发中应用这些技术。
recommend-type

HarmonyOS内核深度探秘:优化自由行旅游系统的策略

# 1. HarmonyOS内核概述与旅游系统需求分析 ## 1.1 HarmonyOS内核概述 HarmonyOS(鸿蒙操作系统)是由华为开发的一个分布式操作系统,旨在提供跨多种设备的无缝体验。其内核设计理念强调高效、安全和模块化,以微内核架构和分布式能力
recommend-type

tkinter模块所有控件

<think>好的,我现在需要回答用户关于Tkinter模块中所有控件列表的问题。首先,我需要回忆Tkinter的基础知识,确保自己了解各个控件的名称和用途。用户希望得到所有支持的控件列表,所以必须全面覆盖,不能遗漏。 首先,我应该从Tkinter的标准控件开始。常见的控件包括Label、Button、Entry这些基础部件。然后是Frame,用于布局,还有Canvas用于绘图。接下来是Checkbutton、Radiobutton,这些属于选择类控件。Listbox和Scrollbar通常一起使用,处理滚动内容。还有Scale(滑块)、Spinbox、Menu、Menubutton这些可能
recommend-type

局域网五子棋游戏:娱乐与聊天的完美结合

标题“网络五子棋”和描述“适合于局域网之间娱乐和聊天!”以及标签“五子棋 网络”所涉及的知识点主要围绕着五子棋游戏的网络版本及其在局域网中的应用。以下是详细的知识点: 1. 五子棋游戏概述: 五子棋是一种两人对弈的纯策略型棋类游戏,又称为连珠、五子连线等。游戏的目标是在一个15x15的棋盘上,通过先后放置黑白棋子,使得任意一方先形成连续五个同色棋子的一方获胜。五子棋的规则简单,但策略丰富,适合各年龄段的玩家。 2. 网络五子棋的意义: 网络五子棋是指可以在互联网或局域网中连接进行对弈的五子棋游戏版本。通过网络版本,玩家不必在同一地点即可进行游戏,突破了空间限制,满足了现代人们快节奏生活的需求,同时也为玩家们提供了与不同对手切磋交流的机会。 3. 局域网通信原理: 局域网(Local Area Network,LAN)是一种覆盖较小范围如家庭、学校、实验室或单一建筑内的计算机网络。它通过有线或无线的方式连接网络内的设备,允许用户共享资源如打印机和文件,以及进行游戏和通信。局域网内的计算机之间可以通过网络协议进行通信。 4. 网络五子棋的工作方式: 在局域网中玩五子棋,通常需要一个客户端程序(如五子棋.exe)和一个服务器程序。客户端负责显示游戏界面、接受用户输入、发送落子请求给服务器,而服务器负责维护游戏状态、处理玩家的游戏逻辑和落子请求。当一方玩家落子时,客户端将该信息发送到服务器,服务器确认无误后将更新后的棋盘状态传回给所有客户端,更新显示。 5. 五子棋.exe程序: 五子棋.exe是一个可执行程序,它使得用户可以在个人计算机上安装并运行五子棋游戏。该程序可能包含了游戏的图形界面、人工智能算法(如果支持单机对战AI的话)、网络通信模块以及游戏规则的实现。 6. put.wav文件: put.wav是一个声音文件,很可能用于在游戏进行时提供声音反馈,比如落子声。在网络环境中,声音文件可能被用于提升玩家的游戏体验,尤其是在局域网多人游戏场景中。当玩家落子时,系统会播放.wav文件中的声音,为游戏增添互动性和趣味性。 7. 网络五子棋的技术要求: 为了确保多人在线游戏的顺利进行,网络五子棋需要具备一些基本的技术要求,包括但不限于稳定的网络连接、高效的数据传输协议(如TCP/IP)、以及安全的数据加密措施(如果需要的话)。此外,还需要有一个良好的用户界面设计来提供直观和舒适的用户体验。 8. 社交与娱乐: 网络五子棋除了是一个娱乐游戏外,它还具有社交功能。玩家可以通过游戏内的聊天系统进行交流,分享经验和策略,甚至通过网络寻找新的朋友。这使得网络五子棋不仅是一个个人娱乐工具,同时也是一种社交活动。 总结来说,网络五子棋结合了五子棋游戏的传统魅力和现代网络技术,使得不同地区的玩家能够在局域网内进行娱乐和聊天,既丰富了人们的娱乐生活,又加强了人际交流。而实现这一切的基础在于客户端程序的设计、服务器端的稳定运行、局域网的高效通信,以及音效文件增强的游戏体验。
recommend-type

自由行旅游新篇章:HarmonyOS技术融合与系统架构深度解析

# 1. HarmonyOS技术概述 ## 1.1 HarmonyOS的起源与发展 HarmonyOS(鸿蒙操作系统)由华为公司开发,旨在构建全场景分布式OS,以应对不同设备间的互联问题。自从2019年首次发布以来,HarmonyOS迅速成长,并迅速应用于智能手机、平板、智能穿戴、车载设备等多种平台。该系
recommend-type

足底支撑相到达73%是什么问题

<think>好的,我现在要处理用户的问题:“足底支撑相达到73%可能的原因及影响”。首先,需要理解用户提到的“足底支撑相73%”具体指什么。足底支撑相通常指步态周期中脚与地面接触的时间占比,正常范围大约在60%-62%左右。如果达到73%,明显超出正常范围,可能意味着步态异常。 接下来,需要确定可能的原因。可能的原因包括生物力学异常,比如足弓异常(扁平足或高弓足)、踝关节活动度受限,或者肌肉力量不足,特别是小腿和足部肌肉。另外,神经系统疾病如脑卒中或帕金森病可能影响步态控制。骨骼关节问题如关节炎、髋膝关节病变也可能导致支撑时间延长。还有代偿性步态,比如因疼痛或受伤而改变步态模式。 然后是
recommend-type

宾馆预约系统开发与优化建议

宾馆预约系统是一个典型的在线服务应用,它允许用户通过互联网平台预定宾馆房间。这种系统通常包含多个模块,比如用户界面、房态管理、预订处理、支付处理和客户评价等。从技术层面来看,构建一个宾馆预约系统涉及到众多的IT知识和技术细节,下面将详细说明。 ### 标题知识点 - 宾馆预约系统 #### 1. 系统架构设计 宾馆预约系统作为一个完整的应用,首先需要进行系统架构设计,决定其采用的软件架构模式,如B/S架构或C/S架构。此外,系统设计还需要考虑扩展性、可用性、安全性和维护性。一般会采用三层架构,包括表示层、业务逻辑层和数据访问层。 #### 2. 前端开发 前端开发主要负责用户界面的设计与实现,包括用户注册、登录、房间搜索、预订流程、支付确认、用户反馈等功能的页面展示和交互设计。常用的前端技术栈有HTML, CSS, JavaScript, 以及各种前端框架如React, Vue.js或Angular。 #### 3. 后端开发 后端开发主要负责处理业务逻辑,包括用户管理、房间状态管理、订单处理等。后端技术包括但不限于Java (使用Spring Boot框架), Python (使用Django或Flask框架), PHP (使用Laravel框架)等。 #### 4. 数据库设计 数据库设计对系统的性能和可扩展性至关重要。宾馆预约系统可能需要设计的数据库表包括用户信息表、房间信息表、预订记录表、支付信息表等。常用的数据库系统有MySQL, PostgreSQL, MongoDB等。 #### 5. 网络安全 网络安全是宾馆预约系统的重要考虑因素,包括数据加密、用户认证授权、防止SQL注入、XSS攻击、CSRF攻击等。系统需要实现安全的认证机制,比如OAuth或JWT。 #### 6. 云服务和服务器部署 现代的宾馆预约系统可能部署在云平台上,如AWS, Azure, 腾讯云或阿里云。在云平台上,系统可以按需分配资源,提高系统的稳定性和弹性。 #### 7. 付款接口集成 支付模块需要集成第三方支付接口,如支付宝、微信支付、PayPal等,需要处理支付请求、支付状态确认、退款等业务。 #### 8. 接口设计与微服务 系统可能采用RESTful API或GraphQL等接口设计方式,提供服务的微服务化,以支持不同设备和服务的接入。 ### 描述知识点 - 这是我个人自己做的 请大家帮忙修改哦 #### 个人项目经验与团队合作 描述中的这句话暗示了该宾馆预约系统可能是由一个个人开发者创建的。个人开发和团队合作在软件开发流程中有着显著的不同。个人开发者需要关注的方面包括项目管理、需求分析、代码质量保证、测试和部署等。而在团队合作中,每个成员会承担不同的职责,需要有效的沟通和协作。 #### 用户反馈与迭代 描述还暗示了该系统目前处于需要外部反馈和修改的阶段。这表明系统可能还处于开发或测试阶段,需要通过用户的实际使用反馈来不断迭代改进。 ### 标签知识点 - 200 #### 未提供信息 “200”这个标签可能指的是HTTP状态码中表示请求成功(OK)的200状态码。但是,由于没有提供更多的上下文信息,无法进一步分析其在本例中的具体含义。 ### 压缩包子文件的文件名称列表知识点 - 1111 #### 文件命名与管理 “1111”这个文件名称可能是一个版本号、日期标记或者是一个简单的标识符。文件命名应当遵循一定的规则,以确保文件的可追溯性和管理的便利性。在软件开发过程中,合理组织文件和版本控制(如使用Git)是必不可少的。 综上所述,宾馆预约系统的开发是一项复杂的工程,它涉及前后端的开发、数据库设计、系统安全、接口设计等多个方面。开发者在开发过程中需要不断学习和应用各类IT知识,以确保系统能够安全、高效、稳定地运行。而对于个人开发项目,如何合理利用有限资源、高效地管理和优化项目过程也是至关重要的。