Skip to content

Commit

Permalink
Merge pull request #591 from mikaelarguedas/package_format2
Browse files Browse the repository at this point in the history
Convert to package format 2
  • Loading branch information
mikeferguson committed Aug 1, 2017
2 parents 7fddf66 + ac57a00 commit ab9312c
Show file tree
Hide file tree
Showing 17 changed files with 228 additions and 329 deletions.
24 changes: 10 additions & 14 deletions amcl/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>amcl</name>
<version>1.14.0</version>
<description>
Expand All @@ -22,21 +24,15 @@

<buildtool_depend>catkin</buildtool_depend>

<build_depend>rosbag</build_depend>
<build_depend>dynamic_reconfigure</build_depend>
<build_depend>message_filters</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>std_srvs</build_depend>
<build_depend>tf</build_depend>

<run_depend>rosbag</run_depend>
<run_depend>roscpp</run_depend>
<run_depend>dynamic_reconfigure</run_depend>
<run_depend>tf</run_depend>
<run_depend>nav_msgs</run_depend>
<run_depend>std_srvs</run_depend>
<depend>dynamic_reconfigure</depend>
<depend>nav_msgs</depend>
<depend>rosbag</depend>
<depend>roscpp</depend>
<depend>std_srvs</depend>
<depend>tf</depend>

<test_depend>rostest</test_depend>
<test_depend>map_server</test_depend>
<test_depend>rostest</test_depend>
</package>
59 changes: 24 additions & 35 deletions base_local_planner/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>base_local_planner</name>
<version>1.14.0</version>
<description>
Expand All @@ -17,43 +19,30 @@
<buildtool_depend version_gte="0.5.68">catkin</buildtool_depend>

<build_depend>cmake_modules</build_depend>
<build_depend>std_msgs</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>tf</build_depend>
<build_depend>rospy</build_depend>
<build_depend>pluginlib</build_depend>
<build_depend>costmap_2d</build_depend>
<build_depend>voxel_grid</build_depend>
<build_depend>angles</build_depend>
<build_depend>geometry_msgs</build_depend>
<build_depend>nav_core</build_depend>
<build_depend>pcl_conversions</build_depend>
<build_depend>pcl_ros</build_depend>
<build_depend>eigen</build_depend>
<build_depend>dynamic_reconfigure</build_depend>
<build_depend>message_generation</build_depend>
<build_depend>libpcl-all-dev</build_depend>
<build_depend>pcl_conversions</build_depend>

<run_depend>std_msgs</run_depend>
<run_depend>nav_msgs</run_depend>
<run_depend>roscpp</run_depend>
<run_depend>tf</run_depend>
<run_depend>rospy</run_depend>
<run_depend>pluginlib</run_depend>
<run_depend>costmap_2d</run_depend>
<run_depend>voxel_grid</run_depend>
<run_depend>angles</run_depend>
<run_depend>geometry_msgs</run_depend>
<run_depend>nav_core</run_depend>
<run_depend>pcl_ros</run_depend>
<run_depend>eigen</run_depend>
<run_depend>dynamic_reconfigure</run_depend>
<run_depend>libpcl-all-dev</run_depend>
<run_depend>message_runtime</run_depend>

<test_depend>rosunit</test_depend>
<depend>angles</depend>
<depend>costmap_2d</depend>
<depend>dynamic_reconfigure</depend>
<depend>eigen</depend>
<depend>geometry_msgs</depend>
<depend>libpcl-all-dev</depend>
<depend>nav_core</depend>
<depend>nav_msgs</depend>
<depend>pcl_ros</depend>
<depend>pluginlib</depend>
<depend>std_msgs</depend>
<depend>rosconsole</depend>
<depend>roscpp</depend>
<depend>rospy</depend>
<depend>tf</depend>
<depend>visualization_msgs</depend>
<depend>voxel_grid</depend>

<exec_depend>message_runtime</exec_depend>

<test_depend>rosunit</test_depend>
<export>
<nav_core plugin="${prefix}/blp_plugin.xml" />
</export>
Expand Down
30 changes: 11 additions & 19 deletions carrot_planner/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>carrot_planner</name>
<version>1.14.0</version>
<description>
Expand All @@ -16,28 +18,18 @@

<buildtool_depend>catkin</buildtool_depend>

<build_depend>roscpp</build_depend>
<build_depend>costmap_2d</build_depend>
<build_depend>pluginlib</build_depend>
<build_depend>nav_core</build_depend>
<build_depend>base_local_planner</build_depend>
<build_depend>tf</build_depend>
<!--<build_depend>angles</build_depend>-->
<build_depend>eigen</build_depend>

<run_depend>roscpp</run_depend>
<run_depend>costmap_2d</run_depend>
<run_depend>pluginlib</run_depend>
<run_depend>nav_core</run_depend>
<run_depend>base_local_planner</run_depend>
<run_depend>tf</run_depend>
<!--<run_depend>angles</run_depend>-->
<run_depend>eigen</run_depend>
<!--<depend>angles</depend>-->
<depend>base_local_planner</depend>
<depend>costmap_2d</depend>
<depend>eigen</depend>
<depend>nav_core</depend>
<depend>pluginlib</depend>
<depend>roscpp</depend>
<depend>tf</depend>

<export>
<nav_core plugin="${prefix}/bgp_plugin.xml" />
</export>

</package>


24 changes: 10 additions & 14 deletions clear_costmap_recovery/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>clear_costmap_recovery</name>
<version>1.14.0</version>
<description>
Expand All @@ -16,19 +18,13 @@
<buildtool_depend>catkin</buildtool_depend>

<build_depend>cmake_modules</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>tf</build_depend>
<build_depend>costmap_2d</build_depend>
<build_depend>nav_core</build_depend>
<build_depend>pluginlib</build_depend>
<build_depend>eigen</build_depend>

<run_depend>roscpp</run_depend>
<run_depend>tf</run_depend>
<run_depend>costmap_2d</run_depend>
<run_depend>nav_core</run_depend>
<run_depend>pluginlib</run_depend>
<run_depend>eigen</run_depend>

<depend>costmap_2d</depend>
<depend>eigen</depend>
<depend>nav_core</depend>
<depend>pluginlib</depend>
<depend>roscpp</depend>
<depend>tf</depend>

<test_depend>rostest</test_depend>

Expand Down
58 changes: 23 additions & 35 deletions costmap_2d/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>costmap_2d</name>
<version>1.14.0</version>
<description>
Expand All @@ -22,42 +24,28 @@
<buildtool_depend>catkin</buildtool_depend>

<build_depend>cmake_modules</build_depend>
<build_depend>dynamic_reconfigure</build_depend>
<build_depend>geometry_msgs</build_depend>
<build_depend>laser_geometry</build_depend>
<build_depend>libpcl-all-dev</build_depend>
<build_depend>map_msgs</build_depend>
<build_depend>message_filters</build_depend>
<build_depend>message_generation</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>pcl_conversions</build_depend>
<build_depend>pcl_ros</build_depend>
<build_depend>pluginlib</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>sensor_msgs</build_depend>
<build_depend>std_msgs</build_depend>
<build_depend>tf</build_depend>
<build_depend>visualization_msgs</build_depend>
<build_depend>voxel_grid</build_depend>

<run_depend>dynamic_reconfigure</run_depend>
<run_depend>geometry_msgs</run_depend>
<run_depend>laser_geometry</run_depend>
<run_depend>libpcl-all-dev</run_depend>
<run_depend>map_msgs</run_depend>
<run_depend>message_filters</run_depend>
<run_depend>message_runtime</run_depend>
<run_depend>nav_msgs</run_depend>
<run_depend>pcl_conversions</run_depend>
<run_depend>pcl_ros</run_depend>
<run_depend>pluginlib</run_depend>
<run_depend>rosconsole</run_depend>
<run_depend>roscpp</run_depend>
<run_depend>sensor_msgs</run_depend>
<run_depend>std_msgs</run_depend>
<run_depend>tf</run_depend>
<run_depend>visualization_msgs</run_depend>
<run_depend>voxel_grid</run_depend>
<depend>dynamic_reconfigure</depend>
<depend>geometry_msgs</depend>
<depend>laser_geometry</depend>
<depend>map_msgs</depend>
<depend>message_filters</depend>
<depend>nav_msgs</depend>
<depend>pcl_conversions</depend>
<depend>pcl_ros</depend>
<depend>pluginlib</depend>
<depend>libpcl-all-dev</depend>
<depend>roscpp</depend>
<depend>rostest</depend>
<depend>sensor_msgs</depend>
<depend>std_msgs</depend>
<depend>tf</depend>
<depend>visualization_msgs</depend>
<depend>voxel_grid</depend>

<exec_depend>message_runtime</exec_depend>
<exec_depend>rosconsole</exec_depend>

<test_depend>map_server</test_depend>
<test_depend>rosbag</test_depend>
Expand Down
36 changes: 14 additions & 22 deletions dwa_local_planner/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>dwa_local_planner</name>
<version>1.14.0</version>
<description>
Expand All @@ -22,29 +24,19 @@

<buildtool_depend>catkin</buildtool_depend>

<build_depend>base_local_planner</build_depend>
<build_depend>cmake_modules</build_depend>
<build_depend>costmap_2d</build_depend>
<build_depend>dynamic_reconfigure</build_depend>
<build_depend>eigen</build_depend>
<build_depend>libpcl-all-dev</build_depend>
<build_depend>nav_core</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>pluginlib</build_depend>
<build_depend>pcl_conversions</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>tf</build_depend>

<run_depend>base_local_planner</run_depend>
<run_depend>costmap_2d</run_depend>
<run_depend>dynamic_reconfigure</run_depend>
<run_depend>eigen</run_depend>
<run_depend>libpcl-all-dev</run_depend>
<run_depend>nav_core</run_depend>
<run_depend>nav_msgs</run_depend>
<run_depend>pluginlib</run_depend>
<run_depend>roscpp</run_depend>
<run_depend>tf</run_depend>

<depend>base_local_planner</depend>
<depend>costmap_2d</depend>
<depend>dynamic_reconfigure</depend>
<depend>eigen</depend>
<depend>libpcl-all-dev</depend>
<depend>nav_core</depend>
<depend>nav_msgs</depend>
<depend>pluginlib</depend>
<depend>roscpp</depend>
<depend>tf</depend>

<export>
<nav_core plugin="${prefix}/blp_plugin.xml" />
Expand Down
25 changes: 10 additions & 15 deletions fake_localization/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>fake_localization</name>
<version>1.14.0</version>
<description>A ROS node that simply forwards odometry information.</description>
Expand All @@ -12,20 +14,13 @@
<buildtool_depend>catkin</buildtool_depend>

<build_depend>angles</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>rosconsole</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>geometry_msgs</build_depend>
<build_depend>tf</build_depend>
<build_depend>message_filters</build_depend>
<build_depend>rospy</build_depend>

<run_depend>roscpp</run_depend>
<run_depend>rosconsole</run_depend>
<run_depend>nav_msgs</run_depend>
<run_depend>geometry_msgs</run_depend>
<run_depend>tf</run_depend>
<run_depend>message_filters</run_depend>
<run_depend>rospy</run_depend>
<depend>geometry_msgs</depend>
<depend>message_filters</depend>
<depend>nav_msgs</depend>
<depend>rosconsole</depend>
<depend>roscpp</depend>
<depend>rospy</depend>
<depend>tf</depend>

</package>
32 changes: 13 additions & 19 deletions global_planner/package.xml
Original file line number Diff line number Diff line change
@@ -1,4 +1,6 @@
<package>
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>global_planner</name>
<version>1.14.0</version>
<description>
Expand All @@ -14,25 +16,17 @@
<buildtool_depend>catkin</buildtool_depend>

<build_depend>angles</build_depend>
<build_depend>costmap_2d</build_depend>
<build_depend>dynamic_reconfigure</build_depend>
<build_depend>geometry_msgs</build_depend>
<build_depend>nav_core</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>navfn</build_depend>
<build_depend>pluginlib</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>tf</build_depend>

<run_depend>costmap_2d</run_depend>
<run_depend>dynamic_reconfigure</run_depend>
<run_depend>geometry_msgs</run_depend>
<run_depend>nav_core</run_depend>
<run_depend>nav_msgs</run_depend>
<run_depend>navfn</run_depend>
<run_depend>pluginlib</run_depend>
<run_depend>roscpp</run_depend>
<run_depend>tf</run_depend>
<depend>costmap_2d</depend>
<depend>dynamic_reconfigure</depend>
<depend>geometry_msgs</depend>
<depend>nav_core</depend>
<depend>nav_msgs</depend>
<depend>navfn</depend>
<depend>pluginlib</depend>
<depend>roscpp</depend>
<depend>tf</depend>

<export>
<nav_core plugin="${prefix}/bgp_plugin.xml" />
</export>
Expand Down

0 comments on commit ab9312c

Please sign in to comment.