This repository has been archived by the owner on Jul 26, 2022. It is now read-only.
forked from RoboStack/ros-noetic
-
Notifications
You must be signed in to change notification settings - Fork 0
/
vinca_win.yaml
109 lines (95 loc) · 2.35 KB
/
vinca_win.yaml
1
2
3
4
5
6
7
8
9
10
11
12
13
14
15
16
17
18
19
20
21
22
23
24
25
26
27
28
29
30
31
32
33
34
35
36
37
38
39
40
41
42
43
44
45
46
47
48
49
50
51
52
53
54
55
56
57
58
59
60
61
62
63
64
65
66
67
68
69
70
71
72
73
74
75
76
77
78
79
80
81
82
83
84
85
86
87
88
89
90
91
92
93
94
95
96
97
98
99
100
101
102
103
104
105
106
107
108
109
ros_distro: noetic
mutex_package: ros-distro-mutex 0.1 noetic
# mapping for package keys
conda_index:
- conda-forge.yaml
- packages-ignore.yaml
build_number: 6
# Ignore all dependencies of selected packages
skip_all_deps: false
# If full rebuild, the build number of the existing package has
# to match the selected build number for skipping
full_rebuild: false
packages_skip_by_deps:
# - rviz
# - diagnostic_updater
packages_remove_from_deps:
# see https://github.com/RoboStack/ros-noetic/issues/25
- image_view
- stage-ros
- stage
skip_existing:
- https://conda.anaconda.org/robostack/
packages_select_by_deps:
# - slam_toolbox # requires fixing https://github.com/RoboStack/ros-noetic/issues/3
# - image_view # GUI needs fixing
# - robot_localization
# - sparse_bundle_adjustment
# - grid_map # fails with pkg-config error
- velodyne_simulator
# - nmea_msgs
- nmea_navsat_driver
# - rosserial_server
- hardware_interface
##
# DONE Win
##
# - moveit
# - mavros
# - navigation
# - cnpy
# - tf2_ros
# - desktop_full
# - perception
# - plotjuggler_ros
# - desktop
# - teb_local_planner
# - octomap
# - rqt_rviz
# - turtlebot3
# - rqt_gui_cpp
# - ros_control
# - rosbridge_suite
# - class_loader
# - ros_controllers
# - joy
# - velodyne_laserscan
# - velodyne_msgs
# - velodyne_pcl
# - imu_tools
# - rviz_visual_tools
# - libfranka # that builds okay but there is a linker error in the tests so they are disabled for now
# - franka_hw
# - franka_visualization
# - franka_msgs
# - franka_description
# - rqt_image_view
# - perception_pcl
# - gmapping
# - interactive_marker_twist_server
# - teleop_twist_joy
# - twist_mux
# - pointgrey_camera_description
# - hector_gazebo_plugins
# - lms1xx
##
# Not bother Win
##
# - urg_node
# - velodyne_driver # probably too tricky to build; see https://github.com/ros-drivers/velodyne/issues/356
# - velodyne_pointcloud # depends on velodyne_driver
##
# NOT RELEASED ON NOETIC...
##
# - franka_example_controllers
# - franka_ros
# - turtlebot3_fake
# - tf2_web_republisher
# - niryo_one_simulation
# - behavior_tree
##
# PROBLEMS:
##
# - rtabmap_ros # openni is missing, and need to find names for
# {'libfreenect-dev', 'libopenni-dev', 'tango-icon-theme', 'libvtk-qt'}
patch_dir: patch