Skip to content

Commit

Permalink
Delete an unused variable and a redundant log message (#1179)
Browse files Browse the repository at this point in the history
Co-authored-by: Vatan Aksoy Tezer <[email protected]>
  • Loading branch information
AndyZe and Vatan Aksoy Tezer authored Apr 15, 2022
1 parent 81f10f1 commit d27518d
Show file tree
Hide file tree
Showing 3 changed files with 0 additions and 3 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -160,7 +160,6 @@ class PoseTracking

planning_scene_monitor::PlanningSceneMonitorPtr planning_scene_monitor_;
moveit::core::RobotModelConstPtr robot_model_;
const moveit::core::JointModelGroup* joint_model_group_;
// Joint group used for controlling the motions
std::string move_group_name_;

Expand Down
1 change: 0 additions & 1 deletion moveit_ros/moveit_servo/src/pose_tracking.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -86,7 +86,6 @@ PoseTracking::PoseTracking(const rclcpp::Node::SharedPtr& node, const ServoParam
readROSParams();

robot_model_ = planning_scene_monitor_->getRobotModel();
joint_model_group_ = robot_model_->getJointModelGroup(move_group_name_);

// Initialize PID controllers
initializePID(x_pid_config_, cartesian_position_pids_);
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -70,7 +70,6 @@ class AddRuckigTrajectorySmoothing : public planning_request_adapter::PlanningRe
if (!smoother_.applySmoothing(*res.trajectory_, req.max_velocity_scaling_factor,
req.max_acceleration_scaling_factor))
{
RCLCPP_WARN(LOGGER, " Trajectory smoothing for the solution path failed.");
result = false;
}
}
Expand Down

0 comments on commit d27518d

Please sign in to comment.