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_dds_tests/package.xml
Views: 1799
1
<?xml version="1.0"?>
2
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
3
<package format="3">
4
<name>ardupilot_dds_tests</name>
5
<version>0.0.0</version>
6
<description>Tests for the ArduPilot AP_DDS library</description>
7
<maintainer email="[email protected]">rhys</maintainer>
8
<license>GLP-3.0</license>
9
10
<exec_depend>ament_index_python</exec_depend>
11
<exec_depend>ardupilot_msgs</exec_depend>
12
<exec_depend>ardupilot_sitl</exec_depend>
13
<exec_depend>launch</exec_depend>
14
<exec_depend>launch_pytest</exec_depend>
15
<exec_depend>launch_ros</exec_depend>
16
<exec_depend>micro_ros_msgs</exec_depend>
17
<exec_depend>python3-geopy</exec_depend>
18
<exec_depend>python3-pytest</exec_depend>
19
<exec_depend>rclpy</exec_depend>
20
<exec_depend>socat</exec_depend>
21
22
<test_depend>ament_black</test_depend>
23
<test_depend>ament_copyright</test_depend>
24
<test_depend>ament_pep257</test_depend>
25
<test_depend>ament_uncrustify</test_depend>
26
<test_depend>ament_xmllint</test_depend>
27
<test_depend>ament_lint_auto</test_depend>
28
<test_depend>ardupilot_msgs</test_depend>
29
<test_depend>ardupilot_sitl</test_depend>
30
<exec_depend>builtin_interfaces</exec_depend>
31
<exec_depend>geographic_msgs</exec_depend>
32
<test_depend>launch</test_depend>
33
<test_depend>launch_pytest</test_depend>
34
<test_depend>micro_ros_agent</test_depend>
35
<test_depend>launch_ros</test_depend>
36
<exec_depend>micro_ros_msgs</exec_depend>
37
<test_depend>python3-pytest</test_depend>
38
<test_depend>rclpy</test_depend>
39
<test_depend>sensor_msgs</test_depend>
40
<test_depend>python3-scipy</test_depend>
41
42
<export>
43
<build_type>ament_python</build_type>
44
</export>
45
</package>
46
47