Skip to content

Commit bf87636

Browse files
authored
update urdf model header (#223)
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
1 parent 32848ee commit bf87636

File tree

2 files changed

+2
-2
lines changed

2 files changed

+2
-2
lines changed

include/robot_state_publisher/robot_state_publisher.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -45,7 +45,7 @@
4545
#include "std_msgs/msg/string.hpp"
4646
#include "tf2_ros/static_transform_broadcaster.h"
4747
#include "tf2_ros/transform_broadcaster.h"
48-
#include "urdf/model.h"
48+
#include "urdf/model.hpp"
4949

5050
using MimicMap = std::map<std::string, urdf::JointMimicSharedPtr>;
5151

src/robot_state_publisher.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -51,7 +51,7 @@
5151
#include "rclcpp_components/register_node_macro.hpp"
5252
#include "sensor_msgs/msg/joint_state.hpp"
5353
#include "std_msgs/msg/string.hpp"
54-
#include "urdf/model.h"
54+
#include "urdf/model.hpp"
5555

5656
namespace robot_state_publisher
5757
{

0 commit comments

Comments
 (0)