Skip to content

Commit 43b6433

Browse files
committed
Formatting
1 parent a7176e1 commit 43b6433

File tree

2 files changed

+6
-3
lines changed

2 files changed

+6
-3
lines changed

ur_robot_driver/include/ur_robot_driver/hardware_interface.h

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -216,7 +216,8 @@ class HardwareInterface : public hardware_interface::RobotHW
216216
void commandCallback(const std_msgs::StringConstPtr& msg);
217217
bool setPayload(ur_msgs::SetPayloadRequest& req, ur_msgs::SetPayloadResponse& res);
218218
bool activateSplineInterpolation(std_srvs::SetBoolRequest& req, std_srvs::SetBoolResponse& res);
219-
bool getRobotSoftwareVersion(ur_msgs::GetRobotSoftwareVersionRequest& req, ur_msgs::GetRobotSoftwareVersionResponse& res);
219+
bool getRobotSoftwareVersion(ur_msgs::GetRobotSoftwareVersionRequest& req,
220+
ur_msgs::GetRobotSoftwareVersionResponse& res);
220221

221222
std::unique_ptr<urcl::UrDriver> ur_driver_;
222223
std::unique_ptr<DashboardClientROS> dashboard_client_;

ur_robot_driver/src/hardware_interface.cpp

Lines changed: 4 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -461,7 +461,8 @@ bool HardwareInterface::init(ros::NodeHandle& root_nh, ros::NodeHandle& robot_hw
461461
"activate_spline_interpolation", &HardwareInterface::activateSplineInterpolation, this);
462462

463463
// Calling this service will return the software version of the robot.
464-
get_robot_software_version_srv = robot_hw_nh.advertiseService("get_robot_software_version", &HardwareInterface::getRobotSoftwareVersion, this);
464+
get_robot_software_version_srv =
465+
robot_hw_nh.advertiseService("get_robot_software_version", &HardwareInterface::getRobotSoftwareVersion, this);
465466

466467
ur_driver_->startRTDECommunication();
467468
ROS_INFO_STREAM_NAMED("hardware_interface", "Loaded ur_robot_driver hardware_interface");
@@ -1178,7 +1179,8 @@ bool HardwareInterface::setPayload(ur_msgs::SetPayloadRequest& req, ur_msgs::Set
11781179
return true;
11791180
}
11801181

1181-
bool HardwareInterface::getRobotSoftwareVersion(ur_msgs::GetRobotSoftwareVersionRequest& req, ur_msgs::GetRobotSoftwareVersionResponse& res)
1182+
bool HardwareInterface::getRobotSoftwareVersion(ur_msgs::GetRobotSoftwareVersionRequest& req,
1183+
ur_msgs::GetRobotSoftwareVersionResponse& res)
11821184
{
11831185
urcl::VersionInformation version_info = this->ur_driver_->getVersion();
11841186
res.major = version_info.major;

0 commit comments

Comments
 (0)