ardupilot/Tools/ros2/ardupilot_dds_tests/package.xml
Rhys Mainwaring 21ea0d9794 Tools: ROS 2 update launch scripts and tests
Add launch module to ardupilot_sitl package
- Move body of launch scripts into package for reuse.
- Add utilities module.

Update launch scripts
- Provide type hints.
- Add arguments to sitl.launch.py.
- Fix formatting bug in sitl.launch.py home argument.

Update micro_ros_agent launch script
- Modify import for lauch_ros.actions.Node.
- Change argument order in node initialiser.
- Add args for UDP transport and set as default.

Update ROS 2 DDS default params
- Add default params for both serial and UDP transports.
- Add DDS_ENABLE.

Rename ROS 2 sitl_dds launch script
- Rename sitl_dds launch script with serial suffix.
- Add launch script for UDP transport.

Update ROS 2 launch test fixtures
- Make common test fixtures more granular.
- Add fixtures and tests for UDP transport.
- Update ROS 2 package.xml dependencies
- Use yield rather than return in test fixtures.
- Use ardupilot_sitl launch module directly.
- Correct return type descriptions.
- Fix flake8 failure.

Update ROS 2 README
- Update launch instructions.

Signed-off-by: Rhys Mainwaring <rhys.mainwaring@me.com>
2023-05-12 07:11:25 +10:00

34 lines
1.2 KiB
XML

<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>ardupilot_dds_tests</name>
<version>0.0.0</version>
<description>Tests for the ArduPilot AP_DDS library</description>
<maintainer email="rhys.mainwaring@me.com">rhys</maintainer>
<license>GLP-3.0</license>
<exec_depend>ament_index_python</exec_depend>
<exec_depend>ardupilot_sitl</exec_depend>
<exec_depend>launch</exec_depend>
<exec_depend>launch_pytest</exec_depend>
<exec_depend>launch_ros</exec_depend>
<exec_depend>micro_ros_msgs</exec_depend>
<exec_depend>python3-pytest</exec_depend>
<exec_depend>rclpy</exec_depend>
<test_depend>ament_copyright</test_depend>
<test_depend>ament_flake8</test_depend>
<test_depend>ament_pep257</test_depend>
<test_depend>ardupilot_sitl</test_depend>
<test_depend>launch</test_depend>
<test_depend>launch_pytest</test_depend>
<test_depend>launch_ros</test_depend>
<exec_depend>micro_ros_msgs</exec_depend>
<test_depend>python3-pytest</test_depend>
<test_depend>rclpy</test_depend>
<export>
<build_type>ament_python</build_type>
</export>
</package>