29 #include <rapidxml.hpp> 31 #include <boost/lexical_cast.hpp> 32 #include <boost/shared_ptr.hpp> 33 #include <eigen3/Eigen/Geometry> 36 #include "asr_msgs/AsrTypeAndId.h" 74 virtual bool getNextRobotState(
const SearchedObjectTypesAndIds &searchedObjectTypesAndIds);
75 virtual bool backToInitial(
const SearchedObjectTypesAndIds &searchedObjectTypesAndIds);
107 if (posesToExplorePtr->empty()) {
110 return posesToExplorePtr->front()->getPtuListSize();
114 return posesToExplorePtr->size();
131 template <
typename T>
virtual bool initHandler()=0
virtual bool getNextRobotState(const SearchedObjectTypesAndIds &searchedObjectTypesAndIds)
void filterSearchedObjectTypes(SearchedObjectTypes &searched_object_types_to_filter, const SearchedObjectTypes &filter_searched_object_types)
bool arePosesFromDemonstrationLeft
void checkParametersFromOtherNode()
virtual ~DirectSearchHandler()
virtual bool backToInitial(const SearchedObjectTypesAndIds &searchedObjectTypesAndIds)
PosePtr getActualRobotPosePtr() const
bool isSameRobotPoseAsBefore
PoseHelperPtr poseHelperPtr
std::vector< std::string > SearchedObjectTypes
void calculateRemainingPosesDistances()
void checkParameterFromOtherNode(ros::NodeHandle &nh, const std::string &node_name, const std::string ¶m_name)
SearchedObjectTypesAndIds getActualFilteredSearchedObjectTypesAndIds() const
PosePtr getActualCameraPosePtr() const
std::vector< asr_msgs::AsrTypeAndId > SearchedObjectTypesAndIds
double remainingPosesDistances
void filterSearchedObjectTypesAndIds(SearchedObjectTypesAndIds &searched_object_types_and_ids_to_filter, const SearchedObjectTypes &filter_searched_object_types)
bool getArePosesFromDemonstrationLeft() const
SearchedObjectTypesAndIds nextFilteredSearchedObjectTypesAndIds
double getRemainingPosesDistances() const
RobotStatePtrVecPtr posesToExplorePtr
virtual bool resetHandler()
int getRemainingPTUPoses() const
boost::shared_ptr< DirectSearchHandler > DirectSearchHandlerPtr
PosePtr nextCameraPosePtr
SearchedObjectTypes getIntersectionOfSearchObjectTypes(const SearchedObjectTypes &first_searched_object_types, const SearchedObjectTypes &second_searched_object_types)
bool getIsSameRobotPoseAsBefore() const
PtuTuplePtr getActualPtuPtr() const
int getRemainingRobotPoses() const
bool getIsNoPoseLeft() const