#include <footstep_planner_plugin.h>
Definition at line 29 of file footstep_planner_plugin.h.
 
◆ FootstepPlannerPlugin()
      
        
          | gazebo::FootstepPlannerPlugin::FootstepPlannerPlugin | ( |  | ) |  | 
      
 
 
◆ ~FootstepPlannerPlugin()
  
  | 
        
          | gazebo::FootstepPlannerPlugin::~FootstepPlannerPlugin | ( |  | ) |  |  | virtual | 
 
 
◆ Load()
  
  | 
        
          | void gazebo::FootstepPlannerPlugin::Load | ( | physics::WorldPtr | _world, |  
          |  |  | sdf::ElementPtr | _sdf |  
          |  | ) |  |  |  | virtual | 
 
The Load function is called by Gazebo when the plugin is inserted into simulation. 
- Parameters
- 
  
    | [in] | _model | A pointer to the model that the plugin is attached to. |  | [in] | _sdf | A pointer to the plugin's SDF element. |  
 
Definition at line 37 of file footstep_planner_plugin.cpp.
 
 
◆ UpdateFootstepPlan()
      
        
          | void gazebo::FootstepPlannerPlugin::UpdateFootstepPlan | ( | const geometry_msgs::PoseArray::ConstPtr & | msg | ) |  | 
      
 
 
◆ InitRos()
      
        
          | void gazebo::FootstepPlannerPlugin::InitRos | ( |  | ) |  | 
      
 
 
◆ InitRosQueueThreads()
      
        
          | void gazebo::FootstepPlannerPlugin::InitRosQueueThreads | ( |  | ) |  | 
      
 
 
◆ ProcessQueueThread()
      
        
          | void gazebo::FootstepPlannerPlugin::ProcessQueueThread | ( |  | ) |  | 
      
 
 
◆ InitGazebo()
      
        
          | void gazebo::FootstepPlannerPlugin::InitGazebo | ( |  | ) |  | 
      
 
 
◆ DeleteVisuals()
      
        
          | void gazebo::FootstepPlannerPlugin::DeleteVisuals | ( |  | ) |  | 
      
 
 
◆ SetVisuals()
      
        
          | void gazebo::FootstepPlannerPlugin::SetVisuals | ( | Eigen::MatrixX3d & | poses | ) |  | 
      
 
 
◆ PublishVisuals()
      
        
          | void gazebo::FootstepPlannerPlugin::PublishVisuals | ( |  | ) |  | 
      
 
 
◆ world
  
  | 
        
          | physics::WorldPtr gazebo::FootstepPlannerPlugin::world |  | private | 
 
 
◆ rosNode
  
  | 
        
          | std::unique_ptr<ros::NodeHandle> gazebo::FootstepPlannerPlugin::rosNode |  | private | 
 
 
◆ footstepPlannerSub
  
  | 
        
          | ros::Subscriber gazebo::FootstepPlannerPlugin::footstepPlannerSub |  | private | 
 
 
◆ rosProcessQueue
  
  | 
        
          | ros::CallbackQueue gazebo::FootstepPlannerPlugin::rosProcessQueue |  | private | 
 
 
◆ rosProcessQueueThread
  
  | 
        
          | std::thread gazebo::FootstepPlannerPlugin::rosProcessQueueThread |  | private | 
 
 
◆ indicators
  
  | 
        
          | Eigen::Matrix<msgs::Visual, Eigen::Dynamic, 1> gazebo::FootstepPlannerPlugin::indicators |  | private | 
 
 
◆ indicatorPub
  
  | 
        
          | transport::PublisherPtr gazebo::FootstepPlannerPlugin::indicatorPub |  | private | 
 
 
◆ gazeboNode
  
  | 
        
          | transport::NodePtr gazebo::FootstepPlannerPlugin::gazeboNode |  | private | 
 
 
The documentation for this class was generated from the following files: