Skip to content

Commit a75d50e

Browse files
committed
Clear JointStates in scene diff (moveit#504)
Joints are handled in trajectories. Scene diffs should not modify joints during execution. Fixes moveit#353.
1 parent b0f388a commit a75d50e

File tree

1 file changed

+3
-0
lines changed

1 file changed

+3
-0
lines changed

core/src/storage.cpp

Lines changed: 3 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -230,6 +230,9 @@ void SubTrajectory::appendTo(moveit_task_constructor_msgs::Solution& msg, Intros
230230
trajectory()->getRobotTrajectoryMsg(t.trajectory);
231231

232232
this->end()->scene()->getPlanningSceneDiffMsg(t.scene_diff);
233+
// reset JointStates (joints are already handled in trajectories)
234+
t.scene_diff.robot_state.joint_state = sensor_msgs::JointState();
235+
t.scene_diff.robot_state.multi_dof_joint_state = sensor_msgs::MultiDOFJointState();
233236
}
234237

235238
double SubTrajectory::computeCost(const CostTerm& f, std::string& comment) const {

0 commit comments

Comments
 (0)