Classes | |
class | ConcatApproxEqualePoses |
class | directSearchAction |
class | DirectSearchHandler |
class | DirectSearchManager |
class | DoFilterIteration |
class | FilterBasic |
class | FilterIsPositionAllowed |
class | FilterMinimumNumberOfDeletedNormals |
class | FilterPosesDependingOnAlreadyFoundObjectTypes |
class | GridInitialisation |
class | GridManager |
class | PoseHelper |
class | PtuTuple |
class | RecordingManager |
class | RobotState |
class | SortHelper |
Functions | |
template<typename T > | |
void | checkParameterFromOtherNode (ros::NodeHandle &nh, const std::string &node_name, const std::string ¶m_name) |
void | checkParametersFromOtherNode () |
bool | checkSearchedObjectTypesAreEquale (const SearchedObjectTypes &searchecObjectTypes1, const SearchedObjectTypes &searchecObjectTypes2) |
void | filterSearchedObjectTypes (SearchedObjectTypes &searched_object_types_to_filter, const SearchedObjectTypes &filter_searched_object_types) |
void | filterSearchedObjectTypesAndIds (SearchedObjectTypesAndIds &searched_object_types_and_ids_to_filter, const SearchedObjectTypes &filter_searched_object_types) |
SearchedObjectTypes | getIntersectionOfSearchObjectTypes (const SearchedObjectTypes &first_searched_object_types, const SearchedObjectTypes &second_searched_object_types) |
SearchedObjectTypes | getSearchedObjectTypesFromAWithoutB (const SearchedObjectTypes &a, const SearchedObjectTypes &b) |
std::ostream & | operator<< (std::ostream &strm, const RobotState &robot_state) |
std::ostream & | operator<< (std::ostream &strm, const RobotStatePtr &robot_state_ptr) |
std::ostream & | operator<< (std::ostream &strm, const RobotStatePtrVec &robot_state_ptr_vec) |
std::ostream & | operator<< (std::ostream &strm, const RobotStatePtrVecPtr &robot_state_ptr_vec_ptr) |
std::ostream & | operator<< (std::ostream &strm, const SearchedObjectTypes &already_searched_object_types) |
std::ostream & | operator<< (std::ostream &strm, const PosePtr &pose_ptr) |
std::ostream & | operator<< (std::ostream &strm, const PtuTuple &ptu_tuple) |
std::ostream & | operator<< (std::ostream &strm, const PtuTuplePtr &ptu_tuple_ptr) |
std::ostream & | operator<< (std::ostream &strm, const PtuTuplePtrVec &ptu_tuple_ptr_vec) |
std::ostream & | operator<< (std::ostream &strm, const PtuTuplePtrVecPtr &ptu_tuple_ptr_vec_ptr) |
Copyright (c) 2016, Borella Jocelyn, Karrenbauer Oliver, Meißner Pascal All rights reserved.
Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met:
THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
Definition at line 116 of file concat_approx_equale_poses.hpp.
Definition at line 123 of file direct_search_handler.hpp.
Definition at line 88 of file do_filter_iteration.hpp.
Definition at line 48 of file filter_basic.hpp.
Definition at line 72 of file filter_is_position_allowed.hpp.
typedef boost::shared_ptr<FilterMinimumNumberOfDeletedNormals> directSearchWS::FilterMinimumNumberOfDeletedNormalsPtr |
Definition at line 59 of file filter_minimum_number_of_deleted_normals.hpp.
typedef boost::shared_ptr<FilterPosesDependingOnAlreadyFoundObjectTypes> directSearchWS::FilterPosesDependingOnAlreadyFoundObjectTypesPtr |
Definition at line 70 of file filter_poses_depending_on_already_found_object_types.hpp.
Definition at line 107 of file pose_helper.hpp.
Definition at line 28 of file ptu_tuple.hpp.
Definition at line 69 of file ptu_tuple.hpp.
typedef std::vector<PtuTuplePtr> directSearchWS::PtuTuplePtrVec |
Definition at line 70 of file ptu_tuple.hpp.
Definition at line 71 of file ptu_tuple.hpp.
Definition at line 50 of file robot_state.hpp.
typedef std::vector<RobotStatePtr> directSearchWS::RobotStatePtrVec |
Definition at line 51 of file robot_state.hpp.
Definition at line 52 of file robot_state.hpp.
typedef std::vector<std::string> directSearchWS::SearchedObjectTypes |
Definition at line 27 of file ptu_tuple.hpp.
typedef std::vector<asr_msgs::AsrTypeAndId> directSearchWS::SearchedObjectTypesAndIds |
Definition at line 45 of file direct_search_handler.hpp.
Definition at line 47 of file sort_helper.hpp.
void directSearchWS::checkParameterFromOtherNode | ( | ros::NodeHandle & | nh, |
const std::string & | node_name, | ||
const std::string & | param_name | ||
) |
Definition at line 182 of file direct_search_handler.cpp.
void directSearchWS::checkParametersFromOtherNode | ( | ) |
Definition at line 170 of file direct_search_handler.cpp.
bool directSearchWS::checkSearchedObjectTypesAreEquale | ( | const SearchedObjectTypes & | searchecObjectTypes1, |
const SearchedObjectTypes & | searchecObjectTypes2 | ||
) |
Definition at line 398 of file direct_search_manager.cpp.
void directSearchWS::filterSearchedObjectTypes | ( | SearchedObjectTypes & | searched_object_types_to_filter, |
const SearchedObjectTypes & | filter_searched_object_types | ||
) |
Definition at line 126 of file direct_search_handler.cpp.
void directSearchWS::filterSearchedObjectTypesAndIds | ( | SearchedObjectTypesAndIds & | searched_object_types_and_ids_to_filter, |
const SearchedObjectTypes & | filter_searched_object_types | ||
) |
Definition at line 141 of file direct_search_handler.cpp.
SearchedObjectTypes directSearchWS::getIntersectionOfSearchObjectTypes | ( | const SearchedObjectTypes & | first_searched_object_types, |
const SearchedObjectTypes & | second_searched_object_types | ||
) |
Definition at line 154 of file direct_search_handler.cpp.
SearchedObjectTypes directSearchWS::getSearchedObjectTypesFromAWithoutB | ( | const SearchedObjectTypes & | a, |
const SearchedObjectTypes & | b | ||
) |
Definition at line 410 of file direct_search_manager.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const RobotState & | robot_state | ||
) |
Definition at line 49 of file robot_state.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const RobotStatePtr & | robot_state_ptr | ||
) |
Definition at line 55 of file robot_state.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const RobotStatePtrVec & | robot_state_ptr_vec | ||
) |
Definition at line 59 of file robot_state.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const RobotStatePtrVecPtr & | robot_state_ptr_vec_ptr | ||
) |
Definition at line 66 of file robot_state.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const SearchedObjectTypes & | already_searched_object_types | ||
) |
Definition at line 88 of file ptu_tuple.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const PosePtr & | pose_ptr | ||
) |
Definition at line 84 of file ptu_tuple.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const PtuTuple & | ptu_tuple | ||
) |
Definition at line 98 of file ptu_tuple.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const PtuTuplePtr & | ptu_tuple_ptr | ||
) |
Definition at line 108 of file ptu_tuple.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const PtuTuplePtrVec & | ptu_tuple_ptr_vec | ||
) |
Definition at line 112 of file ptu_tuple.cpp.
std::ostream & directSearchWS::operator<< | ( | std::ostream & | strm, |
const PtuTuplePtrVecPtr & | ptu_tuple_ptr_vec_ptr | ||
) |
Definition at line 119 of file ptu_tuple.cpp.