[ros-users] errors with image transport

Brian Gerkey gerkey at willowgarage.com
Tue Mar 9 17:47:45 UTC 2010


hi Dan,

On Tue, Mar 9, 2010 at 8:24 AM, Dan Lazewatsky
<lazewatskyd at cse.wustl.edu> wrote:
> I've been having some problems building image transport. On Mac OSX 10.5, I
> can't build image transport at all. The log file is attached.
> The relevant lines are:
> /Users/lazewatskyd/ros/stacks/image_common/image_transport/src/publisher.cpp:
> In member function ‘void
> image_transport::Publisher::Impl::subscriberCB(const
> image_transport::SingleSubscriberPublisher&, const
> image_transport::SubscriberStatusCallback&)’:
> /Users/lazewatskyd/ros/stacks/image_common/image_transport/include/image_transport/single_subscriber_publisher.h:37:
> error: ‘boost::function<void ()(const sensor_msgs::Image&)>
> image_transport::SingleSubscriberPublisher::publish_fn_’ is private
> /Users/lazewatskyd/ros/stacks/image_common/image_transport/src/publisher.cpp:90:
> error: within this context

I had the same problem on OS X 10.5, using gcc 4.0.1.  I was not able
to find an appropriate fix to the code and ended up working around the
problem by upgrading to gcc 4.2.  The problem and workaround are
described in this ticket:
  https://code.ros.org/trac/ros-pkg/ticket/3670#comment:3

> On Ubuntu 9.04, I can't build compressed_image_transport. The log is also
> attached.
> Relevant lines:
> /project/robotics/users/lazewatskyd/pkgs/image_transport_plugins/compressed_image_transport/src/compressed_publisher.cpp:30:
> error: ‘const class ros::NodeHandle’ has no member named ‘getParamCached’
> /project/robotics/users/lazewatskyd/pkgs/image_transport_plugins/compressed_image_transport/src/compressed_publisher.cpp:36:
> error: ‘const class ros::NodeHandle’ has no member named ‘getParamCached’
> /project/robotics/users/lazewatskyd/pkgs/image_transport_plugins/compressed_image_transport/src/compressed_publisher.cpp:43:
> error: ‘const class ros::NodeHandle’ has no member named ‘getParamCached’

Looks like your copy of ros is out of date.
NodeHandle::getParamCached() has been in roscpp since ros 0.11.0.  If
you're working from SVN, a simple 'svn up' in the ros directory will
bring things up to date.

	brian.



More information about the ros-users mailing list