Public Member Functions | |
double | footprintCost (const Eigen::Vector3f &pos, double scale) |
void | onInit () |
bool | tableApprCallback (hrl_table_detect::GetTableApproaches::Request &req, hrl_table_detect::GetTableApproaches::Response &resp) |
TableApproaches () | |
~TableApproaches () | |
Public Attributes | |
ros::Publisher | approach_pub |
ros::Publisher | close_pub |
costmap_2d::Costmap2D | costmap |
costmap_2d::Costmap2DROS * | costmap_ros |
vector< geometry_msgs::Point > | footprint_model |
ros::Publisher | invalid_pub |
ros::NodeHandle | nh |
ros::ServiceServer | table_appr_srv |
tf::TransformListener | tf_listener |
base_local_planner::TrajectoryPlannerROS | traj_planner |
ros::Publisher | valid_pub |
base_local_planner::CostmapModel * | world_model |
Definition at line 56 of file table_approaches.cpp.
Definition at line 76 of file table_approaches.cpp.
Definition at line 79 of file table_approaches.cpp.
double hrl_table_detect::TableApproaches::footprintCost | ( | const Eigen::Vector3f & | pos, |
double | scale | ||
) |
Definition at line 257 of file table_approaches.cpp.
Definition at line 83 of file table_approaches.cpp.
bool hrl_table_detect::TableApproaches::tableApprCallback | ( | hrl_table_detect::GetTableApproaches::Request & | req, |
hrl_table_detect::GetTableApproaches::Response & | resp | ||
) |
Definition at line 106 of file table_approaches.cpp.
Definition at line 60 of file table_approaches.cpp.
Definition at line 60 of file table_approaches.cpp.
costmap_2d::Costmap2D hrl_table_detect::TableApproaches::costmap |
Definition at line 66 of file table_approaches.cpp.
costmap_2d::Costmap2DROS* hrl_table_detect::TableApproaches::costmap_ros |
Definition at line 62 of file table_approaches.cpp.
Definition at line 64 of file table_approaches.cpp.
Definition at line 60 of file table_approaches.cpp.
Definition at line 58 of file table_approaches.cpp.
Definition at line 59 of file table_approaches.cpp.
Definition at line 61 of file table_approaches.cpp.
base_local_planner::TrajectoryPlannerROS hrl_table_detect::TableApproaches::traj_planner |
Definition at line 63 of file table_approaches.cpp.
Definition at line 60 of file table_approaches.cpp.
base_local_planner::CostmapModel* hrl_table_detect::TableApproaches::world_model |
Definition at line 65 of file table_approaches.cpp.