26 asr_msgs::AsrAttributedPointCloud attributedPointCloud,
27 std::string markerNameSpace)
30 std::string referenceNameSpace = markerNameSpace +
"_reference";
31 std::string arrowNamespace = markerNameSpace +
"_arrows";
32 std::string pointCloudNamespace = markerNameSpace +
"_point_cloud";
44 std::map< std::string, ColorRGBA> objectColors;
45 for (asr_msgs::AsrAttributedPoint attributedPoint: attributedPointCloud.elements)
47 std::string object_type = attributedPoint.type;
49 if (objectColors.find(object_type) != objectColors.end())
50 arrowColor = objectColors[object_type];
54 objectColors[object_type] = arrowColor;
57 ISM::PointPtr ismPointPtr(
new ISM::Point(attributedPoint.pose.position.x,
58 attributedPoint.pose.position.y,
59 attributedPoint.pose.position.z));
static ColorRGBA hsvToRGBA(double hue, double saturation, double value)
visualization_msgs::Marker Marker
static Marker createSphereMarker(ISM::PointPtr point, std::string baseFrame, std::string markerNamespace, int id, float radius, ColorRGBA color, double markerLifetime)
static ColorRGBA createColorRGBA(float red, float green, float blue, float alpha)
std_msgs::ColorRGBA ColorRGBA
static Marker createArrowMarkerToPoint(ISM::PointPtr fromPoint, ISM::PointPtr to, std::string baseFrame, std::string markerNamespace, int id, float xScale, float yScale, float zScale, ColorRGBA color, double markerLifetime)
void addMarker(visualization_msgs::Marker marker)
void addPosePredictionVisualization(ISM::PosePtr referencePosePtr, asr_msgs::AsrAttributedPointCloud attributedPointCloud, std::string markerNameSpace)