diff --git a/CMakeLists.txt b/CMakeLists.txt index d3d37fd..9642405 100644 --- a/CMakeLists.txt +++ b/CMakeLists.txt @@ -71,5 +71,4 @@ install( DIRECTORY launch DESTINATION share/${PROJECT_NAME}) -ament_package() - +ament_package() \ No newline at end of file diff --git a/include/rf2o_laser_odometry/CLaserOdometry2DNode.hpp b/include/rf2o_laser_odometry/CLaserOdometry2DNode.hpp index 8a1e170..7590052 100644 --- a/include/rf2o_laser_odometry/CLaserOdometry2DNode.hpp +++ b/include/rf2o_laser_odometry/CLaserOdometry2DNode.hpp @@ -6,7 +6,7 @@ #include #include #include -#include +#include #include namespace rf2o { @@ -47,3 +47,4 @@ class CLaserOdometry2DNode : public rclcpp::Node void initPoseCallBack(const nav_msgs::msg::Odometry::SharedPtr new_initPose); }; + diff --git a/launch/rf2o_laser_odometry.launch.py b/launch/rf2o_laser_odometry.launch.py index c8fee44..4061c74 100644 --- a/launch/rf2o_laser_odometry.launch.py +++ b/launch/rf2o_laser_odometry.launch.py @@ -28,6 +28,6 @@ def generate_launch_description(): 'base_frame_id' : 'base_link', 'odom_frame_id' : 'odom', 'init_pose_from_topic' : '', - 'freq' : 20.0}], + 'freq' : 10.0}], ), ])