moveit / moveit_visual_tools

Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
BSD 3-Clause "New" or "Revised" License
151 stars 102 forks source link

Making hiding the robot state better #52

Closed davetcoleman closed 5 years ago

davetcoleman commented 5 years ago

This is a cross-referenced issue with the one in moveit_msgs

From the code

bool MoveItVisualTools::hideRobot()
{
  static const std::string VJOINT_NAME = "virtual_joint";

  // Always load the robot state before using
  loadSharedRobotState();

  // Apply transform
  Eigen::Isometry3d offset;
  offset.translation().x() = rviz_visual_tools::LARGE_SCALE;
  offset.translation().y() = rviz_visual_tools::LARGE_SCALE;
  offset.translation().z() = rviz_visual_tools::LARGE_SCALE;
  applyVirtualJointTransform(*hidden_robot_state_, offset);

  // Publish
  return publishRobotState(hidden_robot_state_);
}

Remove all the translation stuff and just toggle the hide flag instead.