moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Classes | |
class | AccelerationLimitedPlugin |
class | ButterworthFilter |
class | ButterworthFilterPlugin |
struct | CSCWrapper |
Wrapper struct to make memory management easier for using osqp's C sparse_matrix types. More... | |
struct | OSQPDataWrapper |
Wrapper struct to make memory management easier for using osqp's C API. More... | |
class | RuckigFilterPlugin |
class | SmoothingBaseClass |
Functions | |
MOVEIT_STRUCT_FORWARD (OSQPDataWrapper) | |
rclcpp::Logger | getLogger () |
double | jointLimitAccelerationScalingFactor (const Eigen::VectorXd &accelerations, const moveit::core::JointBoundsVector &joint_bounds) |
bool | updateData (const OSQPDataWrapperPtr &data, OSQPWorkspace *work, Eigen::SparseMatrix< double > &constraints_sparse, const Eigen::VectorXd &lower_bound, const Eigen::VectorXd &upper_bound) |
Variables | |
constexpr double | COMMAND_DIFFERENCE_THRESHOLD = 1E-4 |
constexpr double | ALPHA_UPPER_BOUND = 1.0 |
constexpr double | ALPHA_LOWER_BOUND = 0.0 |
rclcpp::Logger online_signal_smoothing::getLogger | ( | ) |
Definition at line 43 of file acceleration_filter.cpp.
double online_signal_smoothing::jointLimitAccelerationScalingFactor | ( | const Eigen::VectorXd & | accelerations, |
const moveit::core::JointBoundsVector & | joint_bounds | ||
) |
online_signal_smoothing::MOVEIT_STRUCT_FORWARD | ( | OSQPDataWrapper | ) |
|
inline |
|
constexpr |
Definition at line 53 of file acceleration_filter.cpp.
|
constexpr |
Definition at line 51 of file acceleration_filter.cpp.
|
constexpr |
Definition at line 49 of file acceleration_filter.cpp.