14 #include <sensor_msgs/CameraInfo.h>    15 #include <visualization_msgs/Marker.h>    16 #include <visualization_msgs/MarkerArray.h>    28         lens.ns = 
"camera_markers";
    30         lens.action = Marker::ADD;
    31         lens.type = visualization_msgs::Marker::CYLINDER;
    32         lens.frame_locked = 
true;
    41         lens.pose.orientation.w = 1;
    45         board.ns = 
"camera_markers";
    47         board.action = Marker::ADD;
    48         board.type = Marker::CUBE;
    49         board.frame_locked = 
true;
    57         board.pose.orientation.w = 1;
    61         wire.ns = 
"camera_markers";
    63         wire.action = Marker::ADD;
    64         wire.type = Marker::CUBE;
    65         wire.frame_locked = 
true;
    73         wire.pose.position.x = 0;
    76         wire.pose.orientation.w = 1;
    78         markers.markers.push_back(lens);
    79         markers.markers.push_back(board);
    80         markers.markers.push_back(wire);
    85 int main(
int argc, 
char **argv)
    93         auto camera_info = ros::topic::waitForMessage<sensor_msgs::CameraInfo>(
"camera_info", 
nh);
    99         ROS_INFO(
"Camera markers initialized");
 
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
MarkerArray createMarkers()
int main(int argc, char **argv)