Skip to content

Commit

Permalink
Small update
Browse files Browse the repository at this point in the history
  • Loading branch information
sjahr committed Jan 25, 2024
1 parent 4cce9e2 commit 674e10f
Show file tree
Hide file tree
Showing 3 changed files with 6 additions and 7 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -3,4 +3,4 @@ forward_trajectory_parameters:
type: bool,
description: "If a collision is detected should the robot stop at the current pose or continue executing",
default_value: false,
}
}
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@ servo_solver_parameters:
reference_frame: {
type: string,
description: "Frame that is tracked by servo",
#validation: {
# not_empty<>: []
#}
}
validation: {
not_empty<>: []
}
}
Original file line number Diff line number Diff line change
Expand Up @@ -64,7 +64,6 @@ bool ServoSolver::initialize(const rclcpp::Node::SharedPtr& node,
solver_parameters_ = solver_param_listener->get_params();

// Get Servo Parameters
// Get the servo parameters.
const std::string param_namespace = "moveit_servo";
const std::shared_ptr<const servo::ParamListener> servo_param_listener =
std::make_shared<const servo::ParamListener>(node, param_namespace);
Expand Down Expand Up @@ -145,7 +144,7 @@ ServoSolver::solve(const robot_trajectory::RobotTrajectory& local_trajectory,
moveit_servo::KinematicState joint_state = servo_->getNextJointState(current_state, target_twist);
const auto status = servo_->getStatus();
// Servo solver feedback is always the status of the first servo iteration
if (feedback_result.feedback.empty())
if (feedback_result.feedback.empty() && status != moveit_servo::StatusCode::NO_WARNING)
{
feedback_result.feedback = moveit_servo::SERVO_STATUS_CODE_MAP.at(status);
}
Expand Down

0 comments on commit 674e10f

Please sign in to comment.