-
 

Package Summary

Tags No category tags.
Version 1.17.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version noetic-devel
Last Updated 2024-09-13
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS

Additional Links

Maintainers

  • Michael Carroll
  • Shane Loretz

Authors

  • Ken Conley
  • Dirk Thomas
  • Jacob Perron
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rospy

1.17.0 (2024-09-13)

  • Stop using deprecated logger.warn (#2191)
  • Expose is_shutdown_requested in rospy module. (#2267)
  • Fix error "s is not defined" (#2328)
  • Contributors: Guglielmo Gemignani, Michael Grupp, vineet131

1.16.0 (2023-02-15)

1.15.15 (2022-11-23)

  • Move \@jacobperron from maintainer to author (#2302)
  • Add a workaround for a race condition while closing the socket (#2212) (#2233)
  • Contributors: Shane Loretz, Daniele Calisi, madmage

1.15.14 (2022-01-06)

1.15.13 (2021-09-22)

1.15.12 (2021-09-21)

  • Document current_real in timer.py (#2178)
  • Do not set self.transport unless persistent in ServiceProxy (#2171)
  • Fix #2123: Do not raise exception if socket is busy in TCPROSTransport (#2131)
  • Contributors: Kevin Chang, Shingo Kitagawa, 金梦磊

1.15.11 (2021-04-06)

1.15.10 (2021-03-18)

  • Fix "TypeError: not enough arguments for format string" (#2127)
  • Use Logger.warning() instead of the deprecated warn() (#2120)
  • Fix AttributeError isAlive (#2092)
  • Contributors: Brutus The Tschiepel, mikolajz, 金梦磊

1.15.9 (2020-10-16)

  • Update maintainers (#2075)
  • Fix spelling (#2066)
  • Fix error handling with Python 3 (#2050)
  • Contributors: Markus Grimm, Sean Yen, Shane Loretz, larslue, salihmarangoz, tomoya

1.15.8 (2020-07-23)

  • remove not existing NodeProxy from rospy __all_ (#2007)
  • fix typo in topics.py (#1977)

1.15.7 (2020-05-28)

1.15.6 (2020-05-21)

1.15.5 (2020-05-15)

1.15.4 (2020-03-19)

  • add exception for ConnectionAbortedError (#1908)
  • fix mac trying to use epoll instead of kqueue (#1907)
  • fix AttributeError: __exit_ (#1915, regression from 1.14.4)

1.15.3 (2020-02-28)

1.15.2 (2020-02-25)

1.15.1 (2020-02-24)

  • use setuptools instead of distutils (#1870)

1.15.0 (2020-02-21)

  • fix dictionary changed size during iteration (#1894)

1.14.4 (2020-02-20)

  • add default ROS_MASTER_URI (#1666)
  • bump CMake minimum version to avoid CMP0048 warning (#1869)
  • reuse xmlrpc connections everywhere (#1471)
  • use cached parameter for rosout_disable_topics_generation (#1881)
  • add args and kwargs to rospy.log* (#1289)
  • add kwargs to internal logging functions (#1290)
  • add get_param_cached (#1515)
  • more Python 3 compatibility (#1795)
  • fix line endings to be LF (#1794)
  • use condition attributes to specify Python 2 and 3 dependencies (#1792)
  • fix dynamic windowing for Topic Statistics (#1695)
  • do not raise socket exception during shutdown (#1720)
  • add possibility to pass rospy.Duration as timeout to wait_for_service and wait_for_message (#1703)
  • add is_legal_remap() to rosgraph to make remap-detection more precise (#1683)
  • add missing comma in the list of strings (#1760)
  • switch to yaml.safe_load(_all) to prevent YAMLLoadWarning (#1688)
  • fix error handling for Topic constructor (#1701)
  • make sigterm handling Python 3 compatible (#1559)
  • update wiki.ros.org URLs (#1536)
  • show connection info on rosnode info (#1497)
  • import socket, threading in udpros.py (#1494)

1.14.3 (2018-08-06)

  • maintain exception info in RosOutHandler (#1442)

1.14.2 (2018-06-06)

  • fix some errors in some probably not frequented code paths (#1415)
  • fix thread problem with get_topics() (#1416)

1.14.1 (2018-05-21)

1.14.0 (2018-05-21)

  • add API to suppress sequential identical messages (#1309)
  • add parameter to stop clients from generating rosout topics list (#1241)
  • add rosconsole echo (#1324)

1.13.6 (2018-02-05)

  • raise the correct exception from AnyMsg.serialize (#1311)
  • remove unreachable exceptions (#1260)
  • replace Thread.setDaemon() using new API (#1276)

1.13.5 (2017-11-09)

  • fix regresssion from 1.13.3 (#1224)

1.13.4 (2017-11-02)

  • fix uri in message (#1213, regression from 1.13.3)

1.13.3 (2017-10-25)

  • change rospy.Rate hz type from int to float (#1177)
  • use defined error codes rather than hardcoded integers (#1174)
  • improve log messages when waiting for service (#1026)
  • improve logger tests (#1144)

1.13.2 (2017-08-15)

  • fix stack frame identification in rospy logging (#1141, regression from 1.13.1)

1.13.1 (2017-07-27)

  • improve rospy.logXXX_throttle performance (#1091)
  • add option to reset timer when time moved backwards (#1083)
  • abort topic lookup on connection refused (#1044)
  • add rospy.logXXX_once (#1041)
  • remove "ROS time moved backwards" log message (#1027)
  • sleep in rospy wait_for_service even if exceptions raised (#1025)
  • add named loggers (#948)

1.13.0 (2017-02-22)

1.12.7 (2017-02-17)

  • make get_published_topics threadsafe (#958)
  • use poll in write_header() if available to support higher numbered fileno (#929)
  • use epoll instead of poll if available to gracefully close hung connections (#831)
  • fix Python 3 compatibility issues (#565)

1.12.6 (2016-10-26)

  • improve reconnection logic on timeout and other common errors (#851)
  • remove duplicated function (#783)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • raise error on rospy.init_node with None or empty node name string (#895)
  • fix wrong type in docstring for rospy.Timer (#878)
  • fix order of init and publisher in example (#873)

1.12.2 (2016-06-03)

  • add logXXX_throttle functions (#812)

1.12.1 (2016-04-18)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

1.11.17 (2016-03-11)

  • preserve identity of numpy_msg(T) (#758)

1.11.16 (2015-11-09)

  • catch ROSInterruptException from rospy timers when shutting down (#690)

1.11.15 (2015-10-13)

  • validate name after remapping (#669)

1.11.14 (2015-09-19)

  • fix memory/thread leak with QueuedConnection (#661)
  • fix signaling already shutdown to client hooks with the appropriate signature (#651)
  • fix bug with missing current logger levels (#631)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • add rosconsole command line tool to change logger levels (#576)
  • add accessor for remaining time of the Rate class (#588)
  • fix high latency when using asynchronous publishing (#547)
  • fix error handling when publishing on Empty topic (#566)

1.11.10 (2014-12-22)

  • add specific exception for time jumping backwards (#485)
  • make param functions thread-safe (#523)
  • fix infinitely retrying subscriber (#533)
  • fix removal of QueuedConnection leading to wrong subscriber count (#526)
  • fix TCPROS header validation when [callerid]{.title-ref} header is not set (#522, regression from 1.11.1)
  • fix memory leak when using subcriber statistics (#520)
  • fix reported traffic in bytes from Python nodes (#501)

1.11.9 (2014-08-18)

  • populate delivered_msgs field of TopicStatistics message (#486)

1.11.8 (2014-08-04)

  • fix topic/connection statistics reporting code (#482)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

  • make MasterProxy thread-safe (#459)
  • check ROS_HOSTNAME for localhost / ROS_IP for 127./::1 and prevent connections from other hosts in that case ([#452 <https://github.com/ros/ros_comm/issues/452>]{.title-ref})_

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • Python 3 compatibility (#426)

1.11.3 (2014-05-21)

  • allow shutdown hooks to be any callable object (#410)
  • add demux program and related scripts (#407)
  • add publisher queue_size to rostopic

1.11.2 (2014-05-08)

  • use publisher queue_size for statistics (#398)

1.11.1 (2014-05-07)

  • improve asynchonous publishing performance (#373)
  • add warning when queue_size is omitted for rospy publisher (#346)
  • add optional topic/connection statistics (#398)
  • add transport information in SlaveAPI::getBusInfo() for roscpp & rospy (#328)
  • allow custom error handlers for services (#375)
  • add architecture_independent flag in package.xml (#391)

1.11.0 (2014-03-04)

  • fix exception handling for queued connections (#369)
  • use catkin_install_python() to install Python scripts (#361)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • implement optional queueing for rospy publications (#169)
  • overwrite __repr__ for rospy.Duration and Time (ros/genpy#24)
  • add missing dependency on roscpp

1.9.50 (2013-10-04)

  • add support for python coverage tool to work in callbacks

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

  • make rospy nodes killable while waiting for master (#262)

1.9.47 (2013-07-03)

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • add missing run_depend on python-yaml
  • allow configuration of ports for XML RPCs and TCP ROS
  • fix race condition where rospy subscribers do not connect to all publisher
  • fix closing and deregistering connection when connect fails (#128)
  • fix log level of RosOutHandler (#210)

1.9.44 (2013-03-21)

1.9.43 (2013-03-13)

1.9.42 (2013-03-08)

  • make dependencies on rospy optional by refactoring RosStreamHandler to rosgraph (#179)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

  • add colorization for rospy log output (#3691)
  • fix socket polling under Windows (#3959)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
actionlib
actionlib_tools
amr_interop_bridge
app_manager
arbotix_python
epson_imu
fam_cmd_i2c
gds_helper
gnc_visualizer
async_web_server_cpp
audibot_gazebo
sound_play
axis_camera
bagger
bondpy
calibration_estimation
capabilities
cob_android_resource_server
cob_android_script_server
cob_command_gui
cob_dashboard
cob_helper_tools
cob_monitoring
cob_script_server
generic_throttle
scenario_test_tools
service_tools
cob_description
cob_base_controller_utils
cob_cartesian_controller
cob_frame_tracker
cob_hardware_emulation
cob_model_identifier
cob_obstacle_distance
cob_twist_controller
cob_bms_driver
cob_light
cob_mimic
cob_phidget_em_state
cob_phidget_power_state
cob_phidgets
cob_relayboard
cob_sound
cob_voltage_control
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_map_accessibility_analysis
cob_default_robot_behavior
cob_gazebo
cob_gazebo_tools
cob_gazebo_worlds
crane_x7_msgs
cras_py_common
cras_topic_tools
dataspeed_pds_rqt
dataspeed_pds_scripts
dataspeed_ulc_can
dbw_fca_can
dbw_mkz_can
dbw_polaris_can
ddynamic_reconfigure_python
depthai_examples
depthai_ros_driver
diagnostic_aggregator
diagnostic_common_diagnostics
rosdiagnostic
test_diagnostic_aggregator
dual_quaternions_ros
dynamic_reconfigure
dynamixel_sdk
end_effector
ensenso_camera
ensenso_camera_test
smach_ros
fadecandy_driver
fetch_open_auto_dock
fetch_moveit_config
flexbe_core
flexbe_input
flexbe_mirror
flexbe_msgs
flexbe_onboard
flexbe_states
flexbe_testing
flexbe_widget
flexbe_app
floam
frame_editor
franka_example_controllers
franka_gazebo
gazebo_plugins
gazebo_video_monitor_utils
tf2_py
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
gps_common
hfl_driver
ifm3d_ros_driver
camera_calibration
industrial_robot_simulator
inno_sim_interface
interactive_markers
drone_wrapper
rotors_driver
rqt_drone_teleop
rqt_ground_robot_teleop
tello_driver
joint_state_publisher
joint_state_publisher_gui
wiimote
bayesian_belief_networks
chaplus_ros
gdrive_ros
google_chat_ros
julius_ros
pgm_learner
ros_google_cloud_language
rospatlite
rostwitter
switchbot_ros
webrtcvad_ros
dynamic_tf_publisher
jsk_network_tools
multi_map_server
jsk_tools
joy_mouse
pddl_planner
jsk_perception
sound_classification
jsk_interactive
jsk_interactive_test
khi_robot_test
map_laser
leo_fw
laptop_battery_monitor
multires_image
swri_cli_tools
swri_image_util
swri_rospy
swri_transform_util
marvelmind_nav
mavros
microstrain_inertial_rqt
mikrotik_swos_tools
mir_driver
mongodb_log
mongodb_store
move_base_sequence
move_base_swp
moveit_commander
moveit_ros_planning_interface
moveit_ros_visualization
moveit_python
movie_publisher
mqtt_bridge
mrpt_graphslam_2d
fkie_master_discovery
fkie_master_sync
fkie_node_manager
fkie_node_manager_daemon
base_local_planner
fake_localization
map_server
move_base
nmea_navsat_driver
nodelet
test_nodelet_topic_tools
ntrip_client
osm_cartography
route_network
ov_eval
openni2_launch
oxford_gps_eth
pal_carbon_collector
pal_statistics
pass_through_controllers
face_detector
people_velocity_tracker
pilz_robot_programming
pilz_status_indicator_rqt
pincher_arm_bringup
pr2_position_scripts
pr2_teleop
pr2_tuckarm
pr2_dashboard_aggregator
joint_trajectory_action_tools
pr2_tuck_arms_action
ethercat_trigger_controllers
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_controller_manager
pr2_mechanism_diagnostics
pr2_move_base
pr2_power_board
imu_monitor
pr2_camera_synchronizer
pr2_computer_monitor
pr2_counterbalance_check
pr2_motor_diagnostic_tool
pr2_gazebo
pr2_gazebo_plugins
py_trees_ros
radar_pa
radar_pa_msgs
razor_imu_9dof
rc_reason_clients
locomotor
rqt_dwb_plugin
robotont_gazebo
robotont_msgs
ros_comm
test_rosbag
test_rospy
test_rosservice
rosbag
rosservice
rostest
rostopic
controller_manager
controller_manager_msgs
controller_manager_tests
rqt_controller_manager
rqt_joint_trajectory_controller
cartesian_trajectory_controller
cartesian_trajectory_interpolation
inorbit_republisher
ros_numpy
ros_pytest
rospy_tutorials
rosbag_snapshot
rosbash_params
rosapi
rosbridge_library
rosbridge_server
rosee_msg
rospilot
rospy_message_converter
rosserial_arduino
rosserial_client
rosserial_embeddedlinux
rosserial_mbed
rosserial_python
rosserial_vex_cortex
rosserial_vex_v5
rosserial_windows
rosserial_xbee
rqt_gui
rqt_gui_py
rqt_py_common
rqt_action
rqt_bag
rqt_bag_plugins
rqt_console
rqt_ez_publisher
rqt_graph
rqt_launch
rqt_logger_level
rqt_moveit
rqt_msg
rqt_nav_view
rqt_pose_view
rqt_py_console
rqt_py_trees
rqt_reconfigure
rqt_robot_dashboard
rqt_robot_monitor
rqt_runtime_monitor
rqt_srv
rqt_tf_tree
rqt_top
rqt_web
rtabmap_python
rviz
rx_service_tools
schunk_simulated_tactile_sensors
sciurus17_control
sciurus17_msgs
sciurus17_vision
sensehat_ros
sick_scan
snmp_ros
static_transform_mux
swri_profiler
teleop_legged_robots
joy_teleop
key_teleop
mouse_teleop
teleop_twist_keyboard
tf2_client
tf2_server
tf2_web_republisher
timed_roslaunch
trac_ik_python
turtlebot3_example
turtlebot3_teleop
tuw_geometry
tuw_gazebo_msgs
tuw_geometry_msgs
tuw_nav_msgs
tuw_vehicle_msgs
twist_mux
uavcan_communicator
ublox_msg_filters
ubnt_airos_tools
unique_id
ur_kinematics
urdfdom_py
vda5050_connector
video_stream_opencv
visp_tracker
visp_ros
rwt_image_view
rwt_moveit
rwt_plot
volta_description
webots_ros
wge100_camera
wge100_camera_firmware
wifi_ddwrt
wireless_watcher
easy_markers
joy_listener
kalman_filter
rosbaglive
z_laser_gui
z_laser_viz
z_laser_zlp1
massrobotics_amr_sender
slider_publisher
system_fingerprint
atf_core
atf_metrics
atf_plotter
atf_recorder_plugins
atf_test
atf_test_tools
cam2lidar
node_monitoring
ros_monitoring
clearpath_onav_api_examples_lib
clober_tools
cob_fiducials
cras_joy_tools
darknet_ros
electronic_io
boeing_gazebo_model_attachment_plugin
gnss_info
grepros
imu_from_ios_sensorlog
l3cam_ros
leo_example_line_follower
leo_example_object_detection
line_planner
monkeywrench
nicla_vision_ros
oled_display_node
pyhri
quori_arm_controller
raspimouse_control
rocky_tf_monitor
rose2
rqt_pr2_dashboard
serl_franka_controllers
sick_scan_xd
snmp_diagnostics
thunder_line_follower_pmr3100
turtlebot3_autorace_camera
turtlebot3_autorace_core
turtlebot3_autorace_detect
turtlebot3_autorace_driving
vizanti
ros_vosk
wrapyfi_ros_interfaces

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rospy at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.14.13
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-01-26
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS

Additional Links

Maintainers

  • Jacob Perron
  • Michael Carroll
  • Shane Loretz

Authors

  • Ken Conley
  • Dirk Thomas
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rospy

1.14.13 (2022-01-25)

  • Add current_real docstring in timer.py (#2178)
  • Do not set self.transport unless persistent in ServiceProxy (#2171)
  • Fix #2123: Do not raise exception if socket is busy in TCPROSTransport (#2131)
  • Contributors: Jacob Perron, Kevin Chang, Shingo Kitagawa, 金梦磊

1.14.12 (2021-09-21)

1.14.11 (2021-04-26)

  • Fix "TypeError: not enough arguments for format string" (#2127)
  • Fix AttributeError isAlive (#2092)
  • Contributors: Brutus The Tschiepel, 金梦磊

1.14.10 (2020-10-16)

  • Update maintainers (#2075)
  • Fix spelling (#2066)
  • Fix log*_throttle with sim time (#2044)
  • Fix issue with rospy.set_param('') (#2024)
  • Update local parameter cache on set_param (#2021)
  • Contributors: Jacob Perron, Markus Grimm, Shane Loretz, larslue, salihmarangoz, tomoya

1.14.9 (2020-08-20)

1.14.8 (2020-08-12)

1.14.7 (2020-07-31)

  • remove not existing NodeProxy from rospy __all_ (#2007)

1.14.6 (2020-05-29)

1.14.5 (2020-03-19)

  • add exception for ConnectionAbortedError (#1908)
  • fix mac trying to use epoll instead of kqueue (#1907)
  • fix AttributeError: __exit_ (#1915)
  • fix dictionary changed size during iteration (#1894)

1.14.4 (2020-02-20)

  • add default ROS_MASTER_URI (#1666)
  • bump CMake minimum version to avoid CMP0048 warning (#1869)
  • reuse xmlrpc connections everywhere (#1471)
  • use cached parameter for rosout_disable_topics_generation (#1881)
  • add args and kwargs to rospy.log* (#1289)
  • add kwargs to internal logging functions (#1290)
  • add get_param_cached (#1515)
  • more Python 3 compatibility (#1795)
  • fix line endings to be LF (#1794)
  • use condition attributes to specify Python 2 and 3 dependencies (#1792)
  • fix dynamic windowing for Topic Statistics (#1695)
  • do not raise socket exception during shutdown (#1720)
  • add possibility to pass rospy.Duration as timeout to wait_for_service and wait_for_message (#1703)
  • add is_legal_remap() to rosgraph to make remap-detection more precise (#1683)
  • add missing comma in the list of strings (#1760)
  • switch to yaml.safe_load(_all) to prevent YAMLLoadWarning (#1688)
  • fix error handling for Topic constructor (#1701)
  • make sigterm handling Python 3 compatible (#1559)
  • update wiki.ros.org URLs (#1536)
  • show connection info on rosnode info (#1497)
  • import socket, threading in udpros.py (#1494)

1.14.3 (2018-08-06)

  • maintain exception info in RosOutHandler (#1442)

1.14.2 (2018-06-06)

  • fix some errors in some probably not frequented code paths (#1415)
  • fix thread problem with get_topics() (#1416)

1.14.1 (2018-05-21)

1.14.0 (2018-05-21)

  • add API to suppress sequential identical messages (#1309)
  • add parameter to stop clients from generating rosout topics list (#1241)
  • add rosconsole echo (#1324)

1.13.6 (2018-02-05)

  • raise the correct exception from AnyMsg.serialize (#1311)
  • remove unreachable exceptions (#1260)
  • replace Thread.setDaemon() using new API (#1276)

1.13.5 (2017-11-09)

  • fix regresssion from 1.13.3 (#1224)

1.13.4 (2017-11-02)

  • fix uri in message (#1213, regression from 1.13.3)

1.13.3 (2017-10-25)

  • change rospy.Rate hz type from int to float (#1177)
  • use defined error codes rather than hardcoded integers (#1174)
  • improve log messages when waiting for service (#1026)
  • improve logger tests (#1144)

1.13.2 (2017-08-15)

  • fix stack frame identification in rospy logging (#1141, regression from 1.13.1)

1.13.1 (2017-07-27)

  • improve rospy.logXXX_throttle performance (#1091)
  • add option to reset timer when time moved backwards (#1083)
  • abort topic lookup on connection refused (#1044)
  • add rospy.logXXX_once (#1041)
  • remove "ROS time moved backwards" log message (#1027)
  • sleep in rospy wait_for_service even if exceptions raised (#1025)
  • add named loggers (#948)

1.13.0 (2017-02-22)

1.12.7 (2017-02-17)

  • make get_published_topics threadsafe (#958)
  • use poll in write_header() if available to support higher numbered fileno (#929)
  • use epoll instead of poll if available to gracefully close hung connections (#831)
  • fix Python 3 compatibility issues (#565)

1.12.6 (2016-10-26)

  • improve reconnection logic on timeout and other common errors (#851)
  • remove duplicated function (#783)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • raise error on rospy.init_node with None or empty node name string (#895)
  • fix wrong type in docstring for rospy.Timer (#878)
  • fix order of init and publisher in example (#873)

1.12.2 (2016-06-03)

  • add logXXX_throttle functions (#812)

1.12.1 (2016-04-18)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

1.11.17 (2016-03-11)

  • preserve identity of numpy_msg(T) (#758)

1.11.16 (2015-11-09)

  • catch ROSInterruptException from rospy timers when shutting down (#690)

1.11.15 (2015-10-13)

  • validate name after remapping (#669)

1.11.14 (2015-09-19)

  • fix memory/thread leak with QueuedConnection (#661)
  • fix signaling already shutdown to client hooks with the appropriate signature (#651)
  • fix bug with missing current logger levels (#631)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • add rosconsole command line tool to change logger levels (#576)
  • add accessor for remaining time of the Rate class (#588)
  • fix high latency when using asynchronous publishing (#547)
  • fix error handling when publishing on Empty topic (#566)

1.11.10 (2014-12-22)

  • add specific exception for time jumping backwards (#485)
  • make param functions thread-safe (#523)
  • fix infinitely retrying subscriber (#533)
  • fix removal of QueuedConnection leading to wrong subscriber count (#526)
  • fix TCPROS header validation when [callerid]{.title-ref} header is not set (#522, regression from 1.11.1)
  • fix memory leak when using subcriber statistics (#520)
  • fix reported traffic in bytes from Python nodes (#501)

1.11.9 (2014-08-18)

  • populate delivered_msgs field of TopicStatistics message (#486)

1.11.8 (2014-08-04)

  • fix topic/connection statistics reporting code (#482)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

  • make MasterProxy thread-safe (#459)
  • check ROS_HOSTNAME for localhost / ROS_IP for 127./::1 and prevent connections from other hosts in that case ([#452 <https://github.com/ros/ros_comm/issues/452>]{.title-ref})_

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • Python 3 compatibility (#426)

1.11.3 (2014-05-21)

  • allow shutdown hooks to be any callable object (#410)
  • add demux program and related scripts (#407)
  • add publisher queue_size to rostopic

1.11.2 (2014-05-08)

  • use publisher queue_size for statistics (#398)

1.11.1 (2014-05-07)

  • improve asynchonous publishing performance (#373)
  • add warning when queue_size is omitted for rospy publisher (#346)
  • add optional topic/connection statistics (#398)
  • add transport information in SlaveAPI::getBusInfo() for roscpp & rospy (#328)
  • allow custom error handlers for services (#375)
  • add architecture_independent flag in package.xml (#391)

1.11.0 (2014-03-04)

  • fix exception handling for queued connections (#369)
  • use catkin_install_python() to install Python scripts (#361)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • implement optional queueing for rospy publications (#169)
  • overwrite __repr__ for rospy.Duration and Time (ros/genpy#24)
  • add missing dependency on roscpp

1.9.50 (2013-10-04)

  • add support for python coverage tool to work in callbacks

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

  • make rospy nodes killable while waiting for master (#262)

1.9.47 (2013-07-03)

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • add missing run_depend on python-yaml
  • allow configuration of ports for XML RPCs and TCP ROS
  • fix race condition where rospy subscribers do not connect to all publisher
  • fix closing and deregistering connection when connect fails (#128)
  • fix log level of RosOutHandler (#210)

1.9.44 (2013-03-21)

1.9.43 (2013-03-13)

1.9.42 (2013-03-08)

  • make dependencies on rospy optional by refactoring RosStreamHandler to rosgraph (#179)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

  • add colorization for rospy log output (#3691)
  • fix socket polling under Windows (#3959)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
actionlib
amr_interop_bridge
app_manager
ar_track_alvar
arbotix_python
asr_cyberglove_lib
asr_cyberglove_visualization
asr_direct_search_manager
asr_grid_creator
asr_ism
asr_mild_base_fake_driving
asr_mild_base_launch_files
asr_object_database
asr_psm
asr_resources_for_active_scene_recognition
asr_state_machine
asr_world_model
epson_imu
fam_cmd_i2c
gds_helper
gnc_visualizer
async_web_server_cpp
ati_force_torque
audibot_gazebo
sound_play
axis_camera
bagger
bondpy
calibration_estimation
camera_info_manager_py
capabilities
clover
clover_blocks
clover_simulation
cnn_bridge
cob_android_resource_server
cob_android_script_server
cob_command_gui
cob_dashboard
cob_helper_tools
cob_monitoring
cob_script_server
generic_throttle
scenario_test_tools
service_tools
cob_description
cob_base_controller_utils
cob_cartesian_controller
cob_frame_tracker
cob_hardware_emulation
cob_model_identifier
cob_obstacle_distance
cob_twist_controller
cob_bms_driver
cob_light
cob_mimic
cob_phidget_em_state
cob_phidget_power_state
cob_phidgets
cob_relayboard
cob_sound
cob_voltage_control
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_map_accessibility_analysis
cob_default_robot_behavior
cob_gazebo
cob_gazebo_tools
cob_gazebo_worlds
cognitao_ros
costmap_tf_layer
crane_x7_msgs
cras_py_common
cras_topic_tools
dataspeed_pds_rqt
dataspeed_pds_scripts
dataspeed_ulc_can
dbw_fca_can
dbw_mkz_can
dbw_polaris_can
ddynamic_reconfigure_python
diagnostic_aggregator
diagnostic_common_diagnostics
rosdiagnostic
test_diagnostic_aggregator
dual_quaternions_ros
dynamic_reconfigure
dynamixel_sdk
end_effector
ensenso_camera
ensenso_camera_test
smach_ros
edrone_client
edrone_server
gazesense_bridge
gazesense_msgs
fadecandy_driver
fetchit_challenge
fetch_open_auto_dock
fetch_moveit_config
aruco_gazebo
flexbe_core
flexbe_input
flexbe_mirror
flexbe_msgs
flexbe_onboard
flexbe_states
flexbe_testing
flexbe_widget
flexbe_app
flir_ptu_driver
floam
force_torque_sensor
frame_editor
franka_example_controllers
franka_gazebo
gazebo_plugins
gazebo_video_monitor_utils
generic_control_toolbox
tf2_py
tf2_ros
tf2_ros
tf2_sensor_msgs
tf2_sensor_msgs
turtle_tf
turtle_tf2
gpio_control
gps_common
health_metric_collector
heifu_safety
heron_gazebo
hfl_driver
ifm3d_ros_driver
camera_calibration
industrial_robot_simulator
inno_sim_interface
interactive_markers
jason_ros
jason_ros_comm
jderobot_color_tuner
joint_state_publisher
joint_state_publisher_gui
ps3joy
wiimote
bayesian_belief_networks
chaplus_ros
gdrive_ros
google_chat_ros
julius_ros
pgm_learner
ros_google_cloud_language
rospatlite
rostwitter
switchbot_ros
webrtcvad_ros
dynamic_tf_publisher
jsk_network_tools
multi_map_server
jsk_tools
joy_mouse
jsk_tf2_py_python3
pddl_planner
jsk_perception
sound_classification
jsk_interactive
jsk_interactive_test
keypress_monitor
khi_robot_test
kobuki_auto_docking
kobuki_node
kobuki_dashboard
kobuki_qtestsuite
map_laser
launchfile_switcher
leap_motion
leica_gazebo_simulation
leica_point_cloud_processing
leica_scanstation_ros
leica_scanstation_utils
leo_fw
access_point_control
asmach_tutorials
ddwrt_access_point
hostapd_access_point
linksys_access_point
multi_interface_roam
network_monitor_udp
network_traffic_control
laptop_battery_monitor
multires_image
swri_cli_tools
swri_image_util
swri_rospy
swri_transform_util
marvelmind_nav
mav_teleop_twist_keyboard
mavros
md49_base_controller
microstrain_inertial_rqt
mikrotik_swos_tools
mir_driver
mongodb_log
mongodb_store
move_base_sequence
move_base_swp
moveit_commander
moveit_ros_planning_interface
moveit_ros_visualization
moveit_python
movie_publisher
mqtt_bridge
mrp2_display
mrp2_hardware
default_cfg_fkie
master_discovery_fkie
master_sync_fkie
node_manager_fkie
base_local_planner
fake_localization
map_server
move_base
range_sensor_layer
nmc_nlp_lite
nmea_navsat_driver
nodelet
test_nodelet_topic_tools
novatel_span_driver
ntrip_client
omnibase_control
omnibase_description
omronsentech_camera
co_scan
srbot_description
virtual_scan
open_manipulator_with_tb3_tools
osm_cartography
route_network
ov_eval
openni2_launch
orb_slam2_ros
oxford_gps_eth
pal_carbon_collector
pal_statistics
pass_through_controllers
face_detector
people_velocity_tracker
pilz_robot_programming
pilz_store_positions
pilz_status_indicator_rqt
pincher_arm_bringup
ping360_sonar
pouco2000_ros_demo
pr2_position_scripts
pr2_teleop
pr2_tuckarm
pr2_calibration_launch
pr2_dashboard_aggregator
joint_trajectory_action_tools
pr2_tuck_arms_action
ethercat_trigger_controllers
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_controller_manager
pr2_mechanism_diagnostics
pr2_move_base
pr2_power_board
imu_monitor
pr2_camera_synchronizer
pr2_computer_monitor
pr2_counterbalance_check
pr2_motor_diagnostic_tool
pr2_gazebo
pr2_gazebo_plugins
py_trees_ros
pyros_test
r12_hardware_interface
radar_omnipresense
radar_pa
radar_pa_msgs
raspimouse_fake
razor_imu_9dof
rc_reason_clients
rslidar_driver
locomotor
rqt_dwb_plugin
robotont_gazebo
robotont_msgs
rocon_service_pair_msgs
rocon_interactions
rocon_launch
rocon_master_info
rocon_python_comms
rocon_python_utils
rocon_uri
ros_comm
test_rosbag
test_rospy
test_rosservice
rosbag
rosservice
rostest
rostopic
controller_manager
controller_manager_msgs
controller_manager_tests
rqt_controller_manager
rqt_joint_trajectory_controller
cartesian_trajectory_controller
cartesian_trajectory_interpolation
inorbit_republisher
ros_numpy
ros_pytest
ros_robodk_post_processors
rospy_tutorials
rosbag_snapshot
rosbash_params
rosapi
rosbridge_library
rosbridge_server
rosee_msg
rospilot
rospy_message_converter
rosserial_arduino
rosserial_client
rosserial_embeddedlinux
rosserial_mbed
rosserial_python
rosserial_vex_cortex
rosserial_vex_v5
rosserial_windows
rosserial_xbee
rostate_machine
rostest_node_interface_validation
rotors_evaluation
rqt_rotors
rqt_gui
rqt_gui_py
rqt_py_common
rqt_action
rqt_bag
rqt_bag_plugins
rqt_console
rqt_ez_publisher
rqt_graph
rqt_joint_trajectory_plot
rqt_launch
rqt_launchtree
rqt_logger_level
rqt_moveit
rqt_msg
rqt_nav_view
rqt_pose_view
rqt_py_console
rqt_py_trees
rqt_reconfigure
rqt_robot_dashboard
rqt_robot_monitor
rqt_runtime_monitor
rqt_srv
rqt_tf_tree
rqt_top
rqt_virtual_joy
rqt_web
rr_control_input_manager
rr_openrover_description
rr_openrover_driver
rr_rover_zero_driver
rtabmap_ros
rosnode_rtc
hironx_ros_bridge
rviz
rx_service_tools
schunk_simulated_tactile_sensors
sciurus17_control
sciurus17_msgs
sciurus17_vision
seed_r7_navigation
sensehat_ros
sick_scan
snmp_ros
sr_hand
sr_utilities
sr_edc_muscle_tools
sr_robot_lib
sr_example
sr_grasp
sr_robot_commander
sr_robot_launch
sr_3dmouse
sr_grasp_fast_planner
sr_grasp_stability
sr_hand_health_report
strain_gauge_calibration
sr_gui_advanced_controls
sr_gui_biotac
sr_gui_bootloader
sr_gui_change_muscle_controllers
sr_gui_cyberglove_calibrator
sr_gui_muscle_driver_bootloader
sr_gui_controller_tuner
sr_gui_hand_calibration
sr_gui_motor_resetter
sr_data_visualization
static_tf
static_transform_mux
swri_profiler
teleop_keyboard_omni3
teleop_legged_robots
joy_teleop
key_teleop
mouse_teleop
teleop_twist_keyboard
teraranger_array
tf2_client
tf2_server
tf2_web_republisher
timed_roslaunch
trac_ik_python
tts
turtle_teleop_multi_key
turtlebot3_example
turtlebot3_teleop
turtlebot3_automatic_parking
turtlebot3_automatic_parking_vision
turtlebot3_follower
turtlebot3_panorama
turtlebot3_autorace_camera
turtlebot3_autorace_control
turtlebot3_autorace_core
turtlebot3_autorace_detect
turtlesim_dash_tutorial
tuw_geometry
tuw_aruco
tuw_ellipses
tuw_marker_pose_estimation
tuw_gazebo_msgs
tuw_geometry_msgs
tuw_nav_msgs
tuw_vehicle_msgs
twist_mux
uavcan_communicator
ublox_msg_filters
ubnt_airos_tools
underwater_vehicle_dynamics
unique_id
ur_kinematics
urdf_test
urdfdom_py
uuv_assistants
uuv_control_cascaded_pid
uuv_control_utils
uuv_thruster_manager
uuv_trajectory_control
uuv_teleop
vda5050_connector
video_stream_opencv
visp_tracker
visp_ros
rwt_image_view
rwt_moveit
rwt_plot
visualstates
volta_description
webots_ros
wge100_camera
wge100_camera_firmware
wifi_ddwrt
wireless_watcher
easy_markers
joy_listener
kalman_filter
rosbaglive
xaxxon_openlidar
xsens_driver
yocs_ar_pair_approach
yocs_localization_manager
yocs_navigator
yocs_virtual_sensor
z_laser_gui
z_laser_viz
z_laser_zlp1

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rospy at Robotics Stack Exchange