@@ -63,7 +63,7 @@ bool RuckigFilterPlugin::initialize(rclcpp::Node::SharedPtr node, moveit::core::
63
63
params_ = param_listener.get_params ();
64
64
65
65
// Ruckig needs the joint vel/accel/jerk bounds.
66
- getDefaultJointVelAccelBounds ();
66
+ getVelAccelJerkBounds ();
67
67
ruckig::InputParameter<ruckig::DynamicDOFs> ruckig_input (num_joints_);
68
68
ruckig_input.max_velocity = joint_velocity_bounds_;
69
69
ruckig_input.max_acceleration = joint_acceleration_bounds_;
@@ -136,7 +136,7 @@ bool RuckigFilterPlugin::reset(const Eigen::VectorXd& positions, const Eigen::Ve
136
136
return true ;
137
137
}
138
138
139
- void RuckigFilterPlugin::getDefaultJointVelAccelBounds ()
139
+ void RuckigFilterPlugin::getVelAccelJerkBounds ()
140
140
{
141
141
auto joint_model_group = robot_model_->getJointModelGroup (params_.planning_group_name );
142
142
for (const auto & joint : joint_model_group->getActiveJointModels ())
@@ -150,7 +150,7 @@ void RuckigFilterPlugin::getDefaultJointVelAccelBounds()
150
150
}
151
151
else
152
152
{
153
- RCLCPP_ERROR (getLogger (), " No joint vel limit defined. Exiting for safety." );
153
+ RCLCPP_ERROR (getLogger (), " No joint velocity limit defined. Exiting for safety." );
154
154
std::exit (EXIT_FAILURE);
155
155
}
156
156
@@ -161,8 +161,8 @@ void RuckigFilterPlugin::getDefaultJointVelAccelBounds()
161
161
}
162
162
else
163
163
{
164
- RCLCPP_ERROR (getLogger (), " WARNING: No joint accel limit defined. Very large accelerations will be "
165
- " possible." );
164
+ RCLCPP_WARN (getLogger (), " No joint acceleration limit defined. Very large accelerations will be "
165
+ " possible." );
166
166
joint_acceleration_bounds_.push_back (DBL_MAX);
167
167
}
168
168
@@ -184,9 +184,9 @@ void RuckigFilterPlugin::getDefaultJointVelAccelBounds()
184
184
185
185
void RuckigFilterPlugin::printRuckigState ()
186
186
{
187
- RCLCPP_ERROR_STREAM (getLogger (), ruckig_->delta_time << " \n Ruckig input:\n "
188
- << ruckig_input_->to_string () << " \n Ruckig output:\n "
189
- << ruckig_output_->to_string ());
187
+ RCLCPP_INFO_STREAM (getLogger (), ruckig_->delta_time << " \n Ruckig input:\n "
188
+ << ruckig_input_->to_string () << " \n Ruckig output:\n "
189
+ << ruckig_output_->to_string ());
190
190
}
191
191
} // namespace online_signal_smoothing
192
192
0 commit comments