21 #include <ISM/common_type/RecognitionResult.hpp> 22 #include <ISM/typedef.hpp> 26 #include <dynamic_reconfigure/server.h> 27 #include <asr_ism_visualizations/ism_result_visualizerConfig.h> 36 reconfigure_server_ =
new dynamic_reconfigure::Server<asr_ism_visualizations::ism_result_visualizerConfig>(nh);
74 std::vector<ISM::RecognitionResultPtr>
traverseTree(ISM::RecognitionResultPtr result,
int depth);
79 ISM::PosePtr
getAdjustedPose(ISM::PosePtr pose,
int depth,
bool is_child);
80 ISM::QuaternionPtr
calculateOrientation(ISM::PointPtr from_point_ptr, ISM::PointPtr to_point_ptr,
bool pose_relative =
false);
81 ISM::PosePtr
calculateCylinderPose(
const ISM::PosePtr from_pose_ptr,
const ISM::PointPtr to_point_ptr,
double height);
void addVisualization(const ISM::RecognitionResultPtr recognition_result)
void setSceneCount(int scene_count)
visualization_msgs::MarkerArray genTestMarker()
std::map< std::string, ISM::PosePtr > ism_to_parent_ism_map_
~ISMResultVisualizerRVIZ()
std::vector< ISM::RecognitionResultPtr > traverseTree(ISM::RecognitionResultPtr result, int depth)
boost::shared_ptr< ISMResultVisualizerRVIZ > ISMResultVisualizerRVIZPtr
ISMResultVisualizerRVIZ(const ros::Publisher &publisher, const ros::NodeHandle &nh)
#define ROS_DEBUG_STREAM(args)
visualization_msgs::MarkerArray MarkerArray
ISM::PosePtr getAdjustedPose(ISM::PosePtr pose, int depth, bool is_child)
Helper method to translate a point. So we can see the tree depth objects residing in trough their cor...
ISM::PointPtr last_ref_pose_
dynamic_reconfigure::Server< asr_ism_visualizations::ism_result_visualizerConfig > * reconfigure_server_
ISM::QuaternionPtr calculateOrientation(ISM::PointPtr from_point_ptr, ISM::PointPtr to_point_ptr, bool pose_relative=false)
std::map< std::string, int > ism_to_depth_map_
std::map< std::string, VIZ::ColorRGBA > ism_to_color_map_
visualization_msgs::MarkerArray getMarkersFromResult(const ISM::RecognitionResultPtr result)
std::map< std::string, std::pair< ISM::PosePtr, double > > cylinder_map_
void dynamicReconfCallback(asr_ism_visualizations::ism_result_visualizerConfig &config, uint32_t level)
ISM::PosePtr calculateCylinderPose(const ISM::PosePtr from_pose_ptr, const ISM::PointPtr to_point_ptr, double height)