Skip to content

Commit

Permalink
linting and uncrusitfy fixes for CI (#3144)
Browse files Browse the repository at this point in the history
  • Loading branch information
jwallace42 authored and SteveMacenski committed Aug 24, 2022
1 parent 9e83442 commit 104f1e1
Show file tree
Hide file tree
Showing 7 changed files with 20 additions and 5 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -44,13 +44,15 @@ BT::NodeStatus ComputePathThroughPosesAction::on_success()
return BT::NodeStatus::SUCCESS;
}

BT::NodeStatus ComputePathThroughPosesAction::on_aborted() {
BT::NodeStatus ComputePathThroughPosesAction::on_aborted()
{
nav_msgs::msg::Path empty_path;
setOutput("path", empty_path);
return BT::NodeStatus::FAILURE;
}

BT::NodeStatus ComputePathThroughPosesAction::on_cancelled() {
BT::NodeStatus ComputePathThroughPosesAction::on_cancelled()
{
nav_msgs::msg::Path empty_path;
setOutput("path", empty_path);
return BT::NodeStatus::SUCCESS;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,6 +15,10 @@
#ifndef NAV2_COLLISION_MONITOR__CIRCLE_HPP_
#define NAV2_COLLISION_MONITOR__CIRCLE_HPP_

#include <memory>
#include <vector>
#include <string>

#include "nav2_collision_monitor/polygon.hpp"

namespace nav2_collision_monitor
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -48,7 +48,7 @@ class CollisionMonitor : public nav2_util::LifecycleNode
* @brief Constructor for the nav2_collision_safery::CollisionMonitor
* @param options Additional options to control creation of the node.
*/
CollisionMonitor(const rclcpp::NodeOptions & options = rclcpp::NodeOptions());
explicit CollisionMonitor(const rclcpp::NodeOptions & options = rclcpp::NodeOptions());
/**
* @brief Destructor for the nav2_collision_safery::CollisionMonitor
*/
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,6 +15,10 @@
#ifndef NAV2_COLLISION_MONITOR__POINTCLOUD_HPP_
#define NAV2_COLLISION_MONITOR__POINTCLOUD_HPP_

#include <memory>
#include <vector>
#include <string>

#include "sensor_msgs/msg/point_cloud2.hpp"

#include "nav2_collision_monitor/source.hpp"
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -15,6 +15,10 @@
#ifndef NAV2_COLLISION_MONITOR__SCAN_HPP_
#define NAV2_COLLISION_MONITOR__SCAN_HPP_

#include <memory>
#include <string>
#include <vector>

#include "sensor_msgs/msg/laser_scan.hpp"

#include "nav2_collision_monitor/source.hpp"
Expand Down
3 changes: 2 additions & 1 deletion nav2_costmap_2d/plugins/voxel_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -275,7 +275,8 @@ void VoxelLayer::raytraceFreespace(
if (!worldToMap3DFloat(ox, oy, oz, sensor_x, sensor_y, sensor_z)) {
RCLCPP_WARN(
logger_,
"Sensor origin at (%.2f, %.2f %.2f) is out of map bounds (%.2f, %.2f, %.2f) to (%.2f, %.2f, %.2f). "
"Sensor origin at (%.2f, %.2f %.2f) is out of map bounds"
"(%.2f, %.2f, %.2f) to (%.2f, %.2f, %.2f). "
"The costmap cannot raytrace for it.",
ox, oy, oz,
ox + getSizeInMetersX(), oy + getSizeInMetersY(), oz + getSizeInMetersZ(),
Expand Down
2 changes: 1 addition & 1 deletion nav2_waypoint_follower/src/waypoint_follower.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -291,7 +291,7 @@ WaypointFollower::resultCallback(
get_logger(),
"Goal IDs do not match for the current goal handle and received result."
"Ignoring likely due to receiving result for an old goal.");
return;
return;
}

switch (result.code) {
Expand Down

0 comments on commit 104f1e1

Please sign in to comment.