Skip to content

Commit

Permalink
Imported upstream version '2.6.0' of 'upstream'
Browse files Browse the repository at this point in the history
  • Loading branch information
rhaschke committed Sep 16, 2024
1 parent 4c53df7 commit 740e89b
Show file tree
Hide file tree
Showing 5 changed files with 16 additions and 1 deletion.
5 changes: 5 additions & 0 deletions CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,11 @@
Changelog for package moveit_msgs
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

2.6.0 (2024-09-16)
------------------
* Add services for `LoadGeometryFromFile` and `SaveGeometryToFile` services (`#181 <https://github.com/ros-planning/moveit_msgs/issues/181>`_)
* Contributors: Bilal Gill

2.5.0 (2024-06-07)
------------------
* Update CI jobs to run Jazzy, Iron
Expand Down
2 changes: 2 additions & 0 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -91,7 +91,9 @@ set(srv_files
"srv/GetPlannerParams.srv"
"srv/SetPlannerParams.srv"
"srv/UpdatePointcloudOctomap.srv"
"srv/SaveGeometryToFile.srv"
"srv/SaveMap.srv"
"srv/LoadGeometryFromFile.srv"
"srv/LoadMap.srv"
"srv/SaveRobotStateToWarehouse.srv"
"srv/ListRobotStatesInWarehouse.srv"
Expand Down
2 changes: 1 addition & 1 deletion package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package format="3">
<name>moveit_msgs</name>
<version>2.5.0</version>
<version>2.6.0</version>
<description>Messages, services and actions used by MoveIt</description>
<author email="[email protected]">Ioan Sucan</author>
<author email="[email protected]">Sachin Chitta</author>
Expand Down
4 changes: 4 additions & 0 deletions srv/LoadGeometryFromFile.srv
Original file line number Diff line number Diff line change
@@ -0,0 +1,4 @@
# This service loads CollisionObjects from a .scene file into a PlanningScene
string file_path_and_name
---
bool success
4 changes: 4 additions & 0 deletions srv/SaveGeometryToFile.srv
Original file line number Diff line number Diff line change
@@ -0,0 +1,4 @@
# This service saves the CollisionObjects present in a PlanningScene to a .scene file
string file_path_and_name
---
bool success

0 comments on commit 740e89b

Please sign in to comment.