|
From: <tf...@us...> - 2009-08-09 04:31:46
|
Revision: 21220
http://personalrobots.svn.sourceforge.net/personalrobots/?rev=21220&view=rev
Author: tfoote
Date: 2009-08-09 04:31:35 +0000 (Sun, 09 Aug 2009)
Log Message:
-----------
moving FillImage.h to fill_image.h for Jeremy
Modified Paths:
--------------
pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_camera.cpp
pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_prosilica.cpp
pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_stereo_camera.cpp
pkg/trunk/stacks/camera_drivers/dcam/src/nodes/dcam.cpp
pkg/trunk/stacks/camera_drivers/forearm_cam/src/nodes/forearm_node.cpp
pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/fake_poll_node.cpp
pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/prosilica_node.cpp
pkg/trunk/stacks/stereo/stereo_image_proc/include/cam_bridge.h
pkg/trunk/stacks/stereo/stereo_image_proc/src/imageproc.cpp
pkg/trunk/stacks/stereo/stereo_image_proc/src/stereoproc.cpp
pkg/trunk/vision/jpeg/src/decoder.cpp
pkg/trunk/vision/recognition_lambertian/src/publish_scene.cpp
Added Paths:
-----------
pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/fill_image.h
Removed Paths:
-------------
pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/FillImage.h
Modified: pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_camera.cpp
===================================================================
--- pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_camera.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_camera.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -45,7 +45,7 @@
#include <gazebo/MonoCameraSensor.hh>
#include "sensor_msgs/Image.h"
-#include "sensor_msgs/FillImage.h"
+#include "sensor_msgs/fill_image.h"
using namespace gazebo;
GZ_REGISTER_DYNAMIC_CONTROLLER("ros_camera", RosCamera);
Modified: pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_prosilica.cpp
===================================================================
--- pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_prosilica.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_prosilica.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -46,7 +46,7 @@
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
-#include <sensor_msgs/FillImage.h>
+#include <sensor_msgs/fill_image.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <opencv_latest/CvBridge.h>
Modified: pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_stereo_camera.cpp
===================================================================
--- pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_stereo_camera.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/drivers/simulator/gazebo_plugin/src/ros_stereo_camera.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -42,7 +42,7 @@
#include <gazebo/Body.hh>
#include "sensor_msgs/Image.h"
-#include "sensor_msgs/FillImage.h"
+#include "sensor_msgs/fill_image.h"
using namespace gazebo;
Modified: pkg/trunk/stacks/camera_drivers/dcam/src/nodes/dcam.cpp
===================================================================
--- pkg/trunk/stacks/camera_drivers/dcam/src/nodes/dcam.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/camera_drivers/dcam/src/nodes/dcam.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -38,7 +38,7 @@
#include "ros/node.h"
#include "sensor_msgs/Image.h"
-#include "sensor_msgs/FillImage.h"
+#include "sensor_msgs/fill_image.h"
#include "sensor_msgs/CameraInfo.h"
#include "sensor_msgs/StereoInfo.h"
#include "sensor_msgs/PointCloud.h"
Modified: pkg/trunk/stacks/camera_drivers/forearm_cam/src/nodes/forearm_node.cpp
===================================================================
--- pkg/trunk/stacks/camera_drivers/forearm_cam/src/nodes/forearm_node.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/camera_drivers/forearm_cam/src/nodes/forearm_node.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -43,7 +43,7 @@
#include <ros/node.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
-#include <sensor_msgs/FillImage.h>
+#include <sensor_msgs/fill_image.h>
#include <dynamic_reconfigure/SensorLevels.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/update_functions.h>
Modified: pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/fake_poll_node.cpp
===================================================================
--- pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/fake_poll_node.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/fake_poll_node.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -1,7 +1,7 @@
#include "ros/node.h"
#include "sensor_msgs/Image.h"
#include "sensor_msgs/CameraInfo.h"
-#include "sensor_msgs/FillImage.h"
+#include "sensor_msgs/fill_image.h"
#include "prosilica_cam/PolledImage.h"
#include "prosilica_cam/CameraInfo.h"
Modified: pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/prosilica_node.cpp
===================================================================
--- pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/prosilica_node.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/camera_drivers/prosilica_cam/src/nodes/prosilica_node.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -37,7 +37,7 @@
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
-#include <sensor_msgs/FillImage.h>
+#include <sensor_msgs/fill_image.h>
#include <opencv_latest/CvBridge.h>
#include <camera_calibration/pinhole.h>
#include <image_publisher/image_publisher.h>
Deleted: pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/FillImage.h
===================================================================
--- pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/FillImage.h 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/FillImage.h 2009-08-09 04:31:35 UTC (rev 21220)
@@ -1,69 +0,0 @@
-/*********************************************************************
-* Software License Agreement (BSD License)
-*
-* Copyright (c) 2008, Willow Garage, Inc.
-* All rights reserved.
-*
-* Redistribution and use in source and binary forms, with or without
-* modification, are permitted provided that the following conditions
-* are met:
-*
-* * Redistributions of source code must retain the above copyright
-* notice, this list of conditions and the following disclaimer.
-* * Redistributions in binary form must reproduce the above
-* copyright notice, this list of conditions and the following
-* disclaimer in the documentation and/or other materials provided
-* with the distribution.
-* * Neither the name of the Willow Garage nor the names of its
-* contributors may be used to endorse or promote products derived
-* from this software without specific prior written permission.
-*
-* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
-* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
-* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
-* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
-* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
-* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
-* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
-* LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
-* CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
-* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
-* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
-* POSSIBILITY OF SUCH DAMAGE.
-*********************************************************************/
-
-#ifndef FILLIMAGE_HH
-#define FILLIMAGE_HH
-
-#include "sensor_msgs/Image.h"
-
-namespace sensor_msgs
-{
-
- bool fillImage(Image& image,
- uint32_t type_arg,
- uint32_t rows_arg,
- uint32_t cols_arg,
- uint32_t step_arg,
- void* data_arg)
- {
- image.type = type_arg;
- image.height = rows_arg;
- image.width = cols_arg;
- image.step = step_arg;
- size_t st0 = (step_arg * rows_arg);
- image.data.resize(st0);
- memcpy((char*)(&image.data[0]), (char*)(data_arg), st0);
-
- image.is_bigendian = 0;
- return true;
- }
-
- void clearImage(Image& image)
- {
- image.data.resize(0);
- }
-}
-
-
-#endif
Copied: pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/fill_image.h (from rev 21165, pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/FillImage.h)
===================================================================
--- pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/fill_image.h (rev 0)
+++ pkg/trunk/stacks/common_msgs/sensor_msgs/include/sensor_msgs/fill_image.h 2009-08-09 04:31:35 UTC (rev 21220)
@@ -0,0 +1,69 @@
+/*********************************************************************
+* Software License Agreement (BSD License)
+*
+* Copyright (c) 2008, Willow Garage, Inc.
+* All rights reserved.
+*
+* Redistribution and use in source and binary forms, with or without
+* modification, are permitted provided that the following conditions
+* are met:
+*
+* * Redistributions of source code must retain the above copyright
+* notice, this list of conditions and the following disclaimer.
+* * Redistributions in binary form must reproduce the above
+* copyright notice, this list of conditions and the following
+* disclaimer in the documentation and/or other materials provided
+* with the distribution.
+* * Neither the name of the Willow Garage nor the names of its
+* contributors may be used to endorse or promote products derived
+* from this software without specific prior written permission.
+*
+* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
+* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
+* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
+* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
+* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
+* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
+* LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
+* CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
+* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
+* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
+* POSSIBILITY OF SUCH DAMAGE.
+*********************************************************************/
+
+#ifndef FILLIMAGE_HH
+#define FILLIMAGE_HH
+
+#include "sensor_msgs/Image.h"
+
+namespace sensor_msgs
+{
+
+ bool fillImage(Image& image,
+ uint32_t type_arg,
+ uint32_t rows_arg,
+ uint32_t cols_arg,
+ uint32_t step_arg,
+ void* data_arg)
+ {
+ image.type = type_arg;
+ image.height = rows_arg;
+ image.width = cols_arg;
+ image.step = step_arg;
+ size_t st0 = (step_arg * rows_arg);
+ image.data.resize(st0);
+ memcpy((char*)(&image.data[0]), (char*)(data_arg), st0);
+
+ image.is_bigendian = 0;
+ return true;
+ }
+
+ void clearImage(Image& image)
+ {
+ image.data.resize(0);
+ }
+}
+
+
+#endif
Modified: pkg/trunk/stacks/stereo/stereo_image_proc/include/cam_bridge.h
===================================================================
--- pkg/trunk/stacks/stereo/stereo_image_proc/include/cam_bridge.h 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/stereo/stereo_image_proc/include/cam_bridge.h 2009-08-09 04:31:35 UTC (rev 21220)
@@ -36,7 +36,7 @@
#define CAM_BRIDGE_HH
#include "sensor_msgs/RawStereo.h"
-#include "sensor_msgs/FillImage.h"
+#include "sensor_msgs/fill_image.h"
#include "image.h"
namespace cam_bridge
Modified: pkg/trunk/stacks/stereo/stereo_image_proc/src/imageproc.cpp
===================================================================
--- pkg/trunk/stacks/stereo/stereo_image_proc/src/imageproc.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/stereo/stereo_image_proc/src/imageproc.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -38,7 +38,7 @@
#include "cam_bridge.h"
#include "sensor_msgs/Image.h"
-#include "sensor_msgs/FillImage.h"
+#include "sensor_msgs/fill_image.h"
#include "sensor_msgs/CameraInfo.h"
#include <boost/thread.hpp>
Modified: pkg/trunk/stacks/stereo/stereo_image_proc/src/stereoproc.cpp
===================================================================
--- pkg/trunk/stacks/stereo/stereo_image_proc/src/stereoproc.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/stacks/stereo/stereo_image_proc/src/stereoproc.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -41,7 +41,7 @@
#include "cam_bridge.h"
#include "sensor_msgs/Image.h"
-#include "sensor_msgs/FillImage.h"
+#include "sensor_msgs/fill_image.h"
#include "sensor_msgs/CameraInfo.h"
#include "sensor_msgs/StereoInfo.h"
#include "sensor_msgs/PointCloud.h"
Modified: pkg/trunk/vision/jpeg/src/decoder.cpp
===================================================================
--- pkg/trunk/vision/jpeg/src/decoder.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/vision/jpeg/src/decoder.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -33,7 +33,7 @@
*********************************************************************/
#include <sensor_msgs/Image.h>
-#include <sensor_msgs/FillImage.h>
+#include <sensor_msgs/fill_image.h>
#include <sensor_msgs/CompressedImage.h>
#include <ros/ros.h>
Modified: pkg/trunk/vision/recognition_lambertian/src/publish_scene.cpp
===================================================================
--- pkg/trunk/vision/recognition_lambertian/src/publish_scene.cpp 2009-08-09 04:20:46 UTC (rev 21219)
+++ pkg/trunk/vision/recognition_lambertian/src/publish_scene.cpp 2009-08-09 04:31:35 UTC (rev 21220)
@@ -52,7 +52,7 @@
#include <sensor_msgs/DisparityInfo.h>
#include <opencv_latest/CvBridge.h>
-#include <sensor_msgs/FillImage.h>
+#include <sensor_msgs/fill_image.h>
#include <std_msgs/String.h>
#include <point_cloud_mapping/cloud_io.h>
This was sent by the SourceForge.net collaborative development platform, the world's largest Open Source development site.
|