Skip to content

Commit

Permalink
Remove assert from setPlanningSceneDiffMsg()
Browse files Browse the repository at this point in the history
setPlanningSceneDiffMsg() is called via PlanningScene::diff(msg)
with non-diff messages.
  • Loading branch information
rhaschke committed Jun 20, 2024
1 parent 617f17e commit c1a32f0
Showing 1 changed file with 0 additions and 1 deletion.
1 change: 0 additions & 1 deletion moveit_core/planning_scene/src/planning_scene.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -1264,7 +1264,6 @@ void PlanningScene::decoupleParent()

bool PlanningScene::setPlanningSceneDiffMsg(const moveit_msgs::PlanningScene& scene_msg)
{
assert(scene_msg.is_diff == true);
bool result = true;

ROS_DEBUG_NAMED(LOGNAME, "Adding planning scene diff");
Expand Down

0 comments on commit c1a32f0

Please sign in to comment.