Definition at line 190 of file tabletop_pushing_perception_node.cpp.
Definition at line 193 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::abortPushingGoal | ( | std::string | msg | ) | [inline] |
Definition at line 784 of file tabletop_pushing_perception_node.cpp.
ShapeLocation TabletopPushingPerceptionNode::chooseFixedGoalPushStartLoc | ( | ProtoObject & | cur_obj, |
PushTrackerState & | cur_state, | ||
bool | new_object, | ||
int | num_start_loc_pushes_per_sample, | ||
int | num_start_loc_sample_locs, | ||
std::string | trial_id | ||
) | [inline] |
Method to choose an initial pushing location at a specified percentage around the object boundary with 0 distance on the boundary at the dominatnt orientation of the object.
cur_obj | object model of current frame |
cur_state | state estimate of object |
new_object | switch if we are initialzing on a new object |
num_start_loc_pushes_per_sample | The number of samples to attempt at each push locations |
num_start_loc_sample_locs | The number of pushing locations on the boundary to sample |
Definition at line 1200 of file tabletop_pushing_perception_node.cpp.
ShapeLocation TabletopPushingPerceptionNode::chooseLearnedPushStartLoc | ( | ProtoObject & | cur_obj, |
PushTrackerState & | cur_state, | ||
std::string | param_path, | ||
float & | chosen_score, | ||
bool | previous_position_worked, | ||
bool | rotate_push | ||
) | [inline] |
Definition at line 1343 of file tabletop_pushing_perception_node.cpp.
ShapeLocation TabletopPushingPerceptionNode::choosePushStartLoc | ( | ProtoObject & | cur_obj, |
PushTrackerState & | cur_state, | ||
bool | new_object, | ||
int | num_clusters | ||
) | [inline] |
Method to determine which pushing location to choose as a function of current object shape descriptors and history
cur_obj | Object for which we are choosing the push location |
cur_state | Current state information of the object |
new_object | Whether this object is new or has a history |
num_clusters | Number of push clusters to use in finding push locations |
Definition at line 1108 of file tabletop_pushing_perception_node.cpp.
ShapeLocation TabletopPushingPerceptionNode::chooseRandomPushStartLoc | ( | ProtoObject & | cur_obj, |
PushTrackerState & | cur_state, | ||
bool | rotate_push | ||
) | [inline] |
Definition at line 1478 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::displayGoalHeading | ( | cv::Mat & | img, |
PointStamped & | centroid, | ||
double | theta, | ||
double | goal_theta, | ||
bool | force_no_write = false |
||
) | [inline] |
Definition at line 2065 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::displayInitialPushVector | ( | cv::Mat & | img, |
PointStamped & | start_point, | ||
PointStamped & | end_point, | ||
PointStamped & | centroid | ||
) | [inline] |
Definition at line 2046 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::displayLearnedPushLocScores | ( | std::vector< double > & | push_scores, |
XYZPointCloud & | locs, | ||
pcl16::PointXYZ | selected, | ||
bool | rotate_push | ||
) | [inline] |
Definition at line 2145 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::displayPushVector | ( | cv::Mat & | img, |
PointStamped & | start_point, | ||
PointStamped & | end_point, | ||
std::string | display_name = "goal_vector" , |
||
bool | force_no_write = false |
||
) | [inline] |
Definition at line 2020 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::displayRobotGripperPoses | ( | cv::Mat & | img | ) | [inline] |
Definition at line 2119 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::evaluateGoalAndAbortConditions | ( | PushTrackerState & | tracker_state | ) | [inline] |
Definition at line 706 of file tabletop_pushing_perception_node.cpp.
std::vector<pcl16::PointXYZ> TabletopPushingPerceptionNode::findAxisAlignedBoundingBox | ( | PushTrackerState & | cur_state, |
ProtoObject & | cur_obj | ||
) | [inline] |
Definition at line 1519 of file tabletop_pushing_perception_node.cpp.
Pose2D TabletopPushingPerceptionNode::generateStartLocLearningGoalPose | ( | PushTrackerState & | cur_state, |
ProtoObject & | cur_obj, | ||
ShapeLocation & | chosen_loc, | ||
float & | new_push_angle, | ||
bool | rotate_push = false |
||
) | [inline] |
Definition at line 1618 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::getObjectPose | ( | LearnPush::Response & | res | ) | [inline] |
Definition at line 1717 of file tabletop_pushing_perception_node.cpp.
LearnPush::Response TabletopPushingPerceptionNode::getPushStartPose | ( | LearnPush::Request & | req | ) | [inline] |
Definition at line 900 of file tabletop_pushing_perception_node.cpp.
float TabletopPushingPerceptionNode::getRotatePushHeading | ( | PushTrackerState & | cur_state, |
ShapeLocation & | chosen_loc, | ||
ProtoObject & | cur_obj | ||
) | [inline] |
Definition at line 1556 of file tabletop_pushing_perception_node.cpp.
ShapeLocation TabletopPushingPerceptionNode::getStartLocDescriptor | ( | ProtoObject & | cur_obj, |
PushTrackerState & | cur_state, | ||
geometry_msgs::Point | start_pt | ||
) | [inline] |
Definition at line 1651 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::getTableLocation | ( | LocateTable::Request & | req, |
LocateTable::Response & | res | ||
) | [inline] |
ROS Service callback method for determining the location of a table in the scene
req | The service request |
res | The service response |
Definition at line 1970 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::getTablePlane | ( | XYZPointCloud & | cloud, |
PoseStamped & | p | ||
) | [inline] |
Calculate the location of the dominant plane (table) in a point cloud
cloud | The point cloud containing a table |
Definition at line 2003 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::goalPoseValid | ( | Pose2D | goal_pose | ) | const [inline] |
Definition at line 1645 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::gripperNotMoving | ( | ) | [inline] |
Definition at line 1855 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::lArmStateCartCB | ( | const pr2_manipulation_controllers::JTTaskControllerState | l_arm_state | ) | [inline] |
Definition at line 1771 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::lArmStateVelCB | ( | const pr2_manipulation_controllers::JinvTeleopControllerState | l_arm_state | ) | [inline] |
Definition at line 1781 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::learnPushCallback | ( | LearnPush::Request & | req, |
LearnPush::Response & | res | ||
) | [inline] |
Service request callback method to return a location and orientation for the robot to push.
req | The service request |
res | The service response |
Definition at line 802 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::objectDisappeared | ( | PushTrackerState & | tracker_state | ) | [inline] |
Definition at line 1842 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::objectNotBetweenGoalAndGripper | ( | Pose2D & | obj_state | ) | [inline] |
Definition at line 1878 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::objectNotMoving | ( | PushTrackerState & | tracker_state | ) | [inline] |
Definition at line 1828 of file tabletop_pushing_perception_node.cpp.
pcl16::PointXYZ TabletopPushingPerceptionNode::objectPointInWorldFrame | ( | pcl16::PointXYZ | obj_pt, |
PushTrackerState & | cur_state | ||
) | [inline] |
Definition at line 1700 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::objectTooFarFromGripper | ( | Pose2D & | obj_state | ) | [inline] |
Definition at line 1908 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::pointIsBetweenOthers | ( | geometry_msgs::Point | pt, |
Pose2D & | x1, | ||
Pose2D & | x2, | ||
double | epsilon = 0.0 |
||
) | [inline] |
Definition at line 1940 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::pushingTimeUp | ( | ) | [inline] |
Definition at line 1931 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::pushTrackerGoalCB | ( | ) | [inline] |
Definition at line 1792 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::pushTrackerPreemptCB | ( | ) | [inline] |
Definition at line 1820 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::rArmStateCartCB | ( | const pr2_manipulation_controllers::JTTaskControllerState | r_arm_state | ) | [inline] |
Definition at line 1776 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::rArmStateVelCB | ( | const pr2_manipulation_controllers::JinvTeleopControllerState | r_arm_state | ) | [inline] |
Definition at line 1786 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::sensorCallback | ( | const sensor_msgs::ImageConstPtr & | img_msg, |
const sensor_msgs::ImageConstPtr & | depth_msg, | ||
const sensor_msgs::ImageConstPtr & | mask_msg, | ||
const sensor_msgs::PointCloud2ConstPtr & | cloud_msg | ||
) | [inline] |
Definition at line 353 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::spin | ( | ) | [inline] |
Executive control function for launching the node.
Definition at line 2215 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::startTracking | ( | PushTrackerState & | state, |
bool | start_swap = false |
||
) | [inline] |
Definition at line 1751 of file tabletop_pushing_perception_node.cpp.
pcl16::PointXYZ TabletopPushingPerceptionNode::worldPointInObjectFrame | ( | pcl16::PointXYZ | world_pt, |
PushTrackerState & | cur_state | ||
) | [inline] |
Definition at line 1683 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::worldPointsInObjectFrame | ( | XYZPointCloud & | world_cloud, |
PushTrackerState & | cur_state, | ||
XYZPointCloud & | object_cloud | ||
) | [inline] |
Definition at line 1671 of file tabletop_pushing_perception_node.cpp.
void TabletopPushingPerceptionNode::writePredictedScoreToDisk | ( | XYZPointCloud & | hull_cloud, |
ShapeDescriptors & | sds, | ||
std::vector< double > & | pred_scores | ||
) | [inline] |
Definition at line 2191 of file tabletop_pushing_perception_node.cpp.
shared_ptr<ArmObjSegmentation> TabletopPushingPerceptionNode::arm_obj_segmenter_ [protected] |
Definition at line 2319 of file tabletop_pushing_perception_node.cpp.
Definition at line 2239 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::base_output_path_ [protected] |
Definition at line 2256 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::behavior_primitive_ [protected] |
Definition at line 2275 of file tabletop_pushing_perception_node.cpp.
sensor_msgs::CameraInfo TabletopPushingPerceptionNode::cam_info_ [protected] |
Definition at line 2231 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::cam_info_topic_ [protected] |
Definition at line 2262 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::camera_frame_ [protected] |
Definition at line 2259 of file tabletop_pushing_perception_node.cpp.
Definition at line 2261 of file tabletop_pushing_perception_node.cpp.
message_filters::Subscriber<sensor_msgs::PointCloud2> TabletopPushingPerceptionNode::cloud_sub_ [protected] |
Definition at line 2229 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::controller_name_ [protected] |
Definition at line 2274 of file tabletop_pushing_perception_node.cpp.
Definition at line 2246 of file tabletop_pushing_perception_node.cpp.
cv::Mat TabletopPushingPerceptionNode::cur_color_frame_ [protected] |
Definition at line 2240 of file tabletop_pushing_perception_node.cpp.
cv::Mat TabletopPushingPerceptionNode::cur_depth_frame_ [protected] |
Definition at line 2241 of file tabletop_pushing_perception_node.cpp.
Definition at line 2248 of file tabletop_pushing_perception_node.cpp.
Definition at line 2249 of file tabletop_pushing_perception_node.cpp.
cv::Mat TabletopPushingPerceptionNode::cur_self_mask_ [protected] |
Definition at line 2242 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::current_file_id_ [protected] |
Definition at line 2307 of file tabletop_pushing_perception_node.cpp.
message_filters::Subscriber<sensor_msgs::Image> TabletopPushingPerceptionNode::depth_sub_ [protected] |
Definition at line 2227 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::display_wait_ms_ [protected] |
Definition at line 2252 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::footprint_count_ [protected] |
Definition at line 2323 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::force_swap_ [protected] |
Definition at line 2311 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::frame_callback_count_ [protected] |
Definition at line 2269 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::frame_set_count_ [protected] |
Definition at line 2280 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::goal_heading_count_ [protected] |
Definition at line 2268 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::goal_out_count_ [protected] |
Definition at line 2267 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::gripper_not_moving_count_ [protected] |
Definition at line 2291 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::gripper_not_moving_count_limit_ [protected] |
Definition at line 2292 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::gripper_not_moving_thresh_ [protected] |
Definition at line 2290 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::gripper_spread_ [protected] |
Definition at line 2322 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::have_depth_data_ [protected] |
Definition at line 2251 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::hull_alpha_ [protected] |
Definition at line 2321 of file tabletop_pushing_perception_node.cpp.
message_filters::Subscriber<sensor_msgs::Image> TabletopPushingPerceptionNode::image_sub_ [protected] |
Definition at line 2226 of file tabletop_pushing_perception_node.cpp.
Definition at line 2235 of file tabletop_pushing_perception_node.cpp.
Definition at line 2236 of file tabletop_pushing_perception_node.cpp.
Definition at line 2237 of file tabletop_pushing_perception_node.cpp.
Definition at line 2238 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::just_spun_ [protected] |
Definition at line 2278 of file tabletop_pushing_perception_node.cpp.
PoseStamped TabletopPushingPerceptionNode::l_arm_pose_ [protected] |
Definition at line 2281 of file tabletop_pushing_perception_node.cpp.
Twist TabletopPushingPerceptionNode::l_arm_vel_ [protected] |
Definition at line 2283 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::learn_callback_count_ [protected] |
Definition at line 2266 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::major_axis_spin_pos_scale_ [protected] |
Definition at line 2279 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::mask_dilate_size_ [protected] |
Definition at line 2312 of file tabletop_pushing_perception_node.cpp.
message_filters::Subscriber<sensor_msgs::Image> TabletopPushingPerceptionNode::mask_sub_ [protected] |
Definition at line 2228 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::max_goal_x_ [protected] |
Definition at line 2316 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::max_goal_y_ [protected] |
Definition at line 2318 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::max_object_gripper_dist_ [protected] |
Definition at line 2286 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::min_goal_x_ [protected] |
Definition at line 2315 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::min_goal_y_ [protected] |
Definition at line 2317 of file tabletop_pushing_perception_node.cpp.
ros::NodeHandle TabletopPushingPerceptionNode::n_ [protected] |
Definition at line 2224 of file tabletop_pushing_perception_node.cpp.
Definition at line 2225 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::num_downsamples_ [protected] |
Definition at line 2257 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::num_position_failures_ [protected] |
Definition at line 2314 of file tabletop_pushing_perception_node.cpp.
shared_ptr<ObjectTracker25D> TabletopPushingPerceptionNode::obj_tracker_ [protected] |
Definition at line 2270 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_not_between_count_ [protected] |
Definition at line 2297 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_not_between_count_limit_ [protected] |
Definition at line 2298 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::object_not_between_epsilon_ [protected] |
Definition at line 2299 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_not_detected_count_ [protected] |
Definition at line 2293 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_not_detected_count_limit_ [protected] |
Definition at line 2294 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_not_moving_count_ [protected] |
Definition at line 2288 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_not_moving_count_limit_ [protected] |
Definition at line 2289 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::object_not_moving_thresh_ [protected] |
Definition at line 2287 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_too_far_count_ [protected] |
Definition at line 2295 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::object_too_far_count_limit_ [protected] |
Definition at line 2296 of file tabletop_pushing_perception_node.cpp.
shared_ptr<PointCloudSegmentation> TabletopPushingPerceptionNode::pcl_segmenter_ [protected] |
Definition at line 2250 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::point_cloud_hist_res_ [protected] |
Definition at line 2313 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::proxy_name_ [protected] |
Definition at line 2273 of file tabletop_pushing_perception_node.cpp.
Definition at line 2233 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::push_start_time_ [protected] |
Definition at line 2303 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::pushing_arm_ [protected] |
Definition at line 2272 of file tabletop_pushing_perception_node.cpp.
PoseStamped TabletopPushingPerceptionNode::r_arm_pose_ [protected] |
Definition at line 2282 of file tabletop_pushing_perception_node.cpp.
Twist TabletopPushingPerceptionNode::r_arm_vel_ [protected] |
Definition at line 2284 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::record_count_ [protected] |
Definition at line 2265 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::recording_input_ [protected] |
Definition at line 2264 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::start_loc_arc_length_percent_ [protected] |
Definition at line 2309 of file tabletop_pushing_perception_node.cpp.
ShapeLocations TabletopPushingPerceptionNode::start_loc_history_ [protected] |
Definition at line 2300 of file tabletop_pushing_perception_node.cpp.
Definition at line 2308 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::start_loc_push_dist_ [protected] |
Definition at line 2302 of file tabletop_pushing_perception_node.cpp.
int TabletopPushingPerceptionNode::start_loc_push_sample_count_ [protected] |
Definition at line 2310 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::start_loc_push_time_ [protected] |
Definition at line 2301 of file tabletop_pushing_perception_node.cpp.
Definition at line 2306 of file tabletop_pushing_perception_node.cpp.
Definition at line 2263 of file tabletop_pushing_perception_node.cpp.
Definition at line 2230 of file tabletop_pushing_perception_node.cpp.
PoseStamped TabletopPushingPerceptionNode::table_centroid_ [protected] |
Definition at line 2260 of file tabletop_pushing_perception_node.cpp.
Definition at line 2234 of file tabletop_pushing_perception_node.cpp.
shared_ptr<tf::TransformListener> TabletopPushingPerceptionNode::tf_ [protected] |
Definition at line 2232 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::timing_push_ [protected] |
Definition at line 2304 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::tracker_angle_thresh_ [protected] |
Definition at line 2277 of file tabletop_pushing_perception_node.cpp.
double TabletopPushingPerceptionNode::tracker_dist_thresh_ [protected] |
Definition at line 2276 of file tabletop_pushing_perception_node.cpp.
Pose2D TabletopPushingPerceptionNode::tracker_goal_pose_ [protected] |
Definition at line 2271 of file tabletop_pushing_perception_node.cpp.
Definition at line 2305 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::use_displays_ [protected] |
Definition at line 2253 of file tabletop_pushing_perception_node.cpp.
Definition at line 2320 of file tabletop_pushing_perception_node.cpp.
Definition at line 2285 of file tabletop_pushing_perception_node.cpp.
std::string TabletopPushingPerceptionNode::workspace_frame_ [protected] |
Definition at line 2258 of file tabletop_pushing_perception_node.cpp.
Definition at line 2254 of file tabletop_pushing_perception_node.cpp.
bool TabletopPushingPerceptionNode::write_to_disk_ [protected] |
Definition at line 2255 of file tabletop_pushing_perception_node.cpp.