#include <vector>#include <string>#include <fstream>#include <sstream>#include <algorithm>#include <tuple>#include <memory>#include <ros/ros.h>#include <rapidxml.hpp>#include <math.h>#include <boost/lexical_cast.hpp>#include <boost/shared_ptr.hpp>#include <eigen3/Eigen/Geometry>#include "tf/transform_datatypes.h"#include "asr_msgs/AsrTypeAndId.h"#include "model/robot_state.hpp"#include "model/ptu_tuple.hpp"#include "helper/pose_helper.hpp"

Go to the source code of this file.
Classes | |
| class | directSearchWS::DirectSearchHandler |
Namespaces | |
| directSearchWS | |
Typedefs | |
| typedef boost::shared_ptr< DirectSearchHandler > | directSearchWS::DirectSearchHandlerPtr |
| typedef std::vector< asr_msgs::AsrTypeAndId > | directSearchWS::SearchedObjectTypesAndIds |
Functions | |
| template<typename T > | |
| void | directSearchWS::checkParameterFromOtherNode (ros::NodeHandle &nh, const std::string &node_name, const std::string ¶m_name) |
| void | directSearchWS::checkParametersFromOtherNode () |
| void | directSearchWS::filterSearchedObjectTypes (SearchedObjectTypes &searched_object_types_to_filter, const SearchedObjectTypes &filter_searched_object_types) |
| void | directSearchWS::filterSearchedObjectTypesAndIds (SearchedObjectTypesAndIds &searched_object_types_and_ids_to_filter, const SearchedObjectTypes &filter_searched_object_types) |
| SearchedObjectTypes | directSearchWS::getIntersectionOfSearchObjectTypes (const SearchedObjectTypes &first_searched_object_types, const SearchedObjectTypes &second_searched_object_types) |