Skip to content

Commit

Permalink
Update urdf model.h deprecation (#1266)
Browse files Browse the repository at this point in the history
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
  • Loading branch information
ahcorde authored Aug 28, 2024
1 parent 1d031d2 commit 0a66052
Show file tree
Hide file tree
Showing 7 changed files with 10 additions and 8 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -31,7 +31,6 @@
#ifndef RVIZ_DEFAULT_PLUGINS__DISPLAYS__EFFORT__EFFORT_DISPLAY_HPP_
#define RVIZ_DEFAULT_PLUGINS__DISPLAYS__EFFORT__EFFORT_DISPLAY_HPP_

#include <urdf/model.h>

#include <deque>
#include <map>
Expand All @@ -48,6 +47,7 @@
#include <rviz_rendering/objects/effort_visual.hpp>
#include <sensor_msgs/msg/joint_state.hpp>
#include <std_msgs/msg/string.hpp>
#include <urdf/model.hpp>

#include "rviz_default_plugins/visibility_control.hpp"

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -39,7 +39,7 @@
#include <OgreQuaternion.h>
#include <OgreAny.h>

#include "urdf/model.h" // can be replaced later by urdf_model/types.h
#include "urdf/model.hpp" // can be replaced later by urdf_model/types.h

#include "rviz_default_plugins/robot/link_updater.hpp"
#include "rviz_default_plugins/visibility_control.hpp"
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -43,13 +43,13 @@

#include <QObject> // NOLINT cpplint cannot handle include order here

#include "urdf/model.h" // can be replaced later by urdf_model/types.h
#include "urdf_model/pose.h"

#include "rviz_rendering/objects/object.hpp"
#include "rviz_common/interaction/forwards.hpp"

#include "rviz_default_plugins/visibility_control.hpp"
#include "urdf/model.hpp" // can be replaced later by urdf_model/types.h

namespace Ogre
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -47,7 +47,6 @@

#include <QObject>

#include "urdf/model.h"
#include "urdf_model/pose.h"

#include "rviz_rendering/objects/object.hpp"
Expand All @@ -57,6 +56,8 @@
#include "rviz_default_plugins/robot/robot_link.hpp"
#include "rviz_default_plugins/visibility_control.hpp"

#include "urdf/model.hpp"

namespace Ogre
{
class Quaternion;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -49,9 +49,10 @@

#include <QObject>

#include <urdf/model.h> // can be replaced later by urdf_model/types.h
#include <urdf_model/pose.h>

#include <urdf/model.hpp> // can be replaced later by urdf_model/types.h

#include "rviz_rendering/objects/object.hpp"
#include "rviz_common/interaction/forwards.hpp"

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -32,7 +32,6 @@

#include <OgreSceneNode.h>
#include <OgreSceneManager.h>
#include <urdf/model.h>

#include <QString>

Expand All @@ -49,6 +48,7 @@
#include <rviz_rendering/objects/effort_visual.hpp>
#include <sensor_msgs/msg/joint_state.hpp>
#include <rclcpp/logging.hpp>
#include <urdf/model.hpp>

using namespace std::chrono_literals;

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -38,8 +38,6 @@

#include <QFile> // NOLINT cpplint cannot handle include order here

#include "urdf/model.h"

#include "tf2_ros/transform_listener.h"

#include "rviz_common/display_context.hpp"
Expand All @@ -53,6 +51,8 @@
#include "rviz_default_plugins/robot/robot_link.hpp"
#include "rviz_default_plugins/robot/tf_link_updater.hpp"

#include "urdf/model.hpp"

namespace rviz_default_plugins
{
namespace displays
Expand Down

0 comments on commit 0a66052

Please sign in to comment.