Skip to content

Commit

Permalink
Remove commented out line of code
Browse files Browse the repository at this point in the history
  • Loading branch information
tylerjw committed Oct 18, 2022
1 parent 0410e83 commit b74b3de
Showing 1 changed file with 0 additions and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -195,7 +195,6 @@ class MoveGroupInterface::MoveGroupInterfaceImpl
rclcpp::names::append(opt_.move_group_namespace_, move_group::CARTESIAN_PATH_SERVICE_NAME),
rmw_qos_profile_services_default, callback_group_);
#endif
// plan_grasps_service_ = pnode_->create_client<moveit_msgs::srv::GraspPlanning>(GRASP_PLANNING_SERVICE_NAME);

RCLCPP_INFO_STREAM(LOGGER, "Ready to take commands for planning group " << opt.group_name_ << ".");
}
Expand Down

0 comments on commit b74b3de

Please sign in to comment.