moveit2
The MoveIt Motion Planning Framework for ROS 2.
All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Friends Macros Pages
robot_state_display.cpp
Go to the documentation of this file.
1/*********************************************************************
2 * Software License Agreement (BSD License)
3 *
4 * Copyright (c) 2008, Willow Garage, Inc.
5 * All rights reserved.
6 *
7 * Redistribution and use in source and binary forms, with or without
8 * modification, are permitted provided that the following conditions
9 * are met:
10 *
11 * * Redistributions of source code must retain the above copyright
12 * notice, this list of conditions and the following disclaimer.
13 * * Redistributions in binary form must reproduce the above
14 * copyright notice, this list of conditions and the following
15 * disclaimer in the documentation and/or other materials provided
16 * with the distribution.
17 * * Neither the name of Willow Garage nor the names of its
18 * contributors may be used to endorse or promote products derived
19 * from this software without specific prior written permission.
20 *
21 * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
22 * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
23 * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
24 * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
25 * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
26 * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
27 * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
28 * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
29 * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
30 * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
31 * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
32 * POSSIBILITY OF SUCH DAMAGE.
33 *********************************************************************/
34
35/* Author: Ioan Sucan */
36
40
41#include <rclcpp/qos.hpp>
42
43// #include <rviz/visualization_manager.h>
44#include <rviz_default_plugins/robot/robot.hpp>
45#include <rviz_default_plugins/robot/robot_link.hpp>
46
47#include <rviz_common/properties/property.hpp>
48#include <rviz_common/properties/string_property.hpp>
49#include <rviz_common/properties/bool_property.hpp>
50#include <rviz_common/properties/float_property.hpp>
51#include <rviz_common/properties/ros_topic_property.hpp>
52#include <rviz_common/properties/color_property.hpp>
53#include <rviz_common/display_context.hpp>
54#include <rviz_common/frame_manager_iface.hpp>
55
56#include <OgreSceneManager.h>
57#include <OgreSceneNode.h>
58
59#include <memory>
60
61namespace moveit_rviz_plugin
62{
63// ******************************************************************************************
64// Base class constructor
65// ******************************************************************************************
66RobotStateDisplay::RobotStateDisplay() : Display(), update_state_(false)
67{
68 robot_description_property_ = new rviz_common::properties::StringProperty(
69 "Robot Description", "robot_description", "The name of the ROS parameter where the URDF for the robot is loaded",
70 this, SLOT(changedRobotDescription()), this);
71
72 robot_state_topic_property_ = new rviz_common::properties::RosTopicProperty(
73 "Robot State Topic", "display_robot_state",
74 rosidl_generator_traits::data_type<moveit_msgs::msg::DisplayRobotState>(),
75 "The topic on which the moveit_msgs::msg::DisplayRobotState messages are received", this,
76 SLOT(changedRobotStateTopic()), this);
77
78 // Planning scene category -------------------------------------------------------------------------------------------
80 new rviz_common::properties::StringProperty("Robot Root Link", "",
81 "Shows the name of the root link for the robot model", this,
82 SLOT(changedRootLinkName()), this);
83 root_link_name_property_->setReadOnly(true);
84
85 robot_alpha_property_ = new rviz_common::properties::FloatProperty(
86 "Robot Alpha", 1.0f, "Specifies the alpha for the robot links", this, SLOT(changedRobotSceneAlpha()), this);
87 robot_alpha_property_->setMin(0.0);
88 robot_alpha_property_->setMax(1.0);
89
91 new rviz_common::properties::ColorProperty("Attached Body Color", QColor(150, 50, 150),
92 "The color for the attached bodies", this,
93 SLOT(changedAttachedBodyColor()), this);
94
95 enable_link_highlight_ = new rviz_common::properties::BoolProperty("Show Highlights", true,
96 "Specifies whether link highlighting is enabled",
97 this, SLOT(changedEnableLinkHighlight()), this);
99 new rviz_common::properties::BoolProperty("Visual Enabled", true,
100 "Whether to display the visual representation of the robot.", this,
101 SLOT(changedEnableVisualVisible()), this);
103 new rviz_common::properties::BoolProperty("Collision Enabled", false,
104 "Whether to display the collision representation of the robot.", this,
105 SLOT(changedEnableCollisionVisible()), this);
106
107 show_all_links_ = new rviz_common::properties::BoolProperty(
108 "Show All Links", true, "Toggle all links visibility on or off.", this, SLOT(changedAllLinks()), this);
109}
110
111// ******************************************************************************************
112// Deconstructor
113// ******************************************************************************************
115
117{
118 Display::onInitialize();
119 auto ros_node_abstraction = context_->getRosNodeAbstraction().lock();
120 if (!ros_node_abstraction)
121 {
122 RVIZ_COMMON_LOG_WARNING("Unable to lock weak_ptr from DisplayContext in RobotStateDisplay constructor");
123 return;
124 }
125 robot_state_topic_property_->initialize(ros_node_abstraction);
126 node_ = ros_node_abstraction->get_raw_node();
127 robot_ = std::make_shared<RobotStateVisualization>(scene_node_, context_, "Robot State", this);
128 changedEnableVisualVisible();
129 changedEnableCollisionVisible();
130 robot_->setVisible(false);
131}
132
134{
135 robot_->clear();
136 rdf_loader_.reset();
137 Display::reset();
138 if (isEnabled())
139 onEnable();
140}
141
142void RobotStateDisplay::changedAllLinks()
143{
144 Property* links_prop = subProp("Links");
145 QVariant value(show_all_links_->getBool());
146
147 for (int i = 0; i < links_prop->numChildren(); ++i)
148 {
149 Property* link_prop = links_prop->childAt(i);
150 link_prop->setValue(value);
151 }
152}
153
154void RobotStateDisplay::setHighlight(const std::string& link_name, const std_msgs::msg::ColorRGBA& color)
155{
156 rviz_default_plugins::robot::RobotLink* link = robot_->getRobot().getLink(link_name);
157 if (link)
158 {
159 link->setColor(color.r, color.g, color.b);
160 link->setRobotAlpha(color.a * robot_alpha_property_->getFloat());
161 }
162}
163
164void RobotStateDisplay::unsetHighlight(const std::string& link_name)
165{
166 rviz_default_plugins::robot::RobotLink* link = robot_->getRobot().getLink(link_name);
167 if (link)
168 {
169 link->unsetColor();
170 link->setRobotAlpha(robot_alpha_property_->getFloat());
171 }
172}
173
174void RobotStateDisplay::changedEnableLinkHighlight()
175{
176 if (enable_link_highlight_->getBool())
177 {
178 for (std::pair<const std::string, std_msgs::msg::ColorRGBA>& highlight : highlights_)
179 {
180 setHighlight(highlight.first, highlight.second);
181 }
182 }
183 else
184 {
185 for (std::pair<const std::string, std_msgs::msg::ColorRGBA>& highlight : highlights_)
186 {
187 unsetHighlight(highlight.first);
188 }
189 }
190}
191
192void RobotStateDisplay::changedEnableVisualVisible()
193{
194 robot_->setVisualVisible(enable_visual_visible_->getBool());
195}
196
197void RobotStateDisplay::changedEnableCollisionVisible()
198{
199 robot_->setCollisionVisible(enable_collision_visible_->getBool());
200}
201
203 const moveit_msgs::msg::DisplayRobotState::_highlight_links_type& highlight_links)
204{
205 if (highlight_links.empty() && highlights_.empty())
206 return;
207
208 std::map<std::string, std_msgs::msg::ColorRGBA> highlights;
209 for (const moveit_msgs::msg::ObjectColor& highlight_link : highlight_links)
210 {
211 highlights[highlight_link.id] = highlight_link.color;
212 }
213
214 if (enable_link_highlight_->getBool())
215 {
216 std::map<std::string, std_msgs::msg::ColorRGBA>::iterator ho = highlights_.begin();
217 std::map<std::string, std_msgs::msg::ColorRGBA>::iterator hn = highlights.begin();
218 while (ho != highlights_.end() || hn != highlights.end())
219 {
220 if (ho == highlights_.end())
221 {
222 setHighlight(hn->first, hn->second);
223 ++hn;
224 }
225 else if (hn == highlights.end())
226 {
227 unsetHighlight(ho->first);
228 ++ho;
229 }
230 else if (hn->first < ho->first)
231 {
232 setHighlight(hn->first, hn->second);
233 ++hn;
234 }
235 else if (hn->first > ho->first)
236 {
237 unsetHighlight(ho->first);
238 ++ho;
239 }
240 else if (hn->second != ho->second)
241 {
242 setHighlight(hn->first, hn->second);
243 ++ho;
244 ++hn;
245 }
246 else
247 {
248 ++ho;
249 ++hn;
250 }
251 }
252 }
253
254 swap(highlights, highlights_);
255}
256
257void RobotStateDisplay::changedAttachedBodyColor()
258{
259 if (robot_)
260 {
261 QColor color = attached_body_color_property_->getColor();
262 std_msgs::msg::ColorRGBA color_msg;
263 color_msg.r = color.redF();
264 color_msg.g = color.greenF();
265 color_msg.b = color.blueF();
266 color_msg.a = robot_alpha_property_->getFloat();
267 robot_->setDefaultAttachedObjectColor(color_msg);
268 update_state_ = true;
269 }
270}
271
272void RobotStateDisplay::changedRobotDescription()
273{
274 if (isEnabled())
275 reset();
276}
277
278void RobotStateDisplay::changedRootLinkName()
279{
280}
281
282void RobotStateDisplay::changedRobotSceneAlpha()
283{
284 if (robot_)
285 {
286 robot_->setAlpha(robot_alpha_property_->getFloat());
287 QColor color = attached_body_color_property_->getColor();
288 std_msgs::msg::ColorRGBA color_msg;
289 color_msg.r = color.redF();
290 color_msg.g = color.greenF();
291 color_msg.b = color.blueF();
292 color_msg.a = robot_alpha_property_->getFloat();
293 robot_->setDefaultAttachedObjectColor(color_msg);
294 update_state_ = true;
295 }
296}
297
298void RobotStateDisplay::changedRobotStateTopic()
299{
300 using namespace std::placeholders;
301 // reset model to default state, we don't want to show previous messages
302 if (static_cast<bool>(robot_state_))
303 robot_state_->setToDefaultValues();
304 update_state_ = true;
305 robot_->setVisible(false);
306 setStatus(rviz_common::properties::StatusProperty::Warn, "RobotState", "No msg received");
307
308 robot_state_subscriber_ = node_->create_subscription<moveit_msgs::msg::DisplayRobotState>(
309 robot_state_topic_property_->getStdString(), rclcpp::ServicesQoS(),
310 [this](const moveit_msgs::msg::DisplayRobotState::ConstSharedPtr& state) { return newRobotStateCallback(state); });
311}
312
313void RobotStateDisplay::newRobotStateCallback(const moveit_msgs::msg::DisplayRobotState::ConstSharedPtr& state_msg)
314{
315 if (!robot_model_)
316 return;
317 if (!robot_state_)
318 robot_state_ = std::make_shared<moveit::core::RobotState>(robot_model_);
319 // possibly use TF to construct a moveit::core::Transforms object to pass in to the conversion function?
320 try
321 {
322 if (!moveit::core::isEmpty(state_msg->state))
324 setRobotHighlights(state_msg->highlight_links);
325 }
326 catch (const moveit::Exception& e)
327 {
328 robot_state_->setToDefaultValues();
329 setRobotHighlights(moveit_msgs::msg::DisplayRobotState::_highlight_links_type());
330 setStatus(rviz_common::properties::StatusProperty::Error, "RobotState", e.what());
331 robot_->setVisible(false);
332 return;
333 }
334
335 if (robot_->isVisible() != !state_msg->hide)
336 {
337 robot_->setVisible(!state_msg->hide);
338 if (robot_->isVisible())
339 {
340 setStatus(rviz_common::properties::StatusProperty::Ok, "RobotState", "");
341 }
342 else
343 {
344 setStatus(rviz_common::properties::StatusProperty::Warn, "RobotState", "Hidden");
345 }
346 }
347
348 update_state_ = true;
349}
350
351void RobotStateDisplay::setLinkColor(const std::string& link_name, const QColor& color)
352{
353 setLinkColor(&robot_->getRobot(), link_name, color);
354}
355
356void RobotStateDisplay::unsetLinkColor(const std::string& link_name)
357{
358 unsetLinkColor(&robot_->getRobot(), link_name);
359}
360
362{
363 robot_->setVisible(visible);
364}
365
366void RobotStateDisplay::setLinkColor(rviz_default_plugins::robot::Robot* robot, const std::string& link_name,
367 const QColor& color)
368{
369 rviz_default_plugins::robot::RobotLink* link = robot->getLink(link_name);
370
371 // Check if link exists
372 if (link)
373 link->setColor(color.redF(), color.greenF(), color.blueF());
374}
375
376void RobotStateDisplay::unsetLinkColor(rviz_default_plugins::robot::Robot* robot, const std::string& link_name)
377{
378 rviz_default_plugins::robot::RobotLink* link = robot->getLink(link_name);
379
380 // Check if link exists
381 if (link)
382 link->unsetColor();
383}
384
385// ******************************************************************************************
386// Load
387// ******************************************************************************************
389{
390 if (robot_description_property_->getStdString().empty())
391 {
392 setStatus(rviz_common::properties::StatusProperty::Error, "RobotModel", "`Robot Description` field can't be empty");
393 return;
394 }
395
396 rdf_loader_ = std::make_shared<rdf_loader::RDFLoader>(node_, robot_description_property_->getStdString(), true);
398 rdf_loader_->setNewModelCallback([this]() { return loadRobotModel(); });
399}
400
402{
403 if (rdf_loader_->getURDF())
404 {
405 try
406 {
407 const srdf::ModelSharedPtr& srdf =
408 rdf_loader_->getSRDF() ? rdf_loader_->getSRDF() : std::make_shared<srdf::Model>();
409 robot_model_ = std::make_shared<moveit::core::RobotModel>(rdf_loader_->getURDF(), srdf);
410 robot_->load(*robot_model_->getURDF());
411 robot_state_ = std::make_shared<moveit::core::RobotState>(robot_model_);
412 robot_state_->setToDefaultValues();
413 bool old_state = root_link_name_property_->blockSignals(true);
414 root_link_name_property_->setStdString(getRobotModel()->getRootLinkName());
415 root_link_name_property_->blockSignals(old_state);
416 update_state_ = true;
417 setStatus(rviz_common::properties::StatusProperty::Ok, "RobotModel", "Loaded successfully");
418
419 changedEnableVisualVisible();
420 changedEnableCollisionVisible();
421 }
422 catch (std::exception& e)
423 {
424 setStatus(rviz_common::properties::StatusProperty::Error, "RobotModel",
425 QString("Loading failed: %1").arg(e.what()));
426 }
427 }
428 else
429 setStatus(rviz_common::properties::StatusProperty::Error, "RobotModel", "Loading failed");
430
431 highlights_.clear();
432}
433
434void RobotStateDisplay::load(const rviz_common::Config& config)
435{
436 // This property needs to be loaded in onEnable() below, which is triggered
437 // in the beginning of Display::load() before the other property would be available
438 robot_description_property_->load(config.mapGetChild("Robot Description"));
439 Display::load(config);
440}
441
443{
444 Display::onEnable();
445 if (!rdf_loader_)
447 changedRobotStateTopic();
449}
450
451// ******************************************************************************************
452// Disable
453// ******************************************************************************************
455{
457 if (robot_)
458 robot_->setVisible(false);
459 Display::onDisable();
460}
461
462void RobotStateDisplay::update(float wall_dt, float ros_dt)
463{
464 Display::update(wall_dt, ros_dt);
467 {
468 update_state_ = false;
469 robot_state_->update();
470 robot_->update(robot_state_);
471 }
472}
473
474// ******************************************************************************************
475// Calculate Offset Position
476// ******************************************************************************************
478{
479 if (!getRobotModel())
480 return;
481
482 Ogre::Vector3 position;
483 Ogre::Quaternion orientation;
484
485 context_->getFrameManager()->getTransform(getRobotModel()->getModelFrame(), rclcpp::Time(0, 0, RCL_ROS_TIME),
486 position, orientation);
487
488 scene_node_->setPosition(position);
489 scene_node_->setOrientation(orientation);
490}
491
493{
494 Display::fixedFrameChanged();
496}
497
498} // namespace moveit_rviz_plugin
This may be thrown if unrecoverable errors occur.
rviz_common::properties::RosTopicProperty * robot_state_topic_property_
void load(const rviz_common::Config &config) override
moveit::core::RobotModelConstPtr robot_model_
void setHighlight(const std::string &link_name, const std_msgs::msg::ColorRGBA &color)
void update(float wall_dt, float ros_dt) override
const moveit::core::RobotModelConstPtr & getRobotModel() const
void setRobotHighlights(const moveit_msgs::msg::DisplayRobotState::_highlight_links_type &highlight_links)
rviz_common::properties::FloatProperty * robot_alpha_property_
rviz_common::properties::ColorProperty * attached_body_color_property_
rviz_common::properties::StringProperty * root_link_name_property_
rclcpp::Subscription< moveit_msgs::msg::DisplayRobotState >::SharedPtr robot_state_subscriber_
void unsetHighlight(const std::string &link_name)
rviz_common::properties::BoolProperty * enable_visual_visible_
void calculateOffsetPosition()
Set the scene node's position, given the target frame and the planning frame.
void unsetLinkColor(const std::string &link_name)
void newRobotStateCallback(const moveit_msgs::msg::DisplayRobotState::ConstSharedPtr &state)
rviz_common::properties::BoolProperty * enable_link_highlight_
rviz_common::properties::BoolProperty * enable_collision_visible_
rviz_common::properties::BoolProperty * show_all_links_
rviz_common::properties::StringProperty * robot_description_property_
void setLinkColor(const std::string &link_name, const QColor &color)
std::map< std::string, std_msgs::msg::ColorRGBA > highlights_
bool isEmpty(const moveit_msgs::msg::PlanningScene &msg)
Check if a message includes any information about a planning scene, or whether it is empty.
bool robotStateMsgToRobotState(const Transforms &tf, const moveit_msgs::msg::RobotState &robot_state, RobotState &state, bool copy_attached_bodies=true)
Convert a robot state msg (with accompanying extra transforms) to a MoveIt robot state.