Skip to content

Commit

Permalink
Imported upstream version '2.1.1' of 'upstream'
Browse files Browse the repository at this point in the history
  • Loading branch information
JafarAbdi committed Sep 27, 2021
1 parent e39b88c commit 244affa
Show file tree
Hide file tree
Showing 4 changed files with 13 additions and 2 deletions.
2 changes: 1 addition & 1 deletion .github/workflows/industrial_ci_action.yml
Original file line number Diff line number Diff line change
Expand Up @@ -34,7 +34,7 @@ jobs:
steps:
- uses: actions/checkout@v2
- name: cache ccache
uses: pat-s/always-upload-cache@v2.1.3
uses: pat-s/always-upload-cache@v2.1.5
with:
path: ${{ env.CCACHE_DIR }}
key: ccache-${{ env.CACHE_PREFIX }}-${{ github.sha }}
Expand Down
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.1.1 (2021-09-27)
------------------
* Add jerk to JointLimits.msg (`#132 <https://github.com/ros-planning/moveit_msgs/issues/132>`_)
* Contributors: AndyZe

2.1.0 (2021-06-17)
------------------
* Sync with master branch up to `460caab <https://github.com/ros-planning/moveit_msgs/commit/460caab755cfe018ad07effd7dd808127a7e5c61>`_ (`#120 <https://github.com/ros-planning/moveit_msgs/issues/120>`_)
Expand Down
6 changes: 6 additions & 0 deletions msg/JointLimits.msg
Original file line number Diff line number Diff line change
Expand Up @@ -20,3 +20,9 @@ bool has_acceleration_limits
# max acceleration limit
float64 max_acceleration
# min_acceleration is assumed to be -max_acceleration

# true if joint has jerk limits
bool has_jerk_limits
# max jerk limit
float64 max_jerk
# min_jerk is assumed to be -max_jerk
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.1.0</version>
<version>2.1.1</version>
<description>Messages, services and actions used by MoveIt</description>
<author email="isucan@google.com">Ioan Sucan</author>
<author email="sachinc@sri.com">Sachin Chitta</author>
Expand Down

0 comments on commit 244affa

Please sign in to comment.