terrain_model_plugin.cpp
Go to the documentation of this file.
00001 #include <vigir_footstep_planning_plugins/plugins/terrain_model_plugin.h>
00002 
00003 
00004 
00005 namespace vigir_footstep_planning
00006 {
00007 TerrainModelPlugin::TerrainModelPlugin(const std::string& name)
00008   : CollisionCheckPlugin(name)
00009 {
00010 }
00011 
00012 bool TerrainModelPlugin::isUnique() const
00013 {
00014   return true;
00015 }
00016 
00017 bool TerrainModelPlugin::getPointWithNormal(const pcl::PointNormal& /*p_search*/, pcl::PointNormal& /*p_result*/) const
00018 {
00019   return false;
00020 }
00021 
00022 bool TerrainModelPlugin::getHeight(double /*x*/, double /*y*/, double& /*height*/) const
00023 {
00024   return false;
00025 }
00026 
00027 bool TerrainModelPlugin::getFootContactSupport(const geometry_msgs::Pose& /*s*/, double& /*support*/, pcl::PointCloud<pcl::PointXYZI>::Ptr /*checked_positions*/) const
00028 {
00029   return false;
00030 }
00031 }


vigir_footstep_planning_plugins
Author(s): Alexander Stumpf
autogenerated on Sat Jun 8 2019 19:01:52