terrain_model_plugin.cpp
Go to the documentation of this file.
2 
3 
4 
6 {
7 TerrainModelPlugin::TerrainModelPlugin(const std::string& name)
9 {
10 }
11 
13 {
14  return true;
15 }
16 
17 bool TerrainModelPlugin::getPointWithNormal(const pcl::PointNormal& /*p_search*/, pcl::PointNormal& /*p_result*/) const
18 {
19  return false;
20 }
21 
22 bool TerrainModelPlugin::getHeight(double /*x*/, double /*y*/, double& /*height*/) const
23 {
24  return false;
25 }
26 
27 bool TerrainModelPlugin::getFootContactSupport(const geometry_msgs::Pose& /*s*/, double& /*support*/, pcl::PointCloud<pcl::PointXYZI>::Ptr /*checked_positions*/) const
28 {
29  return false;
30 }
31 }
virtual bool getFootContactSupport(const geometry_msgs::Pose &p, double &support, pcl::PointCloud< pcl::PointXYZI >::Ptr checked_positions=pcl::PointCloud< pcl::PointXYZI >::Ptr()) const
virtual bool getHeight(double x, double y, double &height) const
virtual bool getPointWithNormal(const pcl::PointNormal &p_search, pcl::PointNormal &p_result) const


vigir_footstep_planning_plugins
Author(s): Alexander Stumpf
autogenerated on Mon Jun 10 2019 15:47:39