File tree Expand file tree Collapse file tree 1 file changed +2
-0
lines changed Expand file tree Collapse file tree 1 file changed +2
-0
lines changed Original file line number Diff line number Diff line change @@ -170,8 +170,10 @@ bool ExecuteTaskSolutionCapability::constructMotionPlan(const moveit_task_constr
170
170
exec_traj.effect_on_success_ = [this ,
171
171
&scene_diff = const_cast <::moveit_msgs::PlanningScene&>(sub_traj.scene_diff ),
172
172
description](const plan_execution::ExecutableMotionPlan* /* plan*/ ) {
173
+ // Never modify joint state directly (only via robot trajectories)
173
174
scene_diff.robot_state .joint_state = sensor_msgs::JointState ();
174
175
scene_diff.robot_state .multi_dof_joint_state = sensor_msgs::MultiDOFJointState ();
176
+ scene_diff.robot_state .is_diff = true ; // silent empty JointState msg error
175
177
176
178
if (!moveit::core::isEmpty (scene_diff)) {
177
179
ROS_DEBUG_STREAM_NAMED (" ExecuteTaskSolution" , " apply effect of " << description);
You can’t perform that action at this time.
0 commit comments