Hello,
the function bool MoveItVisualTools::publishTrajectoryPath(const moveit_msgs::RobotTrajectory& trajectory_msg, const robot_state::RobotStateConstPtr robot_state, bool blocking) has this bit in it:
// Check if we have enough points
if (!trajectory_msg.joint_trajectory.points.size())
{
ROS_WARN_STREAM_NAMED(name_, "Unable to publish trajectory path because trajectory has zero points");
return false;
}
Trajectories that have multi-DoF points, but no regular points, get rejected by that check.