sensor_message_gateway_main.cpp
Go to the documentation of this file.
00001 
00060 #include "cob_people_detection/sensor_message_gateway_node.h"
00061 
00062 //#######################
00063 //#### main programm ####
00064 int main(int argc, char** argv)
00065 {
00066         // Initialize ROS, specify name of node
00067         ros::init(argc, argv, "sensor_message_gateway");
00068 
00069         // Create a handle for this node, initialize node
00070         ros::NodeHandle nh;
00071 
00072         // Create SensorMessageGatewayNode class instance
00073         cob_people_detection::SensorMessageGatewayNode sensor_message_gateway_node(nh);
00074 
00075         // Create action nodes
00076         //DetectObjectsAction detect_action_node(object_detection_node, nh);
00077         //AcquireObjectImageAction acquire_image_node(object_detection_node, nh);
00078         //TrainObjectAction train_object_node(object_detection_node, nh);
00079 
00080         ros::spin();
00081 
00082         return 0;
00083 }


cob_people_detection
Author(s): Richard Bormann , Thomas Zwölfer
autogenerated on Fri Aug 28 2015 10:24:13