Public Member Functions | Public Attributes | Private Attributes | List of all members
turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin Class Reference

Public Member Functions

void addObject (object_recognition_msgs::RecognizedObject object)
 
unsigned int countObjects () const
 
const geometry_msgs::PoseStamped & getCentroid () const
 
std::string getName () const
 
object_recognition_msgs::ObjectType getType () const
 

Public Attributes

unsigned int id
 

Private Attributes

geometry_msgs::PoseStamped centroid
 
double confidence
 
std::vector< object_recognition_msgs::RecognizedObject > objects
 

Detailed Description

Private class for clustering together the same object detected in consecutive observations and provide a more accurate pose as the centroid of all observations.

Definition at line 608 of file object_detection_action_server.cpp.

Member Function Documentation

void turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::addObject ( object_recognition_msgs::RecognizedObject  object)
inline

Definition at line 615 of file object_detection_action_server.cpp.

unsigned int turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::countObjects ( ) const
inline

Definition at line 612 of file object_detection_action_server.cpp.

const geometry_msgs::PoseStamped& turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::getCentroid ( ) const
inline

Definition at line 613 of file object_detection_action_server.cpp.

std::string turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::getName ( ) const
inline

Definition at line 646 of file object_detection_action_server.cpp.

object_recognition_msgs::ObjectType turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::getType ( ) const
inline

Definition at line 662 of file object_detection_action_server.cpp.

Member Data Documentation

geometry_msgs::PoseStamped turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::centroid
private

Definition at line 674 of file object_detection_action_server.cpp.

double turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::confidence
private

Definition at line 673 of file object_detection_action_server.cpp.

unsigned int turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::id

Definition at line 611 of file object_detection_action_server.cpp.

std::vector<object_recognition_msgs::RecognizedObject> turtlebot_arm_object_manipulation::ObjectDetectionServer::DetectionBin::objects
private

Definition at line 675 of file object_detection_action_server.cpp.


The documentation for this class was generated from the following file:


turtlebot_arm_object_manipulation
Author(s): Jorge Santos
autogenerated on Fri Feb 7 2020 03:56:40