Skip to content

Commit

Permalink
Run clang-format job on 20.04
Browse files Browse the repository at this point in the history
  • Loading branch information
marip8 committed Sep 15, 2023
1 parent 6fe57c8 commit 98eece7
Show file tree
Hide file tree
Showing 5 changed files with 8 additions and 8 deletions.
2 changes: 1 addition & 1 deletion .github/workflows/clang_format.yml
Original file line number Diff line number Diff line change
Expand Up @@ -13,7 +13,7 @@ on:
jobs:
clang_format:
name: Clang-Format
runs-on: ubuntu-latest
runs-on: ubuntu-20.04
steps:
- uses: actions/checkout@v1

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -7,7 +7,7 @@ namespace Ui
{
class Vector3dEditor;
class LinearApproachModifier;
}
} // namespace Ui

namespace noether
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -73,7 +73,7 @@ void LinearApproachToolPathModifierWidget::configure(const YAML::Node& config)

void LinearApproachToolPathModifierWidget::save(YAML::Node& config) const
{
if(ui_->combo_box_menu->currentIndex() == 0)
if (ui_->combo_box_menu->currentIndex() == 0)
{
config[AXIS_KEY] = ui_->combo_box_axis->currentIndex();
config[OFFSET_KEY] = ui_->double_spin_box_offset->value();
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -39,12 +39,12 @@ ToolPaths LinearApproachModifier::modify(ToolPaths tool_paths) const
for (int i = 0; i < n_points_; i++)
{
Eigen::Isometry3d pt;
pt = offset_point * Eigen::Translation3d(-(offset_/(n_points_)*i));
pt = offset_point * Eigen::Translation3d(-(offset_ / (n_points_)*i));
pt.linear() = segment.front().linear();
new_segment.push_back(pt);
}

segment.insert(segment.begin(), new_segment.begin(), new_segment.end());
segment.insert(segment.begin(), new_segment.begin(), new_segment.end());
}
}

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -448,9 +448,9 @@ ToolPaths PlaneSlicerRasterPlanner::planImpl(const pcl::PolygonMesh& mesh) const
}

// Use principal component analysis (PCA) to determine the principal axes of the mesh
Eigen::Vector3d mesh_normal; // Unit vector along shortest mesh PCA direction
Eigen::Matrix3d pca_vecs; // Principal axes, scaled to the size of the mesh in each direction
Eigen::Vector3d centroid; // Mesh centroid
Eigen::Vector3d mesh_normal; // Unit vector along shortest mesh PCA direction
Eigen::Matrix3d pca_vecs; // Principal axes, scaled to the size of the mesh in each direction
Eigen::Vector3d centroid; // Mesh centroid
{
// Use Original PCL point cloud
pcl::PointCloud<pcl::PointXYZ>::Ptr cloud(new pcl::PointCloud<pcl::PointXYZ>());
Expand Down

0 comments on commit 98eece7

Please sign in to comment.