21 #include <asr_world_model/GetViewportList.h> 22 #include "asr_msgs/AsrViewport.h" 24 #include <sensor_msgs/JointState.h> 25 #include <asr_next_best_view/RobotStateMessage.h> 26 #include <asr_next_best_view/SetInitRobotState.h> 27 #include <asr_next_best_view/SetAttributedPointCloud.h> 28 #include <asr_next_best_view/RateViewports.h> 35 #include <ISM/utility/TableHelper.hpp> 58 PosePtr parsePose(
const rapidxml::xml_node<> *node,
const char *poseName)
const;
ros::ServiceClient setAttributedPointCloudServiceClient
SearchedObjectTypes lastSearchedObjectTypes
virtual bool resetHandler()
bool setPointCloudInNBV(const SearchedObjectTypesAndIds &searchedObjectTypesAndIds)
std::string dbfilenameParam
ros::ServiceClient rateViewportsServiceClient
ros::Subscriber ptuDriverStateSubscriber
std::vector< std::string > SearchedObjectTypes
FilterPosesDependingOnAlreadyFoundObjectTypesPtr filterPosesDependingOnAlreadyFoundObjectTypesPtr
bool reorderPosesByNBV(const SearchedObjectTypes &searchedObjectTypes)
bool filterPosesDependingOnAlreadyFoundObjectTypes(const RobotStatePtrVecPtr &robotStates, const SearchedObjectTypes &searchedObjectTypes) const
bool deleteAllRedundantPoses(const RobotStatePtrVecPtr &robotStates) const
virtual bool initHandler()=0
virtual bool backToInitial(const SearchedObjectTypesAndIds &searchedObjectTypesAndIds)
bool checkSearchedObjectTypesAreEquale(const SearchedObjectTypes &searchecObjectTypes1, const SearchedObjectTypes &searchecObjectTypes2)
ros::ServiceClient setInitRobotStateServiceClient
std::vector< asr_msgs::AsrTypeAndId > SearchedObjectTypesAndIds
ros::ServiceClient getViewportListServiceClient
bool setInitialRobotState()
bool reorderPosesByNBVParam
void ptuDriverStateCallback(const sensor_msgs::JointState::ConstPtr &ptuState)
PosePtr parsePose(const rapidxml::xml_node<> *node, const char *poseName) const
bool getViewportsFromWorldModel(std::vector< asr_msgs::AsrViewport > &viewports)
virtual ~DirectSearchManager()
SearchedObjectTypes getSearchedObjectTypesFromAWithoutB(const SearchedObjectTypes &a, const SearchedObjectTypes &b)
bool parsePosesToExploreFromXML(const std::string &path)
virtual bool getNextRobotState(const SearchedObjectTypesAndIds &searchedObjectTypesAndIds)
DoFilterIterationPtr doFilterIterationPtrForPosesDependingOnAlreadyFoundObjectTypes