|
Nav2 Navigation Stack - jazzy
jazzy
ROS 2 Navigation Stack
|
This is the complete list of members for nav2_costmap_2d::KeepoutFilter, including all inherited members.
| activate() final | nav2_costmap_2d::CostmapFilter | virtual |
| callback_group_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| clock_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| CostmapFilter() | nav2_costmap_2d::CostmapFilter | |
| current_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| deactivate() final | nav2_costmap_2d::CostmapFilter | virtual |
| declareParameter(const std::string ¶m_name, const rclcpp::ParameterValue &value) | nav2_costmap_2d::Layer | |
| declareParameter(const std::string ¶m_name, const rclcpp::ParameterType ¶m_type) | nav2_costmap_2d::Layer | |
| enable_service_ | nav2_costmap_2d::CostmapFilter | protected |
| enableCallback(const std::shared_ptr< rmw_request_id_t > request_header, const std::shared_ptr< std_srvs::srv::SetBool::Request > request, std::shared_ptr< std_srvs::srv::SetBool::Response > response) | nav2_costmap_2d::CostmapFilter | protected |
| enabled_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| filter_info_topic_ | nav2_costmap_2d::CostmapFilter | protected |
| getFootprint() const | nav2_costmap_2d::Layer | |
| getFullName(const std::string ¶m_name) | nav2_costmap_2d::Layer | |
| getMaskCost(nav_msgs::msg::OccupancyGrid::ConstSharedPtr filter_mask, const unsigned int mx, const unsigned int &my) const | nav2_costmap_2d::CostmapFilter | protected |
| getMaskData(nav_msgs::msg::OccupancyGrid::ConstSharedPtr filter_mask, const unsigned int mx, const unsigned int my) const | nav2_costmap_2d::CostmapFilter | inlineprotected |
| getMutex() | nav2_costmap_2d::CostmapFilter | inline |
| getName() const | nav2_costmap_2d::Layer | inline |
| hasParameter(const std::string ¶m_name) | nav2_costmap_2d::Layer | |
| initialize(LayeredCostmap *parent, std::string name, tf2_ros::Buffer *tf, const nav2_util::LifecycleNode::WeakPtr &node, rclcpp::CallbackGroup::SharedPtr callback_group) | nav2_costmap_2d::Layer | |
| initializeFilter(const std::string &filter_info_topic) | nav2_costmap_2d::KeepoutFilter | virtual |
| isActive() | nav2_costmap_2d::KeepoutFilter | |
| isClearable() | nav2_costmap_2d::CostmapFilter | inlinevirtual |
| isCurrent() const | nav2_costmap_2d::Layer | inline |
| isEnabled() const | nav2_costmap_2d::Layer | inline |
| KeepoutFilter() | nav2_costmap_2d::KeepoutFilter | |
| Layer() | nav2_costmap_2d::Layer | |
| layered_costmap_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| local_params_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| logger_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| mask_topic_ | nav2_costmap_2d::CostmapFilter | protected |
| matchSize() | nav2_costmap_2d::Layer | inlinevirtual |
| mutex_t typedef | nav2_costmap_2d::CostmapFilter | |
| name_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| node_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| onFootprintChanged() | nav2_costmap_2d::Layer | inlinevirtual |
| onInitialize() final | nav2_costmap_2d::CostmapFilter | virtual |
| process(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j, const geometry_msgs::msg::Pose2D &pose) | nav2_costmap_2d::KeepoutFilter | virtual |
| reset() final | nav2_costmap_2d::CostmapFilter | virtual |
| resetFilter() | nav2_costmap_2d::KeepoutFilter | virtual |
| tf_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| transform_tolerance_ | nav2_costmap_2d::CostmapFilter | protected |
| transformPose(const std::string global_frame, const geometry_msgs::msg::Pose2D &global_pose, const std::string mask_frame, geometry_msgs::msg::Pose2D &mask_pose) const | nav2_costmap_2d::CostmapFilter | protected |
| updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y) override | nav2_costmap_2d::KeepoutFilter | virtual |
| updateCosts(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) final | nav2_costmap_2d::CostmapFilter | virtual |
| worldToMask(nav_msgs::msg::OccupancyGrid::ConstSharedPtr filter_mask, double wx, double wy, unsigned int &mx, unsigned int &my) const | nav2_costmap_2d::CostmapFilter | protected |
| ~CostmapFilter() | nav2_costmap_2d::CostmapFilter | |
| ~Layer() | nav2_costmap_2d::Layer | inlinevirtual |