Skip to content

Commit

Permalink
Add jerk-limited online smoothing plugin
Browse files Browse the repository at this point in the history
  • Loading branch information
AndyZe committed Jul 30, 2024
1 parent cd34e35 commit e22b679
Show file tree
Hide file tree
Showing 9 changed files with 265 additions and 20 deletions.
6 changes: 4 additions & 2 deletions moveit_core/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -92,6 +92,7 @@ install(
moveit_robot_model
moveit_robot_state
moveit_robot_trajectory
moveit_ruckig_filter
moveit_smoothing_base
moveit_test_utils
moveit_trajectory_processing
Expand Down Expand Up @@ -142,9 +143,10 @@ pluginlib_export_plugin_description_file(moveit_core
collision_detector_fcl_description.xml)
pluginlib_export_plugin_description_file(
moveit_core collision_detector_bullet_description.xml)
pluginlib_export_plugin_description_file(moveit_core
filter_plugin_butterworth.xml)
pluginlib_export_plugin_description_file(moveit_core
filter_plugin_acceleration.xml)
pluginlib_export_plugin_description_file(moveit_core
filter_plugin_butterworth.xml)
pluginlib_export_plugin_description_file(moveit_core filter_plugin_ruckig.xml)

ament_package(CONFIG_EXTRAS ConfigExtras.cmake)
8 changes: 8 additions & 0 deletions moveit_core/filter_plugin_ruckig.xml
Original file line number Diff line number Diff line change
@@ -0,0 +1,8 @@
<library path="moveit_acceleration_filter">
<class type="online_signal_smoothing::RuckigFilterPlugin"
base_class_type="online_signal_smoothing::SmoothingBaseClass">
<description>
Jerk/acceleration/velocity-limited command smoothing.
</description>
</class>
</library>
41 changes: 26 additions & 15 deletions moveit_core/online_signal_smoothing/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -13,17 +13,32 @@ set_target_properties(moveit_smoothing_base
ament_target_dependencies(moveit_smoothing_base rclcpp tf2_eigen)

# Plugin implementations
add_library(moveit_acceleration_filter SHARED src/acceleration_filter.cpp)
generate_export_header(moveit_acceleration_filter)
target_include_directories(
moveit_acceleration_filter
PUBLIC $<BUILD_INTERFACE:${CMAKE_CURRENT_BINARY_DIR}>)
set_target_properties(moveit_acceleration_filter
PROPERTIES VERSION "${${PROJECT_NAME}_VERSION}")
generate_parameter_library(moveit_acceleration_filter_parameters
src/acceleration_filter_parameters.yaml)
target_link_libraries(
moveit_acceleration_filter moveit_acceleration_filter_parameters
moveit_robot_state moveit_smoothing_base osqp::osqp)
ament_target_dependencies(
moveit_acceleration_filter srdfdom # include dependency from
# moveit_robot_model
pluginlib)

add_library(moveit_butterworth_filter SHARED src/butterworth_filter.cpp)
generate_export_header(moveit_butterworth_filter)
target_include_directories(
moveit_butterworth_filter
PUBLIC $<BUILD_INTERFACE:${CMAKE_CURRENT_BINARY_DIR}>)
set_target_properties(moveit_butterworth_filter
PROPERTIES VERSION "${${PROJECT_NAME}_VERSION}")

generate_parameter_library(moveit_butterworth_filter_parameters
src/butterworth_parameters.yaml)

target_link_libraries(
moveit_butterworth_filter moveit_butterworth_filter_parameters
moveit_robot_model moveit_smoothing_base)
Expand All @@ -32,23 +47,19 @@ ament_target_dependencies(
srdfdom # include dependency from moveit_robot_model
pluginlib)

add_library(moveit_acceleration_filter SHARED src/acceleration_filter.cpp)
generate_export_header(moveit_acceleration_filter)
add_library(moveit_ruckig_filter SHARED src/ruckig_filter.cpp)
generate_export_header(moveit_ruckig_filter)
target_include_directories(
moveit_acceleration_filter
PUBLIC $<BUILD_INTERFACE:${CMAKE_CURRENT_BINARY_DIR}>)
set_target_properties(moveit_acceleration_filter
moveit_ruckig_filter PUBLIC $<BUILD_INTERFACE:${CMAKE_CURRENT_BINARY_DIR}>)
set_target_properties(moveit_ruckig_filter
PROPERTIES VERSION "${${PROJECT_NAME}_VERSION}")

generate_parameter_library(moveit_acceleration_filter_parameters
src/acceleration_filter_parameters.yaml)

generate_parameter_library(moveit_ruckig_filter_parameters
src/ruckig_filter_parameters.yaml)
target_link_libraries(
moveit_acceleration_filter moveit_acceleration_filter_parameters
moveit_robot_state moveit_smoothing_base osqp::osqp)
moveit_ruckig_filter moveit_robot_state moveit_ruckig_filter_parameters
moveit_smoothing_base ruckig::ruckig)
ament_target_dependencies(
moveit_acceleration_filter srdfdom # include dependency from
# moveit_robot_model
moveit_ruckig_filter srdfdom # include dependency from moveit_robot_model
pluginlib)

# Installation
Expand Down
Original file line number Diff line number Diff line change
@@ -0,0 +1,101 @@
/*********************************************************************
* Software License Agreement (BSD License)
*
* Copyright (c) 2024, Andrew Zelenak
* All rights reserved.
*
* Redistribution and use in source and binary forms, with or without
* modification, are permitted provided that the following conditions
* are met:
*
* * Redistributions of source code must retain the above copyright
* notice, this list of conditions and the following disclaimer.
* * Redistributions in binary form must reproduce the above
* copyright notice, this list of conditions and the following
* disclaimer in the documentation and/or other materials provided
* with the distribution.
* * Neither the name of PickNik Inc. nor the names of its
* contributors may be used to endorse or promote products derived
* from this software without specific prior written permission.
*
* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
* LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
* CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
* POSSIBILITY OF SUCH DAMAGE.
*********************************************************************/

/* Author: Andy Zelenak
Description: applies jerk/acceleration/velocity limits to online motion commands
*/

#pragma once

#include <cstddef>

#include <moveit/robot_model/robot_model.h>
#include <moveit/online_signal_smoothing/smoothing_base_class.h>
#include <moveit_ruckig_filter_parameters.hpp>

#include <ruckig/ruckig.hpp>

namespace online_signal_smoothing
{

class RuckigFilterPlugin : public SmoothingBaseClass
{
public:
/**
* Initialize the smoothing algorithm
* @param node ROS node, used for parameter retrieval
* @param robot_model typically used to retrieve vel/accel/jerk limits
* @param num_joints number of actuated joints in the JointGroup Servo controls
* @return True if initialization was successful
*/
bool initialize(rclcpp::Node::SharedPtr node, moveit::core::RobotModelConstPtr robot_model,
size_t num_joints) override;

/**
* Smooth the command signals for all DOF
* @param positions array of joint position commands
* @param velocities array of joint velocity commands
* @param accelerations array of joint acceleration commands
* @return True if initialization was successful
*/
bool doSmoothing(Eigen::VectorXd& positions, Eigen::VectorXd& velocities, Eigen::VectorXd& accelerations) override;

/**
* Reset to a given joint state
* @param positions reset the filters to these joint positions
* @param velocities (unused)
* @param accelerations (unused)
* @return True if reset was successful
*/
bool reset(const Eigen::VectorXd& positions, const Eigen::VectorXd& velocities,
const Eigen::VectorXd& accelerations) override;

private:
void getDefaultJointVelAccelBounds();

online_signal_smoothing::Params params_;

size_t num_joints_;
moveit::core::RobotModelConstPtr robot_model_;

bool have_initial_ruckig_output_ = false;
ruckig::Ruckig<ruckig::DynamicDOFs> ruckig_;
ruckig::InputParameter<ruckig::DynamicDOFs> ruckig_input_;
ruckig::OutputParameter<ruckig::DynamicDOFs> ruckig_output_;

std::vector<double> default_joint_velocity_bounds_;
std::vector<double> default_joint_acceleration_bounds_;
std::vector<double> default_joint_jerk_bounds_;
};
} // namespace online_signal_smoothing
Original file line number Diff line number Diff line change
Expand Up @@ -89,6 +89,5 @@ class SmoothingBaseClass
*/
virtual bool reset(const Eigen::VectorXd& positions, const Eigen::VectorXd& velocities,
const Eigen::VectorXd& accelerations) = 0;
;
};
} // namespace online_signal_smoothing
Original file line number Diff line number Diff line change
Expand Up @@ -34,7 +34,6 @@

#include <moveit/online_signal_smoothing/acceleration_filter.h>
#include <rclcpp/logging.hpp>
#include <Eigen/Sparse>

// Disable -Wold-style-cast because all _THROTTLE macros trigger this
#pragma GCC diagnostic ignored "-Wold-style-cast"
Expand Down
117 changes: 117 additions & 0 deletions moveit_core/online_signal_smoothing/src/ruckig_filter.cpp
Original file line number Diff line number Diff line change
@@ -0,0 +1,117 @@
/*********************************************************************
* Software License Agreement (BSD License)
*
* Copyright (c) 2024, Andrew Zelenak
* All rights reserved.
*
* Redistribution and use in source and binary forms, with or without
* modification, are permitted provided that the following conditions
* are met:
*
* * Redistributions of source code must retain the above copyright
* notice, this list of conditions and the following disclaimer.
* * Redistributions in binary form must reproduce the above
* copyright notice, this list of conditions and the following
* disclaimer in the documentation and/or other materials provided
* with the distribution.
* * Neither the name of PickNik Inc. nor the names of its
* contributors may be used to endorse or promote products derived
* from this software without specific prior written permission.
*
* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
* LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
* CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
* POSSIBILITY OF SUCH DAMAGE.
*********************************************************************/

#include <moveit/online_signal_smoothing/ruckig_filter.h>
#include <rclcpp/clock.hpp>
#include <rclcpp/logging.hpp>

// Disable -Wold-style-cast because all _THROTTLE macros trigger this
#pragma GCC diagnostic ignored "-Wold-style-cast"

namespace online_signal_smoothing
{
bool RuckigFilterPlugin::initialize(rclcpp::Node::SharedPtr node, moveit::core::RobotModelConstPtr robot_model,
size_t num_joints)
{
// get node parameters and store in member variables
auto param_listener = online_signal_smoothing::ParamListener(node_);
params_ = param_listener.get_params();

num_joints_ = num_joints;
robot_model_ = robot_model;

// Ruckig needs to know the joint vel/accel/jerk bounds.
getDefaultJointVelAccelBounds();
ruckig_input_.max_velocity = default_joint_velocity_bounds_;
ruckig_input_.max_acceleration = default_joint_acceleration_bounds_;
ruckig_input_.max_jerk = default_joint_jerk_bounds_;
// initialize positions. All other quantities are initialized to zero in the constructor.
// This will be overwritten in the first control loop
ruckig_input_.current_position = std::vector<double>(num_joints_, 0.0);

return true;
}

bool RuckigFilterPlugin::doSmoothing(Eigen::VectorXd& positions, Eigen::VectorXd& velocities,
Eigen::VectorXd& accelerations)
{
return true;
}

bool RuckigFilterPlugin::reset(const Eigen::VectorXd& positions, const Eigen::VectorXd& velocities,
const Eigen::VectorXd& accelerations)
{
return true;
}

void RuckigFilterPlugin::getDefaultJointVelAccelBounds()
{
auto joint_model_group = robot_model_->getJointModelGroup(params_.planning_group_name);
for (const auto& joint : joint_model_group->getActiveJointModels())
{
const auto& bound = joint->getVariableBounds(joint->getName());

if (bound.velocity_bounded_)
{
// Assume symmetric limits
default_joint_velocity_bounds_.push_back(bound.max_velocity_);
}
else
{
ROS_ERROR_STREAM("No joint vel limit defined. Exiting for safety.");
std::exit(EXIT_FAILURE);
}

if (bound.acceleration_bounded_)
{
// Assume symmetric limits
default_joint_acceleration_bounds_.push_back(bound.max_acceleration_);
}
else
{
ROS_ERROR_STREAM("WARNING: No joint accel limit defined. Very large accelerations will be "
"possible.");
default_joint_acceleration_bounds_.push_back(DBL_MAX);
}

// MoveIt and the URDF don't support jerk limits, so use a safe default always
default_joint_jerk_bounds_.push_back(DEFAULT_JERK_BOUND);
}

assert(default_joint_jerk_bounds_.size() == num_joints_);
}
} // namespace online_signal_smoothing

#include <pluginlib/class_list_macros.hpp>
PLUGINLIB_EXPORT_CLASS(online_signal_smoothing::RuckigFilterPlugin, online_signal_smoothing::SmoothingBaseClass)
Original file line number Diff line number Diff line change
@@ -0,0 +1,8 @@
online_signal_smoothing:
planning_group_name: {
type: string,
read_only: true,
description: "The name of the MoveIt planning group of the robot \
This parameter does not have a default value and \
must be passed to the node during launch time."
}
2 changes: 1 addition & 1 deletion moveit_ros/moveit_servo/config/panda_simulated_config.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -28,7 +28,7 @@ publish_joint_accelerations: false

## Plugins for smoothing outgoing commands
use_smoothing: true
smoothing_filter_plugin_name: "online_signal_smoothing::AccelerationLimitedPlugin"
smoothing_filter_plugin_name: "online_signal_smoothing::RuckigPlugin"

# If is_primary_planning_scene_monitor is set to true, the Servo server's PlanningScene advertises the /get_planning_scene service,
# which other nodes can use as a source for information about the planning environment.
Expand Down

0 comments on commit e22b679

Please sign in to comment.