File tree Expand file tree Collapse file tree 3 files changed +3
-1
lines changed
rviz_default_plugins/include/rviz_default_plugins/displays Expand file tree Collapse file tree 3 files changed +3
-1
lines changed Original file line number Diff line number Diff line change @@ -44,6 +44,7 @@ class AccelStampedDisplay : public ScrewDisplay<geometry_msgs::msg::AccelStamped
44
44
{
45
45
Q_OBJECT
46
46
47
+ protected:
47
48
// Function to handle an incoming ROS message.
48
49
void processMessage (geometry_msgs::msg::AccelStamped::ConstSharedPtr msg) override ;
49
50
};
Original file line number Diff line number Diff line change @@ -121,6 +121,7 @@ private Q_SLOTS:
121
121
// overrides from Display
122
122
void onEnable () override ;
123
123
void onDisable () override ;
124
+ void processMessage (sensor_msgs::msg::JointState::ConstSharedPtr msg) override ;
124
125
125
126
void load ();
126
127
void clear ();
@@ -132,7 +133,6 @@ private Q_SLOTS:
132
133
std::string robot_description_topic_;
133
134
134
135
private:
135
- void processMessage (sensor_msgs::msg::JointState::ConstSharedPtr msg) override ;
136
136
void topic_callback (const std_msgs::msg::String & msg);
137
137
138
138
rclcpp::Subscription<std_msgs::msg::String>::SharedPtr subscription_;
Original file line number Diff line number Diff line change @@ -44,6 +44,7 @@ class TwistStampedDisplay : public ScrewDisplay<geometry_msgs::msg::TwistStamped
44
44
{
45
45
Q_OBJECT
46
46
47
+ protected:
47
48
// Function to handle an incoming ROS message.
48
49
void processMessage (geometry_msgs::msg::TwistStamped::ConstSharedPtr msg) override ;
49
50
};
You can’t perform that action at this time.
0 commit comments