Skip to content

Commit fe00f83

Browse files
committed
clang format
1 parent f20b562 commit fe00f83

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

moveit_ros/planning/planning_scene_monitor/src/current_state_monitor.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -337,7 +337,7 @@ void CurrentStateMonitor::jointStateCallback(const sensor_msgs::msg::JointState:
337337
{
338338
continue;
339339
}
340-
340+
341341
const moveit::core::JointModel* jm = robot_model_->getJointModel(joint_state->name[i]);
342342
if (!jm)
343343
continue;

0 commit comments

Comments
 (0)