Public Member Functions | List of all members
social_navigation_layers::PassingLayer Class Reference
Inheritance diagram for social_navigation_layers::PassingLayer:
Inheritance graph
[legend]

Public Member Functions

 PassingLayer ()
 
virtual void updateBounds (double origin_x, double origin_y, double origin_z, double *min_x, double *min_y, double *max_x, double *max_y)
 
virtual void updateCosts (costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)
 
- Public Member Functions inherited from social_navigation_layers::ProxemicLayer
virtual void onInitialize ()
 
 ProxemicLayer ()
 
virtual void updateBoundsFromPeople (double *min_x, double *min_y, double *max_x, double *max_y)
 
- Public Member Functions inherited from social_navigation_layers::SocialLayer
bool isDiscretized ()
 
 SocialLayer ()
 
- Public Member Functions inherited from costmap_2d::Layer
virtual void activate ()
 
virtual void deactivate ()
 
const std::vector< geometry_msgs::Point > & getFootprint () const
 
std::string getName () const
 
void initialize (LayeredCostmap *parent, std::string name, tf::TransformListener *tf)
 
bool isCurrent () const
 
 Layer ()
 
virtual void matchSize ()
 
virtual void onFootprintChanged ()
 
virtual void reset ()
 
virtual ~Layer ()
 

Additional Inherited Members

- Protected Member Functions inherited from social_navigation_layers::ProxemicLayer
void configure (ProxemicLayerConfig &config, uint32_t level)
 
- Protected Member Functions inherited from social_navigation_layers::SocialLayer
void peopleCallback (const people_msgs::People &people)
 
- Protected Attributes inherited from social_navigation_layers::ProxemicLayer
double amplitude_
 
double covar_
 
double cutoff_
 
dynamic_reconfigure::Server< ProxemicLayerConfig >::CallbackType f_
 
double factor_
 
dynamic_reconfigure::Server< ProxemicLayerConfig > * server_
 
- Protected Attributes inherited from social_navigation_layers::SocialLayer
bool first_time_
 
double last_max_x_
 
double last_max_y_
 
double last_min_x_
 
double last_min_y_
 
boost::recursive_mutex lock_
 
ros::Duration people_keep_time_
 
people_msgs::People people_list_
 
ros::Subscriber people_sub_
 
tf::TransformListener tf_
 
std::list< people_msgs::Person > transformed_people_
 
- Protected Attributes inherited from costmap_2d::Layer
bool current_
 
bool enabled_
 
LayeredCostmaplayered_costmap_
 
std::string name_
 
tf::TransformListenertf_
 

Detailed Description

Definition at line 13 of file passing_layer.cpp.

Constructor & Destructor Documentation

social_navigation_layers::PassingLayer::PassingLayer ( )
inline

Definition at line 16 of file passing_layer.cpp.

Member Function Documentation

virtual void social_navigation_layers::PassingLayer::updateBounds ( double  origin_x,
double  origin_y,
double  origin_z,
double *  min_x,
double *  min_y,
double *  max_x,
double *  max_y 
)
inlinevirtual

Reimplemented from social_navigation_layers::SocialLayer.

Definition at line 20 of file passing_layer.cpp.

virtual void social_navigation_layers::PassingLayer::updateCosts ( costmap_2d::Costmap2D master_grid,
int  min_i,
int  min_j,
int  max_i,
int  max_j 
)
inlinevirtual

Reimplemented from social_navigation_layers::ProxemicLayer.

Definition at line 83 of file passing_layer.cpp.


The documentation for this class was generated from the following file:


social_navigation_layers
Author(s): David V. Lu!!
autogenerated on Thu Mar 4 2021 04:02:57