This is the complete list of members for jsk_footstep_planner::FootstepState, including all inherited members.
cropPointCloud(pcl::PointCloud< pcl::PointNormal >::Ptr cloud, ANNGrid::Ptr grid_search, double padding_x=0.0, double padding_y=0.0) | jsk_footstep_planner::FootstepState | |
cropPointCloudExact(pcl::PointCloud< pcl::PointNormal >::Ptr cloud, pcl::PointIndices::Ptr near_indices, double padding_x=0.0, double padding_y=0.0) | jsk_footstep_planner::FootstepState | |
cross2d(const Eigen::Vector2f &a, const Eigen::Vector2f &b) const | jsk_footstep_planner::FootstepState | inline |
crossCheck(FootstepState::Ptr other, float collision_padding=0) | jsk_footstep_planner::FootstepState | virtual |
debug_print_ | jsk_footstep_planner::FootstepState | protected |
dimensions_ | jsk_footstep_planner::FootstepState | protected |
FootstepState(int leg, const Eigen::Affine3f &pose, const Eigen::Vector3f &dimensions, const Eigen::Vector3f &resolution) | jsk_footstep_planner::FootstepState | inline |
FootstepState(int leg, const Eigen::Affine3f &pose, const Eigen::Vector3f &dimensions, const Eigen::Vector3f &resolution, int index_x, int index_y, int index_yaw) | jsk_footstep_planner::FootstepState | inline |
fromROSMsg(const jsk_footstep_msgs::Footstep &f, const Eigen::Vector3f &size, const Eigen::Vector3f &resolution) | jsk_footstep_planner::FootstepState | static |
getDimensions() const | jsk_footstep_planner::FootstepState | inlinevirtual |
getLeg() const | jsk_footstep_planner::FootstepState | inlinevirtual |
getPose() const | jsk_footstep_planner::FootstepState | inlinevirtual |
getResolution() const | jsk_footstep_planner::FootstepState | inlinevirtual |
index_x_ | jsk_footstep_planner::FootstepState | protected |
index_y_ | jsk_footstep_planner::FootstepState | protected |
index_yaw_ | jsk_footstep_planner::FootstepState | protected |
indexT() | jsk_footstep_planner::FootstepState | inlinevirtual |
indexX() | jsk_footstep_planner::FootstepState | inlinevirtual |
indexY() | jsk_footstep_planner::FootstepState | inlinevirtual |
isSupportedByPointCloud(const Eigen::Affine3f &pose, pcl::PointCloud< pcl::PointNormal >::Ptr cloud, pcl::KdTreeFLANN< pcl::PointNormal > &tree, pcl::PointIndices::Ptr inliers, const int foot_x_sampling_num, const int foot_y_sampling_num, const double vertex_threshold) | jsk_footstep_planner::FootstepState | virtual |
isSupportedByPointCloudWithoutCropping(const Eigen::Affine3f &pose, pcl::PointCloud< pcl::PointNormal >::Ptr cloud, pcl::KdTreeFLANN< pcl::PointNormal > &tree, pcl::PointIndices::Ptr inliers, const int foot_x_sampling_num, const int foot_y_sampling_num, const double vertex_threshold) | jsk_footstep_planner::FootstepState | virtual |
leg_ | jsk_footstep_planner::FootstepState | protected |
midcoords(const FootstepState &other) | jsk_footstep_planner::FootstepState | virtual |
operator==(FootstepState &other) | jsk_footstep_planner::FootstepState | inline |
pose_ | jsk_footstep_planner::FootstepState | protected |
projectToCloud(pcl::KdTreeFLANN< pcl::PointNormal > &tree, pcl::PointCloud< pcl::PointNormal >::Ptr cloud, ANNGrid::Ptr grid_search, pcl::search::Octree< pcl::PointNormal > &tree_2d, pcl::PointCloud< pcl::PointNormal >::Ptr cloud_2d, const Eigen::Vector3f &z, unsigned int &error_state, FootstepParameters ¶meters) | jsk_footstep_planner::FootstepState | virtual |
Ptr typedef | jsk_footstep_planner::FootstepState | |
resolution_ | jsk_footstep_planner::FootstepState | protected |
setPose(const Eigen::Affine3f &pose) | jsk_footstep_planner::FootstepState | inlinevirtual |
toPoint() | jsk_footstep_planner::FootstepState | inline |
toROSMsg() | jsk_footstep_planner::FootstepState | virtual |
toROSMsg(const Eigen::Vector3f &ioffset) | jsk_footstep_planner::FootstepState | virtual |
vertices(Eigen::Vector3f &a, Eigen::Vector3f &b, Eigen::Vector3f &c, Eigen::Vector3f &d, double collision_padding=0) | jsk_footstep_planner::FootstepState | inline |