Skip to content

Conversation

@mlautman
Copy link
Collaborator

Various small improvements separated by commits.
Biggest change is to filter suction voxel by overlap in parallel.
Some small logging improvements.
Removing ACM entries after they are no longer "allowed"
and adding an error code to string method for filtering

bool generateRandomCuboid(std::string& object_name, geometry_msgs::Pose& object_pose, double& x_depth,
double& y_width, double& z_height)
{
// Generate random cuboid
Copy link
Contributor

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

Should this be updated? It seems only the polar angle is random now

const robot_state::RobotStatePtr& robot_state, double timeout, bool filter_pregrasp, bool visual_debug,
std::size_t thread_id, const std::string& grasp_target_object_id)
std::size_t thread_id, const std::string& grasp_target_object_id,
const moveit_visual_tools::MoveItVisualToolsPtr& visual_tools, double animation_speed)
Copy link
Contributor

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

animation_speed

I find it a bit confusing when code that is, as far as I can tell, purely used for debugging, is mandatory. Would prefer at least a default value that is obviously invalid, together with documenting how to use it.

moveit_grasps::GraspCandidatePtr selected_grasp_candidate;
moveit_msgs::MotionPlanResponse pre_approach_plan;

// return false;
Copy link
Contributor

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

Remove?

Seems like lots of dead code in this file overall.

Sign up for free to join this conversation on GitHub. Already have an account? Sign in to comment

Labels

None yet

Projects

None yet

Development

Successfully merging this pull request may close these issues.

2 participants