Skip to content

Commit

Permalink
Fix up warnings and errors from latest Rolling releases. (#99)
Browse files Browse the repository at this point in the history
* Fix up warnings and errors from latest Rolling releases.

This cleans up two problems:

1.  rclcpp no longer accepts bare "declare_parameters" without
a type, so add an empty string by default.
2.  The tf2_geometry_msgs headers all should now use the .hpp
suffix, so fix that as well.

This should allow this package to build without warnings on the
buildfarm.

Signed-off-by: Chris Lalancette <[email protected]>

* Feedback from review.

Signed-off-by: Chris Lalancette <[email protected]>
  • Loading branch information
clalancette authored Apr 13, 2022
1 parent 239cd09 commit 2d36cbd
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
2 changes: 1 addition & 1 deletion ros2_ouster/include/ros2_ouster/conversions.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -29,7 +29,7 @@
#include "sensor_msgs/msg/imu.hpp"
#include "sensor_msgs/msg/laser_scan.hpp"
#include "tf2/LinearMath/Transform.h"
#include "tf2_geometry_msgs/tf2_geometry_msgs.h"
#include "tf2_geometry_msgs/tf2_geometry_msgs.hpp"
#include "ouster_msgs/msg/metadata.hpp"

#include "ros2_ouster/client/client.h"
Expand Down
4 changes: 2 additions & 2 deletions ros2_ouster/src/ouster_driver.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -48,8 +48,8 @@ OusterDriver::OusterDriver(
this->declare_parameter("proc_mask", std::string("IMG|PCL|IMU|SCAN"));

// Declare parameters used across ALL _sensor_ implementations
this->declare_parameter("lidar_ip");
this->declare_parameter("computer_ip");
this->declare_parameter<std::string>("lidar_ip");
this->declare_parameter<std::string>("computer_ip");
this->declare_parameter("imu_port", 7503);
this->declare_parameter("lidar_port", 7502);
this->declare_parameter("lidar_mode", std::string("512x10"));
Expand Down

0 comments on commit 2d36cbd

Please sign in to comment.