CoCalc Logo Icon
StoreFeaturesDocsShareSupportNewsAboutSign UpSign In
Ardupilot

Real-time collaboration for Jupyter Notebooks, Linux Terminals, LaTeX, VS Code, R IDE, and more,
all in one place. Commercial Alternative to JupyterHub.

GitHub Repository: Ardupilot/ardupilot
Path: blob/master/Tools/ros2/ardupilot_sitl/package.xml
Views: 1799
1
<?xml version="1.0"?>
2
<?xml-model href="http://download.ros.org/schema/package_format3.xsd"
3
schematypens="http://www.w3.org/2001/XMLSchema"?>
4
<package format="3">
5
<name>ardupilot_sitl</name>
6
<version>0.0.0</version>
7
<description>ArduPlane, ArduCopter, ArduRover, ArduSub source</description>
8
<maintainer email="[email protected]">maintainer</maintainer>
9
<license>GPL-3.0</license>
10
11
<buildtool_depend>ament_cmake</buildtool_depend>
12
<buildtool_depend>ament_cmake_python</buildtool_depend>
13
14
<exec_depend>ardupilot_msgs</exec_depend>
15
<exec_depend>builtin_interfaces</exec_depend>
16
<exec_depend>geographic_msgs</exec_depend>
17
<exec_depend>geometry_msgs</exec_depend>
18
<exec_depend>micro_ros_agent</exec_depend>
19
<exec_depend>rosgraph_msgs</exec_depend>
20
<exec_depend>sensor_msgs</exec_depend>
21
<exec_depend>std_msgs</exec_depend>
22
<exec_depend>tf2_msgs</exec_depend>
23
24
<test_depend>ament_lint_auto</test_depend>
25
<test_depend>ament_cmake_black</test_depend>
26
<test_depend>ament_cmake_copyright</test_depend>
27
<test_depend>ament_cmake_lint_cmake</test_depend>
28
<test_depend>ament_cmake_pep257</test_depend>
29
<test_depend>ament_cmake_pytest</test_depend>
30
<test_depend>ament_cmake_uncrustify</test_depend>
31
<test_depend>ament_cmake_xmllint</test_depend>
32
33
<build_depend>ardupilot_msgs</build_depend>
34
35
<export>
36
<build_type>ament_cmake</build_type>
37
</export>
38
</package>
39
40