41 #include <moveit_msgs/srv/get_planning_scene.hpp>
43 #include <rclcpp/qos.hpp>
46 #if __has_include(<tf2/exceptions.hpp>)
47 #include <tf2/exceptions.hpp>
49 #include <tf2/exceptions.h>
51 #if __has_include(<tf2/LinearMath/Transform.hpp>)
52 #include <tf2/LinearMath/Transform.hpp>
54 #include <tf2/LinearMath/Transform.h>
56 #include <tf2_eigen/tf2_eigen.hpp>
57 #include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
59 #include <boost/algorithm/string/join.hpp>
62 #include <std_msgs/msg/string.hpp>
65 using namespace std::chrono_literals;
67 static const rclcpp::Logger
LOGGER = rclcpp::get_logger(
"moveit_ros.planning_scene_monitor.planning_scene_monitor");
71 const std::string PlanningSceneMonitor::DEFAULT_JOINT_STATES_TOPIC =
"joint_states";
72 const std::string PlanningSceneMonitor::DEFAULT_ATTACHED_COLLISION_OBJECT_TOPIC =
"attached_collision_object";
73 const std::string PlanningSceneMonitor::DEFAULT_COLLISION_OBJECT_TOPIC =
"collision_object";
74 const std::string PlanningSceneMonitor::DEFAULT_PLANNING_SCENE_WORLD_TOPIC =
"planning_scene_world";
75 const std::string PlanningSceneMonitor::DEFAULT_PLANNING_SCENE_TOPIC =
"planning_scene";
76 const std::string PlanningSceneMonitor::DEFAULT_PLANNING_SCENE_SERVICE =
"get_planning_scene";
77 const std::string PlanningSceneMonitor::MONITORED_PLANNING_SCENE_TOPIC =
"monitored_planning_scene";
79 PlanningSceneMonitor::PlanningSceneMonitor(
const rclcpp::Node::SharedPtr& node,
const std::string& robot_description,
80 const std::string&
name)
86 const planning_scene::PlanningScenePtr&
scene,
87 const std::string& robot_description,
const std::string&
name)
94 const robot_model_loader::RobotModelLoaderPtr& rm_loader,
95 const std::string&
name)
101 const planning_scene::PlanningScenePtr&
scene,
102 const robot_model_loader::RobotModelLoaderPtr& rm_loader,
103 const std::string&
name)
104 : monitor_name_(
name)
106 , private_executor_(std::make_shared<
rclcpp::executors::SingleThreadedExecutor>())
107 , tf_buffer_(std::make_shared<
tf2_ros::Buffer>(node->get_clock()))
108 , dt_state_update_(0.0)
109 , shape_transform_cache_lookup_wait_time_(0, 0)
110 , rm_loader_(rm_loader)
112 std::vector<std::string> new_args = rclcpp::NodeOptions().arguments();
113 new_args.push_back(
"--ros-args");
114 new_args.push_back(
"-r");
116 new_args.push_back(std::string(
"__node:=") +
node_->get_name() +
"_private_" +
117 std::to_string(
reinterpret_cast<std::size_t
>(
this)));
118 new_args.push_back(
"--");
119 pnode_ = std::make_shared<rclcpp::Node>(
"_",
node_->get_namespace(), rclcpp::NodeOptions().arguments(new_args));
129 use_sim_time_ = node->get_parameter(
"use_sim_time").as_bool();
153 robot_model_.reset();
166 scene->setPlanningSceneDiffMsg(diff);
175 if (rm_loader_->getModel())
177 robot_model_ = rm_loader_->getModel();
183 scene_ = std::make_shared<planning_scene::PlanningScene>(rm_loader_->getModel());
191 scene_->getCollisionEnvNonConst()->setLinkPadding(it.first, it.second);
195 scene_->getCollisionEnvNonConst()->setLinkScale(it.first, it.second);
200 RCLCPP_ERROR(LOGGER,
"Configuration of planning scene failed");
213 scene_->setCollisionObjectUpdateCallback(
221 RCLCPP_ERROR(LOGGER,
"Robot model not loaded");
228 last_robot_state_update_wall_time_ = std::chrono::system_clock::now();
229 dt_state_update_ = std::chrono::duration<double>(0.03);
231 double temp_wait_time = 0.05;
234 node_->get_parameter_or(
robot_description_ +
"_planning.shape_transform_cache_lookup_wait_time", temp_wait_time,
237 shape_transform_cache_lookup_wait_time_ = rclcpp::Duration::from_seconds(temp_wait_time);
239 state_update_pending_.store(
false);
241 using std::chrono::nanoseconds;
242 state_update_timer_ =
pnode_->create_wall_timer(dt_state_update_, [
this]() {
return stateUpdateTimerCallback(); });
251 rcl_interfaces::msg::ParameterDescriptor desc;
253 return pnode_->declare_parameter(param_name, default_val, desc);
259 bool publish_planning_scene =
260 declare_parameter(
"publish_planning_scene",
false,
"Set to True to publish Planning Scenes");
261 bool publish_geometry_updates =
declare_parameter(
"publish_geometry_updates",
false,
262 "Set to True to publish geometry updates of the planning scene");
263 bool publish_state_updates =
264 declare_parameter(
"publish_state_updates",
false,
"Set to True to publish state updates of the planning scene");
266 "publish_transforms_updates",
false,
"Set to True to publish transform updates of the planning scene");
268 "publish_planning_scene_hz", 4.0,
"Set the maximum frequency at which planning scene updates are published");
269 updatePublishSettings(publish_geometry_updates, publish_state_updates, publish_transform_updates,
270 publish_planning_scene, publish_planning_scene_hz);
272 catch (
const rclcpp::exceptions::InvalidParameterTypeException& e)
274 RCLCPP_ERROR_STREAM(LOGGER,
"Invalid parameter type in PlanningSceneMonitor: " << e.what());
275 RCLCPP_ERROR(LOGGER,
"Dynamic publishing parameters won't be available");
279 auto psm_parameter_set_callback = [
this](
const std::vector<rclcpp::Parameter>& parameters) ->
auto
281 auto result = rcl_interfaces::msg::SetParametersResult();
282 result.successful =
true;
284 bool publish_planning_scene =
false, publish_geometry_updates =
false, publish_state_updates =
false,
285 publish_transform_updates =
false;
286 double publish_planning_scene_hz = 4.0;
287 bool declared_params_valid =
pnode_->get_parameter(
"publish_planning_scene", publish_planning_scene) &&
288 pnode_->get_parameter(
"publish_geometry_updates", publish_geometry_updates) &&
289 pnode_->get_parameter(
"publish_state_updates", publish_state_updates) &&
290 pnode_->get_parameter(
"publish_transforms_updates", publish_transform_updates) &&
291 pnode_->get_parameter(
"publish_planning_scene_hz", publish_planning_scene_hz);
293 if (!declared_params_valid)
295 RCLCPP_ERROR(LOGGER,
"Initially declared parameters are invalid - failed to process update callback");
296 result.successful =
false;
300 for (
const auto& parameter : parameters)
302 const auto&
name = parameter.get_name();
303 const auto&
type = parameter.get_type();
308 RCLCPP_ERROR(LOGGER,
"Invalid parameter in PlanningSceneMonitor parameter callback");
309 result.successful =
false;
314 if (
name ==
"planning_scene_monitor.publish_planning_scene")
315 publish_planning_scene = parameter.as_bool();
316 else if (
name ==
"planning_scene_monitor.publish_geometry_updates")
317 publish_geometry_updates = parameter.as_bool();
318 else if (
name ==
"planning_scene_monitor.publish_state_updates")
319 publish_state_updates = parameter.as_bool();
320 else if (
name ==
"planning_scene_monitor.publish_transforms_updates")
321 publish_transform_updates = parameter.as_bool();
322 else if (
name ==
"planning_scene_monitor.publish_planning_scene_hz")
323 publish_planning_scene_hz = parameter.as_double();
326 if (result.successful)
327 updatePublishSettings(publish_geometry_updates, publish_state_updates, publish_transform_updates,
328 publish_planning_scene, publish_planning_scene_hz);
332 callback_handler_ =
pnode_->add_on_set_parameters_callback(psm_parameter_set_callback);
353 scene_->setCollisionObjectUpdateCallback(
354 [
this](
const collision_detection::World::ObjectConstPtr&
object,
362 RCLCPP_WARN(LOGGER,
"Diff monitoring was stopped while publishing planning scene diffs. "
363 "Stopping planning scene diff publisher");
373 if (!
scene_->getName().empty())
375 if (
scene_->getName()[
scene_->getName().length() - 1] ==
'+')
388 std::unique_ptr<std::thread> copy;
394 RCLCPP_INFO(LOGGER,
"Stopped publishing maintained planning scene.");
399 const std::string& planning_scene_topic)
405 RCLCPP_INFO(LOGGER,
"Publishing maintained planning scene on '%s'", planning_scene_topic.c_str());
411 void PlanningSceneMonitor::scenePublishingThread()
413 RCLCPP_DEBUG(LOGGER,
"Started scene publishing thread ...");
417 moveit_msgs::msg::PlanningScene msg;
422 scene_->getPlanningSceneMsg(msg);
425 RCLCPP_DEBUG(LOGGER,
"Published the full planning scene: '%s'", msg.name.c_str());
430 moveit_msgs::msg::PlanningScene msg;
431 bool publish_msg =
false;
432 bool is_full =
false;
449 scene_->getPlanningSceneDiffMsg(msg);
452 msg.robot_state.attached_collision_objects.clear();
453 msg.robot_state.is_diff =
true;
468 scene_->setCollisionObjectUpdateCallback(
469 [
this](
const collision_detection::World::ObjectConstPtr&
object,
481 scene_->getPlanningSceneMsg(msg);
494 RCLCPP_DEBUG(LOGGER,
"Published full planning scene: '%s'", msg.name.c_str());
522 bool sceneIsParentOf(
const planning_scene::PlanningSceneConstPtr&
scene,
528 return sceneIsParentOf(
scene->getParent(), possible_parent);
549 update_callback(update_type);
558 RCLCPP_FATAL_STREAM(LOGGER,
"requestPlanningSceneState() to self-provided service '" << service_name <<
"'");
559 throw std::runtime_error(
"requestPlanningSceneState() to self-provided service: " + service_name);
562 auto client =
pnode_->create_client<moveit_msgs::srv::GetPlanningScene>(service_name);
563 auto srv = std::make_shared<moveit_msgs::srv::GetPlanningScene::Request>();
564 srv->components.components = srv->components.SCENE_SETTINGS | srv->components.ROBOT_STATE |
565 srv->components.ROBOT_STATE_ATTACHED_OBJECTS | srv->components.WORLD_OBJECT_NAMES |
566 srv->components.WORLD_OBJECT_GEOMETRY | srv->components.OCTOMAP |
567 srv->components.TRANSFORMS | srv->components.ALLOWED_COLLISION_MATRIX |
568 srv->components.LINK_PADDING_AND_SCALING | srv->components.OBJECT_COLORS;
571 RCLCPP_DEBUG(LOGGER,
"Waiting for GetPlanningScene service `%s` to exist.", service_name.c_str());
572 if (client->wait_for_service(std::chrono::seconds(5)))
574 RCLCPP_DEBUG(LOGGER,
"Sending service request to `%s`.", service_name.c_str());
575 auto service_result = client->async_send_request(srv);
576 const auto service_result_status = service_result.wait_for(std::chrono::seconds(5));
577 if (service_result_status == std::future_status::ready)
579 RCLCPP_DEBUG(LOGGER,
"Service request succeeded, applying new planning scene");
583 if (service_result_status == std::future_status::timeout)
585 RCLCPP_INFO(LOGGER,
"GetPlanningScene service call to %s timed out. at %s:%d", service_name.c_str(), __FILE__,
593 "Failed to call service %s, have you launched move_group or called psm.providePlanningSceneService()?",
594 service_name.c_str());
603 service_name, [
this](
const moveit_msgs::srv::GetPlanningScene::Request::SharedPtr& req,
604 const moveit_msgs::srv::GetPlanningScene::Response::SharedPtr& res) {
605 return getPlanningSceneServiceCallback(req, res);
609 void PlanningSceneMonitor::getPlanningSceneServiceCallback(
610 const moveit_msgs::srv::GetPlanningScene::Request::SharedPtr& req,
611 const moveit_msgs::srv::GetPlanningScene::Response::SharedPtr& res)
613 if (req->components.components & moveit_msgs::msg::PlanningSceneComponents::TRANSFORMS)
616 moveit_msgs::msg::PlanningSceneComponents all_components;
617 all_components.components = UINT_MAX;
620 scene_->getPlanningSceneMsg(res->scene, req->components.components ? req->components : all_components);
623 void PlanningSceneMonitor::updatePublishSettings(
bool publish_geom_updates,
bool publish_state_updates,
624 bool publish_transform_updates,
bool publish_planning_scene,
625 double publish_planning_scene_hz)
628 if (publish_geom_updates)
631 if (publish_state_updates)
634 if (publish_transform_updates)
637 if (publish_planning_scene)
646 void PlanningSceneMonitor::newPlanningSceneCallback(
const moveit_msgs::msg::PlanningScene::ConstSharedPtr&
scene)
653 bool removed =
false;
656 removed =
scene_->getWorldNonConst()->removeObject(
scene_->OCTOMAP_NS);
666 RCLCPP_WARN(LOGGER,
"Unable to clear octomap since no octomap monitor has been initialized");
682 std::string old_scene_name;
690 RCLCPP_DEBUG(LOGGER,
"scene update %f robot stamp: %f", fmod(
last_update_time_.seconds(), 10.),
692 old_scene_name =
scene_->getName();
697 if (
scene.robot_state.is_diff)
713 if (!
scene.is_diff &&
scene.world.octomap.octomap.data.empty())
720 robot_model_ =
scene_->getRobotModel();
732 bool no_other_scene_upd = (
scene.name.empty() ||
scene.name == old_scene_name) &&
733 scene.allowed_collision_matrix.entry_names.empty() &&
scene.link_padding.empty() &&
734 scene.link_scale.empty();
735 if (no_other_scene_upd)
741 if (!
scene.fixed_frame_transforms.empty())
747 if (!
scene.robot_state.attached_collision_objects.empty() || !
scene.robot_state.is_diff)
757 const moveit_msgs::msg::PlanningSceneWorld::ConstSharedPtr& world)
765 scene_->getWorldNonConst()->clearObjects();
766 scene_->processPlanningSceneWorldMsg(*world);
769 if (world->octomap.octomap.data.empty())
790 if (!
scene_->processCollisionObjectMsg(*obj))
804 scene_->processAttachedCollisionObjectMsg(*obj);
818 const std::vector<const moveit::core::LinkModel*>& links =
getRobotModel()->getLinkModelsWithCollisionGeometry();
819 auto start = std::chrono::system_clock::now();
823 std::vector<shapes::ShapeConstPtr>
shapes = link->getShapes();
824 for (std::size_t j = 0; j <
shapes.size(); ++j)
829 shapes::Mesh* m =
static_cast<shapes::Mesh*
>(
shapes[j]->clone());
830 m->mergeVertices(1e-4);
839 if (!warned && ((std::chrono::system_clock::now() - start) > std::chrono::seconds(30)))
841 RCLCPP_WARN(LOGGER,
"It is likely there are too many vertices in collision geometry");
855 std::vector<std::pair<occupancy_map_monitor::ShapeHandle, std::size_t>>>& link_shape_handle :
857 for (std::pair<occupancy_map_monitor::ShapeHandle, std::size_t>& it : link_shape_handle.second)
871 std::vector<std::pair<occupancy_map_monitor::ShapeHandle, std::size_t>>>& attached_body_shape_handle :
873 for (std::pair<occupancy_map_monitor::ShapeHandle, std::size_t>& it : attached_body_shape_handle.second)
884 std::vector<const moveit::core::AttachedBody*> ab;
885 scene_->getCurrentState().getAttachedBodies(ab);
898 for (std::pair<
const std::string, std::vector<std::pair<occupancy_map_monitor::ShapeHandle, const Eigen::Isometry3d*>>>&
900 for (std::pair<occupancy_map_monitor::ShapeHandle, const Eigen::Isometry3d*>& it :
901 collision_body_shape_handle.second)
911 for (
const std::pair<const std::string, collision_detection::World::ObjectPtr>& it : *
scene_->getWorld())
922 for (std::size_t i = 0; i < attached_body->
getShapes().size(); ++i)
924 if (attached_body->
getShapes()[i]->type == shapes::PLANE || attached_body->
getShapes()[i]->type == shapes::OCTREE)
934 RCLCPP_DEBUG(LOGGER,
"Excluding attached body '%s' from monitored octomap", attached_body->
getName().c_str());
947 for (std::pair<occupancy_map_monitor::ShapeHandle, std::size_t>& shape_handle : it->second)
949 RCLCPP_DEBUG(LOGGER,
"Including attached body '%s' in monitored octomap", attached_body->
getName().c_str());
962 for (std::size_t i = 0; i < obj->shapes_.size(); ++i)
964 if (obj->shapes_[i]->type == shapes::PLANE || obj->shapes_[i]->type == shapes::OCTREE)
974 RCLCPP_DEBUG(LOGGER,
"Excluding collision object '%s' from monitored octomap", obj->id_.c_str());
987 for (std::pair<occupancy_map_monitor::ShapeHandle, const Eigen::Isometry3d*>& shape_handle : it->second)
989 RCLCPP_DEBUG(LOGGER,
"Including collision object '%s' in monitored octomap", obj->id_.c_str());
1027 if (t.nanoseconds() == 0)
1029 RCLCPP_DEBUG(LOGGER,
"sync robot state to: %.3fs", fmod(t.seconds(), 10.));
1041 if (state_update_pending_.load())
1048 RCLCPP_WARN(LOGGER,
"Failed to fetch current robot state.");
1055 auto start =
node_->get_clock()->now();
1056 auto timeout = rclcpp::Duration::from_seconds(wait_time);
1060 timeout > rclcpp::Duration(0, 0))
1064 timeout = timeout - (
node_->get_clock()->now() - start);
1069 RCLCPP_WARN(LOGGER,
"Maybe failed to update robot state, time diff: %.3fs", (t -
last_robot_motion_time_).seconds());
1108 RCLCPP_INFO(LOGGER,
"Starting planning scene monitor");
1110 if (!scene_topic.empty())
1113 scene_topic, rclcpp::ServicesQoS(), [
this](
const moveit_msgs::msg::PlanningScene::ConstSharedPtr&
scene) {
1114 return newPlanningSceneCallback(
scene);
1124 RCLCPP_INFO(LOGGER,
"Stopping planning scene monitor");
1137 std::vector<std::pair<occupancy_map_monitor::ShapeHandle, std::size_t>>>& link_shape_handle :
1140 if (
tf_buffer_->canTransform(target_frame, link_shape_handle.first->getName(), target_time,
1141 shape_transform_cache_lookup_wait_time_))
1143 Eigen::Isometry3d ttr = tf2::transformToEigen(
1144 tf_buffer_->lookupTransform(target_frame, link_shape_handle.first->getName(), target_time));
1145 for (std::size_t j = 0; j < link_shape_handle.second.size(); ++j)
1146 cache[link_shape_handle.second[j].first] =
1147 ttr * link_shape_handle.first->getCollisionOriginTransforms()[link_shape_handle.second[j].second];
1151 std::vector<std::pair<occupancy_map_monitor::ShapeHandle, std::size_t>>>&
1154 if (
tf_buffer_->canTransform(target_frame, attached_body_shape_handle.first->getAttachedLinkName(), target_time,
1155 shape_transform_cache_lookup_wait_time_))
1157 Eigen::Isometry3d transform = tf2::transformToEigen(
tf_buffer_->lookupTransform(
1158 target_frame, attached_body_shape_handle.first->getAttachedLinkName(), target_time));
1159 for (std::size_t k = 0; k < attached_body_shape_handle.second.size(); ++k)
1160 cache[attached_body_shape_handle.second[k].first] =
1162 attached_body_shape_handle.first->getShapePosesInLinkFrame()[attached_body_shape_handle.second[k].second];
1166 if (
tf_buffer_->canTransform(target_frame,
scene_->getPlanningFrame(), target_time,
1167 shape_transform_cache_lookup_wait_time_))
1169 Eigen::Isometry3d transform =
1170 tf2::transformToEigen(
tf_buffer_->lookupTransform(target_frame,
scene_->getPlanningFrame(), target_time));
1171 for (
const std::pair<
const std::string,
1172 std::vector<std::pair<occupancy_map_monitor::ShapeHandle, const Eigen::Isometry3d*>>>&
1174 for (
const std::pair<occupancy_map_monitor::ShapeHandle, const Eigen::Isometry3d*>& it :
1175 collision_body_shape_handle.second)
1176 cache[it.first] = transform * (*it.second);
1180 catch (tf2::TransformException& ex)
1182 rclcpp::Clock steady_clock = rclcpp::Clock();
1183 RCLCPP_ERROR_THROTTLE(LOGGER, steady_clock, 1000,
"Transform error: %s", ex.what());
1190 const std::string& planning_scene_world_topic,
1191 const bool load_octomap_monitor)
1194 RCLCPP_INFO(LOGGER,
"Starting world geometry update monitor for collision objects, attached objects, octomap "
1198 if (!collision_objects_topic.empty())
1201 collision_objects_topic, rclcpp::ServicesQoS(),
1202 [
this](
const moveit_msgs::msg::CollisionObject::ConstSharedPtr& obj) {
return collisionObjectCallback(obj); });
1203 RCLCPP_INFO(LOGGER,
"Listening to '%s'", collision_objects_topic.c_str());
1206 if (!planning_scene_world_topic.empty())
1209 planning_scene_world_topic, rclcpp::ServicesQoS(),
1210 [
this](
const moveit_msgs::msg::PlanningSceneWorld::ConstSharedPtr& world) {
1213 RCLCPP_INFO(LOGGER,
"Listening to '%s' for planning scene world geometry", planning_scene_world_topic.c_str());
1217 if (load_octomap_monitor)
1222 std::make_unique<occupancy_map_monitor::OccupancyMapMonitor>(
node_,
tf_buffer_,
scene_->getPlanningFrame());
1227 octomap_monitor_->setTransformCacheCallback([
this](
const std::string& frame,
const rclcpp::Time& stamp,
1241 RCLCPP_INFO(LOGGER,
"Stopping world geometry monitor");
1246 RCLCPP_INFO(LOGGER,
"Stopping world geometry monitor");
1254 const std::string& attached_objects_topic)
1265 [
this](
const sensor_msgs::msg::JointState::ConstSharedPtr& joint_state) {
return onStateUpdate(joint_state); });
1269 std::unique_lock<std::mutex> lock(state_update_mutex_);
1270 if (dt_state_update_.count() > 0)
1273 state_update_timer_ =
1274 pnode_->create_wall_timer(dt_state_update_, [
this]() {
return stateUpdateTimerCallback(); });
1277 if (!attached_objects_topic.empty())
1281 attached_objects_topic, rclcpp::ServicesQoS(),
1282 [
this](
const moveit_msgs::msg::AttachedCollisionObject::ConstSharedPtr& obj) {
1285 RCLCPP_INFO(LOGGER,
"Listening to '%s' for attached collision objects",
1290 RCLCPP_ERROR(LOGGER,
"Cannot monitor robot state because planning scene is not configured");
1300 if (state_update_timer_)
1301 state_update_timer_->cancel();
1302 state_update_pending_.store(
false);
1305 void PlanningSceneMonitor::onStateUpdate(
const sensor_msgs::msg::JointState::ConstSharedPtr& )
1307 state_update_pending_.store(
true);
1312 if (std::chrono::system_clock::now() - last_robot_state_update_wall_time_ >= dt_state_update_)
1316 void PlanningSceneMonitor::stateUpdateTimerCallback()
1320 if (state_update_pending_.load() &&
1321 std::chrono::system_clock::now() - last_robot_state_update_wall_time_ >= dt_state_update_)
1351 bool update =
false;
1352 if (hz > std::numeric_limits<double>::epsilon())
1354 std::unique_lock<std::mutex> lock(state_update_mutex_);
1355 dt_state_update_ = std::chrono::duration<double>(1.0 / hz);
1358 state_update_timer_ =
pnode_->create_wall_timer(dt_state_update_, [
this]() {
return stateUpdateTimerCallback(); });
1365 if (state_update_timer_)
1366 state_update_timer_->cancel();
1367 std::unique_lock<std::mutex> lock(state_update_mutex_);
1368 dt_state_update_ = std::chrono::duration<double>(0.0);
1369 if (state_update_pending_.load())
1372 RCLCPP_INFO(LOGGER,
"Updating internal planning scene state at most every %lf seconds", dt_state_update_.count());
1380 rclcpp::Time time =
node_->now();
1381 rclcpp::Clock steady_clock = rclcpp::Clock(RCL_STEADY_TIME);
1384 std::vector<std::string> missing;
1388 std::string missing_str = boost::algorithm::join(missing,
", ");
1389 RCLCPP_WARN_THROTTLE(LOGGER, steady_clock, 1000,
"The complete state of the robot is not yet known. Missing %s",
1390 missing_str.c_str());
1395 if (!skip_update_if_locked)
1399 else if (!ulock.try_lock())
1407 scene_->getCurrentStateNonConst().update();
1412 std::unique_lock<std::mutex> lock(state_update_mutex_);
1413 last_robot_state_update_wall_time_ = std::chrono::system_clock::now();
1414 state_update_pending_.store(
false);
1420 RCLCPP_ERROR_THROTTLE(LOGGER, steady_clock, 1000,
1421 "State monitor is not active. Unable to set the planning scene state");
1440 RCLCPP_DEBUG(LOGGER,
"Maximum frequency for publishing a planning scene is now %lf Hz",
1444 void PlanningSceneMonitor::getUpdatedFrameTransforms(std::vector<geometry_msgs::msg::TransformStamped>& transforms)
1446 const std::string& target =
getRobotModel()->getModelFrame();
1448 std::vector<std::string> all_frame_names;
1449 tf_buffer_->_getFrameStrings(all_frame_names);
1450 for (
const std::string& all_frame_name : all_frame_names)
1452 if (all_frame_name == target ||
getRobotModel()->hasLinkModel(all_frame_name))
1455 geometry_msgs::msg::TransformStamped
f;
1458 f =
tf_buffer_->lookupTransform(target, all_frame_name, tf2::TimePointZero);
1460 catch (tf2::TransformException& ex)
1462 RCLCPP_WARN(LOGGER,
"Unable to transform object from frame '%s' to planning frame'%s' (%s)",
1463 all_frame_name.c_str(), target.c_str(), ex.what());
1466 f.header.frame_id = all_frame_name;
1467 f.child_frame_id = target;
1468 transforms.push_back(
f);
1476 std::vector<geometry_msgs::msg::TransformStamped> transforms;
1477 getUpdatedFrameTransforms(transforms);
1480 scene_->getTransformsNonConst().setTransforms(transforms);
1504 RCLCPP_DEBUG(LOGGER,
"No additional default collision operations specified");
1507 RCLCPP_DEBUG(LOGGER,
"Reading additional default collision operations");
1551 static const std::string ROBOT_DESCRIPTION =
void setupScene(const rclcpp::Node::SharedPtr &node, const planning_scene::PlanningScenePtr &scene)
Fetch plugin name from parameter server and activate the plugin for the given scene.
std::shared_lock< std::shared_mutex > ReadLock
Represents an action that occurred on an object in the world. Several bits may be set indicating seve...
std::function< void(const ObjectConstPtr &, Action)> ObserverCallbackFn
This may be thrown during construction of objects if errors occur.
Object defining bodies that can be attached to robot links.
const std::string & getName() const
Get the name of the attached body.
const std::vector< shapes::ShapeConstPtr > & getShapes() const
Get the shapes that make up this attached body.
A link from the robot. Contains the constant transform applied to the link and its geometry.
This class maintains the representation of the environment as seen by a planning instance....
static PlanningScenePtr clone(const PlanningSceneConstPtr &scene)
Clone a planning scene. Even if the scene scene depends on a parent, the cloned scene will not.
static const std::string OCTOMAP_NS
PlanningSceneMonitor Subscribes to the topic planning_scene.
const planning_scene::PlanningScenePtr & getPlanningScene()
Avoid this function! Returns an unsafe pointer to the current planning scene.
void lockSceneRead()
Lock the scene for reading (multiple threads can lock for reading at the same time)
void lockSceneWrite()
Lock the scene for writing (only one thread can lock for writing and no other thread can lock for rea...
void unlockSceneRead()
Unlock the scene from reading (multiple threads can lock for reading at the same time)
void excludeAttachedBodiesFromOctree()
planning_scene::PlanningScenePtr scene_
double default_attached_padd_
default attached padding
void currentWorldObjectUpdateCallback(const collision_detection::World::ObjectConstPtr &object, collision_detection::World::Action action)
Callback for a change in the world maintained by the planning scene.
double default_robot_scale_
default robot scaling
std::unique_ptr< occupancy_map_monitor::OccupancyMapMonitor > octomap_monitor_
planning_scene::PlanningScenePtr copyPlanningScene(const moveit_msgs::msg::PlanningScene &diff=moveit_msgs::msg::PlanningScene())
Returns a copy of the current planning scene.
const moveit::core::RobotModelConstPtr & getRobotModel() const
AttachedBodyShapeHandles attached_body_shape_handles_
void attachObjectCallback(const moveit_msgs::msg::AttachedCollisionObject::ConstSharedPtr &obj)
Callback for a new attached object msg.
std::map< std::string, double > default_robot_link_padd_
default robot link padding
LinkShapeHandles link_shape_handles_
void collisionObjectCallback(const moveit_msgs::msg::CollisionObject::ConstSharedPtr &obj)
Callback for a new collision object msg.
SceneUpdateType publish_update_types_
void configureDefaultPadding()
Configure the default padding.
void publishDebugInformation(bool flag)
PlanningSceneMonitor(const PlanningSceneMonitor &)=delete
PlanningSceneMonitor cannot be copy-constructed.
rclcpp::Subscription< moveit_msgs::msg::AttachedCollisionObject >::SharedPtr attached_collision_object_subscriber_
void stopPublishingPlanningScene()
Stop publishing the maintained planning scene.
void excludeAttachedBodyFromOctree(const moveit::core::AttachedBody *attached_body)
double default_object_padd_
default object padding
void addUpdateCallback(const std::function< void(SceneUpdateType)> &fn)
Add a function to be called when an update to the scene is received.
std::shared_ptr< rclcpp::Node > pnode_
bool newPlanningSceneMessage(const moveit_msgs::msg::PlanningScene &scene)
void setPlanningScenePublishingFrequency(double hz)
Set the maximum frequency at which planning scenes are being published.
void includeWorldObjectInOctree(const collision_detection::World::ObjectConstPtr &obj)
rclcpp::Service< moveit_msgs::srv::GetPlanningScene >::SharedPtr get_scene_service_
void initialize(const planning_scene::PlanningScenePtr &scene)
Initialize the planning scene monitor.
void getMonitoredTopics(std::vector< std::string > &topics) const
Get the topic names that the monitor is listening to.
void triggerSceneUpdateEvent(SceneUpdateType update_type)
This function is called every time there is a change to the planning scene.
void newPlanningSceneWorldCallback(const moveit_msgs::msg::PlanningSceneWorld::ConstSharedPtr &world)
Callback for a new planning scene world.
planning_scene::PlanningSceneConstPtr scene_const_
rclcpp::Subscription< moveit_msgs::msg::CollisionObject >::SharedPtr collision_object_subscriber_
void includeAttachedBodyInOctree(const moveit::core::AttachedBody *attached_body)
void octomapUpdateCallback()
Callback for octomap updates.
rclcpp::Subscription< moveit_msgs::msg::PlanningScene >::SharedPtr planning_scene_subscriber_
void clearUpdateCallbacks()
Clear the functions to be called when an update to the scene is received.
void providePlanningSceneService(const std::string &service_name=DEFAULT_PLANNING_SCENE_SERVICE)
Create an optional service for getting the complete planning scene This is useful for satisfying the ...
std::shared_mutex scene_update_mutex_
if diffs are monitored, this is the pointer to the parent scene
void setStateUpdateFrequency(double hz)
Update the scene using the monitored state at a specified frequency, in Hz. This function has an effe...
double publish_planning_scene_frequency_
std::shared_ptr< tf2_ros::TransformListener > tf_listener_
void stopWorldGeometryMonitor()
Stop the world geometry monitor.
void startStateMonitor(const std::string &joint_states_topic=DEFAULT_JOINT_STATES_TOPIC, const std::string &attached_objects_topic=DEFAULT_ATTACHED_COLLISION_OBJECT_TOPIC)
Start the current state monitor.
void stopStateMonitor()
Stop the state monitor.
@ UPDATE_SCENE
The entire scene was updated.
@ UPDATE_STATE
The state in the monitored scene was updated.
@ UPDATE_GEOMETRY
The geometry of the scene was updated. This includes receiving new octomaps, collision objects,...
@ UPDATE_TRANSFORMS
The maintained set of fixed transforms in the monitored scene was updated.
std::atomic< SceneUpdateType > new_scene_update_
std::shared_ptr< rclcpp::executors::SingleThreadedExecutor > private_executor_
void includeAttachedBodiesInOctree()
bool getShapeTransformCache(const std::string &target_frame, const rclcpp::Time &target_time, occupancy_map_monitor::ShapeTransformCache &cache) const
void startSceneMonitor(const std::string &scene_topic=DEFAULT_PLANNING_SCENE_TOPIC)
Start the scene monitor (ROS topic-based)
void startPublishingPlanningScene(SceneUpdateType event, const std::string &planning_scene_topic=MONITORED_PLANNING_SCENE_TOPIC)
Start publishing the maintained planning scene. The first message set out is a complete planning scen...
std::string robot_description_
bool waitForCurrentRobotState(const rclcpp::Time &t, double wait_time=1.)
Wait for robot state to become more recent than time t.
std::recursive_mutex shape_handles_lock_
std::map< std::string, double > default_robot_link_scale_
default robot link scale
rclcpp::Time last_robot_motion_time_
Last time the state was updated.
void updateSceneWithCurrentState(bool skip_update_if_locked=false)
Update the scene using the monitored state. This function is automatically called when an update to t...
std::thread private_executor_thread_
void excludeWorldObjectsFromOctree()
double default_robot_padd_
default robot padding
std::string monitor_name_
The name of this scene monitor.
bool updatesScene(const planning_scene::PlanningSceneConstPtr &scene) const
Return true if the scene scene can be updated directly or indirectly by this monitor....
CurrentStateMonitorPtr current_state_monitor_
std::recursive_mutex update_lock_
lock access to update_callbacks_
void includeWorldObjectsInOctree()
CollisionBodyShapeHandles collision_body_shape_handles_
void stopSceneMonitor()
Stop the scene monitor.
void includeRobotLinksInOctree()
rclcpp::Time last_update_time_
mutex for stored scene
void excludeRobotLinksFromOctree()
bool requestPlanningSceneState(const std::string &service_name=DEFAULT_PLANNING_SCENE_SERVICE)
Request a full planning scene state using a service call Be careful not to use this in conjunction wi...
void monitorDiffs(bool flag)
By default, the maintained planning scene does not reason about diffs. When the flag passed in is tru...
void currentStateAttachedBodyUpdateCallback(moveit::core::AttachedBody *attached_body, bool just_attached)
Callback for a change for an attached object of the current state of the planning scene.
std::unique_ptr< std::thread > publish_planning_scene_
std::shared_ptr< rclcpp::Node > node_
Last time the robot has moved.
void configureCollisionMatrix(const planning_scene::PlanningScenePtr &scene)
Configure the collision matrix for a particular scene.
void startWorldGeometryMonitor(const std::string &collision_objects_topic=DEFAULT_COLLISION_OBJECT_TOPIC, const std::string &planning_scene_world_topic=DEFAULT_PLANNING_SCENE_WORLD_TOPIC, const bool load_octomap_monitor=true)
Start the OccupancyMapMonitor and listening for:
rclcpp::Publisher< moveit_msgs::msg::PlanningScene >::SharedPtr planning_scene_publisher_
void excludeWorldObjectFromOctree(const collision_detection::World::ObjectConstPtr &obj)
std::vector< std::function< void(SceneUpdateType)> > update_callbacks_
void updateFrameTransforms()
Update the transforms for the frames that are not part of the kinematic model using tf....
planning_scene::PlanningScenePtr parent_scene_
std::condition_variable_any new_scene_update_condition_
std::shared_ptr< tf2_ros::Buffer > tf_buffer_
void unlockSceneWrite()
Lock the scene from writing (only one thread can lock for writing and no other thread can lock for re...
rclcpp::Subscription< moveit_msgs::msg::PlanningSceneWorld >::SharedPtr planning_scene_world_subscriber_
rclcpp::Parameter declare_parameter(const rclcpp::Node::SharedPtr &node, const std::string ¶meter_name)
bool isEmpty(const moveit_msgs::msg::PlanningScene &msg)
Check if a message includes any information about a planning scene, or whether it is empty.
std::function< void(AttachedBody *body, bool attached)> AttachedBodyCallback
std::map< ShapeHandle, Eigen::Isometry3d, std::less< ShapeHandle >, Eigen::aligned_allocator< std::pair< const ShapeHandle, Eigen::Isometry3d > > > ShapeTransformCache
This namespace includes the central class for representing planning contexts.
const rclcpp::Logger LOGGER